Next Article in Journal
Improved Fatigue Reliability Analysis of Deepwater Risers Based on RSM and DBN
Previous Article in Journal
A CFD-Based Data-Driven Reduced Order Modeling Method for Damaged Ship Motion in Waves
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

A Motion Planning Method for Unmanned Surface Vehicle Based on Improved RRT Algorithm

Key Laboratory of Transport Industry of Marine Technology and Control Engineering, Shanghai Maritime University, Shanghai 201306, China
*
Author to whom correspondence should be addressed.
J. Mar. Sci. Eng. 2023, 11(4), 687; https://doi.org/10.3390/jmse11040687
Submission received: 22 February 2023 / Revised: 21 March 2023 / Accepted: 22 March 2023 / Published: 23 March 2023
(This article belongs to the Section Ocean Engineering)

Abstract

:
Aiming at the problem that the path search rules in the traditional path planning methods are divorced from the actual maneuverability of an unmanned surface vehicle (USV), a motion planning method of state prediction rapidly exploring random tree (spRRT) is proposed. This method retains the discrete search of the original rules of RRT while adding the continuity of the motion of USV. Firstly, the state information for each movement (position, yaw angle, velocity, etc.), is calculated based on the mathematical model of USV’s motion which takes into account the complete dynamic constraints. Secondly, this information is added to the RRT path search rules to predict the state points that can be reached by the USV. Furthermore, in order to improve search efficiency and reduce cost, spRRT is enhanced by an elliptic sampling domain (spRRT-Informed). The simulation results indicate that spRRT can effectively plan smooth paths for smoothly navigating USV. The inclusion of the USV motion model has improved steering performance by an average of over 40%. Additionally, the spRRT-Informed enhanced with sampling optimization strategy improves performance by at least 10% over spRRT in terms of sailing time and distance of the path. The results of the simulation conducted in a realistic scenario validate that spRRT-Informed can be used as a reference for practical applications.

1. Introduction

As artificial intelligence develops and labor costs rise, unmanned systems are increasingly used in areas such as industrial production, supply chain logistics, and scientific exploration. The flexibility, low cost, and versatility of unmanned surface vehicles (USVs) have resulted in them being widely used by both the military and commercial sectors over the last decade, such as hydrographic surveys, environmental monitoring, maritime search and rescue, and port security [1,2,3,4,5]. However, in order to accomplish tasks in the above scenarios, path planning is without a doubt a significant technical challenge for USVs. Dynamic constraints will constrain the motion of USV as a result of its physical limitations (propeller speed threshold, thrust change rate, etc.). The path planning problem can be divided into three stages based on the different dynamic constraints: route planning, trajectory planning, and motion planning [6].
Route planning is the first step in the study of path planning problems, in which the object is usually considered a prime. Regardless of the dimensions and dynamics of the studied object, the research approach theoretically applies to mobile robots, unmanned cars, and unmanned surface vehicles. A large number of results have been achieved in this phase of research [7,8,9,10], such as the Dijkstra algorithm, A* algorithm, fuzzy logic algorithm, artificial potential field method, neural network algorithm, ant colony algorithm, particle swarm algorithm, etc. Route planning research specifically for USV is primarily concerned with optimizing route characteristics, such as path distance, path smoothness, or energy efficiency. The scenario may be set in a super-scale environment, in which the size of the ship does not matter [10,11,12,13,14]. However, in some small and complex scenarios, such as ports and inland rivers, the route planning methods are not applicable.
Trajectory (time parameterization continuous path) planning considers partial dynamic constraints such as velocity, yaw angle, and curvature. The trajectory planning study for USV is not limited to determining the path from the start point to the target point. In addition, the path must conform to one or more of USV’s physical characteristics. Wang et al. [15] simulated path planning in a realistic complex marine environment (including shore and water limitations). A multilayer path planner was proposed. In the obstacle avoidance layer, B spline curves were used to reduce the yaw angle cost value substantially. Petr Svec [16] incorporated the concept of prediction into the traditional heuristic search. A step-by-step planning strategy was developed that searches through a candidate trajectory space composed of dynamically feasible control actions. Gao et al. [17] designed a fuzzy control algorithm to dynamically adjust the weight coefficients of the velocity and obstacle distance terms in the cost function of the dynamic window approach (DWA) algorithm. All of these methods are able to obtain feasible trajectories. However, USVs have significant inertia, high drag, and a long response time compared to other unmanned systems such as UAVs and UGVs. Thus, it is still insufficient to consider only partial constraints.
Motion planning for USVs requires that all dynamic constraints be considered. The planning results are based on the motion characteristics of the USV and can be used in practical applications. Most USVs are equipped with limited propellers and rudders, which means USVs are underactuated systems [18]. Motion planning can be applied to underactuated systems in two general approaches [19]. The first approach consists of two steps [20]: Initially, an ideal route is determined by a route planning algorithm. Next, a control system model satisfying all dynamic constraints is designed to drive an underactuated system to its destination. The key to this approach lies in whether the motion control system can approximate the planned route. Essentially, this is an approach to indirect motion planning. Another approach is based on random sampling, such as the RRT algorithm and its variants [21,22,23,24]. The RRT algorithm is suitable for underactuated USVs because the extended new nodes are subject to dynamic constraints. They can be adapted to the target state by different control inputs. Ghosh et al. [25] proposed a bi-directional RRT (Bi-RRT) based kinematic constrained path planning algorithm. A limited number of nodes can be generated without sacrificing accuracy, and smooth trajectory generation can be achieved by incorporating kinematic constraints. Blanco et al. [26] developed a new RRT algorithm based on the trajectory parameter space (TP-space). The scheme establishes a navigation tree with poses as nodes whose edges are all kinematically feasible paths. Wang et al. [27] similarly proposed a method for asymptotically optimizing the kinematic constraints based on Bi-RRT. All three methods apply the control inputs u = ( v , w ) to the path planning process, which results in a smoother path. However, in addition to the large inertia, large drag, and long response time, environmental disturbances such as wind, waves, and currents should be taken into consideration. For this reason, the random sampling-based approach needs to be further improved before it can be applied to the problem of USV motion planning.
In recent years, several scholars have examined the motion planning of underactuated equipment in the water. Du et al. [19] proposed a trajectory cell approach. This approach effectively bridges the gap between the search algorithm and the USV model, as well as achieving fine motion control in small-range scenarios. Han et al. [28] proposed a predicted trajectory approach, which takes into account all the dynamic constraints of the USV. On the basis of the predicted trajectory method, an enhancement of the global path guidance strategy is injected into the search process to increase the efficiency and accuracy of the search. Nevertheless, as the search area becomes larger, the computation time will increase significantly. Chu et al. [29] propose a path planning method based on deep reinforcement learning, which is able to overcome the disturbance of currents in an unknown environment and guide the autonomous underwater vehicle (AUV) through obstacle avoidance and to its destination. Mahmoud Zadeh et al. [30] developed a novel method of uninterrupted path planning. In order to complete a smooth circuit around the mission area, this system performs uninterrupted sampling tasks and prevents sharp changes in the USV’s heading angle. In the study of multiple USVs’ collaborative path planning problems, Tan et al. [31] considered the heterogeneities of USVs while proposing an adaptive adjustable fast marching square method based on fast marching (FM).
The contributions of this research in the field of USV motion planning can be summarized as follows: (i) a state prediction rapidly exploring random tree (spRRT) algorithm is proposed to perform motion planning for USV. This is an RRT algorithm that considers complete dynamic constraints, which is based on the maneuvering mathematical model of USV motion to predict reachable navigational state information (position, yaw angle, speed, etc.). (ii) An asymptotical optimization strategy relating to the elliptic domain is employed to enhance the sampling aspect of the algorithm in order to improve search efficiency and save path costs. Depending on the obstacle environment, spRRT-Informed is capable of setting different types of elliptic sampling domains prior to random sampling. (iii) we set up simulations for the proposed method at the original scale of 1:1.
The remainder of this paper is organized as follows: In Section 2, a mathematical model is presented briefly for describing USV motion under environmental perturbations, and a description of the problem of motion planning is given. Section 3 presents the theory related to spRRT and spRRT-Informed algorithms. Simulation results for three obstacle environments and a realistic scenario are presented and discussed in Section 4. Concluding remarks about our work are given in Section 5.

