Next Article in Journal
Analysis of Characteristic Changes of Blended Very Low Sulfur Fuel Oil on Ultrasonic Frequency for Marine Fuel
Previous Article in Journal
Research on Intelligent Trajectory Control Method of Water Quality Testing Unmanned Surface Vessel
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Three-Dimensional Path Planning for AUVs Based on Standard Particle Swarm Optimization Algorithm

College of Mechanical and Electrical Engineering, Qingdao University of Science and Technology, Qingdao 266061, China
*
Authors to whom correspondence should be addressed.
J. Mar. Sci. Eng. 2022, 10(9), 1253; https://doi.org/10.3390/jmse10091253
Submission received: 21 July 2022 / Revised: 28 August 2022 / Accepted: 30 August 2022 / Published: 5 September 2022
(This article belongs to the Section Ocean Engineering)

Abstract

:
This paper proposes an improved standard particle swarm optimization 2011 for autonomous underwater vehicles (AUVs). A mutation operator with a threshold is introduced to solve the problem of particles falling into the local extreme, and a nonlinear adaptive parameter strategy is introduced to accelerate the convergence speed. The proposed algorithm considers “path length”, “path safety”, “path smoothness” and “physical constraints” synthetically. For the specific navigation environment of AUVs, the path planning simulation is conducted based on MATLAB/Simulink, and the navigation guidance and control closed-loop simulation system is established. Simulation results show the effectiveness of the proposed algorithm.

1. Introduction

Nowadays, autonomous underwater vehicles (AUVs) are extensively employed in military and civilian areas, such as geological sampling [1], mine clearance [2], ocean floor survey [3], oil and gas exploration [4,5], and so on [6]. Because AUVs always need to be fully self-contained accomplish intelligently, and decision-making action during its mission, much research has been carried out worldwide with particular emphasis on autonomy, control, and navigation [7]. Recently, the development in the field of navigation, guidance and control systems has contributed significantly to the progress achieved in the development of AUVs. Naeem W. et al. [8] extensively discussed some effective guidance laws applicable to AUVs such as Lyapunov-based guidance, Proportional Navigation guidance (PNG), and Line-of-Sight (LOS) guidance. M. Breivik et al. [9] proposed the Pure Pursuit (PP) guidance and the Constant Bearing (CB) guidance in the case of AUVs. With an appropriate guidance strategy, an AUV can effectively perform its tasks by successively passing through the fixed waypoints toward the destination.
Path planning is an essential problem in autonomous control technology. To a certain extent, it reflects the intelligent level of AUVs [10]. At present, path planning can be divided into two categories: global and local path planning. The goal of global path planning is to find a feasible path in a known static environment, while local path planning aims at searching for an optimal or suboptimal path in unknown environments. In past decades, many approaches have been proposed for path planning of AUVs, including the Dijkstra algorithm [11], A* algorithm [12], artificial potential field algorithm (APF) [13], genic algorithm (GA) [14], particle swarm optimization (PSO) algorithm [15,16], neural network [17] and reinforcement learning [18,19]. However, the single path planning algorithm has limitations in specific scenarios. Therefore, combining different algorithms to solve the path planning problem for AUVs becomes more and more important. For example, Lim et al. proposed a PSO algorithm for the path planning of AUVs by introducing a selective differential evolution strategy where the complexity of computation was reduced significantly [20]. In [21], an ant colony optimization algorithm was developed by employing the pheromone elimination method, which can overcome the local extremum easily. To solve the premature problem in the conventional genetic algorithm, Yan and Pan presented a modified genetic algorithm by building a route planning model, which can quickly find the optimal path [22]. Therefore, the combination of different path planning algorithms attracted more and more researchers’ attention [23].
To quickly and accurately plan the safe optimal paths for AUVs in complex navigation environments, this paper proposes an improved standard PSO 2011 (SPSO-2011) algorithm. The contributions of this article are as follows:
  • The proposed algorithm introduces a mutation operator with a threshold and a nonlinear adaptive parameter strategy, which can effectively shorten the length of the path and accelerate convergence speed compared with the PSO algorithm and the SPSO-2011 algorithm.
  • A 3D guidance and control system is carried out to verify the effectiveness of the proposed algorithm. Simulation results show that the proposed algorithm has certain advantages in terms of path length and path rationality.
The remainder of this article is organized as follows. Section 2 establishes the AUV kinematic and dynamic models. Section 3 proposes a 3D guidance and control system for AUVs. Section 4 establishes the fitness function of the path. Section 5 proposes an improved SPSO-2011 algorithm. Simulation results are presented in Section 6. Finally, we offer some concluding remarks in Section 7.

2. AUV Kinematic and Dynamic Models

