Next Article in Journal
R103 and R115 Affinity Mutants of ATeam ATP Biosensors
Previous Article in Journal
Research on Ultrasonic Focusing Stacked Transducers for Composite
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

A Hybrid Ant Colony Optimization and Dynamic Window Method for Real-Time Navigation of USVs

1
School of Electrical Engineering, Naval University of Engineering, Wuhan 430033, China
2
Shanghai Marine Equipment Research Institute, Shanghai 200030, China
*
Author to whom correspondence should be addressed.
Sensors 2025, 25(19), 6181; https://doi.org/10.3390/s25196181
Submission received: 17 August 2025 / Revised: 25 September 2025 / Accepted: 25 September 2025 / Published: 6 October 2025
(This article belongs to the Section Sensors and Robotics)

Abstract

Unmanned surface vehicles (USVs) rely on multi-sensor perception, such as radar, LiDAR, GPS, and vision, to ensure safe and efficient navigation in complex maritime environments. Traditional ant colony optimization (ACO) for path planning, however, suffers from premature convergence, slow adaptation, and poor smoothness in cluttered waters, while the dynamic window approach (DWA) without global guidance can become trapped in local obstacle configurations. This paper presents a sensor-oriented hybrid method that couples an improved ACO for global route planning with an enhanced DWA for local, real-time obstacle avoidance. In the global stage, the ACO state–transition rule integrates path length, obstacle clearance, and trajectory smoothness heuristics, while a cosine-annealed schedule adaptively balances exploration and exploitation. Pheromone updating combines local and global mechanisms under bounded limits, with a stagnation detector to restore diversity. In the local stage, the DWA cost function is redesigned under USV kinematics to integrate velocity adaptability, trajectory smoothness, and goal-deviation, using obstacle data that would typically originate from onboard sensors. Simulation studies, where obstacle maps emulate sensor-detected environments, show that the proposed method achieves shorter paths, faster convergence, smoother trajectories, larger safety margins, and higher success rates against dynamic obstacles compared with standalone ACO or DWA. These results demonstrate the method’s potential for sensor-based, real-time USV navigation and collision avoidance in complex maritime scenarios.

1. Introduction

Unmanned surface vehicles (USVs), as autonomous platforms for ocean mapping, environmental monitoring, port inspection, and maritime security, rely heavily on multi-sensor systems—such as LiDAR, radar, GPS, inertial measurement units (IMUs), and cameras—to perceive their surroundings and ensure safe navigation [1,2]. These sensors provide critical information about static and dynamic obstacles, traffic conditions, and environmental uncertainty, enabling USVs to plan safe and efficient trajectories in real time [3,4,5]. However, converting raw sensor data into globally optimal and locally feasible paths remains a major challenge [6,7].
Path planning in sensor-driven USV navigation is typically organized into two layers [8]. Global path planning uses prior maps or sensor-fused environment models to produce optimal routes in relatively static settings [9], while local path planning depends on real-time perception for dynamic obstacle avoidance and trajectory refinement under sensor noise and environmental changes [10]. Relying solely on one layer often fails in cluttered waterways with narrow passages and moving obstacles. This has motivated research on integrating global and local planners to achieve both global efficiency and local reactivity for USVs in sensor-rich environments [11].
In recent years, researchers have explored a variety of advanced path planning techniques. For example, Bahwini et al. proposed a method for path planning in soft tissue deformation environments [12], which employs finite element modeling and bio-heat transfer analogy to explicitly account for environmental deformation and uncertainty, demonstrating strong adaptability in microscale scenarios. However, such approaches are primarily tailored for deformable media, which differ substantially from the large-scale rigid waterways encountered by unmanned surface vehicles (USVs), and they also incur considerable computational overhead. The optimal path planning method based on Cellular Neural Networks (CNNs) leverages parallel computation and dynamical system modeling, exhibiting strong nonlinear processing capability and distributed characteristics in complex environments [13]; nevertheless, the network scale and parameter sensitivity limit its applicability to large-scale maritime charts. In the field of unmanned aerial vehicles (UAVs), researchers have proposed the crossover recombination-based global-best Brainstorm Optimization algorithm (GBSO-CR), which enhances global exploration and diversity control to achieve superior paths in three-dimensional threat environments. Despite these advantages, its high computational complexity and strong parameter dependence restrict its suitability for real-time online path planning in USVs [14].
Overall, these approaches provide diverse strategies for addressing environmental uncertainty, dynamic changes, and real-time constraints. On the one hand, soft tissue deformation and thermal modeling methods are more applicable to small-scale or specific medium environments, making them difficult to adapt to maritime scenarios with rigid obstacles and large-scale continuous waterways. On the other hand, methods based on CNNs and brainstorm optimization, despite their strong global search and parallel processing capabilities, typically incur high computational costs and thus fall short of meeting the real-time planning requirements of USVs in dynamic marine environments.
Among global planners, Ant Colony Optimization (ACO) is popular for mobile robots and USVs thanks to its distributed search, positive feedback, and robustness in complex environments [15,16]. Yet the standard ACO exhibits several drawbacks in continuous spaces and densely cluttered scenes:
  • Premature convergence: pheromones accumulate rapidly on a few paths, trapping the search in local optima.
  • Insufficient safety: distance-only heuristics may drive paths that skim obstacle boundaries.
  • Poor smoothness: without heading constraints, routes contain sharp turns that increase energy consumption and complicate control.
  • Limited adaptability: success rates degrade in highly dynamic environments, and feasible paths may not be found.