2. Preliminaries

2.1. USV Motion Mathematical Model

The motion of the underactuated USV actually behaves as a 6-degree-of-freedom spatial motion with a strong coupling phenomenon. In motion planning problems, the USV navigation process can be regarded as the 3-degree-of-freedom motion of a rigid body in the plane (surge, sway, and yaw). In order to simplify the model, two assumptions are made in this paper:
(1)
USV is symmetric about the longitudinal section amidships. The rigid body mass is constant and uniformly distributed.
(2)
Ignore the higher order damping terms and assume that the restoring force matrix is a zero array.
The USV motion is simulated by a mathematical model [32,33] based on Newtonian and Lagrangian mechanics, described as follows:
M ν ˙ + C ν ν + D ν ν = τ m a n + τ e n v
η ˙ = R ψ ν
R ψ = cos ψ sin ψ 0 sin ψ cos ψ 0 0 0 1
where ν = u , v , r and η = x , y , ψ represent the velocity (in the body reference system) and position (in the inertial reference system) in plane motion, respectively, as shown in Figure 1. ν and η are interconverted by Formula (2). M = M R B + M A is the system inertia matrix, consisting of rigid body inertia and hydrodynamic added inertia. C ν = C ν R B + C ν A is the centrifugal and Coriolis forces and moments acting on the ship. It is only effective when certain steering maneuvers are performed by the USV. D ν is the hydrodynamic damping forces and moments acting on the ship, ensuring that the system output is bounded.
The correlation coefficient matrix in Formula (1) is expressed as follows:
M = m X u ˙ 0 0 0 m Y v ˙ m x g Y r ˙ 0 m x g Y r ˙ I z N r ˙ = m 11 0 0 0 m 22 m 23 0 m 32 m 33
C ν = 0 0 m 22 v + m 23 r 0 0 m 11 u m 22 v + m 23 r m 11 u 0
D = X u 0 0 0 Y v Y r 0 Y r N r
where m is the full ship mass of the USV, I z is the rotational inertia, X , Y and N represent the hydrodynamic coefficient. In Formula (1), the right part of the equal sign is the external input force and moment, which τ m a n is the control input of the ship maneuvering system, and the environmental disturbance τ e n v . We consider a current field [34] with a fixed velocity and direction as an environmental disturbance in this paper. As shown in Figure 1, assuming that the current velocity U c and current direction angle β c are constant in the inertial system X i O i Y i . The current velocity in the x-axis and y-axis directions are calculated, respectively, as follows:
v c x = U c cos β c v c y = U c sin β c
The influence of the current field in the USV motion planning should be considered in terms of both current direction and current velocity. In Figure 1, it is assumed that the USV velocity U at O b , and the course angle relative to the axis O i X i is χ . The effect of the current field on the USV will be reflected in its sailing speed. V x and V y are the projections of the USV on the axis O i X i and the axis O i X i , respectively. They can be calculated by Formula (8).
V x = U cos χ + v c x V y = U sin χ + v c y

2.2. Motion Planning Formulation

The global map is shown in Figure 2. This map is provided by Google Map, and the location is Dishui Lake in Lin-gang Special Area, Shanghai. Let X denote the state space, X o b s X denote the obstacle space, and the free space is represented by a subset X f r e e = X / X o b s . Motion planning aims to identify a collision-free path from the start point to the goal region on the global map. All dynamic constraints must be satisfied by this path. Let U n denote the control space, and finding a path can be regarded as finding a set of motion control inputs u : 0 , T U . The Eulerian integral representation is used in this study to express the USV motion dynamic expression:
x t + 1 = f x t , u t
where u t U , x t and x t + 1 denote the two neighboring states, respectively. For any t 0 , T under x : 0 , T X f r e e , x 0 = x s t a r t , x T X g o a l , the planning path is feasible if all satisfy x t X f r e e .