According to the AUV motion properties and neglecting the roll dynamics, the 5-degree-of-freedom (DOF) kinematic and dynamics models of an underactuated AUV can be expressed as [24]:
x ˙ = u cos ( θ ) cos ( ψ ) v sin ( ψ ) + w sin ( θ ) cos ( ψ ) , y ˙ = u cos ( θ ) sin ( ψ ) + v cos ( ψ ) + w sin ( θ ) sin ( ψ ) , z ˙ = u sin ( θ ) + w cos ( θ ) , θ ˙ = q , ψ ˙ = r / cos ( θ ) ,
u ˙ = m 22 m 11 v r m 33 m 11 w q d 11 m 11 u + 1 m 11 τ u , v ˙ = m 11 m 22 u r d 22 m 22 u , w ˙ = m 11 m 33 u q d 33 m 33 w , q ˙ = m 33 m 11 m 55 u w d 55 m 55 q ρ g G M L sin ( θ ) m 55 + 1 m 55 τ q , r ˙ = m 11 m 22 m 66 u v d 66 m 66 r + 1 m 66 τ r ,
where x, y, z, θ and ψ are the positions and attitude of the AUV in the earth-fixed frame in Figure 1; u, v, w, q and r are the corresponding linear and angular velocities in the body-fixed frame; τ u , τ q and τ r are the control forces and moments of the AUV produced by thrusters and propellers; m i i ( i = 1 , 2 , 3 , 5 , 6 ) denote the inertia and added mass parameters of the AUV, and d i i ( i = 1 , 2 , 3 , 5 , 6 ) denote the hydrodynamic damping coefficients, denotes the volume of fluid displaced by the AUV, g denotes the acceleration of gravity, ρ denotes the fluid density, G denotes the gravity of the AUV, and M L denotes the distance between the center of gravity and the center of buoyancy [25].

3. Three-Dimensional Guidance System

The 3D guidance system is motivated by the 2D guidance law. This paper simplifies a 3D guidance system into two independent and decoupled 3-DOF cases; namely, the horizontal-plane guidance and the vertical-plane guidance. The horizontal-plane guidance strategy makes AUVs converge to a straight line on the horizontal plane via generating the reference heading angle; similarly, the vertical-plane guidance strategy generates the reference pitch angle to converge to a straight line on the vertical plane. The block diagram of the 3D guidance system is given in Figure 2.
To obtain the 3D guidance algorithm, the original 2D guidance algorithm is extended. The inertial frame is transformed into the path frame by two rotations, and the tracking error vector is built to clearly represent the distance from the AUV to the path.
The first step is to rotate the inertial frame by α around the z axis, and the second step is to rotate the resulting frame from the first rotation by β around the y axis, where α and β , defined by (3) and (4), are the slope of the trajectory straight line before each rotation. The rotations can be described by two rotation matrices, R z ( α ) and R y ( β ) , given in (5) and (6), respectively.
α = arctan ( y i + 1 y i x i + 1 x i ) ,
β = arctan ( z i z i + 1 ( x i + 1 x i ) 2 + ( y i + 1 y i ) 2 ) ,
R z ( α ) = cos ( α ) sin ( α ) 0 sin ( α ) cos ( α ) 0 0 0 1 ,
R y ( β ) = cos ( β ) 0 sin ( β ) 0 1 0 sin ( β ) 0 cos ( β ) .
Then, the tracking error vector e = [ e x , e y , e z ] T can be computed in the path frame as (7), where e x , e y and e z are the along, cross and vertical tracking errors, respectively.
e = R y ( β ) R z ( α ) ( p W i ) .
In order to make the AUV follow the desired path, the lookahead guidance algorithm is employed by introducing a virtual target [26]. In this algorithm, the error components e y and e z are used to guide the AUV to the virtual target. To guarantee that the tracking errors e y and e z converge to zero, the guidance angles ψ d and θ d are set as
ψ d = α + arctan ( e y δ y ) ,
θ d = θ + arctan ( e z δ z ) .
where δ y and δ z are designed to force the position of the AUV to the x z and x y planes of the path frame, respectively. Then, we can obtain the desired angular velocities q d and r d by proportional controller gains k ψ and k θ .
The steps of the lookahead guidance algorithm for AUVs are listed in Algorithm 1.
Algorithm 1: Lookahead guidance algorithm.
Input: ( W i = [ x i , y i , z i ] T , W i + 1 = [ x i + 1 , y i + 1 , z i + 1 ] T , p = [ x , y , z ] t , ψ , θ , δ y , δ z , k ψ , k θ , i = ( 1 , 2 , n ) )
Output: ( r d , q d )
1:
for i = 1 to n 1 do
2:
     α arctan ( y i + 1 y i x i + 1 x i )
3:
     W i R = R z ( α ) W i
4:
     W i R = [ x i R , y i R , z i R ] T
5:
     W i + 1 R R z ( α ) W i + 1