For local planning, the Dynamic Window Approach (DWA) [17] evaluates motion commands directly in the robot’s (or USV’s) velocity space under kinematic constraints and is widely used for obstacle avoidance. However, classical DWA primarily relies on local sensing and lacks global guidance; it is prone to getting stuck in cul-de-sacs, concavities, or complex obstacle clusters, reducing efficiency and even preventing goal reachability [18]. Recent work has attempted to integrate improved ACO and DWA variants to combine global guidance with local reactivity. For example, Song et al. [19] proposed an ACO–DWA fusion strategy that enhances pheromone initialization and evaluation functions, achieving shorter and smoother paths for mobile robots in dynamic environments.
To address these issues, we propose a fusion method that couples an improved ACO with an enhanced DWA for USV path planning:
Global stage: the improved ACO fuses three heuristics—path length, obstacle clearance, and trajectory smoothness—into the transition rule, and adopts a cosine-annealed temperature to balance exploration and exploitation. A pheromone update with lower/upper bounds and a stagnation-triggered restart enhances convergence and diversity.
Local stage: the DWA cost is redesigned under USV kinematics by incorporating trajectory smoothness and goal-deviation terms, enabling dynamic tracking of the global reference path with real-time collision avoidance.
Fusion strategy: ACO supplies a safe and smooth global reference, while DWA performs trajectory optimization and avoidance around dynamics, preserving global optimality and local real-time feasibility.
The main contributions of our work are as follows:
(1)
A multi-heuristic, temperature-controlled ACO that improves the safety and smoothness of global routes.
(2)
A DWA cost tailored to USV motion characteristics, fusing speed, smoothness, and goal-deviation to realize dynamic avoidance with global-path tracking.
(3)
An ACO–DWA integration that tightly couples global and local planning, markedly improving success rates in complex dynamic scenes.
(4)
Comprehensive simulations showing that the proposed method outperforms standalone ACO and standalone DWA in path length, smoothness, safety margin, and avoidance success.

2. USV Kinematic Modeling

To incorporate a trajectory smoothness metric into the planner, we first establish a steering kinematic model for the USV [20]. Under a small-angle approximation and standard simplifications—neglecting sideslip and wave-induced disturbances—the planar motion of a USV can be treated as a nonholonomic system whose state is (x,y,θ), where θ is the heading.
As illustrated in Figure 1 (simplified steering model), assume the heading is aligned with the velocity direction. Let ϕ denote the rudder (steering) angle and L the distance from the center of mass to the steering center. The kinematics are then
x ˙ = v c o s θ y ˙ = v s i n θ θ ˙ = v L t a n ϕ
where
v : longitudinal surge speed of the USV;
ϕ : rudder/steering angle;
L : distance from the center of mass to the steering center;
θ : heading angle.
Figure 1. Simplified steering model.
Figure 1. Simplified steering model.
Sensors 25 06181 g001

3. Methods

3.1. Improved ACO

3.1.1. Multi-Heuristic Fusion

In the standard ACO, the heuristic information η i j = 1 / d i j only accounts for path length and thus fails to balance safety and smoothness. We introduce three factors—Distance, Clearance, and Smoothness—and fuse them with weights:
η i j fusion = w d · 1 d i j + ε + w c · c l i p D j , 0 , D m a x D m a x + w s · 1 + c o s θ i j 2
where
  • d i j : Euclidean distance from node i to node j ;
  • D j : distance from node j to the nearest obstacle;
  • θ i j : turning angle computed from the USV kinematic model;
  • w d , w c , w s : weights of the three factors;
  • ε : a small constant to avoid division by zero;
  • c l i p x , 0 , D max = m i n m a x { x , 0 } , D max .
This fusion discourages “hugging” obstacles while favoring feasible paths with gentler heading changes.

3.1.2. Temperature-Controlled Transition Probability

To balance exploration and exploitation adaptively, a temperature term T ( t ) modulates the influence of the heuristic:
P i j k ( t ) = τ i j ( t ) α η i j fusion β / T ( t ) l A k τ i l ( t ) α η i l fusion β / T ( t )
where A k is the selectable neighborhood for ant k . The temperature follows a cosine-annealing schedule:
T ( t ) = T m i n + T m a x T m i n 2 1 + c o s π ( t 1 ) t m a x
At early iterations, T is larger, β / T is smaller, and the search is more exploratory; as T decreases, the algorithm shifts toward exploitation and stabilizes.

3.1.3. Local Pheromone Update

When an ant traverses edge i j , we apply a local “de-biasing” update:
τ i j ( 1 ξ ) τ i j + ξ τ 0 ,   ξ ( 0 , 1 )
which reduces over-commitment to recently used edges and increases diversity.