3. Main Algorithms

In this section, the proposed spRRT algorithm and its enhanced spRRT-Informed are described in detail. The basic RRT algorithm is improved by an extension rule based on state prediction to obtain the spRRT algorithm. In order to enhance the search efficiency, an; improved elliptic sampling domain strategy is used to obtain the spRRT-Informed algorithm.

3.1. Extension Rule Based on State Prediction

RRT algorithm discretizes the continuous space by extending a step size. However, the basic RRT algorithm does not consider the actual manipulability of USV when setting the extension step. It adopts the extension rule that is reachable in all directions, which will largely reduce the adaptability of the planning results on the USV platform. In this paper, we retain the basic RRT topology tree notation as T W , which is responsible for exploring the space. An additional tree [21] generated by the USV motion mathematical model is noted as T S , which is responsible for the auxiliary extension. Considering that the lateral thrust acting on the underactuated USV is small during the motion of the USV, the lateral thrust is assumed to be zero. In order to simplify the model, the USV is configured to be fully propelled, and the longitudinal thrust is set to be a constant. A control moment space M s [28] is formed by only retaining the yaw moment as a control input.
Extend function based on state prediction is shown in Algorithm 1.
Algorithm 1 Extend function
1.  Function  E x t e n d T W , T S , q r a n d , M s
2.       Q n e a r e s t N e a r e s t N e i g h b o u r T W , q r a n d ;
3.       Q n e w S t e e r Q n e a r e s t , q r a n d ;
4.      if  O b s t a c l e F r e e Q n e a r e s t , Q n e w  then
5.        for each moment τ r i in M s  do
6.           X n e w P r e d i c t e d S t a t e Q n e w , τ r i ;
7.          if T r a j e c t o r y F r e e X n e w  then
8.             T W . A d d Q n e w ;
9.             T S . A d d Q n e w ;
10.  return  X n e w , Q n e w ;
11.  End Function
In Algorithm 1, Line 2–3, space is extended in the same manner as in the basic RRT algorithm. As shown in Figure 3a, q r a n d is obtained by sampling the entire space at random. Q n e a r e s t is determined by traversing the entire T W tree ( T W tree nodes are marked with capital letters Q). In order to obtain the extended node Q n e w , the tree is grown step by step starting from Q n e a r e s t .
Algorithm 1, Line 4 detects whether the proposed extended node Q n e w collides with an obstacle. If there is no collision, it temporarily connects Q n e w to the nearest T W tree node by a dashed line and goes on to the next step.
In Algorithm 1, Line 5–6, the state points of USV are predicted based on the mapping of Q n e a r e s t in the T S tree (i.e., it is both a single and a full mapping) based on X i n i t (the nodes of the T S tree are denoted by capital letters X). Initially, the moment space M s is discretized into a series of feasible yaw moments, each denoted as τ r i . In this case, Formula (10) is obtained by updating Formula (9), where x 0 denotes the state property of X i n i t , t refers to the prediction time, and k = [1, 2, … , 10] indicates the number of predicted state points for a single yaw moment. According to Formulas (1), (2), and (10), the predicted USV motion states are shown in Figure 3b. An effective extended region is established by using Q n e w as the center of a circle and Er as the radius. As shown in Figure 3c, the predicted state point falling within it is noted as X n e w .
x = x 0 + 0 k * t f x 0 , τ r d t
In Algorithm 1, Line 7–8, it is determined whether the trajectory property of X n e w collides with an obstacle. X n e w is inserted into the T S tree if there is no collision. In the meantime, Q n e w is inserted into the T W tree to complete this extension, as shown in Figure 3d.

3.2. Sampling Performance Enhancement

The RRT algorithm is susceptible to blind sampling and low search efficiency if it is explored randomly in the space. In other words, there is no probability that the RRT algorithm will construct an optimal path within a finite number of iterations [35]. In order to enhance the sampling aspect of the algorithm flow, an asymptotical optimization strategy [35,36] is used. The Informed-RRT* algorithm is composed of two phases, the initial path-finding phase and the initial path being found phase. In the previous phase, the process is the same as that in the basic RRT algorithm. In the later phase, the elliptic sampling domain is determined based on the found path length, the start point, and the goal position, as well as the distance c min between these two points, as shown in Figure 4. The long-axis distance of the elliptic sampling domain is the current path c b e s t , whereas the short-axis distance is c b e s t 2 c m i n 2 .
Considering the properties of an ellipse, the distance between the points within the domain and the two focal points is longer than the distance between the points on the side of the ellipse. As a result, the total length of the paths generated within the elliptic sampling domain will be shorter than the length of the paths generated outside of the elliptical sampling domain. A reduction in the length of the path c b e s t is persistently observed as the algorithm searches. In this approach, the elliptical sampling domain is continually reduced, which ultimately results in optimization.
This study proposed a strategy for the improvement of the elliptic sampling domain based on the complexity of the map environment. The elliptic sampling domain is set in the above manner when no obstacle stands between the start point and the goal position. If the path between these two is blocked by obstacles, a double elliptic sampling domain should be used instead of the single elliptic sampling domain. Initially, a transition point is established in the approximate center of the map. Next, an elliptic sampling domain is constructed with the start point and transition point as focal points. Furthermore, as shown in Figure 5, another elliptic sampling domain is constructed with the transition point and goal position as focal points. The purpose of this setup is to increase the sampling probability of the center of the sampling domain (as shown in Figure 5) while maintaining the advantages of a single ellipse sampling domain. Due to the fact that optimal paths often require intermediate positions. Thus, the number of excellent nodes can be increased by increasing the sampling probability of the middle region. The algorithm is improved in terms of its ability to seek optimization.

3.3. Algorithm Summary