6:
     β arctan ( z i R z i + 1 R x i + 1 R x i R )
7:
     e = [ e x , e y , e z ] T
8:
     e = R y ( β ) R z ( α ) ( p W i )
9:
     ψ d = α + arctan ( e y δ y )
10:
    θ d = θ + arctan ( e z δ z )
11:
    r d = k ψ ( ψ d ψ )
12:
    q d = k θ ( θ d θ )
13:
   return ( r d , q d )
This paper designs two independent controllers for the underactuated AUV based on the desired surge velocity u d , the desired pitch angle rate q d , and the desired heading angle rate r d to control the horizontal-plane and vertical-plane motions, respectively [27].
Define the surge velocity error z 1 , the pitch angle rate error z 2 and the heading angle rate error z 3 as:
z 1 : = u u d , z 2 : = q q d , z 3 : = r r d .
Step 1: Differentiating (10) with respect to time, respectively, and we have
m 11 z ˙ 1 = m 11 u ˙ m 11 u d ˙ , m 55 z ˙ 2 = m 55 q ˙ m 55 q ˙ d , m 66 z ˙ 3 = m 66 r ˙ m 66 r ˙ d .
Step 2: The control law can be designed as:
τ u = k 1 z 1 m 22 v r + m 33 w q + d 11 u + m 11 u d ˙ , τ q = k 2 z 2 ( m 33 m 11 ) u w + d 55 q + ( ρ g G M L sin ( θ ) ) + m 55 q ˙ d , τ r = k 3 z 3 ( m 11 m 22 ) u v + d 66 r + m 66 r ˙ d ,
where k 1 > 0 , k 2 > 0 and k 3 > 0 are the parameters to be designed.
Step 3: Define a Lyapunov function candidate as:
V ( z 1 , z 2 , z 3 ) = 1 2 m 11 z 1 2 + 1 2 m 55 z 2 2 + 1 2 m 66 z 3 2 .
Differentiating the Lyapunov function with respect to time, and we have
V ˙ ( z 1 , z 2 , z 3 ) = z 1 m 11 z ˙ 1 + z 2 m 55 z ˙ 2 + z 3 m 66 z ˙ 3 .
Substituting Equations (2), (11) and (12) into (15), and we have
V ˙ ( z 1 , z 2 , z 3 ) = z 1 m 11 z ˙ 1 + z 2 m 55 z ˙ 2 + z 3 m 66 z ˙ 3 = z 1 m 55 ( u ˙ u d ˙ ) + z 2 m 55 ( q ˙ q ˙ d ) + z 3 m 66 ( r ˙ r ˙ d ) = k 1 z 1 2 k 2 z 2 2 k 3 z 3 2 0 .
According to the Lyapunov stability theorem, the errors z 1 , z 2 and z 3 can converge to zero, and the closed-loop system is asymptotically stable.

4. Multi-Objective Optimization

If P 0 is the starting point and P N is the destination point, then the path can be expressed as follows:
W = ( P 0 , x 1 , y 1 , z 1 , , x n , y n , z n , P N ) ,
where P n = ( x n , y n , z n ) is a middle waypoint of the path, both the line segment from ( x n 1 , y n 1 , z n 1 ) to ( x n , y n , z n ) and the line segment from ( x n , y n , z n ) to ( x n + 1 , y n + 1 , z n + 1 ) do not cut obstacle areas.
According to the given navigation environment and the physical property of AUVs, some formal constraints are formulated as follows:
x m i n < x n < x m a x , n = 1 , n ¯ , y m i n < y n < y m a x , n = 1 , n ¯ , z m i n < z n < z m a x , n = 1 , n ¯ , γ < γ m a x , φ > φ m i n ,
where x m i n and x m a x are constraints for x n , y m i n and y m a x are constraints for y n , z m i n and z m a x are constraints for z n , γ m a x is the maximum allowed angle of the planning path on the horizontal plane, and φ m i n is the minimal allowed angle of the planning path on the vertical plane.

4.1. Path Length

The total length of the path is usually discussed because it determines the sailing time and energy expenditure. The total length of the path can be calculated by:
L = n = 1 N P n P n 1 ,
where P n P n 1 indicates the Euclidean distance between P n = ( x n , y n , z n ) and P n 1 = ( x n 1 , y n 1 , z n 1 ) .
During path planning, the path length ratio is usually used to calculate the path length, specifically as follows:
A 1 = L P N P 0 ,
where P N P 0 represents the Euclidean distance between the starting point P 0 and the destination point P N .

4.2. Path Smoothness