3.1.4. Global Pheromone Update with Bounds

At the end of each iteration, pheromones evaporate and are reinforced by both ant contributions and an elite term:
τ i j ( 1 ρ ) τ i j + Δ τ i j a n t + q ( t ) Δ τ i j e l i t e
With
Δ τ i j ant = k = 1 m Q L k 1 ( i j ) path k ,   Δ τ i j elite = Q L best 1 { ( i j ) best _ path }
where L k is the length of ant k ’s path and L best is the current best length. We use a dynamic elite coefficient
q ( t ) = e x p t 1 t m a x 1
and impose pheromone bounds
τ i j m i n τ m a x , m a x τ m i n , τ i j
These mechanisms speed up convergence while preventing premature stagnation.

3.1.5. Stagnation Criterion and Restart

If the best value shows no improvement for P consecutive iterations, we trigger a “pull-back” restart:
τ i j ( 1 γ ) τ i j + γ τ 0 , γ ( 0 , 1 )
which resets the pheromone field toward its initialization to restore exploration capability.

3.2. Pseudocode for the Improved ACO

At initialization (see Algorithm 1), pheromone levels τ i j are set to τ 0 and the fused heuristic η i j fusion in (2) is precomputed (or updated on demand) from the distance, clearance and smoothness terms. We fix α , β , ρ , ξ , τ m i n , τ m a x , γ and define the cosine-annealed temperature schedule T ( t ) in (4) together with the time-varying elite gain q ( t ) in (8). For each iteration t = 1 , , t m a x (or until an early-stopping criterion is met), a colony of m ants independently constructs candidate paths using the transition rule (3) and applies the local update (5) along traversed edges. After all ants return, path costs are evaluated and the incumbent best solution is updated. Global pheromone evaporation and reinforcement are then performed using (6) and (7), followed by bounding in (9) to prevent premature saturation. If the best cost has not improved for P consecutive iterations, the stagnation pull-back in (10) is triggered to restore exploration. The loop records the periteration best cost for the convergence plot, and the final best path can be optionally post-processed by visibility-based node pruning or mild smoothing before being passed to the local planner. The environment map used for path construction can be either derived from sensor perception or generated by simulation.
Algorithm 1Improved-ACO (Global Planning)
InputGrid map, start s, goal g, ACO parameters
Outputbest_path, best_cost
1Initialize pheromone τ τ 0 on all feasible edges.
2Precompute distance field D and fused heuristic η fusion .
3Set best_cost + , no_improve 0 .
4for t = 1 to t m a x do
5 perIterAntTau   0 ;   perIterElite   0
6       T = T m i n + T m a x T m i n 2 1 + c o s π ( t 1 ) t m a x .
7       for   k = 1 to m do
8 p a t h k   ConstructPath _ Pro   M , s , g , τ , η fusion , T , C min , ξ , τ 0 , α , β .
9 p a t h k R e m o v e R e d u n d a n t ( p a t h k )
10 L k P a t h L e n g t h ( p a t h k )
11 perIterAntTau     perIterAntTau + Δ τ ( p a t h k , L k , Q )
12   end for
13       if   all   L k = then
14 C m i n m a x 0 , C m i n Δ C ; rerun this iteration
15   if still infeasible then return failure
16   end if
17   Find best individual L , p a t h   among L k , p a t h k
18       if   L < best_cost then
19 b e s t c o s t L , b e s t _ p a t h p a t h , n o _ i m p r o v e 0
20   else
21 no _ improve   no_improve +1
22   end if
23       p e r I t e r E l i t e Q / L added only on edges of p a t h
24       q ( t ) e x p t 1 t max 1
25       τ ( 1 ρ ) τ + perIterAntTau + q ( t ) · p e r I t e r E l i t e
26       τ m i n τ max , m a x τ min , τ
27       if   no _ improve   P then
28 τ ( 1 γ ) τ + γ τ 0
29 no _ improve     0
30   end if
31end for
32return best_path, best_cost

3.3. Simulation of the Improved ACO

We evaluate the proposed method in a 21 × 21 grid map with sparse obstacles, which emulate a simplified sensor-detected map. The maximum number of iterations is 250. After a path is generated, redundant waypoints are removed by a visibility-based triangle clipping procedure. The start and goal are set to (1,21) and (21,1), respectively. Baselines include several representative ACO variants: the original Ant System (AS) [21], Ant Colony Optimization (ACO) as a general framework [22], Ant Colony System (ACS) [23], Rank-based Ant System (RAS) [24], and Elitist Ant System (EAS) [21]. The proposed variant (“Ours”) is the improved ACO. Key parameter settings are summarized in Table 1.
In Figure 2, the red solid line with circles denotes vanilla ACO, the green curve AS, the dark-blue curve ACS, the cyan curve RAS, the black curve EAS, and the blue curve our improved ACO. The proposed method reduces fruitless branches during search and removes superfluous turns in the post-optimization stage, yielding markedly smoother trajectories. As summarized in Table 2, the average path length of the proposed method is 29.49—about 4.7% shorter than vanilla ACO—and its runtime is 1.24 s, which is lower than the baselines. Figure 3 further shows that our dynamic pheromone updating and node-pruning strategy leads to faster convergence.

