Ship Formation Algorithm Based on the LeaderFollower Method
Ship Formation Algorithm Based on the LeaderFollower Method
ABSTRACT In recent years, marine engineers have increasingly relied on multiship collaborative work
to complete complex tasks at sea and improve maritime transport efficiency. Ship formation significantly
contributes to the maintenance of stability during multiship-coordinated operations, but establishing the
formation structure while ensuring the safety of each ship remains challenging. Therefore, this study
proposes an improved leader–follower-based formation algorithm as a solution to this issue. First, the fast
marching square method was used for global static path planning. The leader–follower formation control
method then enabled the path tracking of the follower ship to the leader ship. Finally, an improved artificial
potential field method was used for local collision avoidance, and virtual obstacles were added to improve the
situation in which the ship probably entered a local minimum point. The experimental results revealed that the
proposed algorithm could plan a route with time, smoothness, and safety advantages for the formation leader
and quickly form a stable formation. Notably, the ship can quickly initiate collision avoidance operations
when it encounters an obstacle posing a collision risk.
INDEX TERMS Artificial potential field method, fast marching square method, formation of ships,
leader–follower method, local collision, path planning.
but its calculation process is overly complex and memory- the artificial potential field method to realize the local path
intensive, making it unsuitable for large-scale path planning. planning of the ship.
Moreover, the A∗ algorithm is a heuristic algorithm proposed With the maturation of the single ship control theory, Pro-
by Hart et al. [24]; this algorithm is the most effective method fessor Fossen and his team initiated research into multiship
for determining the shortest path in static networks, extend- cooperative formation control in 2002 [34]. Many important
ing Dijkstra’s algorithm. Although the A∗ algorithm has a theoretical and technical advances have been made in the
simple underlying principle and outperforms the Dijkstra study of formation control of surface ships, thanks to the
algorithm, it relies heavily on the heuristic function, resulting collaboration of international navigation and control circles.
in a massive amount of computation, and both algorithms Because maintaining formation stability is crucial for ship
require additional smoothing. Furthermore, James proposed formation, inspired by the behaviors of birds gathering, ant
a numerical method called fast marching to solve the Eikonal colonies, and bee swarms, researchers have proposed var-
equation’s boundary value problem [25]. This method gen- ious formation structures, such as leader–follower, virtual
erates potential fields by simulating the propagation of elec- structure [35], [36], [37], [38], [39], and behavior-based
tromagnetic waves as they travel from their source point to methods [40], [41], [42].
their destination. The potential field simulated by this method Among these formation methods, the formation control
has only one global minimum point, the starting point, and method based on leader-follower method has the advan-
its path is generated by the gradient descent method, which tages of simple principle and easy implementation, which
effectively avoids the problem of a local minimum. Based on is favored by scholars. The leader–follower method adopts
this, the enhanced fast marching square method is suitable for a centralized control structure. The basic concept is to des-
ship tracking due to its excellent smoothness and security. ignate one or more team members as leaders and the rest
The current local path planning algorithms mainly include as followers. The leader can track the desired trajectory
fuzzy logic algorithm [26], [27], artificial potential field and posture, and the follower can communicate with the
method [28], [29], [30], [31], velocity obstacle method [32], leader. Meanwhile, maintaining relative distance, azimuth,
[33] and so on. Guan et al. proposed a ship domain model and attitude consistency with the pilot is essential for achiev-
based on fuzzy logic aimed at providing early warning of ship ing formation control of a particular formation. Ding and
collision risk and a reasonable reference that can be used in Guo [43] studied the surface ship formation problem based
combination with the International Regulation for Preventing on the leader-follower method. By designating one ship in
Collisions at Sea [26]. Shang et al. designed a fuzzy con- a multiship system as the system’s leader and the other
troller to improve the problem of trajectory oscillation, which ships as its followers, the formation problem was viewed
outputs the environment danger factor to adjust the step size as the following and coordination problem of all following
of robot and enhance the trajectory smoothness of robot in ships to the position and direction of the system’s leader.
complex environment [27]. Yang studied the development Liu et al. used control theory to investigate the controllability
process of the obstacle avoidance system for autonomous of a leader–follower multiagent system in switched commu-
vehicles and propose an optimization scheme for the obstacle nication topology and presented the system’s controllability
avoidance algorithm [28]. Chen and Xu proposed a method of conditions in this setting [44]. Ajwad et al. studied the same
removing the shaking state based on a favorable path, and on system based on a continuo–discrete observer and demon-
this basis, visibility graph method is used to optimize the path strated the proposed algorithm’s stability using Lyapunov
of the AUV to avoid obstacles [31]. Wang et al. proposed a theory [45]. Wang et al. also studied the consistency of the
USV autonomous dynamic obstacle avoidance method based aforementioned system under a directed hostile communica-
on the enhanced velocity obstacle method in order to achieve tion topology [46].
path replanning [32]. This paper proposes an improved leader-follower forma-
However, in local path planning algorithms, ships often tion algorithm to establish the formation structure and ensure
work in a partially or completely unknown environment, the safety of the formation. The global static path planning
which requires continuous detection of the surrounding envi- is carried out by the fast marching square method, and it
ronment by sensors. According to the data detected by the is combined with the leader-following method for the first
sensors: the distance, size, shape, etc. between the obstacle time to realize the path tracking from the follower ship to the
and the ship itself, its position, speed, and direction are con- leader ship. Notably, the preceding studies did not consider
stantly adjusted. This obstacle avoidance method requires the the possible obstacles encountered by followers during navi-
performance of the ship’s own sensors to be very powerful, gation. Therefore, this study proposes an improved artificial
and the designed algorithm should be more and more accurate potential field method to solve this problem, enabling the
and practical. The artificial potential field method is a more follower to independently take collision avoidance behavior
mature and effective algorithm, which allows moving objects when collision risk occurs during the trajectory tracking of
to avoid obstacles while considering the motion performance the leader and to return to the team after a collision avoidance
of moving objects. It has the advantages of strong real-time operation.
performance, simple mathematical calculation, smooth path The remainder of this paper is structured as follows.
planning, and easy programming. Therefore, this paper uses Section II introduces the basic concepts and applications of
where (x, y) is the coordinates in the position and pose space Case 2: when T1 ≥ T > T2 , the Eikonal equation can be
of the calculated point, T (x, y) is the time when the interface written as follows:
reaches the point (x, y), and W (x, y) is the local propagation 1
(T − T2 )2 = 2 , (10)
speed of the interface at the point (x, y). Fij
Although the FMM used to solve the Eikonal equation
shares commonalities with the Dijkstra method, the Dijk- where T1 = max(Tx , Ty ), T2 = min(Tx , Ty ).
stra algorithm updates based on Euclidean distance between The solution to this equation is
nodes, whereas the FMM algorithm updates based on the 1
T = T2 + . (11)
approximate partial differential equation obtained from the Fij
simplified Eikonal equation.
Because the other solution of time T is negative, it does not
To use FMM, the space must be discretized. Fig. 1 shows
satisfy the condition and is thus dropped.
a discrete 2D space. The Eikonal equation can be written as
Now, determine whether the solution satisfies the assump-
follows:
tions, i.e., if the following inequality is true:
T − Tx T − Ty 1
max( , 0)2 + max( , 0)2 = 2 , (2) 1
1x 1y Fij T = T2 + ≤ T1 . (12)
Fij
where Tx = min(T(x−1x,y) , T(x+1x,y) ), Ty = min(T(x,y−1y) ,
The solution to this inequality is
T(x,y+1y) ).
Notably, the solution set for time T in this equation can be 1
T1 − T2 ≥ , (13)
obtained as follows: Fij
Algorithm 1 Fast Marching Method Algorithm Description • Step 4: From the ship’s starting point, a gradient descent
Input: The velocity of a point in a 2-dimensional discrete is made across the entire arrival time map, moving
space Fij , toward its target point (the global minimum of the result-
Point set S, Discrete space step size 1h, ing map). By using FMS, a path that incorporates arrival
Output: Time T time, smoothness, and safety is obtained.
1: ∀p ∈ / S, T (p) = +∞
2: for p ∈ S do In this section, FMS solves the global path-planning problem
3: ps = Neighbor(p) and provides the formation leader with the planned path to
4: T (ps) = T (p) + 1h track. Then, the subsequent section will solve the problem of
5: Trial ← ps, Alive ← S how to realize the tracking of the follower to the leader in
6: end for order to maintain formation stability.
7: while Trial ̸ = ∅ do
8: m = min(Trial) III. LEADER–FOLLOWER SHIP FORMATION
9: Alive ← m A. STRUCTURE OF THE SHIP FORMATION
10: ms = Neighbor(m) With the development of ship clustering technology, which
11: for ∀p ∈ S, p ∈/ Alive do was inspired by natural behaviors, such as bird gathering, ant
12: {i, j} = p colonies, and bee swarms, researchers began exploring ways
13: Tx = min(T(i−1h,j) , T(i+1h,j) ) to control multiple smart ships simultaneously, resulting in
14: Ty = min(T(i,j−1h) , T(i,j+1h) ) the creation of ship formation technology. The implemen-
15: if Tx − Ty < 1h Fij then
tation of ship formation technology can increase efficiency
r
2 and performance while addressing the shortcomings of single
Tx +Ty + −(Tx −Ty )2
Fij2 ships, such as inadequate carrying capacity and insufficient
16: T = 2 > Tx
information processing capacity. Simultaneously, the stability
17: else
and safety of ship formation are improving thanks to advance-
18: T = min(Tx , Ty ) + F1ij
ments in computer science and technology, communication
19: end if technology, and navigation technology.
20: T (p) = min{T (p), T } Typical cluster collaborative control technologies include
21: Trail ← p leader–follower, virtual structure, and behavior-based
22: end for methods.
23: return T The virtual structure approach treats the entire system as
a rigid-body structure, with the individuals making up the
formation serving as the rigid body’s reference points with
addressing the path defects generated directly by FMM, fixed relative positions. When the entire body is in motion,
notably that the path is too close to the obstacle and is not each individual can achieve a fixed shape formation motion
smooth. by tracking the corresponding reference points on the rigid
FMS applies the basic FMM twice. body. Group behavior can be easily programmed using this
• Step 1: The environment is modeled similarly to when method, which also yields excellent results in the areas of
FMM is used. Convert the environment into a binary trajectory tracking and formation keeping.
grid. Separate the cells that belong to the barrier and the The fundamental concept underlying the behavioral
cells that correspond to the passable area. method is as follows: first, the agent’s expected basic behav-
• Step 2: By applying FMM for the first time, FMS iors are specified. In general, behaviors include collision
treats each obstacle-marked cell on the map as a wave avoidance, obstacle avoidance, target-directed driving, and
source and simultaneously expands multiple waves. The formation maintenance. When the sensor is stimulated by the
resultant value of each map cell represents the time external environment, it responds based on the sensor’s input
required for the wave to reach the nearest obstacle, information and outputs the response vector as the expected
which is proportional to the obstacle’s distance. The behavior response.
potential diagram obtained from this step is the velocity The benefits of the leader–follower method include a sim-
potential W (x). ple principle, easy implementation, and good stability. As a
• Step 3: Based on the potential diagram W (x), FMM result, this study uses a centralized control structure in which
is executed again from the target point. This time, the one ship acts as the formation leader and the others act as its
target point is treated as the only wave source to ensure a followers.
global minimum. The wave expands across the map until As a global path-planning algorithm, FMS described in
it reaches its initial point. For each cell in the feasible Section II can be used to plot the course of a ship formation’s
region, the wave expansion velocity is extracted from leader. In this section, we will determine how to maintain
the velocity potential diagram W (x) calculated in the the relative distance and azimuth between the follower and
previous step. leader.
1) LAPLACIAN MATRIX
The Laplacian matrix, also known as the admittance matrix,
Kirchhoff matrix, or discrete Laplacian operator, is mainly
used in graph theory. As a matrix representation of a graph,
the Laplacian matrix can reflect the degree of graph con-
nectivity while describing the point–edge relationship in the
graph.
Given a figure G = {V , E}, as shown in Fig. 5, V =
{v1 , v2 , . . . , vn } represents the vertices in the graph, E ⊂ v×v
is the graph edge; the Laplacian matrix is defined as L =
D − A, where D stands for the degree matrix and A is the
adjacency matrix.
The degree matrix is a diagonal matrix whose diagonal
value is the sum of the total number of adjacent nodes that FIGURE 6. Leader–follower multiship formation system.
maintain a communication relationship with each vertex in
the graph. The degree matrix in this graph is
2) APPLICATION OF THE LAPLACIAN MATRIX IN SHIP
FORMATION
2
2
The leader–follower multiship formation system treats each
3 .
ship in the system as a network node and the information
D= (16) transmission link between ships as an edge connecting differ-
3
2 ent nodes. Thus, a multiship system and its communication
2 network can be modeled as a diagram. However, unlike the
undirected graph introduced in Section III, Part B(1), due
The adjacency matrix is a symmetric matrix whose value to the existence of information flow in formation, the ship
on the main diagonal is 0. If a communication relationship formation system is constructed as a directed graph, as shown
exists between points vi and vj , then aij = aji = 1; otherwise, in Fig. 6, where the arrow direction represents the direction
aij = aji = 0. The adjacency matrix is of information transmission.
Given the directed graph G = {V , E}, V =
0 1 1 0 0 0
1 0 1 0 0 0 {v1 , v2 , . . . , vn } represents the vertices in the graph, i.e., N
1 1 0 1 0 0
ships in the system, E ⊂ v × v is the graph edge.
A= . (17) In this digraph, the adjacency matrix A is transformed into
0 0 1 0 1 1
0 0 0 1 0 1 a weight matrix; if vertex v is the starting point of edge E,
then aij = 1, otherwise aij = 0. The degree matrix D
0 0 0 1 1 0
is transformed into an indegree matrix, with the diagonal
Thus, the Laplacian matrix can be written as elements representing the sum of the nodes’ intake degree.
Thus, the weight matrix of the system can be written as
2 −1 −1 0 0 0 follows:
−1
2 1 0 0 0
3 0 0
−1 −1
−1 . 0 0 0 0 0
L =D−A= 0
0 −1 3 −1 −1
1 0 0 0 0
1 1 0 0 0.
0
0 0 −1 2 −1 A= (19)
0 0 0 −1 −1 2 0 1 0 0 0
(18) 0 0 1 1 0
FIGURE 25. Improved artificial potential field method for collision 2) ALGORITHM SIMULATION OF THE IMPROVED ARTIFICIAL
avoidance. POTENTIAL FIELD METHOD IN MULTI-OBSTACLE
ENVIRONMENT
process. At about 12 min, the force balances and falls into the The initial information of the leader and each follower is
position of the local minimum point. At this time, a virtual listed in Table 3. As shown in Fig. 26, the leader is rep-
obstacle is introduced in the left direction of the object (the resented by a black circle, and followers are represented by
red cross in Fig. 25). This virtual obstacle will provide a force circles of other colors.
perpendicular to the direction of travel, so that the resultant The preset obstacles are represented by a cross in Fig. 26.
force of the follower is not zero, and the added virtual obstacle The leader sails following the preplanned path, as stip-
prevents the ship from reentering the local minimum point. ulated in this experiment, to move toward the target point
Finally, at about 14 min, all followers reach the preset (9, 9). The rest of the followers follow the leader in a preset
position and maintain a stable structure with the leader after formation (the two wings are at 60◦ , and the distance between
that. the two adjacent ships on the same side is 0.5 km).
[2] J. Tang, G. Liu, and Q. Pan, ‘‘A review on representative swarm intelligence
algorithms for solving optimization problems: Applications and trends,’’
IEEE/CAA J. Autom. Sinica, vol. 8, no. 10, pp. 1627–1643, Oct. 2021, doi:
10.1109/JAS.2021.1004129.
[3] C. Pan, Z. Zhang, W. Sun, J. Shi, and H. Wang, ‘‘Development of ship
weather routing system with higher accuracy using SPSS and an improved
genetic algorithm,’’ J. Mar. Sci. Technol., vol. 26, no. 4, pp. 1324–1339,
Feb. 2021, doi: 10.1007/s00773-021-00807-z.
[4] P. Zhou, Z. Zhou, Y. Wang, and H. Wang, ‘‘Ship weather rout-
ing based on hybrid genetic algorithm under complicated sea condi-
tions,’’ J. Ocean Univ. China, vol. 22, no. 1, pp. 28–42, Feb. 2023,
doi: 10.1007/s11802-023-5002-1.
[5] W. Zhao, Y. Wang, Z. Zhang, and H. Wang, ‘‘Multicriteria ship route
planning method based on improved particle swarm optimization–genetic
algorithm,’’ J. Mar. Sci. Eng., vol. 9, no. 4, p. 357, Mar. 2021, doi:
10.3390/jmse9040357.
[6] W. Zhao, H. Wang, J. Geng, W. Hu, Z. Zhang, and G. Zhang, ‘‘Multi-
objective weather routing algorithm for ships based on hybrid particle
swarm optimization,’’ J. Ocean Univ. China, vol. 21, no. 1, pp. 28–38,
Feb. 2022, doi: 10.1007/s11802-022-4709-8.
FIGURE 28. The position error curve between the leader and each [7] J. Li, H. Wang, W. Zhao, and Y. Xue, ‘‘Ship’s trajectory planning based
follower.
on improved multiobjective algorithm for collision avoidance,’’ J. Adv.
Transp., vol. 2019, pp. 1–12, Apr. 2019, doi: 10.1155/2019/4068783.
[8] J. Li, H. Wang, Z. Guan, and C. Pan, ‘‘Distributed multi-objective algo-
As shown in Figures 27-28, the follower enters the multi- rithm for preventing multi-ship collisions at sea,’’ J. Navigat., vol. 73, no. 5,
obstacle area at about 7.5min and enters the collision avoid- pp. 971–990, Sep. 2020, doi: 10.1017/S0373463320000053.
ance state. Finally regains the stability of the formation at [9] G. Zhang, Y. Wang, J. Liu, W. Cai, and H. Wang, ‘‘Collision-avoidance
decision system for inland ships based on velocity obstacle algo-
about 17min. rithms,’’ J. Mar. Sci. Eng., vol. 10, no. 6, p. 814, Jun. 2022, doi:
10.3390/jmse10060814.
VI. CONCLUSION [10] Y. Wang, Y. Zhang, H. Zhao, and H. Wang, ‘‘Assessment method based
on AIS data combining the velocity obstacle method and Pareto selection
The FMS and leader–follower method are combined in this for the collision risk of inland ships,’’ J. Mar. Sci. Eng., vol. 10, no. 11,
study. The FMS is used to plot a collision-free and smooth p. 1723, Nov. 2022, doi: 10.3390/jmse10111723.
course for the ship’s sailing reference, after which the con- [11] M. Saad, A. I. Salameh, S. Abdallah, A. El-Moursy, and C.-T. Cheng,
‘‘A composite metric routing approach for energy-efficient shortest path
sistency theory is used to make the follower track the leader planning on natural terrains,’’ Appl. Sci., vol. 11, no. 15, p. 6939, Jul. 2021,
and to realize the effect of formation keeping. In addition, doi: 10.3390/app11156939.
an improved artificial potential field method is proposed to [12] W. Zhang, D. Xia, G. Chang, Y. Hu, Y. Huo, F. Feng, Y. Li, and H. Li,
‘‘APFD: An effective approach to taxi route recommendation with mobile
solve the possible obstacles encountered by the follower dur- trajectory big data,’’ Frontiers Inf. Technol. Electron. Eng., vol. 23, no. 10,
ing navigation, enabling the follower to take collision avoid- pp. 1494–1510, Sep. 2022, doi: 10.1631/FITEE.2100530.
ance behavior independently. This method can effectively [13] H. Niu, Z. Ji, A. Savvaris, and A. Tsourdos, ‘‘Energy efficient path
planning for unmanned surface vehicle in spatially-temporally variant
prevent the ship from entering the local minimum point posi- environment,’’ Ocean Eng., vol. 196, Jan. 2020, Art. no. 106766, doi:
tion. Meanwhile, after the independent collision avoidance 10.1016/j.oceaneng.2019.106766.
is completed, the consistency theory is reapplied to return [14] X. Chen, N. Bose, M. Brito, F. Khan, G. Millar, C. Bulger, and T. Zou,
the ship to the team. The method and algorithm presented in ‘‘Risk-based path planning for autonomous underwater vehicles in an oil
spill environment,’’ Ocean Eng., vol. 266, Dec. 2022, Art. no. 113077, doi:
this paper are verified through computer simulation, and the 10.1016/j.oceaneng.2022.113077.
results demonstrate the method’s feasibility. [15] X. Tong, S. Yu, G. Liu, X. Niu, C. Xia, J. Chen, Z. Yang, and
This study proposes the following ideas for the next stage Y. Sun, ‘‘A hybrid formation path planning based on A* and multi-target
improved artificial potential field algorithm in the 2D random environ-
of research: When the FMS method is used to perform the ments,’’ Adv. Eng. Informat., vol. 54, Oct. 2022, Art. no. 101755, doi:
final step of gradient descent, the selected path is mainly 10.1016/j.aei.2022.101755.
considered to travel in the highest area of the potential [16] L. Wang, Z. Zhang, Q. Zhu, and S. Ma, ‘‘Ship route planning based
on double-cycling genetic algorithm considering ship maneuverabil-
field diagram obtained through FMM operation, ensuring the ity constraint,’’ IEEE Access, vol. 8, pp. 190746–190759, 2020, doi:
path’s safety. However, in some cases, selecting this area is 10.1109/ACCESS.2020.3031739.
unnecessary, as the navigation’s safety may be satisfied in the [17] W. Lu and M. Wu, ‘‘Optimization of vehicle automatic navigation
path based on remote sensing and GIS,’’ Optik, vol. 270, Nov. 2022,
area above a certain value, suggesting that the selection of a Art. no. 169952, doi: 10.1016/j.ijleo.2022.169952.
slightly lower area can not only ensure safety but also reduce [18] H.-B. Wang, X.-G. Li, P.-F. Li, E. I. Veremey, and M. V. Sotnikova,
the distance sailed. Future research will modify the algorithm ‘‘Application of real-coded genetic algorithm in ship weather rout-
presented in this study to set a fitness function that balances ing,’’ J. Navigat., vol. 71, no. 4, pp. 989–1010, Jul. 2018, doi:
10.1017/S0373463318000048.
the speed and safety of the planned path using FMS. [19] E. Krell, S. A. King, and L. R. Garcia Carrillo, ‘‘Autonomous surface
vehicle energy-efficient and reward-based path planning using particle
swarm optimization and visibility graphs,’’ Appl. Ocean Res., vol. 122,
REFERENCES May 2022, Art. no. 103125, doi: 10.1016/j.apor.2022.103125.
[1] J. Tang, X. Chen, X. Zhu, and F. Zhu, ‘‘Dynamic reallocation model of [20] J. Zhong, B. Li, S. Li, F. Yang, P. Li, and Y. Cui, ‘‘Particle swarm opti-
multiple unmanned aerial vehicle tasks in emergent adjustment scenarios,’’ mization with orientation angle-based grouping for practical unmanned
IEEE Trans. Aerosp. Electron. Syst., early access, Aug. 1, 2022, doi: surface vehicle path planning,’’ Appl. Ocean Res., vol. 111, Jun. 2021,
10.1109/TAES.2022.3195478. Art. no. 102658, doi: 10.1016/j.apor.2021.102658.
VOLUME 11, 2023 21667
M. Li et al.: Ship Formation Algorithm Based on the Leader–Follower Method
[21] A. Serani, G. Fasano, G. Liuzzi, S. Lucidi, U. Iemma, E. F. [41] G. Sun, R. Zhou, B. Di, and H. Yu, ‘‘A physicochemically inspired
Campana, F. Stern, and M. Diez, ‘‘Ship hydrodynamic optimization approach to flocking control of multiagent system,’’ Nonlinear Dyn.,
by local hybridization of deterministic derivative-free global algo- vol. 102, pp. 2627–2648, Nov. 2020, doi: 10.1007/s11071-020-06062-y.
rithms,’’ Appl. Ocean Res., vol. 59, pp. 115–128, Sep. 2016, doi: [42] M. Fernando, ‘‘Online flocking control of UAVs with mean-field approx-
10.1016/j.apor.2016.04.006. imation,’’ in Proc. IEEE Int. Conf. Robot. Autom. (ICRA), May 2021,
[22] G. Zhang, H. Wang, W. Zhao, Z. Guan, and P. Li, ‘‘Application of improved pp. 8977–8983, doi: 10.1109/ICRA48506.2021.9560899.
multi-objective ant colony optimization algorithm in ship weather rout- [43] L. Ding and G. Guo, ‘‘Formation control for ship fleet based on backstep-
ing,’’ J. Ocean Univ. China, vol. 20, no. 1, pp. 45–55, Jan. 2021, doi: ping,’’ Control Decis., vol. 27, no. 2, pp. 299–303, 2012.
10.1007/s11802-021-4436-6. [44] B. Liu, T. Chu, L. Wang, and G. Xie, ‘‘Controllability of a leader–follower
[23] E. W. Dijkstra, ‘‘A note on two problems in connexion with dynamic network with switching topology,’’ IEEE Trans. Autom. Control,
graphs,’’ Numer. Math., vol. 1, no. 1, pp. 269–271, Dec. 1959, doi: vol. 53, no. 4, pp. 1009–1013, May 2008, doi: 10.1109/TAC.2008.919548.
10.1007/BF01386390. [45] S. A. Ajwad, T. Ménard, E. Moulay, M. Defoort, and P. Coirault, ‘‘Observer
[24] P. E. Hart, N. J. Nilsson, and B. Raphael, ‘‘Correction to a formal basis for based leader-following consensus of second-order multi-agent systems
the heuristic determination of minimum cost paths,’’ ACM SIGART Bull., with nonuniform sampled position data,’’ J. Franklin Inst., vol. 356, no. 16,
no. 37, pp. 28–29, Dec. 1972, doi: 10.1145/1056777.1056779. pp. 10031–10057, Nov. 2019, doi: 10.1016/j.jfranklin.2019.09.025.
[25] A. S. James, Level Set Methods and Fast Marching Methods. New York, [46] Q. Wang, K. Liu, X. Wang, L. Wu, and J. Lv, ‘‘Leader-following consensus
NY, USA: Cambridge Univ. Press, 1996. of multi-agent systems under antagonistic networks,’’ Neurocomputing,
[26] Z. Guan, Y. Wang, Z. Zhou, and H. Wang, ‘‘Research on early warning vol. 413, pp. 339–347, Nov. 2020, doi: 10.1016/j.neucom.2020.07.006.
of ship danger based on composition fuzzy inference,’’ J. Mar. Sci. Eng., [47] O. Khatib, ‘‘Real-time obstacle avoidance for manipulators and mobile
vol. 8, no. 12, p. 1002, Dec. 2020, doi: 10.3390/jmse8121002. robots,’’ Int. J. Robot. Res., vol. 5, no. 1, pp. 90–98, Mar. 1986, doi:
[27] M. Shang, M. Chu, and M. Grethler, ‘‘Path planning based on 10.1177/027836498600500106.
artificial potential field and fuzzy control,’’ in Proc. IEEE Int.
Conf. Power Electron., Comput. Appl., Mar. 2021, pp. 304–308, doi:
10.1109/ICPECA51329.2021.9362519.
[28] X. Yang, ‘‘Development of obstacle avoidance for autonomous vehicles MINGYANG LI was born in Siping, China,
and an optimization scheme for the artificial potential field method,’’ in in 1998. He received the bachelor’s degree in elec-
Proc. 2nd Int. Conf. Comput. Data Sci. (CDS), Jan. 2021, pp. 12–18, doi: tronic information science and technology from
10.1109/CDS52072.2021.00010. Jilin University, Jilin, in 2020, where he is cur-
[29] Z. Xin, X. Rongwu, and C. Guo, ‘‘AUV path planning in dynamic environ- rently pursuing the M.D. degree in circuits and
ment based on improved artificial potential field method based on visibility
systems. His research interest includes ship forma-
graph,’’ J. Phys., Conf., vol. 2383, no. 1, Dec. 2022, Art. no. 012090, doi:
tion algorithm.
10.1088/1742-6596/2383/1/012090.
[30] L. Liu, B. Wang, and H. Xu, ‘‘Research on path-planning algo-
rithm integrating optimization A-star algorithm and artificial potential
field method,’’ Electronics, vol. 11, no. 22, p. 3660, Nov. 2022, doi:
10.3390/electronics11223660.
[31] C. Zheyi and X. Bing, ‘‘AGV path planning based on improved
artificial potential field method,’’ in Proc. IEEE Int. Conf. Power KAI MENG was born in Xuzhou, China, in 1998.
Electron., Comput. Appl. (ICPECA), Jan. 2021, pp. 32–37, doi: He received the bachelor’s degree in electronic and
10.1109/ICPECA51329.2021.9362519. information engineering from Yangzhou Univer-
[32] J. Wang, R. Wang, D. Lu, H. Zhou, and T. Tao, ‘‘USV dynamic sity, Jiangsu, in 2021. He is currently pursuing
accurate obstacle avoidance based on improved velocity obstacle the M.D. degree in circuits and systems with Jilin
method,’’ Electronics, vol. 11, no. 17, p. 2720, Aug. 2022, University. His research interests include localiza-
doi: 10.3390/electronics11172720. tion and navigation.
[33] T. Xu, S. Zhang, Z. Jiang, and Z. Liu, ‘‘Collision avoidance of high-
speed obstacles for mobile robots via maximum-speed aware velocity
obstacle method,’’ IEEE Access, vol. 8, pp. 138493–138507, 2020, doi:
10.1109/ACCESS.2020.3012513.
[34] R. Skjetne, S. Moi, and T. I. Fossen, ‘‘Nonlinear formation control of
marine craft,’’ in Proc. 41st IEEE Conf. Decis. Control., Dec. 2002,
pp. 1699–1704, doi: 10.1109/CDC.2002.1184765. JIELU CHEN was born in Nantong, China,
[35] I.-A.-F. Ihle, M. Arcak, and T. I. Fossen, ‘‘Passivity-based designs for in 1988. She received the master’s degree in
synchronized path-following,’’ Automatica, vol. 43, no. 9, pp. 1508–1518, computer science and engineering from Shanghai
Sep. 2007, doi: 10.1016/j.automatica.2007.02.018. Jiao Tong University, in 2020. Her research
[36] R. Ghabcheloo, A. P. Aguiar, A. Pascoal, C. Silvestre, I. Kaminer, and interest includes navigation automation based on
J. Hespanha, ‘‘Coordinated path-following control of multiple underac- auto-pilot.
tuated autonomous vehicles in the presence of communication failures,’’
in Proc. 45th IEEE Conf. Decis. Control, Dec. 2006, pp. 4345–4350, doi:
10.1109/CDC.2006.376989.
[37] M. Breivik, V. E. Hovstein, and T. I. Fossen, ‘‘Straight-line target tracking
for unmanned surface vehicles,’’ Model., Identificat. Control, Norwegian
Res. Bull., vol. 29, no. 4, pp. 131–149, 2008, doi: 10.4173/MIC.2008.4.2.
[38] R. Cui, S. Sam Ge, B. Voon Ee How, and Y. Sang Choo, ‘‘Leader–
follower formation control of underactuated autonomous underwater vehi- HONGBO WANG (Member, IEEE) was born
cles,’’ Ocean Eng., vol. 37, nos. 17–18, pp. 1491–1502, Dec. 2010, doi: in Changchun, China, in 1969. She received the
10.1016/j.oceaneng.2010.07.006. Ph.D. degree from Saint Petersburg State Uni-
[39] I.-A.-F. Ihle, J. Jouffroy, and T. I. Fossen, ‘‘Formation control of marine versity, Russia. She is currently with the Col-
surface craft: A Lagrangian approach,’’ IEEE J. Ocean. Eng., vol. 31, no. 4, lege of Electronic Science and Engineering, Jilin
pp. 922–934, Oct. 2006, doi: 10.1109/JOE.2006.880426. University. Her research interests include ship
[40] F. Huang, P. Wu, and X. Li, ‘‘Distributed flocking control of quad-rotor motion control, weather routing, and ship collision
UAVs with obstacle avoidance under the parallel-triggered scheme,’’ Int. avoidance.
J. Control, Autom. Syst., vol. 19, no. 3, pp. 1375–1383, Jan. 2021, doi:
10.1007/s12555-019-0315-y.