The flow of the spRRT-Informed algorithm is shown in Algorithm 2. An example of spRRT-Informed trace is shown in Figure 6.
Algorithm 2 spRRT-Informed
Input: Q i n i t , X i n i t , X g o a l , X c e n t e r , map, M s
Output: X b e s t , c b e s t
1.   T W Q i n i t
2.   T S X i n i t
3.  Flag i s F r e e Q i n i t , X g o a l
4.  while ( i t e r m a x )
5.      if Flag == TRUE then
6.         c b e s t R R T p l a n n e r Q i n i t , X g o a l , m a p ;
7.         q r a n d R a n d o m S a m p l e c b e s t , m a p ;
8.         X n e w , Q n e w E x t e n d T W , T S , q r a n d , M s ;
9.         T W , T S U p d a t e S t r u c t u r e T W , T S ;
10.      if Flag == FALSE then
11.         c b e s t 1 , c b e s t 2 R R T p l a n n e r Q i n i t , X c e n t e r , X g o a l , m a p ;
12.         q r a n d R a n d o m S a m p l e c b e s t 1 , c b e s t 2 , m a p ;
13.         X n e w , Q n e w E x t e n d T W , T S , q r a n d , M s ;
14.         T W , T S U p d a t e S t r u c t u r e T W , T S ;
15.  return;
(1)
Initialization Stage, Line 1–2, Algorithm 2: The spRRT-Informed algorithm maintains both the spatial search tree T W and the auxiliary extension tree T S . The root nodes of both trees, Q i n i t and X i n i t , are initialized at the start point.
(2)
Sampling Stage, Line 3, 5–7 or Line 3, 10–12, Algorithm 2: For the purpose of conducting official sampling, it is necessary to determine whether obstacles prevent access to the goal position and the start point. As described in Section 3.2, if the concatenation is blocked, X c e n t e r is initialized and the double elliptic sampling domain is used. Conversely, a single elliptic sampling domain is used. Different types of elliptic domains follow similar sampling steps: The shortest distance c b e s t (the two distances in the case of the double elliptic sampling domain, c b e s t 1 and c b e s t 2 ) is output by the basic RRT algorithm and saved in the database. After the elliptic sampling domain is constructed, the random position q r a n d is sampled and output. The value of c b e s t (the two distances in the case of the double elliptic sampling domain, c b e s t 1 and c b e s t 2 ) is updated only when the basic RRT outputs a shorter distance.
(3)
Extension Stage, Line 8 or Line 13, Algorithm 2: This stage has been described in Section 3.1 in more detail. As shown in Figure 6, the blue dashed line indicates the predicted states. If X n e w falls within the goal region, then the path will be backtracked to the start point. According to Figure 6, the path produced by the backtracking is valid.
(4)
Optimization Stage, Line 9 or Line 14, Algorithm 2: Because of the inclusion of flow field disturbances, the path cost is replaced by the time cost [37]. In order to reduce time costs, the structure of the two trees is optimized at the end of each iteration. If a child node is unfeasible, it can be repropagated or deleted [38]. During each iteration, the success rate of extending the predicted states can only be increased by as many child nodes as possible. Figure 7 illustrates the process of optimizing the tree structure: As shown in Figure 7a, an optimization region is defined with the node Q n e w as its center and O r as its radius. A traversal of the T W tree is performed in order to identify all nodes within the optimization region except for the parent node of Q n e w . Next, the T S tree mapping X n e w of Q n e w is used as the initial state to predict states. If the cost of the replacement state point is less than the original cost, as shown in Figure 7b,c, the wiring of the two trees is updated. In the end, the parents of the updated node in both trees are passed to the child as new parents, thus ending this optimization.

4. Simulation Results

In order to verify the superiority of the algorithm, simulations are conducted in three different types of obstacle environments. Simulation in Dishui Lake scenario is performed to test the ability of the spRRT-Informed algorithm to simulate the real application. All algorithms are implemented in MATLAB 2021b and executed on Intel Core 7 CPU 2.2 GHz with 16 GB RAM.
Considering the underactuated nature of USV, CybershipII [39] is used as a simulation experimental subject in this study. CybershipII has a maximum speed of 0.581 m/s, a full ship mass of 23.8 kg, a length of 1.255 m, and a width of 0.29 m. Due to the size of CybershipII, the environmental scale is set at 50 m × 50 m. As shown in Table 1, the parameters related to the prediction state are presented. Parameters related to RRT are: step size is 3 m, tree structure optimization radius O r is 5 m, and prediction effective radius E r is 0.5 m.

4.1. Performance Analysis of Algorithms

4.1.1. Scenario 1

We set up three obstacles of different configurations. The start point is [5,5], the goal region consists of a circle with coordinates [45,45] as the center and 3 m as the radius, and the initial state of the USV is [0,0,0,5,5,0]. The simulation results for the four algorithms RRT*, Informed-RRT*, spRRT, and spRRT-Informed when the maximum number of iterations is set to 1000 are shown in Figure 8.
Despite the fact that the RRT* algorithm can obtain the path in a short time, the path shown in Figure 8a has many redundant nodes. As a result of the lack of consideration of dynamic constraints on USV in the extension operation, most newly created nodes become unfeasible. For example, many steering angles on the path are beyond the USV’s actual performance range. Compared with the RRT* algorithm, the spRRT algorithm and spRRT-Informed algorithm can output smooth and feasible paths considering the USV complete dynamic constraints. Each of the four algorithms is tested 100 times and the resulting path characteristic parameters are shown in Table 2.
As the USV dynamic constraint is not considered, the sailing time of RRT* or Informed-RRT* cannot be calculated. The inclusion of the USV motion model improves steering performance by over 40.645%. The simulation results of spRRT and spRRT-Informed demonstrate that two parameters, the path distance and steering angle, can be applied to USV. Compared to spRRT, spRRT-Informed with a double elliptic sampling domain has an average reduction of 14.051% in the performance parameter of sailing time. The standard deviation is reduced by 90.074%. In the performance parameter of distance, spRRT-Informed is on average 13.134% shorter compared to spRRT, and the standard deviation is reduced by 86.708%.

4.1.2. Scenario 2