3.4. Improved DWA

3.4.1. Kinematic Model and Dynamic-Window Feasibility

Under a small-angle approximation and neglecting sideslip and wave disturbances, the USV’s planar motion follows the kinematics in (1), where the surge speed is aligned with the heading. Let v be the surge speed, ϕ the rudder (steering) angle, θ the heading, and L the distance from the vehicle’s CoG to the steering center. The minimum turning radius is given by the geometric relation
R m i n = L t a n φ m a x
In practice, actuator saturation and hull dynamics impose bounds on speed, steering angle, and their rates. With sampling period Δ t and current control ( v k , ϕ k ), the dynamic window is
v m a x v m i n , v k + a m i n Δ t , m i n v m a x , v k + a m a x Δ t φ m a x φ m i n , φ k + φ ˙ m i n Δ t , m i n φ m a x , φ k + φ ˙ m a x Δ t
To avoid numerical stagnation and deadlock, we enforce a low-speed threshold v v ϵ > 0 . During sampling, candidates that violate curvature/steering feasibility (e.g., | ϕ | > ϕ m a x or equivalently κ = t a n ϕ / L beyond its bound) are discarded.

3.4.2. Prediction Model and Safety Criterion

For each candidate control ( v , ϕ ), we roll out the kinematics (1) for N p steps to obtain the predicted trajectory
Γ = x l , y l , θ l l = 1 , 2 , , N p
Let the minimum Euclidean distance to all static/dynamic obstacles be
d m i n = m i n l m i n o O x l , y l x o , y o
where O is the obstacle set and ( x o , y o ) an obstacle position.
To couple hard safety with sensitivity near critical regions, we adopt a dual-threshold rule:
  • Hard safety: if d m i n < D (hard safety radius), the candidate is infeasible and rejected.
  • Soft safety: for d m i n D , a logistic cost enhances sensitivity near the soft boundary:
    Clear = K 1 1 + e x p c d m i n d l i m 1 2
    where d l i m > D , c > 0 controls the slope, and K scales the penalty.
Around d m i n d l i m , the cost varies most rapidly, prompting early avoidance. Predicted positions of moving obstacles may be obtained via constant-velocity, constant-acceleration, or coordinated-turn models; our framework is agnostic to the predictor.

3.4.3. Objective Function

To keep local avoidance consistent with the global objective, we maximize a multi-term score that blends goal heading, trajectory smoothness, clearance, speed preference, and relative goal bearing:
J ( v , ϕ ) = α H e a d i n g ( v , ϕ ) + β S m o o t h ( v , ϕ ) + δ C l e a r ( v , ϕ ) + γ V e l o c i t y ( v , ϕ ) + μ R e l A n g l e ( v , ϕ )
with nonnegative weights α , β , δ , γ , μ .
(1) Goal-heading term.
Let the local tracking target (e.g., the next point on the global path) be x g , y g . With predicted terminal state ( x N p , y N p , θ N p ), the desired bearing is
θ des = a t a n 2 y g y N p , x g x N p
and the heading score is
Heading = 1 + c o s θ N p θ d e s 2 [ 0 , 1 ]
(2) Smoothness term.
To discourage sharp turns and improve maneuverability/efficiency,
Smooth = 1 N p 1 l = 1 N p 1 1 + c o s θ l + 1 θ l 2 [ 0 , 1 ]
(3) Clearance term.
If d m i n < D the candidate is rejected; otherwise the soft safety cost follows (16). For completeness we restate it:
Clear = K 1 1 + e x p c d m i n d l i m 1 2
(4) Speed preference.
Encouraging efficient motion via normalized surge speed,
Velocity = v v m i n v m a x v m i n [ 0 , 1 ]
(5) Relative goal-bearing term.
To re-align toward the goal after detours,
RelAngle = 1 + c o s θ d e s θ k 2 [ 0 , 1 ]
where θ k is the current heading.

3.5. Pseudocode of the Improved DWA