Path smoothness should be considered to avoid the mutations in navigation direction in path planning. Mutations in navigation direction will not only increase energy consumption, but also reduce navigation accuracy. Therefore, in order to avoid the mutations in navigation direction, the fitness function is defined as:
A 2 = n = 1 N γ n m i n ( ( x n 1 , y n 1 ) , ( x n , y n ) , ( x n , y n ) , ( x n + 1 , y n + 1 ) ) + n = 1 N φ n ( z n z n 1 ) 2 + ( ( x n x n 1 ) 2 ) ,
where · represents the Euclidean distance, γ n and φ n represent the angle of the planning path on the horizontal plane and the angle of the planning path on the vertical plane, which are calculated according to the following formula:
γ n = arctan z n z n 1 ( x n x n 1 ) 2 + ( y n y n 1 ) 2 , φ n = π arccos ( x n x n 1 ) ( x n + 1 x n ) + ( y n y n 1 ) ( y n + 1 y n ) ( x n x n 1 ) 2 + ( y n y n 1 ) 2 + ( x n + 1 x n ) 2 + ( y n + 1 y n ) 2 .

4.3. Path Safety

A safe path must avoid all the obstacles. The obstacles are assumed to be static with known position. The underwater obstacle is usually assumed to be a stationary target and positioned. The solutions should be penalized when the generated path cuts any obstacles. The safety fitness function of the path can be expressed as:
A 3 = + , if P n P n 1 O B , 0 , if P n P n 1 O B = ,
where A 3 is the fitness function of the path, O B represents the collection of all obstacle areas, if the planned path does not intersect all obstacles, the fitness function of the path is 0, conversely, it is + .

4.4. The Construction of the Total Fitness Function

The path planning algorithm takes the path length, the path safety and the path smoothness as the main optimization goal. It is common to aggregate the multiple objectives into a single fitness function, which is nonzero and monotonic. The total fitness function of the path comes from a weighted sum of objectives above, and the smaller fitness function value represents a better path. Define the total fitness function as:
F = η 1 A 1 + η 2 A 2 + η 3 A 3 , i = 1 η i = 1 ,
where F represents the total fitness function of the path, η i (i = 1, 2, 3) are weight factors that determine the importance of each objective.

5. The Improved SPSO-2011 Algorithm

Evolutionary algorithms have been widely applied to solve multi-objective optimization engineering problems. One of the most popular evolutionary algorithms is the particle swarm optimization (PSO) algorithm.
The SPSO-2011 exploits the idea of rotational invariance to improve the standard PSO. The improved SPSO-2011 algorithm still utilizes the update rules of the SPSO-2011 algorithm and uses the uniform random initialization. Velocity and position of the particle are updated by
V i ( t + 1 ) = ω V i ( t ) c 1 + c 2 3 X i ( t ) + c 1 P b e s t i ( t ) + c 2 G b e s t 3 , X i ( t + 1 ) = X i ( t ) + V i ( t + 1 ) ,
where i = 1 , 2 , , M , with M equal to swarm size and t = 1 , 2 , , T with T equal to the maximum number of iterations, V represents the velocity of the particle, X the position of the particle, ω is the inertia weight, c 1 is the cognitive learning factor, c 2 is the social learning factor, G b e s t denotes the best position that the whole swarm has found so far, and P b e s t denotes the best position that the particle has found so far.

5.1. The Improved Adaptive Parameters

The inertia weight ω is applied to balance the global and local search capabilities. The larger the w, the faster the particle convergence rate and the stronger the global search ability, but it reduces the local search ability of the particles and ultimately leads to lower global convergence accuracy. The smaller w will improve the convergence accuracy of the particles, but reduces the convergence speed of the particles, which easily makes the particle into the local optimum in the search process and cannot jump out of the local extreme value [28]. In the SPSO-2011 algorithm, the inertia weight is a fixed value, but it cannot consider both the search accuracy and the search range. A nonlinear adaptive strategy can ensure that all particles can quickly spread into the whole search space in the early search stage to determine the approximate range of the global extrema, accelerating the particle convergence in the late search stage [29]. In the improved SPSO-2011 algorithm, the inertia weight w linearly increases in the early stage, which increases the search range, prevents falling into the local optimum, and then the inertia weight w nonlinearly reduces in the late stage to improve the search accuracy. The nonlinear adaptive inertia weight was proposed as the followed formula:
ω = ω r + ( t T ) * ( ω m a x ω m i n ) , 0 < t < T i t e r m i n 2 , ω = ω m i n + e ( k * t ) 2 T * ( ω m a x ω m i n ) , T i t e r m i n 2 < t < T , ω = ω m a x , ω > ω m a x ,
where ω r represents the initial value, ω m i n is the minimum value, ω m a x is the maximum value, and i t e r m i n represents the minimum number of iterations.
In the SPSO-2011 algorithm, the update speed of the particle swarm is mainly adjusted through the cognitive learning factor and the social learning factor, but due to the lack of changes in learning factors, it is easy to make the particle fall into the local optimum. In the improved SPSO-2011 algorithm, two learning factors are devised with dynamic adjustment methods to avoid the local optimum. The dynamic adjustment methods are as follows:
c 1 = c 1 m a x K 1 * t T * ( c 1 m a x c 1 m i n ) , c 2 = c 2 m i n + K 2 * t T * ( c 2 m a x c 2 m i n ) ,
where c 1 m i n represents the minimum value of the cognitive learning factor, c 2 m i n represents the minimum value of the social learning factor, c 1 m a x represents the maximum value of the cognitive learning factor, c 2 m a x represents the maximum value of the social learning factor, and K 1 and K 2 represent two adjustable and positive constants.

