1. Introduction
With the improvement and refinement of unmanned surface vehicle (USV) systems, the application of multiple USVs is gradually expanding in the tasks with increasing complexity and scale. The execution of tasks by multiple USVs is receiving more and more attention, such as monitoring pollutants [1], water quality detection [2], warehouse logistics [3], mapping [4], and hunting [5]. The path planning for multiple USVs is one of the important foundations and prerequisites for task planning and execution [6].
Recently, there has been progress regarding path planning for USVs in task planning. To reduce computational complexity, some researchers use the Euclidean Distance instead of path planning to construct the cost matrix for task planning, and plan paths after task allocation [7,8,9,10,11], while others study path-planning solutions that reduce complexity. Xia et al. [12] proposed an improved genetic algorithm with the shortest path for the path planning of the USV accessing the task nodes after multi-task assignment, and an artificial potential field function was proposed to avoid USV collision during navigation. Ma et al. [13] proposed the collaborative coverage-improved BA* algorithm (CCIBA*). In the algorithm, coverage path planning for a single vehicle is achieved by task decomposition and level map updating. Then, a multiple-vehicle collaborative behavior strategy was designed for coverage path planning, composed of area division, recall and transfer, area exchange, and recognizing obstacles. Zhao et al. [14] proposed a region division method based on a Voronoi diagram, which divides the region and assigns it to each USV. The improved salp swarm algorithm was used to solve the traditional model predictive control (MPC) for path planning. Yao et al. [15] used the bioinspired neural network to plan the standard path of a single USV for obstacle avoidance between the start point and destination. Then, based on the result of the neural activity values, the cost matrix of the Hungarian algorithm was built and modified for task assignment among multi-USVs. Yu et al. [16] proposed the improved Hungarian algorithm used for multi-target allocation and a virtual field RRT* algorithm to solve the problem of path planning for multi-USVs in space-varying ocean currents. Pei et al. [17] proposed an improved Dyna-Q algorithm incorporating heuristic search strategies, the simulated annealing mechanism, and the reactive navigation principle into Q-learning based on the Dyna architecture for robots in the grid map. A novel action-selection strategy combining the ε-greedy policy with the cooling schedule control is presented to tackle the exploration–exploitation dilemma and enhance the performance of global searching, the convergence property, and learning efficiency for path planning. Zhang et al. [18] proposed a new path-planning method that utilizes integrated environment representation and reinforcement learning to control a mobile robot with non-holonomic constraints in unknown dynamic environments. With the control algorithm presented, the novel approach enables one to find the optimal path to the target efficiently and avoid collisions without the shapes of the obstacles or even any information about the obstacles’ velocities. Wu et al. [19] proposed a novel deep neural network (DNN)-based method for real-time online path planning, including an online three-dimensional path planning network to learn 3D local path planning policies and a path planning framework to realize near-optimal real-time online path planning.
Most research focuses on reducing the complexity of path planning for single USVs. However, a large number of USVs and more possible allocation schemes result in a lot of paths that need to be planned with global centralized computing for large-scale and complex task planning. When the number of USVs is , the computational complexity is usually as high as , as paths need to be planned from all different start points to all different target points. When the number of USVs is large, the calculation time of traditional path-planning algorithms will be too long. Therefore, the complexity of the path planning of multiple USVs needs to be reduced [20], as shown in Table 1.
The main contributions in this paper can be summarized as follows:
A low-complexity path-planning algorithm (LCPP) for multiple USVs is proposed based on the visibility graph method, which reduces the computational complexity from to .
The parameters of the adaptive line-of-sight (ALOS) guidance algorithm are optimized using the simulated annealing algorithm to enhance the safety of each USV traveling along the edge of obstacles.
The remainder of this paper is organized as follows. Section 2 formulates and analyzes the path planning for multiple USVs in task planning. Section 3 presents the low-complexity path planning algorithm (LCPP) and ALOS with the optimized parameter. The results of simulation and comparison are presented in Section 4, followed by conclusions in Section 5.
2. Problem Modeling
The frequently used notations are shown in Table 2.
On a two-dimensional sea chart, the position of the USV can be represented by . represents the planned path from the start point to the target point , and is the path parameter, which can be either the length variable of a straight path or the angle variable of a curved path. The selection of path variables depends on whether the path is a straight line or a curve. is constrained by the motion constraint of the USV and safety constraint related to obstacles. The path planning for multiple USVs is from USVs at start points to target points, as shown in (1).
(1)
The USV motion constraint refers to the fact that the rudder angle , the rudder angle rate , and the heading rate are less than , , and , respectively, as shown in (2).
(2)
In path planning, the length of the path taken per unit of time is the step size . Based on the minimum turning radius in the USV motion, the relationship between the step size (or the USV speed ) and the maximum heading rate is shown in (3) and Figure 1.
(3)
The security constraint is used to avoid obstacles that appear on the route and maintain a safe distance from them. The obstacle is represented by a polygon consisting of multiple endpoints . It is necessary to ensure that the USV adjusts its heading to avoid obstacles within a safe distance, so the distance from the unmanned ship to the obstacle is larger than the safe distance from the obstacle and larger than the minimum turning radius , as shown in (4) and Figure 2.
(4)
3. Path Planning with Low-Complexity and Optimized Guidance in Task Planning
The flow chart for the algorithms is shown in Figure 3.
3.1. LCPP for Path Planning of Multiple USVs
The visibility graph method (VG) takes the start point , target point , and vertices of polygonal obstacles as the vertices, connects these vertices to each other, and preserves the lines that do not cross obstacles as visible edges [21]. In Figure 4, the paths are planned from the start point to the target point using VG in an area with two obstacles. The gray rectangle represents obstacles and the blue line segment represents the planned path.
The key for VG is to determine whether the line between any two vertices passes through an obstacle. It can directly detect whether the line between any two vertices passes through an obstacle or simplify the judgment by using the following methods [21]: (1) the line between adjacent vertices of the same obstacle does not pass through the obstacle, and the line between non-adjacent vertices of the same convex obstacle passes through the obstacle; (2) the determination of whether the line connecting the vertices of different obstacles passes through an obstacle can be transformed into determining whether its vertex line intersects with the edges that make up the obstacle.
LCPP is shown in Algorithm 1, as a low-complexity path-planning algorithm for multiple USVs based on VG.
In order to improve the path safety of USVs and reduce the computational complexity of planning paths and subsequent screening of the shortest path, LCPP adds safety boundaries and reduces the number of planned paths based on VG. The main purpose of LCPP is to construct the safety boundary of obstacles and the path between the starting point, target point, and obstacles. The path of LCPP can be divided into the following three types:
-
(1). The path along the safety boundary of obstacles. The safety boundary of the obstacle vertex is represented by a circular arc and is tangential to the safety boundary of the connected straight line.
As shown in Figure 5, the arc is the safe boundary of the vertex , and the safe distance is . In the figure, the arcs , , and and lines , , and are the paths in LCPP.
-
(2). The path from the start point and target point to the vertex of the obstacle. Because the starting and target points are the locations where USVs depart and arrive, the path from the start and target points to the obstacle vertex should be the tangent of the arc from the start and target points to the obstacle vertex. When the tangent point of the tangent falls on the safe arc corresponding to the vertex, the tangent is an optional path. When the USV moves toward the target point, if it needs to update the path, the path from the USV to the obstacle vertex needs to be recalculated because the USV has moved from the start point to a new position. The target point is always stationary, so there is no need to recalculate the path from the target point to the obstacle vertex.
As shown in Figure 6, we take the initial state of the starting point and obstacle safety boundary. We filter the two tangent lines from the start point to the safety circle of in Figure 7, where the tangent point of the route falls on the corresponding safety arc of , and is therefore an optional path. If the tangent point of the route does not fall on the safe arc, it is an abandoned path that cannot be chosen. Similarly, as shown in Figure 8, both the route and the route are nonselectable abandoned paths. The final optional path result is shown in Figure 9, where only route and route are optional paths.
-
(3). The path between the vertices of obstacles. The path between obstacle vertices is based on VG to select feasible theoretical paths, construct a safe circle for obstacle vertices, construct four tangents between vertex safe circles, and observe the position of the tangents. If both tangent points of the tangent line are on the safe arc, then the path is an optional path and other paths are unsafe and unselected abandoned paths. Judging the path between obstacle vertices in this way not only increases the safety of the path but also eliminates nonselectable paths in advance, reducing the filtering range for subsequent selectable path selections.
As shown in Figure 10, the blue line is the optional path extended by the obstacle edge, the purple arc is the safety arc extended by the obstacle vertex, and the yellow line is the four tangent lines between the corresponding safety circles of the vertex and . Only tangents with all tangent points on the safe arc are optional paths, so based on the positions of the eight tangent points corresponding to the four tangents, only route is an optional path. Two obstacles each have four vertices. If the vertices of the same obstacle are also judged, 28 calculations are required, and there is no need to use tangents to judge the vertices themselves. As shown in Figure 11, LCPP has four selectable paths between two obstacle vertices, while VG corresponds to six paths. In comparison, the improved selectable paths are safer and have fewer options, which is beneficial for reducing the filtering range in subsequent path selection.
In theory, the complexity of LCPP is related to the number of USVs and the number of vertices of obstacles. However, in map-based path planning, the number of vertices of obstacles is usually fixed. Therefore, in environments where only fixed obstacles exist, LCPP for path planning of multiple USVs can be regarded as only related to the number of USVs.
The path planning for multiple USVs in task planning is to plan the paths of each USV to each target point, which requires planning paths, and the computational complexity is . However, according to the calculation process of LCPP, the path between obstacle vertices only needs to be calculated once, the path from start points to obstacles needs to be planned times, and the path from target points to obstacles needs to be planned times. Therefore, the planning complexity of LCPP is only . In the path planning of a large number of USVs, the lower the complexity, the better. Therefore, LCPP is a better low-complexity path-planning algorithm than other algorithms for multiple USVs in task planning.
The initial environment for comparing LCPP and VG is shown in Figure 12. The calculation results of VG are shown in Figure 13, where the green lines represent the path from the start point to the vertex of the obstacle, with five lines. The blue lines represent the path from the target point to the vertex of the obstacle, with five lines. The red straight line is the path from the vertex of the obstacle to the vertex of the obstacle, with 39 lines.
As shown in Figure 14, we construct safety boundaries for the four obstacles on the map. The light blue straight line is the straight part of the obstacle safety boundary, and the purple arc is the curved part of the safety boundary. As shown in Figure 15 and Figure 16, there are 10 optional paths starting from the starting point, and 4 remaining paths. As shown in Figure 17 and Figure 18, there are 10 optional paths starting from the target point, and 4 remaining paths. By judging the paths between all obstacle vertices, 20 paths from obstacle vertices to obstacle vertices can be obtained, represented by the red lines shown in Figure 19.
Since the Dijkstra algorithm calculates the weights (path lengths) from the start point to all nodes in the graph, it can calculate the shortest path from one start point to target points at a time. The path planning for multiple USVs in task planning is to plan the paths of USVs to target points, usually requiring planning paths. However, the Dijkstra algorithm only needs to be calculated times, and the computational complexity is , as shown in Figure 20 and Figure 21.
There are 16 paths from each starting point to each target point. The paths from the same starting point to all target points are calculated each time using the Dijkstra algorithm, as shown in Figure 22, Figure 23, Figure 24 and Figure 25.
3.2. ALOS with the Optimized Parameter
The LOS guidance law [22] is based on the lookahead distance and projection, as shown in Figure 26.
In the process of guidance, we only need to control the heading of the USV to the desired heading of LOS to ensure the cross-track error is equal to 0, as shown in (5) and (6). is the angle of the path relative to the true north. is the sideslip angle. is the desired angle of LOS to minimize the cross-track error.
(5)
(6)
The desired path consists of a series of path points . and form a straight path, can be calculated as shown in (7). In the curve guidance, can be calculated, as shown in (8), for any point on the desired path [23].
(7)
(8)
The desired point of LOS is . According to the geometric relationship, the lookahead distance , cross-track error , and can be calculated, as shown in (9) and (10).
(9)
(10)
In the ALOS with the lookahead distance [24,25], the steady-state error is zero. in (11) can be adjusted to reduce the maximum error and convergence time . and are the maximum and minimum lookahead distances and is the natural constant. The maximum error corresponds to the safety of the USV, and the convergence time corresponds to controllability. Therefore, it is necessary to find a suitable based on the specific weight function and the optimization algorithm to reduce the maximum error and convergence time .
(11)
The important parameters of the USV trajectory after guidance include the maximum error , the steady state error , and the convergence time , as shown in Figure 27 and (12). When the USV trajectory is between the safe boundary and the obstacle, is negative, indicating more danger. Error outside the safe boundary is relatively safe. In the figure, the trajectory is more dangerous than the trajectory .
(12)
Although ALOS can eliminate steady-state errors in straight paths, it may not be possible to completely eliminate steady-state errors in curved paths due to the rapid switching of desired path points. By changing the desired path, the steady-state error can be reduced, and the actual trajectory can be stabilized at the desired path, as shown in Figure 28. The desired path is changed to , so that the trajectory is exactly stable on the originally expected path . Therefore, the steady-state error can be reduced by changing the desired path when designing the desired path.
The algorithm for calculating the evaluation parameter is shown in Algorithm 2.
Algorithm 2. Calculate evaluation parameter | |
Input: , USV motion model , USV control algorithm , LOS algorithm , weighting function , end time of LOS , initial position , initial speed , and initial heading of USV, desired path , , | |
Output: evaluation parameter | |
1: | ; |
2: | While |
3: | ; // track error |
4: | ; // desired heading |
5: | ; // desired rudder angle |
6: | ; // USV travels |
7: | ; |
8: | End |
9: | ); |
10: | ; |
In (11), in ALOS is a single variable, so a simple and flexible simulated annealing algorithm is suitable for determining of the formula, as shown in Algorithm 3.
Algorithm 3. Parameter selection of LOS using Simulated Annealing | |
Input: Initial temperature , final temperature , attenuation coefficient , initial solution , length of Markov chain , random function , | |
Output: Best solution | |
1: | ; ; ; ; |
2: | While && |
3: | ; |
4: | If |
5: | ; |
6: | Else if |
7: | ; |
8: | End |
9: | |
10: | ; |
11: | End |
4. Simulation
4.1. LCPP for Path Planning of Multiple USVs
LCPP proposed in this paper is compared with the A * algorithm [26], the Fast Marching Method (FMM) [7,9], the Rapidly Exploring Random Tree algorithm (RRT) [27], the Bidirectional Rapidly Exploring Random Tree algorithm (Bi RRT) [28], the Probabilistic Roadmap algorithm (PRM) [29], the Gradient Descent Genetic Algorithm (GA/GD) [30], and Ant Colony Optimization (ACO) [31]. The algorithms used for comparison in the simulation are shown in Table 3.
The path planning for multiple USVs in task planning is composed of path planning for the single USV, so the calculation time of the single USV is first analyzed, and then the calculation time and path length of multiple USVs are compared.
-
(1). Calculation time and path length of path planning for the single USV
Figure 29 and Figure 30 show the initial maps and the path using LCPP. In Figure 31, Figure 32, Figure 33 and Figure 34, paths are planned using A*1, A*2, and A*3. Figure 35 and Figure 36 show the potential field maps constructed by FMM from the start point to the target point and the paths planned based on potential field gradient descent. Figure 37, Figure 38, Figure 39, Figure 40, Figure 41 and Figure 42 show the random exploration process and planned paths using RRT, Bi RRT, and PRM in the map. Figure 43 and Figure 44 show the paths planned using GA/GD and ACO. The calculation time of these algorithms is shown in Table 4.
In the figure and table, the LCPP proposed in this paper has a shorter path length compared to other algorithms, and constructing reusable paths between obstacles results in a longer initial calculation time (static obstacles mean the path between obstacles is calculated only once). However, as the number of USVs increases, the calculation time for the same start point increases less, indicating that LCPP is suitable for scenarios with a large number of USVs.
In other path-planning algorithms, the A * algorithm has lower calculation time and path distance values. The FMM plans a shorter path and constructs a potential field map covering the entire map, which takes a longer calculation time. The RRT has a longer calculation time and path length than the Bi-RRT and PRM. GA/GD and ACO have relatively longer calculation times and path lengths according to the population size and iteration times.
-
(2). Calculation time and path length of path planning for multiple USVs.
The calculation time of 10 algorithms for path planning from 1 USV (1 path) to 50 USVs (2500 paths) is shown in Figure 45. Among them, the calculation times of FMM, RRT, Bi RRT, GA/GD, and ACO are too long. Therefore, the calculation time of LCPP, A*1, A*2, A*3, and PRM, which are less time-consuming, is further enlarged and compared, as shown in Figure 46.
In the figure, the calculation time of LCPP increases linearly, and the path-planning complexity is only . The computation time of other algorithms increases exponentially, and their path planning complexity is . Although LCPP initially takes some time to construct the path between obstacles (static obstacles mean the path between obstacles is calculated only once), as the number of USVs increases (such as in Figure 46, where the number of USVs is greater than 14), the calculation time of LCPP will eventually be less than other algorithms.
The average lengths of the paths planned by 10 algorithms are shown in Figure 47. LCPP has the shortest path length.
4.2. ALOS with the Optimized Parameter
The parameters of ALOS need to be selected based on the motion model and control algorithm of the USV. The data of the USV in the simulation is shown in Table 5.
The simplified dynamic model of the USV [32] is established in (13). The mass matrix parameters of the USV can be obtained as follows: , , and . The damping matrix parameters of the USV after interpolation and adjustment are as follows: , , and .
(13)
The thrust generated by the thruster is based on the reference of the Wageningen B-Screw Series [33] according to the propeller speed. The thrust of the USV in each direction [34] is shown in (14), where .
(14)
The initial speed of the USV is 1 m/s. In the LOS, and are set to 6 times and 3 times the length of the USV, respectively. The control algorithm for USV is PID, with the input of and the output of the rudder angle . The relevant parameters are , , and .
The key parameters for the Simulated Annealing algorithm are as follows: the initial temperature is 100; the final temperature is ; and the random function is a standard normal distribution; the mean is 0; the standard deviation is 0.1; the initial solution is 0.01; the attenuation coefficient is 0.95; and the maximum iteration is 1000. The weight function is designed as shown in (15).
(15)
-
(1). Trajectory and cross-track error of the straight desired path
In the simulation of the straight desired path, the initial position is . The points of the desired path (DP) are and . We add the lateral time-varying disturbance velocity , where is the speed of the USV and is the simulation time. The comparison results between ALOS with the optimized parameter (OP-ALOS) and guidance algorithms of Fossen and Wan are shown in Figure 48, Figure 49, Figure 50 and Figure 51.
Due to significant time-varying disturbances, the cross-track errors of USVs have not remained stable, and the corresponding stability errors and convergence time are invalid. The maximum errors corresponding to the five trajectories of OP-ALOS and Fossen’s algorithm are 0.1659, 0.2349, 0.2757, 0.4392, and 0.6001, with relatively small differences. The maximum errors corresponding to the five trajectories of OP-ALOS and Wan’s algorithm are 0.2871, 0.3186, 0.2757, 0.2121, and 0.2966. All maximum errors are positive, indicating that the USV is always on the same side as the start point relative to the desired path. The maximum error of OP-ALOS is 0.2757, which is relatively small, proving its effectiveness in time-varying disturbances.
-
(2). Trajectory and cross-track error of the curve desired path
In the simulation of the curve desired path, the comparison results between ALOS with the optimized parameter (OP-ALOS) and guidance algorithms of Fossen and Wan are shown in Figure 52, Figure 53, Figure 54 and Figure 55.
Due to significant time-varying disturbances, the trajectory errors of USVs have not remained stable, and the corresponding stability errors and convergence time are invalid. The maximum errors corresponding to the five trajectories of OP-ALOS and Fossen’s algorithm are −1.4597, −1.5166, 0.0110, −1.5332, and −1.5763, with relatively small differences. The maximum errors corresponding to the five trajectories of OP-ALOS and Wan’s algorithm are −0.1291, −0.1301, 0.0110, −0.1897, and −0.1613. Among them, the four maximum errors are all negative, indicating that the USV is always on the opposite side of the desired path from the start point, which is more dangerous. The maximum error of OP-ALOS is 0.0110, with a relatively small absolute value, which proves the effectiveness of the optimized guidance algorithm in time-varying disturbances.
5. Conclusions
In this paper, LCPP is proposed as a low-complexity path-planning algorithm for multiple USVs based on the visibility graph method. While ensuring a shorter path distance, the algorithm outperforms the comparison algorithm in terms of computational complexity, reducing the original path planning computational complexity to . When the number of USVs is large, the LCPP algorithm requires less calculation time and maintains a shorter path distance. OP-ALOS is proposed as an algorithm of ALOS with optimized parameters to ensure the USV approaches obstacle edges quickly and maintains a specific safe distance from the obstacles. Even in time-varying disturbances, this algorithm can also reduce the maximum error. The effectiveness of the algorithm has been verified through simulation. In addition, this algorithm can only be used in static and known environments. In the future, we will investigate more USVs working together to explore unknown environments and reach target points.
Conceptualization, Z.H.; Methodology, Z.H.; Software, P.W.; Validation, P.W., Z.X. and D.K.; Formal analysis, P.W.; Investigation, K.X.; Resources, Z.X. and D.K.; Data curation, K.X.; Writing—original draft, Z.H.; Writing—review & editing, Z.H.; Supervision, K.X.; Project administration, K.X. All authors have read and agreed to the published version of the manuscript.
Not applicable.
Not applicable.
Data are contained within the article.
The authors declare no conflict of interest.
Footnotes
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.
Differences in path planning for multiple USVs in task planning.
The Traditional Path-Planning Algorithms | A Low-Complexity Path Planning | |
---|---|---|
The planned path | Plan | Plan possible paths and find the shortest path |
Computational complexity | | Plan possible paths: |
Calculation time | Exponential growth | Linear growth |
Frequently used notations.
Notations | The Meaning of Notations |
---|---|
| Position of the start point |
| Position of the target point |
| Position of the USV |
| Position of edge points of the obstacle |
| Position of the desired path point |
Comparison algorithms.
Algorithm | Note |
---|---|
LCPP | Based on VG and using Dijkstra algorithm. |
A*1 | The grid is 50 m × 50 m |
A*2 | The grid is 25 m × 25 m. |
A*3 | The grid is 10 m × 10 m. |
FMM | Based on potential field. The minimum potential field unit is 10 m × 10 m, and step length is 80 m. |
RRT | Initial step length is 100 m. The minimum step length is 80 m. |
Bi-RRT | Step length is 80 m. |
PRM | The number of key nodes is 20. |
GA/GD | Population size 100, iteration times 1000. |
ACO | Population size 100, iteration times 1000. |
Calculation time and path length.
Algorithm | The First Calculation | The Second Calculation | The Third Calculation | |||
---|---|---|---|---|---|---|
Calculation Time (s) | Path Length (m) | Calculation Time (s) | Path Length (m) | Calculation Time (s) | Path Length (m) | |
LCPP | 215.169 | 2568.2 | The same start point: 0.269 | 2568.2 | The same start point: 0.721 | 2568.2 |
A*1 | 1.720 | 3026.3 | 1.494 | 3026.3 | 1.392 | 3026.3 |
A*2 | 1.847 | 3026.3 | 1.826 | 3026.3 | 1.827 | 3026.3 |
A*3 | 2.686 | 3026.3 | 2.652 | 3026.3 | 2.641 | 3026.3 |
FMM | 19.981 | 2826.0 | 19.362 | 2826.0 | 21.035 | 2826.0 |
RRT | 12.570 | 4111.0 | 12.060 | 3831.9 | 9.799 | 3447.6 |
Bi-RRT | 6.137 | 3267.2 | 4.588 | 3431.0 | 4.366 | 3366.3 |
PRM | 1.513 | 3084.2 | 1.533 | 3032.2 | 1.716 | 3273.8 |
GA/GD | 74.840 | 3548.0 | 91.038 | 3744.0 | 91.408 | 3664.0 |
ACO | 113.545 | 3090.1 | 101.123 | 3033.6 | 105.098 | 3123.3 |
The data of the USV.
The Data of the USV | Value |
---|---|
Mass | |
Length | |
Width | |
Sea water density | |
Distance between thrusters | |
Propeller diameter | |
Propeller speed | |
Rudder angle | |
Rudder rate | |
References
1. Salima, B.; Assia, B.; Ghalem, B. HA-UVC: Hybrid approach for unmanned vehicles cooperation. Multiagent Grid Syst.; 2020; 16, pp. 1-45. [DOI: https://dx.doi.org/10.3233/MGS-200319]
2. Zhong, J.B.; Li, B.Y.; Li, S.X.; Yang, F.; Li, P.; Cui, Y. Particle swarm optimization with orientation angle-based grouping for practical unmanned surface vehicle path planning. Appl. Ocean Res.; 2021; 111, 102658. [DOI: https://dx.doi.org/10.1016/j.apor.2021.102658]
3. Dvorak, M.; Dolezel, P.; Stursa, D.; Chouai, M. Genetic Algorithm-Based Task Assignment for Fleet of Unmanned Surface Vehicles in Dynamically Changing Environment. Cybern. Syst.; 2023; 55, pp. 1314-1331. [DOI: https://dx.doi.org/10.1080/01969722.2023.2240645]
4. Zwolak, K.; Wigley, R.; Bohan, A.; Zarayskaya, Y.; Bazhenova, E.; Dorshow, W.; Sumiyoshi, M.; Sattiabaruth, S.; Roperez, J.; Proctor, A. et al. The Autonomous Underwater Vehicle Integrated with the Unmanned Surface Vessel Mapping the Southern Ionian Sea. The Winning Technology Solution of the Shell Ocean Discovery XPRIZE. Remote Sens.; 2020; 12, 1344. [DOI: https://dx.doi.org/10.3390/rs12081344]
5. Wu, G.X.; Xu, T.T.; Sun, Y.S.; Zhang, J. Review of multiple unmanned surface vessels collaborative search and hunting based on swarm intelligence. Int. J. Adv. Robot. Syst.; 2022; 19, 17298806221091885. [DOI: https://dx.doi.org/10.1177/17298806221091885]
6. Xing, B.W.; Yu, M.J.; Liu, Z.C.; Tan, Y.; Sun, Y.; Li, B. A Review of Path Planning for Unmanned Surface Vehicles. J. Mar. Sci. Eng.; 2023; 11, 1556. [DOI: https://dx.doi.org/10.3390/jmse11081556]
7. Liu, Y.C.; Bucknall, R. Efficient multi-task allocation and path planning for unmanned surface vehicle in support of ocean operations. Neurocomputing; 2018; 275, pp. 1550-1566. [DOI: https://dx.doi.org/10.1016/j.neucom.2017.09.088]
8. Chen, X.Y.; Zhang, P.; Du, G.L.; Li, F. Ant Colony Optimization Based Memetic Algorithm to Solve Bi-Objective Multiple Traveling Salesmen Problem for Multi-Robot Systems. IEEE Access; 2018; 6, pp. 21745-21757. [DOI: https://dx.doi.org/10.1109/ACCESS.2018.2828499]
9. Liu, Y.C.; Song, R.; Bucknall, R.; Zhang, X. Intelligent multi-task allocation and planning for multiple unmanned surface vehicles (USVs) using self-organising maps and fast marching method. Inf. Sci.; 2019; 496, pp. 180-197. [DOI: https://dx.doi.org/10.1016/j.ins.2019.05.029]
10. Ning, Q.; Tao, G.P.; Chen, B.C.; Lei, Y.; Yan, H.; Zhao, C. Multi-UAVs trajectory and mission cooperative planning based on the Markov model. Phys. Commun.; 2019; 35, 100717. [DOI: https://dx.doi.org/10.1016/j.phycom.2019.100717]
11. Lusk, P.C.; Cai, X.Y.; Wadhwania, S.; Paris, A.; Fathian, K.; How, J.P. A Distributed Pipeline for Scalable, Deconflicted Formation Flying. IEEE Robot. Autom. Lett.; 2020; 5, pp. 5213-5220. [DOI: https://dx.doi.org/10.1109/LRA.2020.3006823]
12. Xia, G.Q.; Sun, X.X.; Xia, X.M. Multiple Task Assignment and Path Planning of a Multiple Unmanned Surface Vehicles System Based on Improved Self-Organizing Mapping and Improved Genetic Algorithm. J. Mar. Sci. Eng.; 2021; 9, 556. [DOI: https://dx.doi.org/10.3390/jmse9060556]
13. Ma, Y.; Zhao, Y.J.; Li, Z.X.; Bi, H.; Wang, J.; Malekian, R.; Sotelo, M.A. CCIBA*: An Improved BA* Based Collaborative Coverage Path Planning Method for Multiple Unmanned Surface Mapping Vehicles. IEEE Trans. Intell. Transp. Syst.; 2022; 23, pp. 19578-19588. [DOI: https://dx.doi.org/10.1109/TITS.2022.3170322]
14. Zhao, Z.Y.; Zhu, B.; Zhou, Y.; Yao, P.; Yu, J. Cooperative Path Planning of Multiple Unmanned Surface Vehicles for Search and Coverage Task. Drones; 2023; 7, 21. [DOI: https://dx.doi.org/10.3390/drones7010021]
15. Yao, P.; Wu, K.Q.; Lou, Y.T. Path Planning for Multiple Unmanned Surface Vehicles Using Glasius Bio-Inspired Neural Network With Hungarian Algorithm. IEEE Syst. J.; 2022; 17, pp. 3906-3917. [DOI: https://dx.doi.org/10.1109/JSYST.2022.3222357]
16. Yu, J.B.; Chen, Z.H.; Zhao, Z.Y.; Yao, P.; Xu, J. A traversal multi-target path planning method for multi-unmanned surface vessels in space-varying ocean current. Ocean Eng.; 2023; 278, 114423. [DOI: https://dx.doi.org/10.1016/j.oceaneng.2023.114423]
17. Pei, M.; An, H.; Liu, B.; Wang, C. An Improved Dyna-Q Algorithm for Mobile Robot Path Planning in Unknown Dynamic Environment. IEEE Trans. Syst. Man Cybern. Syst.; 2022; 52, pp. 4415-4425. [DOI: https://dx.doi.org/10.1109/TSMC.2021.3096935]
18. Zhang, J. Path Planning for a Mobile Robot in Unknown Dynamic Environments Using Integrated Environment Representation and Reinforcement Learning. Proceedings of the 2019 Australian & New Zealand Control Conference (ANZCC); Auckland, New Zealand, 27–29 November 2019; pp. 258-263.
19. Wu, K.; Wang, H.; Esfahani, M.A.; Yuan, S. Achieving Real-Time Path Planning in Unknown Environments Through Deep Neural Networks. IEEE Trans. Intell. Transp. Syst.; 2022; 23, pp. 2093-2102. [DOI: https://dx.doi.org/10.1109/TITS.2020.3031962]
20. Qin, Y.M.; Liu, J.X.; Shao, X.; Duan, S. Rapid path planning for Unmanned Surface Vessels. Proceedings of the SPIE 11th International Symposium on Multispectral Image Processing and Pattern Recognition (MIPPR)—Remote Sensing Image Processing, Geographic Information Systems, and Other Applications, 2019; Wuhan, China, 14 February 2020; Volume 11432, pp. 279-285.
21. Lozano-Pérez, T.; Wesley, M.A. An Algorithm for Planning Collision Free Paths Among Polyhedral Obstacles. Commun. ACM; 1979; 22, pp. 560-570. [DOI: https://dx.doi.org/10.1145/359156.359164]
22. Lekkas, A.M.; Fossen, T.I. Line-of-Sight Guidance for Path Following of Marine Vehicles. Adv. Mar. Robot.; 2013; 5, pp. 63-92.
23. Fossen, T.I. Handbook of Marine Craft Hydrodynamics and Motion Control. Guidance Systems; John Wiley & Sons: Hoboken, NJ, USA, 2011; pp. 240-284.
24. Lekkas, A.M.; Fossen, T.I. Integral LOS Path Following for Curved Paths Based on a Monotone Cubic Hermite Spline Parametrization. IEEE Trans. Control. Syst. Technol.; 2014; 22, pp. 2287-2301. [DOI: https://dx.doi.org/10.1109/TCST.2014.2306774]
25. Fossen, T.I.; Pettersen, K.Y. On uniform semiglobal exponential stability (USGES) of proportional line-of-sight guidance laws. Automatica; 2014; 50, pp. 2912-2917. [DOI: https://dx.doi.org/10.1016/j.automatica.2014.10.018]
26. Liu, L.S.; Wang, B.; Xu, H. Research on Path-Planning Algorithm Integrating Optimization A-Star Algorithm and Artificial Potential Field Method. Electronics; 2022; 11, 3660. [DOI: https://dx.doi.org/10.3390/electronics11223660]
27. Zhang, Z.; Wu, D.F.; Gu, J.D.; Li, F. A Path-Planning Strategy for Unmanned Surface Vehicles Based on an Adaptive Hybrid Dynamic Stepsize and Target Attractive Force-RRT Algorithm. J. Mar. Sci. Eng.; 2019; 7, 132. [DOI: https://dx.doi.org/10.3390/jmse7050132]
28. Zhang, Z.C.; Wu, H.B.; Zhou, H.; Song, Y.; Chen, Y.; He, K.; Gao, J. Recovery Path Planning for Autonomous Underwater Vehicles Using Constrained Bi-RRT*-Smart Algorithms. Proceedings of the OCEANS Conference; Limerick, Ireland, 5–8 June 2023.
29. Liu, C.Y.; Xie, S.B.; Sui, X.; Huang, Y.; Ma, X.; Guo, N.; Yang, F. PRM-D* Method for Mobile Robot Path Planning. Sensors; 2023; 23, 3512. [DOI: https://dx.doi.org/10.3390/s23073512] [PubMed: https://www.ncbi.nlm.nih.gov/pubmed/37050570]
30. Mustafa, Y.A.; Ali, E.S.; Osman, T.E.; Khalifa, O.O.; Mohamed, Z.O.; Saeed, R.A.; Saeed, M.M. Multi-Drones Energy Efficient Based Path Planning Optimization using Genetic Algorithm and Gradient Decent Approach. Proceedings of the 9th International Conference on Mechatronics Engineering (ICOM); Kuala Lumpur, Malaysia, 13–14 August 2024; pp. 171-176.
31. Hu, J.H.; Er, M.J.; Liu, T.H.; Wang, S. A Hybrid Algorithm Based on Ant Colony and Genetic Algorithm for AUV Path Planning. Proceedings of the 2nd Conference on Fully Actuated System Theory and Applications (CFASTA); Qingdao, China, 14–16 July 2023; pp. 888-893.
32. Mu, D.; Wang, G.; Fan, Y.; Sun, X.; Qiu, B. Modeling and Identification for Vector Propulsion of an Unmanned Surface Vehicle: Three Degrees of Freedom Model and Response Model. Sensors; 2018; 18, 1889. [DOI: https://dx.doi.org/10.3390/s18061889]
33. Helma, S. Surprising Behaviour of the Wageningen B-Screw Series Polynomials. J. Mar. Sci. Eng.; 2020; 8, 211. [DOI: https://dx.doi.org/10.3390/jmse8030211]
34. Faramin, M.; Goudarzi, R.H.; Maleki, A. Track-keeping observer-based robust adaptive control of an unmanned surface vessel by applying a 4-DOF maneuvering model. Ocean Eng.; 2019; 183, pp. 11-23. [DOI: https://dx.doi.org/10.1016/j.oceaneng.2019.04.051]
You have requested "on-the-fly" machine translation of selected content from our databases. This functionality is provided solely for your convenience and is in no way intended to replace human translation. Show full disclaimer
Neither ProQuest nor its licensors make any representations or warranties with respect to the translations. The translations are automatically generated "AS IS" and "AS AVAILABLE" and are not retained in our systems. PROQUEST AND ITS LICENSORS SPECIFICALLY DISCLAIM ANY AND ALL EXPRESS OR IMPLIED WARRANTIES, INCLUDING WITHOUT LIMITATION, ANY WARRANTIES FOR AVAILABILITY, ACCURACY, TIMELINESS, COMPLETENESS, NON-INFRINGMENT, MERCHANTABILITY OR FITNESS FOR A PARTICULAR PURPOSE. Your use of the translations is subject to all use restrictions contained in your Electronic Products License Agreement and by using the translation functionality you agree to forgo any and all claims against ProQuest or its licensors for your use of the translation functionality and any output derived there from. Hide full disclaimer
© 2025 by the authors. Licensee MDPI, Basel, Switzerland. This article is an open access article distributed under the terms and conditions of the Creative Commons Attribution (CC BY) license (https://creativecommons.org/licenses/by/4.0/). Notwithstanding the ProQuest Terms and Conditions, you may use this content in accordance with the terms of the License.
Abstract
Path planning for multiple unmanned surface vehicles (USVs) in task planning is a high-complexity problem. When the number of USVs is
You have requested "on-the-fly" machine translation of selected content from our databases. This functionality is provided solely for your convenience and is in no way intended to replace human translation. Show full disclaimer
Neither ProQuest nor its licensors make any representations or warranties with respect to the translations. The translations are automatically generated "AS IS" and "AS AVAILABLE" and are not retained in our systems. PROQUEST AND ITS LICENSORS SPECIFICALLY DISCLAIM ANY AND ALL EXPRESS OR IMPLIED WARRANTIES, INCLUDING WITHOUT LIMITATION, ANY WARRANTIES FOR AVAILABILITY, ACCURACY, TIMELINESS, COMPLETENESS, NON-INFRINGMENT, MERCHANTABILITY OR FITNESS FOR A PARTICULAR PURPOSE. Your use of the translations is subject to all use restrictions contained in your Electronic Products License Agreement and by using the translation functionality you agree to forgo any and all claims against ProQuest or its licensors for your use of the translation functionality and any output derived there from. Hide full disclaimer