Outline. Initialize kinematic bounds and weights ( α , β , δ , γ , μ ). At each control cycle: (i) build the dynamic window (12) around ( v k , ϕ k ) and sample feasible ( v , ϕ ) respecting | ϕ | ϕ m a x and v v ϵ ; (ii) roll out (1) for N p steps to get Γ ; (iii) compute d m i n by (15); reject candidates with d m i n < D , evaluate surviving ones by (16) with terms (19)–(22); (iv) select the maximizer of J and apply it; (v) advance the state and repeat. The detailed pseudocode is summarized in Algorithm 2.
Algorithm 2Improved-DWA (Local Planning with Hard/Soft Safety and Multi-Objective)
Input Input :   Current   state   x = ( x , y , θ , v , ω ) , local goal, static map, predicted dynamic obstacles, DWA parameters.
Output Control   u = v , ϕ ,   best   trajectory   t r a j j .
1 Build   dynamic   window :   v m a x v m i n , v k + a m i n Δ t , m i n v m a x , v k + a m a x Δ t ; ϕ m a x ϕ m i n , ϕ k + ϕ ˙ m i n Δ t , m i n ϕ m a x , ϕ k + ϕ ˙ m a x Δ t .
2 Prune   samples   with   | ϕ | > ϕ m a x   or   v < v ε ;
3 b e s t S c o r e ;   u ;   t r a j ;
4 For   each   sample   ( v , ϕ ) in dynamic window do
5 Predict   N p -step trajectory Γ = x l , y l , θ l l = 1 N p .
6 d m i n m i n l m i n o x l , y l x o , y o over static + predicted obstacles.
7 If   d m i n < D then continue.
8 Compute   desired   heading   θ des = a t a n 2 y g y N p , x g x N p .
9 Heading = 1 + c o s θ N p θ d e s 2 .
10 Smooth = 1 N p 1 l 1 N p 1 1 + c o s θ l + 1 θ l 2
11 C l e a r = K 1 1 + e x p c d m i n d l i m 1 2
12 Velocity = v v m i n v m a x v m i n .
13 RelAngle = 1 + c o s θ des θ k 2 .
14 J = α Heading + β Smooth + δ C l e a r + γ Velocity + μ RelAngle .
15 If   J > bestScore   then   update   bestScore ,   u = ( v , ϕ ) , t r a j = Γ .
16 Return   u , t r a j .

4. ACO-DWA Fusion

4.1. Algorithmic Flowchart

The overall procedure of the proposed global–local hybrid planner is summarized in a flowchart (Figure 4). In the global planning stage, the improved ACO constructs the grid graph and initializes both the pheromone distribution and fused heuristic function. Ant paths are iteratively generated through a temperature-controlled transition rule, while pheromone trails are updated locally and globally under bounded values, with a stagnation–restart mechanism to avoid premature convergence. Throughout this process, the best-so-far solution is retained as the candidate global path. To further enhance path quality, line-of-sight pruning and multi-segment polyline refinement are applied to remove redundant waypoints and reduce unnecessary heading changes, yielding a smooth global reference trajectory.
For local tracking, the improved DWA aligns the initial USV heading with the tangent of the first reference segment and constructs the dynamic window according to the vehicle’s kinematic constraints. Within this window, feasible velocity–yaw pairs ( v , ϕ ) are sampled and rolled out into short-horizon trajectories. Each candidate is evaluated using a composite cost function that balances goalheading alignment, smoothness, clearance, speed preference, and relative bearing. Unsafe trajectories are discarded, and the one with the highest score is executed. A receding update strategy is then adopted: the USV always tracks the sub-path starting from the closest reference waypoint and repeats the local control cycle until the goal is reached or a re-planning condition is triggered.

4.2. Simulation

This section validates the proposed global–local hybrid planner on a 20 × 20 grid environment (Figure 5). The map is generated from a predefined binary matrix, while the start and goal positions are interactively specified by the user. The scenario includes three moving obstacles, each following a polyline trajectory generated by the A* algorithm with a constant step size, as well as several additional static obstacles that are interactively placed to emulate unexpected obstacles detected by onboard sensors.
At the global layer, the improved ACO adopts the inverse squared Euclidean distance to the goal as the base heuristic, combined with time-varying evaporation and global pheromone reinforcement. The algorithm iterates to obtain a feasible discrete route, then applies line-of-sight pruning and multi-stage polyline refinement to reduce turns and produce a smooth global reference path. As illustrated in Figure 5, subfigure (a) shows the three moving obstacles, (b) depicts the initial planned path, and (c) presents the optimized global–local hybrid trajectory.
At the local layer, the improved DWA automatically aligns the initial heading with the tangent of the first reference segment and tracks only the sub-path beginning at the nearest reference waypoint. Under dynamic/unknown obstacles, it samples feasible velocities in real time and evaluates a composite cost that blends heading, clearance, speed, and short-horizon prediction. Figure 6 presents the simulation results of the proposed ACO–DWA fusion algorithm. Subfigures (a)–(i) illustrate the sequential navigation states of the USV during its motion, where the trajectories remain feasible and collision-free under dynamic obstacles.
To further validate the effectiveness and robustness of the proposed planner, we conducted repeated trials under randomized obstacle configurations. Each method was executed 100 times, and performance was evaluated using four metrics: success rate, path length, minimum clearance, and goal time. The statistical results are summarized in Table 3. The proposed Improved ACO–DWA achieved the highest success rate (0.94), the shortest path length (28.3 m), the largest minimum clearance (0.57 m), and the shortest goal time (112.2 s). Compared with the baseline ACO + DWA, our method reduced path length by about 6% and increased minimum clearance by over 20%, while ensuring more efficient and safer navigation. These improvements are statistically significant (p < 0.05).
The improved ACO reaches a stable feasible solution within a small number of generations; after polyline refinement the path becomes significantly shorter and smoother. With the DWA fusion, the USV reaches the goal without collision, exhibiting smooth variations in speed and attitude throughout the motion.

5. Discussion