5.2. Mutation Operator

The mutation is employed to give new information to the population and increase population diversity. In this paper, the improved SPSO-2011 algorithm introduces a mutation operator with a threshold. In the improved SPSO-2011 algorithm, when the cumulative number of iterations is greater than the threshold and the individual fitness function value is always greater than the global fitness function in the cumulative process, the mutation is performed. Otherwise, the cumulative number of iterations is 0. The improved method can effectively increase global search ability and avoid falling into the local optimum. The random mutation can be expressed by the following equation:
X i ( t + 1 ) = r a n d * D ,
where r a n d is the random number in the [ 0 , 1 ] and D is the range of map.
The flow chart of the improved SPSO-2011 algorithm is shown in Figure 3.

6. Simulation Results

To verify the effectiveness of the proposed algorithm, this paper contrasts with the PSO and SPSO-2011 algorithms in terms of planning time and path length. For certain AUV, a 3D guidance and control strategy is designed, and a closed-loop simulation system is established based on MATLAB/Simulink. Comparative simulations are carried out to verify the effectiveness of the proposed algorithm.
The simulations are carried out in different 3D spaces with different obstacles and different starting and destination points. In general, the underwater obstacles mainly include sea ridges, underwater shipwrecks, marine suspended matter and other objects. To facilitate the problem description, the sphere and cuboids are used to describe the underwater obstacles. The parameters of the proposed Improved SPSO-2011 algorithm are given in Table 1. The simulations are carried out on a 500 m × 500 m × 100 m 3D space with some equivalent obstacles. In 3D space, the starting point is ( 2 , 10 , 7 ) , and the destination point is ( 480 , 430 , 30 ) . All obstacles are replaced by regular balls or cuboids. The main parameters of the improved SPSO-2011 algorithm are: γ m a x < | ± π / 3 | , φ m i n > | ± π / 6 | , M = 200 , ω r = 0.7 , ω m i n = 0.4 , ω m a x = 0.9 , c 1 m i n = c 2 m i n = 0.9 , c 1 m a x = c 2 m a x = 2.2 , K 1 = K 2 = 0.2 , i t e r m i n = 70 , T = 100 , k = 1.5 and P m a x = 7 . Model parameters of the AUV are given by m 11 = 25 kg, m 22 = 17.5 kg, m 33 = 30 kg, m 55 = 22.5 kgm 2 , m 66 = 15 kgm 2 , d 11 = 30 kgs 1 , d 22 = 30 kgs 1 , d 33 = 30 kgs 1 , d 55 = 25 kgm 2 s 1 , d 66 = 25 kgm 2 s 1 , and ρ g G M L = 5 [30,31]. The initial states of the AUV are set as [ x ( 0 ) , y ( 0 ) , z ( 0 ) , θ ( 0 ) , ψ ( 0 ) ] = [ 2 ( m ) , 10 ( m ) , 7 ( m ) , 0 ( r a d ) , 0 ( r a d ) ] . The constant surge velocity of the AUV is set as u d = 1.5 ms 1 . The 3D guidance algorithm and controller parameters are chosen as k 1 = 1 , k 2 = 1 , k 3 = 1 , k ψ = 1 , k θ = 1 , δ y = 10 and δ z = 10 .
The parameters of 3D space and the positions of starting and destination points are shown in Table 2. Simulations of the PSO algorithm, the SPSO-2011 algorithm and the improved SPSO-2011 algorithm are performed using MATLAB, and each three path planning algorithms were performed eight times. The optimal fitness function values of three path planning algorithms in different 3D spaces with different obstacles and different starting and destination points are shown in Figure 4. It can be clearly observed that the proposed improved SPSO-2011 algorithm has a faster convergence rate and the minimum fitness function values 0.9145 and 0.8926 for 3D space 1 and 2, respectively. This confirms that the proposed improved SPSO-2011 algorithm has better performance than the PSO and SPSO-2011 algorithms. The optimal planned paths of three path planning algorithms are shown in Figure 5. The shortest distance of the paths, and the average distance of the paths of three path planning algorithms, are shown in Table 2. As seen in Figure 5 and Table 2, under the proposed improved SPSO-2011 algorithm, the planned path has the shorter path length and higher path smoothness in 3D spaces 1 and 2. From the values of the average distance of the paths in Table 2, the proposed algorithm has the shortest average distance of the paths, and thus can effectively avoid falling into the local optimum.
To verify the path performability, the planned path in the 3D space 1 is selected for tracking control by employing the proposed 3D guidance and control algorithm. The simulation results are illustrated in Figure 6 and Figure 7. The 3D following trajectory of the AUV is illustrated in Figure 6a. The corresponding following trajectories in the xy, xz and yz planes are illustrated in Figure 6b–d, respectively. Figure 7a shows the desired heading angle and actual heading angle. Figure 7b shows the desired pitch angle and actual pitch angle. From Figure 6 and Figure 7, we can observe that the proposed 3D guidance and control algorithm can make the AUV track the planned path accurately and the desired heading and pitch angles are reasonable.
Simulation results demonstrate the effectiveness of the proposed algorithm. Compared with the PSO algorithm and SPSO-2011 algorithm, the proposed algorithm has the following advantages:
  • Under the proposed algorithm, the phenomenon of local optima can be avoided effectively and thus plan shorter path lengths.
  • The proposed algorithm has the faster convergence rate and higher accuracy.
  • The proposed 3D guidance algorithm can accurately track the planned path, indicating that the planned path has good performability.