In scenario 2, the line from the start point to the goal region is blocked by obstacles. All obstacles need to be “bypassed”. The start point is [5,35], the goal region consists of a circle with coordinates [45,10] as the center and 3 m as the radius, and the initial state of the USV is [0,0,0,5,35,−pi/2]. When the maximum number of iterations is set to 1000, the simulation results comparing the four algorithms of RRT*, Informed-RRT*, spRRT, and spRRT-Informed are shown in Figure 9. Each of the three algorithms is tested 100 times and the resulting path characteristics parameters are shown in Table 3.
In scenario 2, the inclusion of the USV motion model improves steering performance by over 72.563%. In the performance indicator of sailing time, the spRRT-Informed has an average reduction of 12.377% compared to the spRRT. The standard deviation is reduced by 84.887%. In the performance indicator of distance, spRRT-Informed is on average 6.636% shorter compared to spRRT. The standard deviation is reduced by 47.554%. According to the analysis of the simulation results in Scenario 1, spRRT-Informed offers a significant advantage in terms of algorithm exploration performance over spRRT. As shown in Figure 10, in the case of different elliptic domains, the sailing time of optimal paths is examined at 100 intervals over a maximum of 1000 iterations. It is evident from the descent curves in the figure that, in a “bypassed” environment, the double elliptic sampling domain performs better in finding the optimal solution.

4.1.3. Scenario 3

An environment in which the line from the start point to the goal position is not blocked by obstacles. The start point is [5,42], the goal region consists of a circle with coordinates [45,5] as the center and 3 m as the radius, and the initial state of the USV is [0,0,0,5,42,−pi/4]. When the maximum number of iterations is set to 1000, the simulation results comparing the four algorithms of RRT*, Informed-RRT*, spRRT, and spRRT-Informed are shown in Figure 11. Each of the three algorithms is tested 100 times and the resulting path characteristics parameters are shown in Table 4.
In the performance indicator of sailing time, the spRRT-Informed has an average reduction of 7.374% compared to the spRRT. The standard deviation is reduced by 67.056%. In the performance indicator of distance, spRRT-Informed is on average 7.008% shorter compared to spRRT. The standard deviation is reduced by 67.073%. In scenario 3, a single elliptic sampling domain is selected because there is no obstruction in the line between the start point and the goal region. As shown in Figure 12, when the double elliptic sampling domain is used, the optimal paths are viewed at 100 intervals over 1000 maximum iterations. It can be concluded from the time cost values shown in Figure 12 that the use of a double elliptical sampling domain can improve the overall convergence by searching for better paths with fewer iterations.

4.1.4. Dishui Lake scenario

Due to the scale of the Dishui Lake scenario being 630 times that of the three obstacle scenarios, intermediate waypoints (shown in Figure 13a) are set accordingly. The start point is [1520,230], the goal region consists of a circle with coordinates [300,300] as the center and 3 m as the radius, and the initial state of the USV is [0.5,0,0,1520,230,−pi/4].
The goal region is eventually reached by cruising each waypoint. The result of spRRT-Informed for motion planning is demonstrated in Figure 13b. spRRT-Informed can plan a time-parametrized continuous path for USV in a real-world scenario. This path has no collisions and is a feasible path from the start point to the goal region. As shown in Figure 14, during the planning process, the information on each status point of the USV is displayed. It can be seen from various data that there is no sudden start and stop or sharp change in heading angle, which verifies the stability of USV navigation. Therefore, the spRRT-Informed algorithm can be used as a reference for practical applications.
The simulations above are all performed while maintaining the original size of the USV and without adjusting the resolution of the map. USV motion planning is tested with three small-scale obstacle scenarios at 50 m by 50 m. The spRRT-Informed is capable of supporting simulations related to traction simulation in the Dishui Lake scenario. Simulation results confirm the theoretical feasibility of the method being applied to real USV autonomous navigation. However, spRRT and spRRT-Informed can only be used for motion planning in situations in which global information is available. It is necessary to improve the algorithms when dynamic obstacles or time-varying environmental disturbances are present in the scene.

5. Conclusions

In this paper, we propose spRRT based on the RRT algorithm and its improved spRRT-Informed for USV motion planning. The complete dynamic constraints of the USV are taken into account in the proposed methods. The spRRT improves the extended link of the basic RRT algorithm by incorporating the USV manipulative motion mathematical model. In order to improve search efficiency and save path costs, the elliptic sampling domain in spRRT-Informed is set to optimize sampling based on the type of obstacle environment.
According to the simulation results obtained in three types of obstacle environments, spRRT and spRRT-Informed algorithms solve the problem of planning paths that do not match the actual performance of USVs. The spRRT-Informed with optimized sampling shows better performance in terms of path characteristics, with more than 30% improvement in algorithmic search performance over spRRT. The optimization performances of single and double elliptic domains are also compared in the scenario 3 simulation. The comparison result shows that the double elliptic domain gives the algorithm faster convergence. Simulation in the Dishui Lake scenario validates the practical feasibility of the spRRT-Informed algorithm.
The time cost is used as a reference for evaluating the path since perturbations in the flow field are considered. The USV may be able to avoid unnecessary energy consumption in future practical applications as a result of this. However, as shown in Figure 12b, considering only the time cost requires a certain amount of path smoothness and security to be sacrificed. Therefore, in future research, the problem of the interaction and implication of optimization objectives such as time cost, path smoothness, and path security arising from the motion planning process needs to be addressed.

Author Contributions

Conceptualization, S.M. and P.Y.; methodology, S.M. and P.Y.; software, S.M.; validation, D.G. and C.B.; writing—original draft preparation, S.M.; writing—review and editing, P.Y., D.G., C.B. and Z.W.; funding acquisition, D.G. All authors have read and agreed to the published version of the manuscript.

Funding

This research received no external funding.

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