The integration of a multi-heuristic, temperature-controlled ACO with a kinematically feasible DWA produces trajectories that are short, smooth, and safe, while maintaining real-time responsiveness to dynamic obstacles. The combined heuristics of distance, clearance, and smoothness guide ACO away from wall-following shortcuts and abrupt heading changes; the cosine-annealed schedule stabilizes the exploration–exploitation balance, preventing early stagnation. Pheromone bounding, together with a stagnation–reset mechanism, further mitigates premature convergence.
On the local layer, aligning the initial heading with the first reference segment and tracking the nearest sub-path effectively reduce oscillations and dead ends. The redesigned DWA cost mirrors global objectives—heading consistency, clearance, smoothness, and velocity adaptability—thereby improving the continuity between global and local planning.
Computation remains modest through the use of dynamic ant counts, early stopping, array reuse, and parallel rollout. The DWA component operates at control frequency, enabling real-time deployment. The main limitations are the scalability of dense pheromone storage on large maps, and the absence of explicit modeling for currents and waves. The method also requires careful weight tuning. These limitations could be alleviated by sparse or learned roadmaps, disturbance-aware prediction, and automated parameter adaptation.

6. Conclusions

This paper presented a fused ACO–DWA planner for USV navigation that combines global optimality with local feasibility. The improved ACO generates safe and smooth global corridors, while the DWA executes collision-free tracking in the presence of dynamics and moving obstacles. Simulation experiments demonstrated faster convergence, shorter and smoother paths, and more stable real-time avoidance compared with classical ACO variants.
Future research will focus on improving scalability, modeling environmental disturbances such as currents and winds, automatic weight tuning, incorporation of formal safety guarantees (e.g., barrier functions or chance constraints), multi-USV cooperative planning, and validation on real-world sensor-based USV platforms.

Author Contributions

Conceptualization, Y.X. and S.Y.; methodology, Y.X.; software, Y.X.; validation, X.X., Y.Z., S.Y. and B.H.; formal analysis, Y.X.; investigation, Y.X.; resources, Y.X., J.H. and L.L.; data curation, Y.X. and L.W.; writing—original draft preparation, Y.X.; writing—review and editing, Y.X. and Y.Z.; visualization, Y.X.; supervision, L.W.; project administration, L.W.; funding acquisition, L.W. All authors have read and agreed to the published version of the manuscript.

Funding

This research was funded by the National Natural Science Foundation of China, grant number 41771487 and the National Key Research and Development Program, grant number 2022YFC3102800.

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

Data are contained within the article.

Conflicts of Interest

Author Bi He was employed by the company Shanghai Marine Equipment Research Institute. The remaining authors declare that the research was conducted in the absence of any commercial or financial relationships that could be construed as a potential conflict of interest.