7. Conclusions

This paper proposes an improved SPSO-2011 algorithm. A mutation operator with a threshold is introduced to prevent falling into local optima and a nonlinear adaptive parameter strategy is introduced to accelerate convergence speed. The construction of the total fitness function considers “path length”, “path smoothness”, “path safety” and “physical constraints”, which can effectively avoid collision with threats, obtain a shorter path, and save energy consumption. Compared with the PSO algorithm and the SPSO-2011 algorithm, simulation results show that the proposed algorithm has greater advantages in terms of path length and planning time. To verify the performability of the planned path, a 3D guidance algorithm and controller are designed for AUVs. Simulation results show that the AUV can accurately track the planned path based on the improved SPSO-2011 algorithm.

Author Contributions

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

Funding

Authors wish to thank the funding from the Taishan Scholar Project of Shandong Province (ts20190937) and National Natural Science Foundation of China (52176076).

Informed Consent Statement

Not applicable.

Data Availability Statement

Not applicable.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Konoplin, A.Y.; Konoplin, N.Y. System for automatic soil sampling by underwater vehicle. In Proceedings of the 2017 International Conference on Industrial Engineering, Applications and Manufacturing (ICIEAM), St. Petersburg, Russia, 16–19 May 2017. [Google Scholar]
  2. Xu, Y.R.; Xiao, K. Technology development of autonomous ocean vehicle. Acta Autom. Sin. 2018, 33, 518. [Google Scholar]
  3. Villar, S.A.; Acosta, G.G.; Sousa, A.L.; Rozenfeld, A. Evaluation of an efficient approach for target tracking from acoustic imagery for the perception system of an autonomous underwater vehicle. Int. J. Adv. Robot. Syst. 2014, 11, 24. [Google Scholar] [CrossRef]
  4. Gao, Z.Y.; Guo, G. Fixed-time leader-follower formation control of autonomous underwater vehicles with event-triggered intermittent communications. IEEE Access 2018, 3, 27902–27911. [Google Scholar] [CrossRef]
  5. Wynn, R.B.; Huvenne, V.A.; Le Bas, T.P.; Murton, B.J.; Connelly, D.P.; Bett, B.J.; Ruhl, H.A.; Morris, K.J.; Peakall, J.; Parsons, D.R.; et al. Autonomous Underwater Vehicles (AUVs): Their past, present and future contributions to the advancement of marine geoscience. Mar. Geol. 2014, 352, 451–468. [Google Scholar] [CrossRef]
  6. Fossen, T.I.; Breivik, M.; Skjetne, R. Line-of-sight path following of underactuated marine craft. IFAC Proc. Vol. 2003, 36, 211–216. [Google Scholar] [CrossRef]
  7. Sahoo, A.; Dwivedy, S.K.; Robi, P.S. Advancements in the field of autonomous underwater vehicle. Ocean. Eng. 2020, 181, 145–160. [Google Scholar] [CrossRef]
  8. Naeem, W.; Sutton, R.; Ahmad, S.M.; Burns, R.S. A review of guidance laws applicable to unmanned underwater vehicles. J. Navig. 2003, 56, 15–29. [Google Scholar] [CrossRef]
  9. Breivik, M.; Fossen, T.I. Guidance laws for autonomous underwater vehicles. Underw. Veh. 2009, 4, 51–76. [Google Scholar]
  10. Zhao, Y.J.; Zheng, Z.; Liu, Y. Survey on computational-intelligence-based UAV path planning. Knowl.-Based Syst. 2018, 158, 54–64. [Google Scholar] [CrossRef]
  11. Khachiyan, L.; Gurvich, V.; Zhao, J.H. Extending Dijkstra’s Algorithm to Maximize the Shortest Path by Node-Wise Limited Arc Interdiction; Springer: Berlin/Heidelberg, Germany, 2006; pp. 221–234. [Google Scholar]
  12. Ammar, A.; Bennaceur, H.; Châari, I.; Koubâa, A.; Alajlan, M. Relaxed Dijkstra and A* with linear complexity for robot path planning problems in large-scale grid environments. Soft Comput. 2016, 20, 4149–4171. [Google Scholar] [CrossRef]
  13. Fan, X.J.; Guo, Y.J.; Liu, H.; Wei, B.; Lyu, W. Improved artificial potential field method applied for AUV path planning. Math. Probl. Eng. 2020, 2020, 6523158. [Google Scholar] [CrossRef]
  14. Sun, Y.; Zhang, R.B. Research on global path planning for AUV based on GA. In Mechanical Engineering and Technology; Springer: Berlin/Heidelberg, Germany, 2012; pp. 311–318. [Google Scholar]
  15. Cai, L.; Jia, J.P. Path planning with PSO for autonomous vehicle. Adv. Eng. Mater. Appl. Mech. 2016, 263–266. [Google Scholar]
  16. Das, P.K.; Behera, H.S.; Das, S.; Tripathy, H.K.; Panigrahi, B.K.; Pradhan, S.K. A hybrid improved PSO-DV algorithm for multi-robot path planning in a clutter environment. Neurocomputing 2016, 207, 735–753. [Google Scholar] [CrossRef]
  17. Lin, C.; Wang, H.; Yuan, J.; Yu, D.; Li, C. An improved recurrent neural network for unmanned underwater vehicle online obstacle avoidance. Ocean. Eng. 2019, 189, 106327. [Google Scholar] [CrossRef]
  18. Wang, Z.; Zhang, S.W.; Feng, X.N.; Sui, Y.C. Autonomous underwater vehicle path planning based on actor-multi-critic reinforcement learning. Proc. Inst. Mech. Eng. Part I J. Syst. Control Eng. 2021, 235, 1787–1796. [Google Scholar] [CrossRef]
  19. Cheng, C.; Zhu, D.; Sun, B.; Chu, Z.; Nie, J.; Zhang, S. Path planning for autonomous underwater vehicle based on artificial potential field and velocity synthesis. In Proceedings of the IEEE/2015 IEEE 28th Canadian Conference on Electrical and Computer Engineering (CCECE), Halifax, NS, Canada, 3–6 May 2015. [Google Scholar]
  20. Lim, H.S.; Fan, S.; Chin, C.K.; Chai, S.; Bose, N. Particle swarm optimization algorithms with selective differential evolution for AUV path planning. Int. J. Robot. Autom. 2020, 9, 94–112. [Google Scholar] [CrossRef]
  21. Yang, L.; Li, K.S.; Zhang, W.S.; Wang, Y.; Chen, Y.; Zheng, L.F. Three-dimensional Path Planning for Underwater Vehicles Based on an Improved Ant Colony Optimization Algorithm. J. Eng. Sci. Tech. Rev. 2015, 8, 24–33. [Google Scholar] [CrossRef]
  22. Yan, S.K.; Pan, F. Research on route planning of AUV based on genetic algorithms. In Proceedings of the 2019 IEEE International Conference on Unmanned Systems and Artificial Intelligence (ICUSAI), Xi’an, China, 22–24 November 2019. [Google Scholar]
  23. Cheng, C.X.; Sha, Q.X.; He, B.; Li, G. Path planning and obstacle avoidance for AUV: A review. Ocean. Eng. 2021, 235, 109355. [Google Scholar] [CrossRef]
  24. Do, K.D. Coordination control of underactuated ODINs in three-dimensional space. Robot. Auton. Syst. 2013, 61, 853–867. [Google Scholar] [CrossRef]
  25. Pettersen, K.Y.; Egeland, O. Time-varying exponential stabilization of the position and attitude of an underactuated autonomous underwater vehicle. IEEE Trans. Autom. Control 1999, 44, 112–115. [Google Scholar] [CrossRef] [Green Version]
  26. Breivik, M.; Fossen, T.I. Principles of guidance-based path following in 2D and 3D. In Proceedings of the 44th IEEE Conference on Decision and Control, Seville, Spain, 12–15 December 2005. [Google Scholar]
  27. Lekkas, A.M. Guidance and Path-Planning Systems for Autonomous Vehicles; Norwegian University of Science and Technology: Trondheim, Norway, 2014. [Google Scholar]
  28. Xu, S.H.; Li, X.X. An adaptive changed inertia weight particle swarm algorithm. Sci. Technol. Eng. 2012, 9, 1671–1815. [Google Scholar]
  29. Cheng, Z.; Dong, M.N.; Yang, T.K.; Han, L.J. Extraction of solar cell model parameters based on self-adaptive chaos particle swarm optimization algorithm. Trans. China Electrotech. Soc. 2014, 29, 245–252. [Google Scholar]
  30. Do, K.D.; Pan, J. Control of Ships and Underwater Vehicles: Design for Underactuated and Nonlinear Marine Systems; Springer: London, UK, 2009. [Google Scholar]
  31. Fossen, T.I. Marine Control Systems–Guidance. Navigation, and Control of Ships, Rigs and Underwater Vehicles. Marine Cybernetics, Trondheim, Norway, Org. Number NO 985 195 005 MVA, ISBN 8292356002. 2002. Available online: www.marinecybernetics.com (accessed on 8 November 2002).