Not applicable.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Liu, Y.; Bucknall, R.; Zhang, X. The fast marching method based intelligent navigation of an unmanned surface vehicle. Ocean Eng. 2017, 142, 363–376. [Google Scholar] [CrossRef] [Green Version]
  2. Wang, N.; Sun, Z.; Yin, J.; Zou, Z.; Su, S.-F. Fuzzy unknown observer-based robust adaptive path following control of underactuated surface vehicles subject to multiple unknowns. Ocean Eng. 2019, 176, 57–64. [Google Scholar] [CrossRef]
  3. Guan, G.; Wang, L.; Geng, J.; Zhuang, Z.; Yang, Q. Parametric automatic optimal design of usv hull form with respect to wave resistance and seakeeping. Ocean Eng. 2021, 235, 109462. [Google Scholar] [CrossRef]
  4. Feng, Z.; Pan, Z.; Chen, W.; Liu, Y.; Leng, J. Usv application scenario expansion based on motion control, path following and velocity planning. Machines 2022, 10, 310. [Google Scholar] [CrossRef]
  5. Yu, K.; Liang, X.-F.; Li, M.-Z.; Chen, Z.; Yao, Y.-L.; Li, X.; Zhao, Z.-X.; Teng, Y. Usv path planning method with velocity variation and global optimisation based on ais service platform. Ocean Eng. 2021, 236, 109560. [Google Scholar] [CrossRef]
  6. Zhou, C.H.; Gu, S.D.; Wen, Y.Q.; Du, Z.; Xiao, C.S.; Huang, L.; Zhu, M. The review unmanned surface vehicle path planning: Based on multi-modality constraint. Ocean Eng. 2020, 200, 14. [Google Scholar] [CrossRef]
  7. Aggarwal, S.; Kumar, N. Path planning techniques for unmanned aerial vehicles: A review, solutions, and challenges. Comput. Commun. 2020, 149, 270–299. [Google Scholar] [CrossRef]
  8. Majeed, A.; Lee, S. A fast global flight path planning algorithm based on space circumscription and sparse visibility graph for unmanned aerial vehicle. Electronics 2018, 7, 375. [Google Scholar] [CrossRef] [Green Version]
  9. Mao, S.; Yang, P.; Gao, D.; Liu, Z. Global path planning for unmanned surface vehicle based on bacterial foraging-improved ant colony hybrid algorithm. Control Eng. China 2022, 1, 1–9. [Google Scholar] [CrossRef]
  10. Song, R.; Liu, Y.; Bucknall, R. Smoothed a* algorithm for practical unmanned surface vehicle path planning. Appl. Ocean Res. 2019, 83, 9–20. [Google Scholar] [CrossRef]
  11. Niu, H.; Lu, Y.; Savvaris, A.; Tsourdos, A. Efficient path planning algorithms for unmanned surface vehicle. IFAC-PapersOnLine 2016, 49, 121–126. [Google Scholar] [CrossRef]
  12. Wu, G.; Atilla, I.; Tahsin, T.; Terziev, M.; Wang, L. Long-voyage route planning method based on multi-scale visibility graph for autonomous ships. Ocean Eng. 2021, 219, 108242. [Google Scholar] [CrossRef]
  13. Yao, P.; Zhao, R.; Zhu, Q. A hierarchical architecture using biased min-consensus for usv path planning. IEEE Trans. Veh. Technol. 2020, 69, 9518–9527. [Google Scholar] [CrossRef]
  14. Zhao, L.; Wang, F.; Bai, Y. Route planning for autonomous vessels based on improved artificial fish swarm algorithm. Ships Offshore Struct. 2022. [Google Scholar] [CrossRef]
  15. Wang, N.; Jin, X.Z.; Er, M.J. A multilayer path planner for a usv under complex marine environments. Ocean Eng. 2019, 184, 1–10. [Google Scholar] [CrossRef]
  16. Svec, P.; Schwartz, M.; Thakur, A.; Gupta, S.K. Trajectory planning with look-ahead for unmanned sea surface vehicles to handle environmental disturbances. In Proceedings of the 2011 IEEE/RSJ International Conference on Intelligent Robots and Systems, San Francisco, CA, USA, 25–30 September 2011; pp. 1154–1159. [Google Scholar]
  17. Gao, D.; Zhou, P.; Shi, W.; Wang, T.; Wang, Y. A Dynamic Obstacle Avoidance Method for Unmanned Surface Vehicle under the International Regulations for Preventing Collisions at Sea. J. Mar. Sci. Eng. 2022, 10, 901. [Google Scholar] [CrossRef]
  18. Du, Z.; Wen, Y.; Xiao, C.; Zhang, F.; Huang, L.; Zhou, C. Motion planning for Unmanned Surface Vehicle based on Trajectory Unit. Ocean Eng. 2018, 151, 46–56. [Google Scholar] [CrossRef]
  19. Du, Z.; Wen, Y.; Xiao, C.; Huang, L.; Zhou, C.; Zhang, F. Trajectory-cell based method for the unmanned surface vehicle motion planning. Appl. Ocean Res. 2019, 86, 207–221. [Google Scholar] [CrossRef]
  20. La Valle, S.M. Motion Planning. IEEE Robot. Autom. Mag. 2011, 18, 108–118. [Google Scholar] [CrossRef]
  21. Moon, C.-B.; Chung, W. Kinodynamic Planner Dual-Tree RRT (DT-RRT) for Two-Wheeled Mobile Robots Using the Rapidly Exploring Random Tree. IEEE Trans. Ind. Electron. 2014, 62, 1080–1090. [Google Scholar] [CrossRef]
  22. Wang, J.; Chi, W.; Li, C.; Meng, M.Q.-H. Efficient Robot Motion Planning Using Bidirectional-Unidirectional RRT Extend Function. IEEE Trans. Autom. Sci. Eng. 2021, 19, 1859–1868. [Google Scholar] [CrossRef]
  23. Chiang, H.-T.L.; Hsu, J.; Fiser, M.; Tapia, L.; Faust, A. RL-RRT: Kinodynamic Motion Planning via Learning Reachability Estimators from RL Policies. IEEE Robot. Autom. Lett. 2019, 4, 4298–4305. [Google Scholar] [CrossRef] [Green Version]
  24. Li, Y.; Cui, R.; Li, Z.; Xu, D. Neural Network Approximation Based Near-Optimal Motion Planning with Kinodynamic Constraints Using RRT. IEEE Trans. Ind. Electron. 2018, 65, 8718–8729. [Google Scholar] [CrossRef]
  25. Ghosh, D.; Nandakumar, G.; Narayanan, K.; Honkote, V.; Sharma, S. Kinematic Constraints Based Bi-directional RRT (KB-RRT) with Parameterized Trajectories for Robot Path Planning in Cluttered Environment. In Proceedings of the 2019 International Conference on Robotics and Automation (ICRA), Montreal, QC, Canada, 20–24 May 2019; pp. 8627–8633. [Google Scholar] [CrossRef]
  26. Blanco, J.L.; Bellone, M.; Gimenez, A. TP-Space RRT—Kinematic Path Planning of Non-Holonomic Any-Shape Vehicles. Int. J. Adv. Robot. Syst. 2015, 12, 55. [Google Scholar] [CrossRef]
  27. Wang, J.; Li, B.; Meng, M.Q.-H. Kinematic Constrained Bi-directional RRT with Efficient Branch Pruning for robot path planning. Expert Syst. Appl. 2020, 170, 114541. [Google Scholar] [CrossRef]
  28. Han, S.; Wang, L.; Wang, Y.; He, H. An efficient motion planning based on grid map: Predicted Trajectory Approach with global path guiding. Ocean Eng. 2021, 238, 109696. [Google Scholar] [CrossRef]
  29. Chu, Z.; Wang, F.; Lei, T.; Luo, C. Path Planning Based on Deep Reinforcement Learning for Autonomous Underwater Vehicles Under Ocean Current Disturbance. IEEE Trans. Intell. Veh. 2022, 8, 108–120. [Google Scholar] [CrossRef]
  30. MahmoudZadeh, S.; Abbasi, A.; Yazdani, A.; Wang, H.; Liu, Y. Uninterrupted path planning system for Multi-USV sampling mission in a cluttered ocean environment. Ocean Eng. 2022, 254, 111328. [Google Scholar] [CrossRef]
  31. Tan, G.; Zhuang, J.; Zou, J.; Wan, L. Adaptive adjustable fast marching square method based path planning for the swarm of heterogeneous unmanned surface vehicles (USVs). Ocean Eng. 2023, 268, 113432. [Google Scholar] [CrossRef]
  32. Breivik, M. Nonlinear Maneuvering Control of Underactuated Ships. Master’s Thesis, Norwegian University of Science and Technology, Trondheim, Norway, 2003; pp. 10–30. [Google Scholar]
  33. Fossen, T.I. Handbook of Marine Craft Hydrodynamics and Motion Control; John Wiley & Sons: New York, NY, USA, 2011. [Google Scholar]
  34. Ma, Y.; Hu, M.; Yan, X. Multi-objective path planning for unmanned surface vehicle with currents effects. ISA Trans. 2018, 75, 137–156. [Google Scholar] [CrossRef]
  35. Karaman, S.; Frazzoli, E. Sampling-based algorithms for optimal motion planning. Int. J. Robot. Res. 2011, 30, 846–894. [Google Scholar] [CrossRef] [Green Version]
  36. Gammell, J.D.; Srinivasa, S.S.; Barfoot, T.D. Informed rrt: Optimal sampling-based path planning focused via direct sampling of an admissible ellipsoidal heuristic. In Proceedings of the 2014 IEEE/RSJ International Conference on Intelligent Robots and Systems, Chicago, IL, USA, 14–18 September 2014; pp. 2997–3004. [Google Scholar]
  37. Guo, X.; Ji, M.; Zhao, Z.; Wen, D.; Zhang, W. Global path planning and multi-objective path control for unmanned surface vehicle based on modified particle swarm optimization (PSO) algorithm. Ocean Eng. 2020, 216, 107693. [Google Scholar] [CrossRef]
  38. Jeon, J.H.; Karaman, E.S.; Frazzoli, E. Anytime computation of time-optimal off-road vehicle maneuvers using the rrt. In Proceedings of the 2011 50th IEEE Conference on Decision and Control and European Control Conference, Orlando, FL, USA, 12–15 December 2011; pp. 3276–3282.
  39. Skjetne, R.; Smogeli, Ø.N.; Fossen, T.I. A Nonlinear Ship Manoeuvering Model: Identification and adaptive control with experiments for a model ship. Model. Identif. Control 2004, 25, 3–27. [Google Scholar] [CrossRef] [Green Version]