References

  1. Bai, X.; Li, B.; Xu, X.; Xiao, Y. A review of current research and advances in unmanned surface vehicles. J. Mar. Sci. Appl. 2022, 21, 47–58. [Google Scholar] [CrossRef]
  2. Yang, T.; Jiang, Z.; Sun, R.; Cheng, N.; Feng, H. Maritime search and rescue based on group mobile computing for unmanned aerial vehicles and unmanned surface vehicles. IEEE Trans. Ind. Inform. 2020, 16, 7700–7708. [Google Scholar] [CrossRef]
  3. Jorge, V.A.M.; Granada, R.; Maidana, R.G.; Jurak, D.A.; Heck, G.; Negreiros, A.P.F.; dos Santos, D.H.; Gonçalves, L.M.G.; Amory, A.M. A survey on unmanned surface vehicles for disaster robotics: Main challenges and directions. Sensors 2019, 19, 702. [Google Scholar] [CrossRef]
  4. de Andrade, E.M.; Sales, J.S., Jr.; Fernandes, A.C. Operative Unmanned Surface Vessels (USVs): A Review of Market-Ready Solutions. Automation 2025, 6, 17. [Google Scholar] [CrossRef]
  5. Gu, Y.; Goez, J.C.; Guajardo, M.; Wallace, S.W. Autonomous vessels: State of the art and potential opportunities in logistics. Int. Trans. Oper. Res. 2021, 28, 1706–1739. [Google Scholar] [CrossRef]
  6. Xing, B.; Yu, M.; Liu, Z.; Tan, Y.; Sun, Y.; Li, B. A review of path planning for unmanned surface vehicles. J. Mar. Sci. Eng. 2023, 11, 1556. [Google Scholar] [CrossRef]
  7. Hashali, S.D.; Yang, S.; Xiang, X. Route planning algorithms for unmanned surface vehicles (USVs): A comprehensive analysis. J. Mar. Sci. Eng. 2024, 12, 382. [Google Scholar] [CrossRef]
  8. Chen, J.; Zhang, R.; Han, W.; Jiang, W.; Hu, J.; Lu, X.; Liu, X.; Zhao, P. Path planning for autonomous vehicle based on a two–layered planning model in complex environment. J. Adv. Transp. 2020, 2020, 6649867. [Google Scholar] [CrossRef]
  9. Liu, L.; Wang, X.; Yang, X.; Liu, H.; Li, J.; Wang, P. Path planning techniques for mobile robots: Review and prospect. Expert Syst. Appl. 2023, 227, 120254. [Google Scholar] [CrossRef]
  10. Long, Y.; Liu, S.; Qiu, D.; Li, C.; Guo, X.; Shi, B.; AbouOmar, M.S. Local path planning with multiple constraints for USV based on improved bacterial foraging optimization algorithm. J. Mar. Sci. Eng. 2023, 11, 489. [Google Scholar] [CrossRef]
  11. Barrera, C.; Padron, I.; Luis, F.S.; Llinas, O. Trends and challenges in unmanned surface vehicles (Usv): From survey to shipping. TransNav Int. J. Mar. Navig. Saf. Sea Transp. 2021, 15, 135–142. [Google Scholar] [CrossRef]
  12. Bahwini, T.; Zhong, Y.; Gu, C. Path planning in the presence of soft tissue deformation. Int. J. Interact. Des. Manuf. (IJIDeM) 2019, 13, 1603–1616. [Google Scholar] [CrossRef]
  13. Zhong, Y.; Shirinzadeh, B.; Yuan, X. Optimal Robot Path Planning with Cellular Neural Network. Int. J. Intell. Mechatron. Robot. 2011, 1, 20–39. [Google Scholar] [CrossRef]
  14. Zhou, Q.; Gao, S.; Qu, B.; Gao, X.; Zhong, Y. Crossover recombination-based global-best brain storm optimization algorithm for uav path planning. Proc. Rom. Acad. Ser. A-Math. Phys. Tech. Sci. Inf. Sci. 2022, 23, 207–216. [Google Scholar]
  15. Heng, H.; Ghazali, M.H.M.; Rahiman, W. Exploring the application of ant colony optimization in path planning for Unmanned Surface Vehicles. Ocean Eng. 2024, 311, 118738. [Google Scholar] [CrossRef]
  16. Lyridis, D.V. An improved ant colony optimization algorithm for unmanned surface vehicle local path planning with multi-modality constraints. Ocean Eng. 2021, 241, 109890. [Google Scholar] [CrossRef]
  17. Dobrevski, M.; Skočaj, D. Dynamic adaptive dynamic window approach. IEEE Trans. Robot. 2024, 40, 3068–3081. [Google Scholar] [CrossRef]
  18. Zhang, J.; Ling, H.; Tang, Z.; Song, W.; Lu, A. Path planning of USV in confined waters based on improved A∗ and DWA fusion algorithm. Ocean Eng. 2025, 322, 120475. [Google Scholar] [CrossRef]
  19. Song, B.; Tang, S.; Li, Y. A new path planning strategy integrating improved ACO and DWA algorithms for mobile robots in dynamic environments. Math. Biosci. Eng 2024, 21, 2189–2211. [Google Scholar] [CrossRef]
  20. Wang, N.; Zhang, Y.; Ahn, C.K.; Xu, Q. Autonomous pilot of unmanned surface vehicles: Bridging path planning and tracking. IEEE Trans. Veh. Technol. 2021, 71, 2358–2374. [Google Scholar] [CrossRef]
  21. Dorigo, M.; Maniezzo, V.; Colorni, A. Ant system: Optimization by a colony of cooperating agents. IEEE Trans. Syst. Man Cybern. Part B. (Cybern.) 1996, 26, 29–41. [Google Scholar] [CrossRef] [PubMed]
  22. Dorigo, M.; Birattari, M.; Stutzle, T. Ant colony optimization. IEEE Comput. Intell. Mag. 2007, 1, 28–39. [Google Scholar] [CrossRef]
  23. Dorigo, M.; Gambardella, L.M. Ant colony system: A cooperative learning approach to the traveling salesman problem. IEEE Trans. Evol. Comput. 2002, 1, 53–66. [Google Scholar] [CrossRef]
  24. Bullnheimer, B.; Hartl, R.; Strauss, C. A new rank based version of the ant system: A computational study. Cent. Eur. J. Oper. Res. 1999, 7, 25–38. [Google Scholar]