Figure 1. AUVs with body and earth-fixed reference frames.
Figure 1. AUVs with body and earth-fixed reference frames.
Jmse 10 01253 g001
Figure 2. The block diagram of the 3D guidance system.
Figure 2. The block diagram of the 3D guidance system.
Jmse 10 01253 g002
Figure 3. The improved SPSO-2011 algorithm flow chart.
Figure 3. The improved SPSO-2011 algorithm flow chart.
Jmse 10 01253 g003
Figure 4. The fitness function curves of three path planning algorithms in different 3D spaces.
Figure 4. The fitness function curves of three path planning algorithms in different 3D spaces.
Jmse 10 01253 g004
Figure 5. Compared with the optimal path of three path planning algorithms.
Figure 5. Compared with the optimal path of three path planning algorithms.
Jmse 10 01253 g005
Figure 6. (a) The following optimal path in the 3D space 1. (b) The following optimal path in the xy plane. (c) The following optimal path in the yz plane. (d) The following optimal path in the xz plane.
Figure 6. (a) The following optimal path in the 3D space 1. (b) The following optimal path in the xy plane. (c) The following optimal path in the yz plane. (d) The following optimal path in the xz plane.
Jmse 10 01253 g006
Figure 7. Tracking results of guidance angles. (a) Desired heading angle and actual heading angle. (b) Desired pitch angle and actual pitch angle.
Figure 7. Tracking results of guidance angles. (a) Desired heading angle and actual heading angle. (b) Desired pitch angle and actual pitch angle.
Jmse 10 01253 g007
Table 1. The parameters of the improved SPSO-2011 algorithm.
Table 1. The parameters of the improved SPSO-2011 algorithm.
VariablesValue
γ m a x π / 3
φ m i n π / 6
ω r 0.7
ω m i n 0.4
ω m a x 0.9
i t e r m i n 70
c 1 m i n 0.9
c 2 m i n 0.9
c 1 m a x 2.1
c 2 m a x 2.1
P m a x 7
K 1 0.2
K 2 0.2
M200
T100
k 1.5
Table 2. Performance comparisons of path planning algorithms in different 3D spaces.
Table 2. Performance comparisons of path planning algorithms in different 3D spaces.
Algorithm3D SpacesThe Shortest Distance
of Paths (Meters)
The Average Distance
of Paths (Meters)
PSO3D space1: 500 m × 500 m × 100 m663.54665.98
SPSO-2011The starting point: ( 2 , 10 , 7 ) 660.10669.99
Improved SPSO-2011The destination point: ( 480 , 430 , 30 ) 655.12657.26
PSO3D space2: 1500 m × 1500 m × 300 m1828.351834.77
SPSO-2011The starting point: ( 18 , 20 , 25 ) 1829.831836.91
Improved SPSO-2011The destination point: ( 1200 , 1400 , 60 ) 1820.891827.71
Publisher’s Note: MDPI stays neutral with regard to jurisdictional claims in published maps and institutional affiliations.

Share and Cite

MDPI and ACS Style

Zhan, B.; An, S.; He, Y.; Wang, L. Three-Dimensional Path Planning for AUVs Based on Standard Particle Swarm Optimization Algorithm. J. Mar. Sci. Eng. 2022, 10, 1253. https://doi.org/10.3390/jmse10091253

AMA Style

Zhan B, An S, He Y, Wang L. Three-Dimensional Path Planning for AUVs Based on Standard Particle Swarm Optimization Algorithm. Journal of Marine Science and Engineering. 2022; 10(9):1253. https://doi.org/10.3390/jmse10091253

Chicago/Turabian Style

Zhan, Bangshun, Shun An, Yan He, and Longjin Wang. 2022. "Three-Dimensional Path Planning for AUVs Based on Standard Particle Swarm Optimization Algorithm" Journal of Marine Science and Engineering 10, no. 9: 1253. https://doi.org/10.3390/jmse10091253

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