Figure 1. Diagram of USV motion under fixed current field disturbance.
Figure 1. Diagram of USV motion under fixed current field disturbance.
Jmse 11 00687 g001
Figure 2. Conversion from the satellite image to binarization map: (a) the Dishui Lake partial (location: 30°53′34.51″ N, 121°55′52.59″ E, width: 1750 m, height: 900 m); (b) the binarization map.
Figure 2. Conversion from the satellite image to binarization map: (a) the Dishui Lake partial (location: 30°53′34.51″ N, 121°55′52.59″ E, width: 1750 m, height: 900 m); (b) the binarization map.
Jmse 11 00687 g002
Figure 3. Extension rules based on state prediction: (a) extending Q n e w node; (b) predicting states; (c) determining validity; (d) extending X n e w node.
Figure 3. Extension rules based on state prediction: (a) extending Q n e w node; (b) predicting states; (c) determining validity; (d) extending X n e w node.
Jmse 11 00687 g003
Figure 4. Single elliptic domain.
Figure 4. Single elliptic domain.
Jmse 11 00687 g004
Figure 5. Double elliptic domain.
Figure 5. Double elliptic domain.
Jmse 11 00687 g005
Figure 6. An example of spRRT-Informed trace.
Figure 6. An example of spRRT-Informed trace.
Jmse 11 00687 g006
Figure 7. Optimization of two trees’ structures: (a) establishing an optimization region; (b) determining validity; (c) updating structures of T W and T S .
Figure 7. Optimization of two trees’ structures: (a) establishing an optimization region; (b) determining validity; (c) updating structures of T W and T S .
Jmse 11 00687 g007
Figure 8. Results of path under scenario 1: (a) RRT*; (b) Informed-RRT*; (c) spRRT; (d) spRRT-Informed.
Figure 8. Results of path under scenario 1: (a) RRT*; (b) Informed-RRT*; (c) spRRT; (d) spRRT-Informed.
Jmse 11 00687 g008aJmse 11 00687 g008b
Figure 9. Results of path under scenario 2: (a) RRT*; (b) Informed-RRT*; (c) spRRT; (d) spRRT-Informed.
Figure 9. Results of path under scenario 2: (a) RRT*; (b) Informed-RRT*; (c) spRRT; (d) spRRT-Informed.
Jmse 11 00687 g009
Figure 10. Comparison of the convergence of two elliptic sampling domains in scenario 2.
Figure 10. Comparison of the convergence of two elliptic sampling domains in scenario 2.
Jmse 11 00687 g010
Figure 11. Results of path under scenario 3: (a) RRT*; (b) Informed-RRT*; (c) spRRT; (d) spRRT-Informed.
Figure 11. Results of path under scenario 3: (a) RRT*; (b) Informed-RRT*; (c) spRRT; (d) spRRT-Informed.
Jmse 11 00687 g011
Figure 12. Comparison of the convergence of two elliptic sampling domains in scenario 3.
Figure 12. Comparison of the convergence of two elliptic sampling domains in scenario 3.
Jmse 11 00687 g012
Figure 13. Simulation result in the Dishui Lake scenario: (a) diagram of intermediate waypoints; (b) global motion planning result for spRRT-Informed.
Figure 13. Simulation result in the Dishui Lake scenario: (a) diagram of intermediate waypoints; (b) global motion planning result for spRRT-Informed.
Jmse 11 00687 g013
Figure 14. Navigation state information of the USV.
Figure 14. Navigation state information of the USV.
Jmse 11 00687 g014
Table 1. Simulation parameters of CybershipII.
Table 1. Simulation parameters of CybershipII.
DescriptionValue
Unit predicted time t 1 s
Period predicted time T 10 s
Resolution of yaw moment τ r 0.02 N × m
Maximum values of yaw moment τ r max 0.2 N × m
Minimum values of yaw momen τ r min −0.2 N × m
Surge force τ u 2 N × m
Longitudinal current field velocity v c x 0.2 m/s
Transverse current field velocity v c y 0.1 m/s
Table 2. Path characteristic parameters under scenario 1.
Table 2. Path characteristic parameters under scenario 1.
MethodsPerformancesMeanMinMaxσ
RRT*Sailing time (s)----
Distance (m)57.55955.496958.9720.908
Steering angle (rad)0.2840.0020.9570.202
Informed-RRT*Sailing time (s)----
Distance (m)55.09954.81856.3850.485
Steering angle (rad)0.1554.795 × 10−40.9370.149
spRRTSailing time (s)124.40106.2138.68.916
Distance (m)71.61861.12092.5768.795
Steering angle (rad)0.09203.338 × 10−42.2640.335
spRRT-
Informed
Sailing time (s)106.92103.8110.00.885
Distance (m)62.21260.11464.3011.169
Steering angle (rad)0.06961.030 × 10−41.0380.229
Table 3. Path characteristics parameters under scenario 2.
Table 3. Path characteristics parameters under scenario 2.
MethodsPerformancesMeanMinMaxσ
RRT*Sailing time (s)----
Distance (m)74.94670.40782.2222.098
Steering angle (rad)0.3828.553 × 10−41.9410.367
Informed-RRT*Sailing time (s)----
Distance (m)71.37269.05872.9890.564
Steering angle (rad)0.3201.850 × 10−41.7660.347
spRRTSailing time (s)176.3150.0258.029.570
Distance (m)100.56380.869139.87115.988
Steering angle (rad)0.08783.103 × 10−41.9680.287
spRRT-
Informed
Sailing time (s)154.48138.0170.44.469
Distance (m)93.89079.636108.5128.385
Steering angle (rad)0.07864.671 × 10−41.3430.259
Table 4. Path characteristics parameters under scenario 3.
Table 4. Path characteristics parameters under scenario 3.
MethodsPerformancesMeanMinMaxσ
RRT*Sailing time (s)----
Distance (m)53.02051.75954.2160.661
Steering angle (rad)0.1654.130 × 10−41.0100.143
Informed-RRT*Sailing time (s)----
Distance (m)52.09851.60852.7910.329
Steering angle (rad)0.0382.230 × 10−40.2260.041
spRRTSailing time (s)99.5491.6112.05.397
Distance (m)57.22452.75664.4533.119
Steering angle (rad)0.05622.110 × 10−41.3270.188
spRRT-
Informed
Sailing time (s)92.289.096.41.778
Distance (m)53.21451.64456.4641.027
Steering angle (rad)0.05711.055 × 10−40.8990.167
Disclaimer/Publisher’s Note: The statements, opinions and data contained in all publications are solely those of the individual author(s) and contributor(s) and not of MDPI and/or the editor(s). MDPI and/or the editor(s) disclaim responsibility for any injury to people or property resulting from any ideas, methods, instructions or products referred to in the content.

Share and Cite

MDPI and ACS Style

Mao, S.; Yang, P.; Gao, D.; Bao, C.; Wang, Z. A Motion Planning Method for Unmanned Surface Vehicle Based on Improved RRT Algorithm. J. Mar. Sci. Eng. 2023, 11, 687. https://doi.org/10.3390/jmse11040687

AMA Style

Mao S, Yang P, Gao D, Bao C, Wang Z. A Motion Planning Method for Unmanned Surface Vehicle Based on Improved RRT Algorithm. Journal of Marine Science and Engineering. 2023; 11(4):687. https://doi.org/10.3390/jmse11040687

Chicago/Turabian Style

Mao, Shouqi, Ping Yang, Diju Gao, Chunteng Bao, and Zhenyang Wang. 2023. "A Motion Planning Method for Unmanned Surface Vehicle Based on Improved RRT Algorithm" Journal of Marine Science and Engineering 11, no. 4: 687. https://doi.org/10.3390/jmse11040687

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