Figure 2. Compares the paths produced by different ACO variants.
Figure 2. Compares the paths produced by different ACO variants.
Sensors 25 06181 g002
Figure 3. Runtime and convergence curves of different ACO variants.
Figure 3. Runtime and convergence curves of different ACO variants.
Sensors 25 06181 g003
Figure 4. Flowchart of the proposed ACO–DWA hybrid path planner.
Figure 4. Flowchart of the proposed ACO–DWA hybrid path planner.
Sensors 25 06181 g004
Figure 5. Global–local hybrid planning in a dynamic environment. (a) Three moving obstacles; (b) Initial planned path; (c) Optimized path.
Figure 5. Global–local hybrid planning in a dynamic environment. (a) Three moving obstacles; (b) Initial planned path; (c) Optimized path.
Sensors 25 06181 g005
Figure 6. Sequential navigation process of the USV using the fused ACO–DWA planner. The blue dashed line represents the reference trajectory, and the blue solid line represents the actual trajectory. The triangle indicates the start position, and the green sector represents the forward heading direction. The red * marks the goal point. Hollow circles indicate intermediate waypoints. Black areas denote static obstacles, grey areas are expanded obstacles, and yellow blocks represent dynamic obstacles. (a) Start position and initial path planning; (b) Initial path tracking; (c) Passing the first obstacle cluster; (d) Mid-course turning and local adjustment; (e) Local adjustment near obstacles; (f) Exiting obstacle avoidance and continuing forward; (g) Approaching the goal region; (h) Entering the goal vicinity with fine adjustment; (i) Reaching the goal point.
Figure 6. Sequential navigation process of the USV using the fused ACO–DWA planner. The blue dashed line represents the reference trajectory, and the blue solid line represents the actual trajectory. The triangle indicates the start position, and the green sector represents the forward heading direction. The red * marks the goal point. Hollow circles indicate intermediate waypoints. Black areas denote static obstacles, grey areas are expanded obstacles, and yellow blocks represent dynamic obstacles. (a) Start position and initial path planning; (b) Initial path tracking; (c) Passing the first obstacle cluster; (d) Mid-course turning and local adjustment; (e) Local adjustment near obstacles; (f) Exiting obstacle avoidance and continuing forward; (g) Approaching the goal region; (h) Entering the goal vicinity with fine adjustment; (i) Reaching the goal point.
Sensors 25 06181 g006
Table 1. Key parameters of the improved ACO.
Table 1. Key parameters of the improved ACO.
SymbolMeaningValue
m Number of ants20
α Pheromone importance1.5
β Heuristic importance0.5
ρ Evaporation rate0.30
Q Pheromone deposit constant40
t max Maximum iterations250
C min Minimum safety clearance (cells)1.0
Table 2. Performance comparison across ACO variants.
Table 2. Performance comparison across ACO variants.
MethodACOASACSRASEASOurs
Best iteration1016223
Avg. path length30.9733.9934.2934.0334.7729.49
Runtime (s)4.4955.03916.845.37114.361.24
Smoothed×××××
Note: √ indicates that path smoothing is applied; × indicates no smoothing.
Table 3. Statistical results of different methods (mean ± std; 95% CIs in parentheses).
Table 3. Statistical results of different methods (mean ± std; 95% CIs in parentheses).
MethodSuccess ↑Path Length ↓ (m)Min Clearance ↑ (m)Goal Time ↓ (s)
ACO + DWA0.88 (0.85–0.90)30.1 ± 5.4 (28.4–31.8)0.46 ± 0.10 (0.42–0.50)118.2 ± 12.3 (113.7–122.7)
AS + DWA0.90 (0.88–0.92)29.6 ± 5.1 (28.0–31.2)0.48 ± 0.10 (0.44–0.52)116.0 ± 11.9 (111.7–120.3)
ACS + DWA0.92 (0.90–0.94)29.1 ± 5.0 (27.5–30.7)0.50 ± 0.10 (0.46–0.54)114.6 ± 11.5 (110.4–118.7)
RAS + DWA0.92 (0.90–0.94)28.9 ± 4.9 (27.3–30.5)0.51 ± 0.10 (0.47–0.55)114.1 ± 11.2 (110.0–118.2)
Ours0.94 (0.92–0.95)28.3 ± 4.8 (26.8–29.8)0.57 ± 0.10 (0.53–0.61)112.2 ± 10.8 (108.4–116.0)
Note: ↑ indicates that a larger value is better, whereas ↓ indicates that a smaller value is better.
Disclaimer/Publisher’s Note: The statements, opinions and data contained in all publications are solely those of the individual author(s) and contributor(s) and not of MDPI and/or the editor(s). MDPI and/or the editor(s) disclaim responsibility for any injury to people or property resulting from any ideas, methods, instructions or products referred to in the content.

Share and Cite

MDPI and ACS Style

Xue, Y.; Wang, L.; He, B.; Yang, S.; Zhao, Y.; Xu, X.; Hou, J.; Li, L. A Hybrid Ant Colony Optimization and Dynamic Window Method for Real-Time Navigation of USVs. Sensors 2025, 25, 6181. https://doi.org/10.3390/s25196181

AMA Style

Xue Y, Wang L, He B, Yang S, Zhao Y, Xu X, Hou J, Li L. A Hybrid Ant Colony Optimization and Dynamic Window Method for Real-Time Navigation of USVs. Sensors. 2025; 25(19):6181. https://doi.org/10.3390/s25196181

Chicago/Turabian Style

Xue, Yuquan, Liming Wang, Bi He, Shuo Yang, Yonghui Zhao, Xing Xu, Jiaxin Hou, and Longmei Li. 2025. "A Hybrid Ant Colony Optimization and Dynamic Window Method for Real-Time Navigation of USVs" Sensors 25, no. 19: 6181. https://doi.org/10.3390/s25196181

APA Style

Xue, Y., Wang, L., He, B., Yang, S., Zhao, Y., Xu, X., Hou, J., & Li, L. (2025). A Hybrid Ant Colony Optimization and Dynamic Window Method for Real-Time Navigation of USVs. Sensors, 25(19), 6181. https://doi.org/10.3390/s25196181

Note that from the first issue of 2016, this journal uses article numbers instead of page numbers. See further details here.

Article Metrics

Back to TopTop