Next Article in Journal
Modelling and Clustering Sea Conditions: Bivariate FiniteMixtures of Generalized Additive Models for Location, Shape, and Scale Applied to the Analysis of Meteorological Tides and Wave Heights
Previous Article in Journal
Vibration Isolation Performance of a Constrained Damping Base for a High-Pressure Plunger Pump
Previous Article in Special Issue
Comparison of Linear and Nonlinear Model Predictive Control in Path Following of Underactuated Unmanned Surface Vehicles
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Trajectory Planning for Cooperative Double Unmanned Surface Vehicles Connected with a Floating Rope for Floating Garbage Cleaning

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. 2024, 12(5), 739; https://doi.org/10.3390/jmse12050739
Submission received: 16 March 2024 / Revised: 26 April 2024 / Accepted: 26 April 2024 / Published: 28 April 2024
(This article belongs to the Special Issue Motion Control and Path Planning of Marine Vehicles—2nd Edition)

Abstract

:
Double unmanned surface vehicles (DUSVs) towing a floating rope are more effective at removing large floating garbage on the water’s surface than a single USV. This paper proposes a comprehensive trajectory planner for DUSVs connected with a floating rope for cooperative water-surface garbage collection with dynamic collision avoidance, which takes into account the kinematic constraints and dynamic cooperation constraints of the DUSVs, which reflects the current collection capacity of DUSVs. The optimal travel sequence is determined by solving the TSP problem with an ant colony algorithm. The DUSVs approach the garbage targets based on the guidance of target key points selected by taking into account the dynamic cooperation constraints. An artificial potential field (APF) combined with a leader–follower strategy is adopted so that the each USV passes from different sides of the garbage to ensure garbage capturing. For dynamic obstacle avoidance, an improved APF (IAPF) combined with a leader–follower strategy is proposed, for which a velocity repulsion field is introduced to reduce travel distance. A fuzzy logic algorithm is adopted for adaptive adjustment of the desired velocities of the DUSVs to achieve better cooperation between the DUSVs. The simulation results verify the effectiveness of the algorithm of the proposed planner in that the generated trajectories for the DUSVs successfully realize cooperative garbage collection and dynamic obstacle avoidance while complying with the kinematic constraints and dynamic cooperation constraints of the DUSVs.

1. Introduction

In recent years, water pollution caused by floating garbage has become increasingly serious and patches of garbage often appear on water surfaces, as shown in Figure 1. It is very important to clean up the garbage in good time [1,2,3]. Currently, the main ways for cleaning water-surface garbage include manual salvage, mechanical salvage, and using clean-up boats. However, the safety risk of manual salvage is high, and cleaning that relies heavily on manual operations is inefficient and costly. Therefore, with the development of advanced technologies, surface garbage cleaning by unmanned surface vehicles [4,5,6] has attracted much research interest. In practice, full coverage of the targeted area is generally required for thorough cleaning, and single USVs are often limited in their capability to handle the tasks of garbage cleaning of a large area and large patches of congregated garbage [7,8,9,10]. Double USVs connected by a floating rope, as shown in Figure 2a, provide stronger load capacity and better fault tolerance and hence are more efficient at cleaning areas where the pollution is serious and garbage appears in patches.
Path planning is a critical part of the autonomous navigation of USVs for ensuring the safety and efficiency of the whole process of operation. It generally aims to generate a collision-free path from the starting point to the target position without explicit consideration of the constraints of vehicle dynamics and timing [11,12]. For multiple USVs conducting cooperative operations, the cooperation constraints between the USVs need to be taken into account, and certain pose relationships between the USVs need to be maintained at each moment [13]. In such cases, trajectory planning is necessary, which is concerned with generating the time-parameterized state trajectories for each USV at each moment. For water-surface garbage cleaning with cooperative double USVs connected with a floating rope, the two USVs are required to operate cooperatively to reach the designated positions for each USV at each time instant; therefore, physical, time, and position constraints need to be fulfilled simultaneously.
In trajectory planning for cooperative multi-USVs, the objectives considered include aspects of shortest travel distance, collision avoidance with safety distance, minimum calculation time, trajectory smoothness, and motion-related collaboration constraints such as collaborative behavior [14]. Collaborative behaviors are categorized into time collaborative behavior and time-and-position collaborative behavior [15,16]. The former requires that each USV leaves or reaches the target area at the same time or in sequence, while the latter requires not only time coordination but also the simultaneous position coordination of each USV, so that the trajectories meet the predefined time and spatial relationship to the greatest extent [17]. However, few pieces of research in the literature have worked on collaborative multi-USVs with physical connections while the movement of each USV is relatively free [18]. Formation control or generating cooperative trajectories for physically connected cooperative USVs is a much more challenging problem due to the extra constraints imposed by the physical connection.
Giron-Sierria et al. [19,20] studied the autonomous double USV towing system for recovering floating oil spills at sea. The Dubins path was used to generate the trajectories for the double USVs, which were composed of straight lines and arcs. Zhu et al. [21] proposed a distance-based cooperative control strategy with dual modes of formation and tracking for double USVs cleaning Enteromorpha. Factors such as power, torques in the floating rope, and interference of water flow were all considered in order to achieve intelligent selection of the operation mode of the double USVs. Jiang Wen [22] proposed a formation method based on heading information fusion and a trajectory tracking method based on null-space behavior fusion to deal with the problem of separation and entanglement in cooperative towing by double USVs. However, the studies mentioned above mainly focused on the formation control and coordinative behaviors of double USVs and considered only tasks of collecting a single pollutant target. The problem of planning cooperative trajectories for double USVs connected with a float rope for the whole task of cleaning a water-surface area with many garbage targets is yet to be solved. In particular, the influence of the relative positions of the two USVs on the load capacity of the floating rope need to be addressed.
During the mission of water-surface floating garbage cleaning, the locations of floating garbage and obstacles such as buoys and water plants change due to environmental disturbances such as wind, currents, and waves. Furthermore, dynamic obstacles may also include boats and animals such as ducks. Hence, it is important to take into account the position changes of garbage targets and obstacles in order to achieve the safe and efficient operation of the whole cleaning process. The trade-off between distance cost and computational consumption is one of the main issues in dealing with real-time planning. In the work by Kong et al. [23] for path planning for a single surface autonomous vehicle for floating garbage cleaning, path re-planning is conducted when changes in the positions of garbage areas are detected by the cooperative UAV and the re-planning point is decided based on a neural network to strike a compromise between distance cost and computational burden. The artificial potential field (APF) has been extensively used for local path planning, such as in dynamic obstacle avoidance. It determines the motion of the USV at the next time step according to the attractive fields of the targets and repulsive fields of obstacles in the surrounding environment and the current state of the USV. Its advantages are its simple structure, good real-time performance, and low computational consumption. However, APF-based methods are not apt at achieving the optimal path in the face of dynamic obstacles. To this end, Gao et al. [24] introduced into the traditional repulsion field function the dynamic distance between the robot and the obstacle and the adjustment factor to solve the problem of unreachable targets. Zhang et al. [25] proposed an improved artificial potential field by introducing a water flow field to solve the problem of unreachable targets. However, there is still a problem with dynamic obstacle avoidance, as the robot tends to bypass the obstacle from the front, leading to longer path lengths and failure in obstacle avoidance. Few pieces of research have studied APF for the cooperative operations of DUSVs, while it is found that the garbage collection problem for physically connected DUSV may be viewed as a special dynamic obstacle avoidance problem to be potentially solved by APF.
Motivated by the problems mentioned above, this paper studies the trajectory planning problem for cooperative double USVs connected with a floating rope for multi-floating garbage collection and dynamic obstacle avoidance. The main challenges to be addressed include the following: (1) Different from garbage collection by a single USV, which passes through the garbage, the floating rope connected to the two USVs needs to bypass the garbage closely from different sides of the garbage separately. (2) For dynamic obstacle avoidance, the double USVs need to pass from the same side of obstacles within a safe distance. (3) The distance between the two USVs needs to be dynamically adjusted to allow enough enclosed area within the floating rope for the current garbage target while maintaining between the minimum and maximum distance to avoid internal collision avoidance and garbage escaping.
Therefore, a comprehensive trajectory planner is proposed for multi-floating garbage collection and dynamic obstacle avoidance, taking into consideration kinematic constraints and dynamic cooperation constraints that reflect the time-varying load capacity of the DUSVs system. The planning assumes prior knowledge of the initial positions of all garbage areas and obstacles with the possible assistance of an unmanned aerial vehicle (UAV) and real-time updating of the positions of the encountered garbage and obstacles based on on-board sensors. An optimal sequence for visiting all the garbage areas is obtained based on the initial positions of the garbage areas. Then, the trajectories of the DUSVs for approaching each garbage area and capturing the garbage while avoiding all encountered obstacles are generated. The main contributions of this paper can be summarized as follows:
(1)
Kinematic constraints of the USV and dynamic cooperation constraint between the DUSVs are considered. The cooperation constraint in terms of distances between the two USVs reflects the current garbage collection capacity of the DUSVs.
(2)
For garbage collection, a method based on APF combined with a leader–follower strategy is proposed to ensure each USV bypasses the garbage from different sides in order to realize garbage capture.
(3)
For dynamic obstacle avoidance, a method based on an improved artificial potential field (APF) combined with a leader–follower strategy is proposed. The velocity repulsion field between DUSVs and dynamic obstacle is introduced to deal with the issue of long trajectories.
(4)
For precise cooperation between the DUSVs, a speed control method based on a fuzzy logic algorithm is proposed for adaptive adjustment of the acceleration and deceleration coefficients for the DUSVs.

2. The Problem Description of DUSVs Garbage Cleaning

Consider the scenario of a water area with multiple large areas of floating garbage and obstacles, both static and dynamic, such as aquatic plants, buoys, and ships. A scene model of water-surface garbage collection by floating-rope-connected DUSVs is established. As illustrated in Figure 2, the DUSVs system ( P 1 , P 2 ) is cooperative in order to perform the autonomous floating garbage cleaning. It assumes that the initial positions of all garbage areas and obstacles are known with the assistance of an unmanned aerial vehicle (UAV), and positions of the encountered garbage and obstacles are updated based on on-board sensors. It aims to determine the cooperative dynamic trajectories of the underactuated DUSVs connected with a floating rope for cleaning all the floating garbage without any collisions with obstacles.
Assume that the start point is S ( x s , y s ) , the end point is E ( x E , y E ) , the center of the garbage target is T i ( x T i , y T i ) , where i = 1 , 2 p , p is the number of garbage targets, and the velocity vector is [ v T x , v T y ] . The center of obstacles is O i ( x O i , y O i ) , where i = 1 , 2 k , k is the number of obstacles and the velocity vector is [ v O x , v O y ] .
The objective for the trajectory planning problem of the DUSVs can be described as generating the two optimal trajectories, τ i d ( t ) = ( x i d , y i d , ψ i d , t ) , i = 1 , 2 , of the DUSVs, starting from the launch point, S, capturing each garbage target, T i , by the DUSVs passing from different sides of the garbage targets separately, avoiding all obstacles, O i , by the two USVs passing from the same side of the obstacle, and finally reaching the end point, E, while abiding with the kinematic and cooperation constraints. The model of the obstacles and garbage targets, along with all the constraints, will be discussed in this section.

2.1. The Model of Obstacle and Garbage Target

2.1.1. Obstacle Model

Due to the uncertainty of obstacles on the water’s surface, it is necessary to reserve a sufficient safe distance between the obstacle and the hull. Therefore, the obstacle is modeled as a circle and expanded to ensure a safe distance. The point set of the obstacle area can be represented as:
Ω O = p O | p O O i 2 ( E O R O ) 2 ,
where p O denotes any point in the obstacle area, R O represents the radius of the obstacle, and E O is the expansion coefficient of the obstacle.

2.1.2. Garbage Target Model

As shown in Figure 3, due to the uncertain shape of the surface garbage irregular garbage is modeled with a circle or an ellipse, which are expanded to ensure that the DUSVs can safely collect the garbage. The point set of the garbage target area can be expressed as follows:
Ω T = p T | [ ( x T x T i ) cos ϑ + ( y T y T i ) sin ϑ ] 2 ( E T R a ) 2 + [ ( y T y T i ) cos ϑ + ( x T x T i ) sin ϑ ] 2 ( E T R b ) 2 1 ,
where, R a and R b are the long and short half axis of the elliptical garbage target; when R a = R b = R T , the model represents a circular garbage target; ϑ is the angle between the long half axis and the horizontal direction; E T represents the expansion coefficient of the garbage target.

2.2. The Kinematic Constraints of USV

Assume that the USVs move on a calm water surface, consider that the pose vector of the USV expressed in the world coordinate system is η = x , y , ψ T , where x and y denote the position coordinate, and  ψ is the heading angle. The velocity vector of the USV in the body frame is denoted as υ = u , v , r T , where u and v are the surge and sway velocities, and r is the yaw angular velocity. Hence, the three-degree-of-freedom model of the USV in the horizontal plane can be written as:
η ˙ = J ( ψ ) υ ,
where, J ( ψ ) = cos ψ sin ψ 0 sin ψ cos ψ 0 0 0 1 .
On account of the fact that the USVs are underactuated and the sway velocity is relatively small in calm water, the zero sway velocity is assumed, v = 0 . The surge speed, u, surge acceleration, a, and sway angular velocity, r, must satisfy the following constraints:
u u max ,
a a max ,
r r max .
In addition, the surge velocity and yaw angular velocity of the USV are related by R = | u r | , where R is the turning radius. Therefore, the references u d and r d need to meet the constraint for R,
R R min ,
where, R min is the minimum turning radius.
Thus, the reference trajectory, τ d ( t ) , of the USV can be expressed as:
x t d y t d ψ t d = x t 1 d y t 1 d ψ t 1 d + u t 1 d cos ψ t 1 d u t 1 d sin ψ t 1 d n · | r t 1 d | Δ t ,
where u d and ψ d are the expected linear velocity and angular velocity, satisfying constraints (4)–(6). n is used to explicitly represent the three decisions for steering the USV, i.e., n = 1 , 0 , 1 , corresponding to turning right, heading forward, and turning left.

2.3. The Cooperation Constraints of DUSVs

In this section, the dynamic cooperation constraints in terms of the distance between the two USVs are analyzed. Aspects of internal collision avoidance, garbage escaping, and dynamic load capacity in terms of distance between the two USVs are considered.
First and foremost, there is the lower bound on distance between the DUSVs set to avoid internal collisions, and the upper bound set to avoid garbage escaping:
L min < L < L m a x ,
where L = P 1 P 2 is the distance between the two USVs.
Figure 4 shows the area, S, enclosed by the DUSVs and the floating rope in two different states. The state shown in Figure 4a is the desired state, with the two USVs in parallel and the enclosed area, S, larger than in Figure 4b, which is the undesired state. In the desired state, the enclosed area, S, is determined by the length of the floating rope, l p , and the distance, L, between the DUSVs.
Define the current area demand, S t , as the sum of the areas of the garbage targets that have already been collected and the current garbage target to be connected. To allow the collection of the current garbage target, it is important to adjust L so that:
S > S t ,
where S is the current enclosed area of the floating rope.
Next, we are to find the relationship between S and L for the desired state. The floating rope is under tension on the water surface, and the drag of the water causes it to deform. The shape of the floating rope can be approximated by a catenary suspended in the air [26]. A coordinate system with its origin fixed at the lowest point of the rope is selected, as shown in Figure 4a, and  the equation that describes the curve of the floating rope is given as:
y = b ( cosh x b 1 ) b > 0 ,
where ( x , y ) denotes any points of the floating rope curve. b is the catenary coefficient and take b > 0 . The length of the floating rope, l p , can be expressed as:
l p = 2 b sinh x d b ,
where x d denotes the abscissa of the endpoint of the floating rope curve.
To illustrate the relationship between S and L, suppose l p = 16 m. The relationship between x d and b is depicted in Figure 5a. The endpoint abscissa is considered to be positive, x d > 0 , for ease of analysis. This shows that x d and b are positively correlated. By integration, the area surrounded by the floating rope, S, is given as follows:
S = 2 b x d cosh x d b 2 b 2 sinh x d b .
Based on Formulas (12) and (13), the relationship between S and b can be determined and is shown in Figure 5b. It shows that S reaches its maximum of 39.5 m 2 when b = 3.8 , which corresponds to x d = 5.5 and L = 11 , as indicated by Figure 5a. Therefore, it can be concluded that S continuously decreases as L decreases from 11. Therefore, it is reasonable to select the upper bound of the distance between the DUSVs as L m a x = 11 , and  L could be adjusted in real-time according to the current area demand, S t .
To sum up, the constraints (9) and (10) are the cooperation constraints for the DUSVs. During mission planning, it is necessary to estimate the total area of all garbage to be collected and then choose a floating rope of appropriate length to ensure that all garbage can be collected in one single mission. In the case when the garbage cannot be handled by one single mission, multiple missions needs to be planned. During the mission, the states S and S t are checked in real-time, and L is adjusted accordingly to make sure that the cooperation constraints are satisfied.

3. The Structure of the Algorithm

To obtain optimal dynamic trajectories for the DUSVs that can access all floating garbage targets non-repeatedly while avoiding dynamic obstacles, the first step is to determine the optimal access sequence of the multiple garbage targets based on the principle of the shortest travel distance. During the mission, dynamic trajectories are generated by following the optimal access order. For each garbage target, there are the garbage approaching phase and the garbage capturing phase. In the garbage approaching phase, the trajectories are generated based on the guidance of key points around the current target. For garbage capturing, the APF method and a leader–follower strategy are proposed, and the garbage capturing phase start once the DUSVs enter the repulsive field of the current garbage target. When obstacles are encountered, i.e., the DUSVs enter the repulsive field of an obstacle, trajectories for dynamic obstacle avoidance are generated. A method based on IAPF and a leader–follower strategy is adopted, which takes into account the relative speed between the obstacle and the USVs so that the DUSVs bypass the obstacle from the same side of the obstacle with shorter travel distance. The generated trajectories need to meet the kinematic constraints and cooperation constraints. A speed control strategy based on a fuzzy logic algorithm is introduced to keep the DUSVs in good cooperation. A flowchart of the proposed trajectory planning method is depicted in Figure 6.

3.1. The Optimal Access Sequence of Multiple Garbage Targets

There are p garbage areas scattering over the water surface, which are described as T 1 , T 2 , T 3 . . . T p . The aim is to find the optimal access sequence, Γ = { S , T c ( 1 ) , T c ( 2 ) T c ( p ) , E } , starting from the launch point, S, through each garbage area only once, and finally reaching the end point, E. This problem is established as a traveling salesman problem (TSP) to find a solution that minimizes the total length of the path:
Γ * = arg min Γ i = 1 p + 1 d ( Γ ( i ) , Γ ( i + 1 ) ) ,
where d ( Γ ( i ) , Γ ( i + 1 ) ) is the Euclidean distance between the center of two garbage targets.
An ant colony algorithm [27] is adopted for solving the established TSP to strike a balance between computational complexity and performance for the problem of water-surface cleaning. Yang et al. [28] employed the discrete grouping teaching optimization algorithm (DGTOA) to solve the multi-point path planning problem with many target points. Jindriska et al. [29] proposed a new improved heuristic method to solve the sufficiently close enough TSP problem (CETSP) in an environment with obstacles and many densely distributed targets. Both of the algorithms mentioned above are complex and computationally costly. In comparison, the TSP problem for water-surface garbage cleaning has relatively fewer target points. Therefore, the ant colony algorithm is selected for its advantages of strong global searching ability and easy implementation with less computational cost.

3.2. DUSV Cooperative Garbage Target Approaching and Capturing

Following the optimal access sequence, the DUSVs approach and capture the garbage targets one by one while bypassing all obstacles whenever encountered. In this section, the algorithm for generating trajectories for garbage target approaching and capturing is presented.

3.2.1. Garbage Approaching Based on the Guidance of Target Key Points

To generate the trajectories for approaching the current garbage target, the headings of the two USVs are guided by the two key points of the garbage target, i.e., the orientations from each USV towards the two key points are respectively chosen as the desired headings for the DUSVs, in order to realize that each USV passes the garbage target from different sides. The two key points of the current garbage target are selected based on the garbage model, and the dynamic cooperation constraints as described in Section 2.3 are considered.
The two key points are initially chosen as the resulting tangent points, N i ( x N i , y N i ) , i = 1 , 2 , by making tangents from the current reference position of the two USVs to the current garbage target modeled as a circle or ellipse, as shown in Figure 7. Then, adjustment, δ , is made when necessary so that the distance between the two key points meets cooperation constraints (12) and (13). If  δ = 0 , the key points are just the two tangent points of N i on the circle or ellipse.
Therefore, the current expected heading, ψ i d , of the DUSVs is given by:
ψ i d = π 2 θ i ,
where
θ i = tan 1 [ y N y i / x N x i ] .

3.2.2. Garbage Capturing Based on APF and Leader–Follower Strategy

When the DUSVs enter within a certain distance of the current garbage target, the system enters into the garbage capturing stage. For garbage capturing, the trajectories for the double USVs need to pass the garbage from different sides without contacting the garbage. However, during the capturing phase and the phase of switching from the current garbage target to the next garbage target, there is a risk of colliding with the current garbage target. To address this issue, APF combined with a leader–follower strategy is proposed to generate the cooperative trajectory for capturing the garbage target without collision.
The artificial potential field consists of an attractive field and a repulsive field [30]. To prevent collisions with the current garbage target and to take the next garbage target in the sequence into consideration, a repulsion field is set up for the current garbage target, T i , and an attractive field for the next garbage target, T i + 1 , as shown in Figure 8.
The function of the repulsion field of the current garbage target, U r e p T i ( P ) , and its gradient are given as follows:
U r e p T i ( P ) = 1 2 η 1 ρ P , T i 1 ρ T i 2 , ρ P , T i ρ T i 0 , ρ P , T i > ρ T i
U r e p T i ( P ) = η 1 ρ P , T i 1 ρ T i · ρ P , T i ρ 2 P , T i , ρ P , T i ρ T i 0 , ρ P , T i > ρ T i ,
where η denotes the repulsion gain coefficient, ρ ( P , T i ) = P T i is the distance from the USV to the center of the current garbage target, T i , as shown in Figure 7, and the distance of influence of the garbage target, T i , is given by ρ T i . The repulsive field is defined as zero outside the distance of influence.
The attractive field function of the next garbage target is given as:
U a t t T i + 1 ( P ) = 1 2 ξ ρ 2 P , T i + 1 , ρ P , T i + 1 ρ t ρ t ξ ρ P , T i + 1 1 2 ξ ρ t 2 , ρ P , T i + 1 > ρ t .
As can be seen, U a t t T i + 1 ( P ) is divided into two parts by introducing the interim distance, ρ t , to avoid the problem of excessive attractive force due to the long distance to the next garbage target [31]. The corresponding gradient function is given as follows:
U a t t T i + 1 ( P ) = ξ ρ P T i + 1 , ρ P , T i + 1 ρ t ρ t ξ , ρ P , T i + 1 > ρ t ,
where ξ denotes the positive proportional coefficient, ρ ( P , T i + 1 ) = P T i + 1 is the distance between the USV and the next garbage target, T i + 1 , and ρ t is the distance of influence of the next garbage target.
The total potential field and force are the sum of the attractive and repulsive fields and the sum of the attractive and repulsive forces, respectively:
U T i ( P ) = U a t t T i + 1 ( P ) + U r e p T i ( P )
F T i ( P ) = F a t t T i + 1 + F r e p T i ,
where F a t t T i + 1 = U a t t T i + 1 ( P ) and F r e p T i = U r e p T i ( P ) .
When either USV enters the distance of influence of the repulsive field of the current garbage target, T i , the system enters the phase for capturing the current garbage target. The USV that first enters is designated as the leader, and the other USV is in turn the follower. The expected pose of the leader at the next time instant, τ ( t + 1 ) = x t + 1 y t + 1 ψ t + 1 T , is determined by Equation (8), for which we needs to determine n, with  n = 1 , 0 , 1 corresponding to turning right, heading forward, and turning left, respectively. n is chosen among the three directions and along the greatest descending direction of the potential field according to Equation (22). The follower takes the opposite turning direction to the leader to ensure that the two USVs can pass from different sides of the garbage target at the same time.
Once the leader gets out of the distance of influence of the repulsive field of the current target, the DUSVs complete the capturing of the current target and switch to the next garbage target.

3.3. Cooperative Dynamic Obstacle Avoidance Based on IAPF Method and Leader–Follower Strategy

During the mission, the DUSVs may encounter static as well as dynamic obstacles on the water surface. In this section, the algorithm for generating trajectories for dynamic obstacle avoidance is presented. When the DUSVs travel within a certain distance of the obstacle, the system enters into the phase for obstacle avoidance. The trajectories for DUSVs need to pass the obstacle from same side of the obstacle without getting the floating rope entangled with the obstacle. To address this issue, IAPF combined with a leader–follower strategy is proposed.
To prevent collisions with the encountered obstacle, O i , while considering capturing the current garbage target, T i , the potential field is comprised of the repulsive field of the current obstacle, O i , and the attractive field of the current garbage target, T i , as shown in Figure 9.
By the traditional APF method, the repulsion field function, U r e p O i ( P ) , is obtained by:
U r e p O i ( P ) = 1 2 η 1 ρ P , O i 1 ρ O i 2 , ρ P , O i ρ O i 0 , ρ P , O i > ρ O i .
The corresponding repulsive force is given by the gradient function as follows:
U r e p O i ( P ) = η 1 ρ P , O i 1 ρ O i · ρ P , O i ρ 2 P , O i , ρ P , O i ρ O i 0 , ρ P , O i > ρ O i ,
where η denotes the repulsion gain coefficient, ρ ( P , O i ) = P O i is the distance between the USV to the center of the obstacle, O i , and ρ O i is the distance of influence of the repulsive force field, within which the repulsive force takes effect.
The traditional APF method can quickly plan collision-free trajectories in the environment with only static obstacles. However, when dealing with complex dynamic obstacles, its adaptability decreases, leading to poor performance in obstacle avoidance. To deal with the issue, we propose to introduce into the repulsion field function an extra term called the relative velocity repulsive field, which takes into account the relative velocity between the DUSVs and the obstacles. The improved repulsion field function, U r e p O i ( P ) , is given as:
U r e p O i ( P ) = U r e p O i ( P ) + U r e p v , ρ P , O i ρ O i σ 1 , σ 2 ( 0 , π ) U r e p v , ρ O i < ρ P , O i ρ O i σ 1 , σ 2 ( 0 , π ) 0 , ρ P , O i > ρ O i ,
where U r e p v = 1 2 ς u o r 2 ρ ( P , O i ) is the proposed repulsive potential field with regard to relative velocity between the USV and the obstacle, u o r i = u i u o , as shown in Figure 10, ς denotes the coefficient for the relative velocity repulsive field, and σ i denotes the orientation of u o r i with respect to P O i . When σ 1 , σ 2 ( 0 , π ) , the extension line of the speed vector of the obstacle and the extension lines of the speed vector of the USV intersect, which implies that the DUSVs are at risk of colliding with the dynamic obstacle in the near future. ρ O i is selected as the distance of influence of the encountered dynamic obstacle on account of the relative velocity, which is larger and thus more conservative than the distance of influence, ρ O i , for static obstacles. When σ 1 and σ 2 are beyond ( 0 , π ) , the USV and the dynamic obstacle move away from each other; hence, the velocity repulsion is defined as zero. In this way, the relative velocity repulsion potential field help the USVs avoid the dynamic obstacle in time.
The corresponding gradient function, U r e p v ( P ) , is obtained by:
U r e p O i ( P ) = η 1 ρ P , O i 1 ρ O i · ρ P , O i ρ 2 P , O i + ς u o r ρ P , O i , ρ P , O i ρ O i σ 1 , σ 2 ( 0 , π ) ς u o r ρ P , O i , ρ O i < ρ P , O i ρ O i σ 1 , σ 2 ( 0 , π ) 0 , ρ P , O i > ρ O i .
The attractive field, U a t t T i ( P ) , of the current garbage target is expressed as:
U a t t T i ( P ) = 1 2 ξ ρ 2 P , T i , ρ P , T i ρ o ρ o ξ ρ P , T i 1 2 ξ ρ o 2 , ρ P , T i > ρ o .
The corresponding gradient function, U a t t T i ( P ) , is obtained by:
U a t t T i ( P ) = ξ ρ P T i , ρ P , T i ρ o ρ o ξ , ρ P , T i > ρ o ,
where ξ denotes the positive proportional coefficient, ρ ( P , T i ) = P T i is the distance between the USV and the current garbage target, T i , and ρ o is the distance of influence of the current garbage target. In addition, to avoid excessive attractive force caused by a long distance from the garbage target, U a t t T i ( P ) is divided into two parts [31].
Within the distance of influence, ρ O i , of the obstacle, the total potential field is the sum of the repulsive and attractive fields:
U O i ( P ) = U a t t T i ( P ) + U r e p O i ( P ) .
The corresponding total force is the sum of repulsive and attractive forces:
F O i ( P ) = F r e p O i + F a t t T i ,
where F r e p O i = U r e p O i ( P ) and F a t t T i = U a t t T i ( P ) .
The USV that first enters within the distance of influence, ρ O i , of the obstacle is designated as the leader, and the other USV in turn becomes the follower, whose heading is determined according to the leader. The expected pose of the leader at the next time instant, τ ( t + 1 ) = x t + 1 y t + 1 ψ t + 1 T , is given according to Equation (8), for which n needs to be determined, with  n = 1 , 0 , 1 , corresponding to the three turning directions (right, forward, and left), respectively. n is selected among the three directions with the greatest potential descend based on Equation (30). The follower makes the same turning as the leader to ensure that the DUSVs can pass from the same side of the obstacle at the same time.
Once the leader gets out of the obstacle avoidance area, i.e., the distance of influence of the potential field of the obstacle, ρ ( P , O i ) ρ O i , the trajectories for avoiding the obstacle are complete and the DUSVs continue with the approaching and capturing of the current garbage target, T i , as described in Section 3.2.

3.4. Fuzzy Logic-Based Speed Control Strategy

During the mission, the DUSVs need to keep in good cooperation at a low speed, u i < 2 m/s. The two USVS in perfect cooperation should reach the two target key points, N 1 , N 2 , of the garbage target, respectively, at the same time. However, an undesired state, as shown in Figure 4b, may occur when the longitudinal distance between the two USVs increases, which increases the risk of garbage escaping.
A fuzzy logic-based speed controller is proposed to gradually reduce the longitudinal distance between the DUSVs for achieving the desired cooperative performance of the DUSVs. The difference of the distances between the two USVs and their respective target key points is defined as:
L d i f = P 1 N 1 P 2 N 2 .
The main principal of the proposed speed control strategy is that when USV P 1 is further away from its target key point, then P 1 accelerates and USV P 2 decelerates; on the contrary, P 2 accelerates and P 1 decelerates to ensure that L d i f < g , where g is the upper bound of L d i f . A tuning coefficient, λ , is introduced for the speed control, as follows:
u 1 ( k + 1 ) u 2 ( k + 1 ) = u 1 ( k ) u 2 ( k ) + λ λ Δ u , L d i f > 0 u 1 ( k ) u 2 ( k ) + λ λ Δ u , L d i f < 0 ,
where λ represents the tuning coefficient for acceleration and deceleration of the USVs; Δ u denotes the speed increment for a sampling period, h, with the prescribed acceleration; a, u 1 ( k ) , and u 2 ( k ) are the surge velocities of the DUSVs; and  u 1 ( k + 1 ) and u 2 ( k + 1 ) are the surge velocities at the next time instant. A simple speed compensator with the same λ for different L d i f has poor performance, resulting in garbage escape and poor coordination between the DUSVs. A fuzzy logic algorithm is seen as an effective method for parameter adaptation [32,33]. Therefore, a fuzzy logic algorithm is adopted for adaptive adjustment of the tuning coefficient, λ , according to L d i f .
Hence, the distance difference, L d i f , is taken as the input of the fuzzy speed controller. Four fuzzy subsets (N, M, F, and VF) are defined over the value interval [0, 10] of L d i f . The output of the fuzzy speed controller is the coefficient λ , which takes values in the range of [0, 3], and four fuzzy subsets (S, M, B, and VB) are defined over this range. The Gaussian function is chosen as the membership functions for all variables. The specific description of fuzzy rules is shown in Table 1.

3.5. Section Summary

In summary, during mission planning, with the information of initial locations of the garbage targets, a floating rope of appropriate length is chosen and the optimal access sequence of the garbage targets is determined. After that, the DUSVs are launched. During the mission, dynamic trajectories are planned for the DUSVs, involving cooperative garbage target approaching, garbage capturing, and dynamic obstacle avoidance. The integration of the APF/IAPF method and multi-strategies including target key point-based guidance, a leader–follower strategy, dynamic cooperation constraint, and fuzzy logic-based speed control strategy help to generate the desired trajectory. To facilitate the understanding of the trajectory generation process, the pseudo-code of the algorithm is presented in Algorithm  1.
Algorithm 1: DUSV cooperative dynamic trajectory planning based on improved artificial potential field fusion multi-strategy
Input: 
Locations of obstacles O i and garbage T i , initial states η and υ of DUSVs, constraints u m a x , a m a x , L m i n , and  L m a x , and the optimal visiting sequence Γ = { S , T c ( 1 ) , T c ( 2 ) T c ( p ) , E } ;
Output: 
Optimal trajectories of DUSVs τ d ( t ) ;
1:
Initialization; Choose the current visiting target as T c ( i ) , i = 1
2:
while True do
3:
    if  L d i f > h  then
4:
        Adjust the speed u 1 , u 2 of DUSVs to improve the coordination of the DUSVs so that L d i f < g and constraint (9) are satisified.
5:
    end if
6:
    if  P 1 , P 2 are outside of the field range ρ T i or ρ O i of of the current garbage or any obstacle, respectively then
7:
        Approach T c i , adjust the key points N 1 , N 2 by constraint (9) and (10). Generate the next moment trajectory points P 1 ( t + 1 ) , P 2 ( t + 1 ) .
8:
    else
9:
          if Either P 1 or P 2 enter the range ρ T i of repulsion field of the current target T c ( i )  then
10:
           Assign the leader and the follower; Generate the trajectories for the leader based on APF method;The follower takes the opposite turning direction;
11:
             if the leader gets out of ρ T i  then
12:
                 Capturing of garbage T c i completes; Switch to the next visiting target i = i + 1 ;
13:
             end if
14:
          else if Either P 1 or P 2 enters the range ρ O i of the relative velocity repulsion field of the any obstacle and σ 1 , σ 2 ( 0 , π )  then
15:
             Assign the leader and the follower; The local trajectory for the leader is generated by IAPF; the follower takes the same turning direction;
16:
             if the leader gets out of obstacle avoidance region ρ O i  then
17:
                 Obstacle avoidance completes, break;
18:
             end if
19:
          end if
20:
    end if
21:
    if the current visiting target is the end point then
22:
        Approach the end point; The trajectories τ d ( t ) completes, the task is completed, break;
23:
    end if
24:
end while
25:
Output optimal trajectories τ d ( t ) .

4. Simulation and Discussion

In this section, a simulation is conducted to verify the performance of the proposed trajectory planning algorithm, specifically, the effectiveness of garbage collection, dynamic obstacle avoidance, and the satisfaction of the cooperation constraints in terms of speed and distance coordination between the two USVs.

4.1. The Simulation Configurations

An environmental map of 50 m × 50 m is set up with starting and ending points at different positions. Within this map, multiple large areas of garbage with a radius between 1–2 m and obstacles of radius between 2–3 m are randomly generated. Details of the configurations of the simulation are listed in Table 2.
To verify the effectiveness of the proposed algorithm for solving dynamic trajectory planning problems, both static obstacles and dynamic obstacles are added to the simulations. The relevant parameters are set as shown in Table 3.
The settings of the parameters of the trajectory planner used in the simulations are shown in Table 4.

4.2. The Simulation Results

The simulation results are analyzed from the following two parts. Firstly, the whole generated reference trajectories of the DUSVs are shown in Figure 11 to visually verify effective garbage approaching, capturing, and obstacle avoidance. The effectiveness of the improved method in dynamic obstacle avoidance is stressed with results in Figure 11 and Table 5. Secondly, the changes of the relevant state variables over time, including the speed of the DUSVs, distances as well as distance differences to the key points between the DUSVs, and the resulting area capacities, are shown in Figure 12, which are to verify the satisfaction of cooperation constraints.
Figure 11 shows the generated reference trajectories of the DUSVs for cooperative surface garbage cleaning in the environment with static and dynamic obstacles. The results obtained by the proposed algorithm using the IAPF method is compared with that using the traditional APF method. The trajectories are generated as discrete reference positions and orientations for the DUSVs with time intervals of 0.1 s. The triangles appearing at time intervals of 1s represent the time-varying poses of the DUSVs. In particular, the coordinates and time of the trajectories are shown when the DUSVs enter the garbage target capture area. The black dotted arrows and red arrows near the obstacles and garbage targets indicate the motion direction of the corresponding obstacles and garbage targets. The gray and pink shaded wide trails indicate the trajectories of the obstacles and the garbage targets.
This shows that the computed optimal access sequence of the garbage targets is S , T 1 , T 2 , T 4 , T 5 , T 3 , E . Both algorithms have shown their capability to generate the trajectories for the DUSVs to capture all the garbage while avoiding all the obstacles. In the beginning, the DUSVs travel towards the current garbage target, T 1 ; the distance between the DUSVs is gradually increased to ensure safety as well as to meet the current area demand of T 1 . When entering the distance of influence of the potential field of T 1 , the DUSVs pass from different sides of T 1 , so that the garbage can be captured by the floating rope while being attracted towards the next garbage, T 2 . Following that, dynamic obstacle O 1 is encountered and the DUSVs pass from the same side of the obstacle under the guidance of the repulsive potential field and the attractive potential of the current garbage target, T 2 . When the DUSVs leave the repulsive potential field of O 2 , they carry on to approach the current target, T 2 , and the distance between the two USVs is adjusted to meet the current area demand, i.e., the sum of areas of T 1 and T 2 . When T 2 is captured, the DUSVs switch to approach the next target, T 4 , and so on until they finish with the final target, T 3 , and travel to the finishing point, E. During the whole process, the speeds of the DUSVs are adjusted by a fuzzy logic-based speed controller to keep the DUSVs in parallel.
In addition, the trajectories around t = 21 s and t = 43 s are plotted separately to compare the performance for dynamic collision avoidance. It is observed that the algorithm with IAPF is effective in reducing the length of trajectories for bypassing the dynamic obstacles compared to the algorithm with traditional APF.
Table 5 presents the total trajectory length and navigation time by the two algorithms. It can be seen that the algorithm with IAPF provides shorter trajectory lengths and costs less navigation time to complete the task, which indicates its efficiency in scenarios with dynamic obstacles.
Figure 12 shows the changes in relevant state variables of the DUSVs over time to verify the effectiveness of the proposed algorithms in meeting the cooperation constraints. Figure 12a,b show the changes in speed of the DUSVs, u 1 and u 2 , and distance difference, L d i f , over time under the proposed fuzzy logic-based speed controller and simple speed compensator, respectively. For both cases, it shows that, in the beginning, the two USVs travels in parallel at the same speed, which gradually increases to the maximum 2 m/s. In the finishing period, the DUSVs also travel at the same speed, which gradually decreases until the end of the mission. Figure 12a shows that between 32–33 s and 38–42 s, there are obvious variations in u 2 . The distance difference, L d i f , surpasses the threshold of 2 m and reaches 3.3 m at 38 s. This is due to the fact that USV1 turns from the outside of T 4 to capture T 4 and thus lags behind USV1. With the proposed speed controller, USV2 slows down and L d i f is effectively reduced within 4 s. Figure 12b shows that between 25–29 s, 32–35 s, and 39–47 s, there are obvious variations in u 2 and the distance difference between the DUSVs and the target key points is greater than 2 m. Especially between 39–47 s, it takes 8 s to reduce the distance difference down below 2 m, indicating poor performance of the simple compensator. Therefore, it can be concluded that the proposed speed control strategy effectively improves the cooperation of the DUSVs.
Figure 12c shows the changes in the expected distance, L, between the DUSVs over time. It shows that the initial expected spacing of the DUSVs is 2 m. During the whole process, L is always between the lower bound of 2 m and the upper bound of 11 m. This effectively prevents internal collision between the DUSVs. The values of L are marked at the particular time instants, which correspond to the marked positions of the DUSVs in Figure 11b. It was found that L is gradually increased to prevent any collision with the garbage targets and ensure no escape of garbage.
Figure 12d shows the changes in current area demand S t and the current enclosed area of the floating rope, S, over time. It can be seen that at current capacity, S can always accommodate the demand, S t . At 46 s, when the DUSVs start to approach the final garbage, T 3 , the demand, S t , reaches its maximum and S is gradually increased until reaching the demand at 49 s. It should be noticed that constraint (10) is conservative as the estimated garbage area with the circular or elliptical model is larger than the actual garbage area. This implies that the enclosed areas have well satisfied the actual area demands over time.
In summary, the above results indicate that the proposed comprehensive trajectory planner for the floating-rope-connected DUSVs for water surface garbage cleaning is satisfying in generating cooperative trajectories for the two USVS that meet the requirements for garbage collection with good coordination for preventing garbage escaping and internal collision while avoiding dynamic obstacles with a shorter travel distance

5. Conclusions and Future Work

To address the problem that a single USV has difficulty in effectively collecting large floating garbage, a comprehensive trajectory planner for DUSVs connected with a floating rope for surface garbage collection with dynamic obstacle avoidance is proposed, which considers the kinematic constraints of the under-actuated USV and time-varying cooperation constraints of the DUSVs. The DUSVs approach the garbage targets based on the guidance of the target key points, which consider the cooperation constraints. The APF method combined with the leader–follower strategy is proposed for cooperative garbage capturing, and an improved APF with the inclusion of a velocity repulsion field combined with the leader–follower strategy is adopted for dynamic obstacle avoidance with shorter travel distance. Cooperation between the double USVs is ensured through the proposed fuzzy logic-based speed controller. The simulation results show the effectiveness of the proposed algorithm in generating satisfactory trajectories for cooperative garbage collection and dynamic obstacle avoidance while meeting all the constraints. This implies that more efficient and effective cleaning could be achieved in practice with the proposed planner than conventional methods that have not taken the practical issues, i.e., size and shape and the dynamic nature of floating garbage, into account.
The proposed planner is limited by its assumption of full prior knowledge of the initial positions of all garbage areas and obstacles with an UAV and real-time updating of the actual locations of garbage areas and obstacles through on-board sensors. Future work would take into account the uncertainties in positions of the garbage areas and obstacles due to actual communication and sensing.

Author Contributions

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

Funding

This research was funded by the National Natural Science Foundation of China, grant number 52271322.

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

Data are contained within the article.

Acknowledgments

The authors would like to extend their gratitude to Yu Tian and Yining Tian for their invaluable support and constructive ideas provided throughout this research.

Conflicts of Interest

The authors declare no conflicts of interest.

References

  1. Yue, M.; Haixin, L.; Xijie, N.; Zhiyuan, Z.; Qimin, Z. A New Type of Two-body Surface Garbage Cleaning Vessel. Ordnance Ind. Autom. 2023, 42, 80–85. [Google Scholar]
  2. Phirke, S.; Patel, A.; Jani, J. Design of an autonomous water cleaning bot. Mater. Today Proc. 2021, 46, 8742–8747. [Google Scholar] [CrossRef]
  3. Zhang, Y.; Huang, Z.; Chen, C.; Wu, X.; Xie, S.; Zhou, H.; Gou, Y.; Gu, L.; Ma, M. A Spiral-Propulsion Amphibious Intelligent Robot for Land Garbage Cleaning and Sea Garbage Cleaning. J. Mar. Sci. Eng. 2023, 11, 1482. [Google Scholar] [CrossRef]
  4. Wang, Y.; Zhao, Y.; Wu, Y.; Zhang, S.; Wang, J. A Multi-sensor Intelligent Surface Garbage Cleaning Robot. In Proceedings of the 2021 IEEE International Conference on Mechatronics and Automation (ICMA), Takamatsu, Japan, 8–11 August 2021; pp. 797–801. [Google Scholar]
  5. Adarsh, J.; Anush, O.; Shrivarshan, R.; Krishnaan, S.M.; Akash, J.; Arul, R.; Angalaeswari, S. Ocean Surface Cleaning Autonomous Robot (OSCAR) using Object Classification Technique and Path Planning Algorithm. J. Phys. Conf. Ser. 2021, 2115, 012021. [Google Scholar] [CrossRef]
  6. Kong, S.; Tian, M.; Qiu, C.; Wu, Z.; Yu, J. IWSCR: An Intelligent water-surface Cleaner Robot for Collecting Floating Garbage. IEEE Trans. Syst. Man Cybern. Syst. 2021, 51, 6358–6368. [Google Scholar] [CrossRef]
  7. Akib, A.; Tasnim, F.; Biswas, D.; Hashem, M.B.; Rahman, K.A.; Bhattacharjee, A.; Fattah, S.A. Unmanned Floating Waste Collecting Robot. In Proceedings of the TENCON 2019—2019 IEEE Region 10 Conference (TENCON), Kochi, India, 17–20 October 2019; pp. 2645–2650. [Google Scholar]
  8. Zhu, J.; Yang, Y.; Cheng, Y. SMURF: A Fully Autonomous Water Surface Cleaning Robot with A Novel Coverage Path Planning Method. J. Mar. Sci. Eng. 2022, 10, 1620. [Google Scholar] [CrossRef]
  9. Xie, B.; Zhang, X. Complete Coverage Path Planning for Multiple Robots for Facade Maintenance Operations. Comput. Eng. Appl. 2023, 59, 319–327. [Google Scholar]
  10. Ji, C.Y.; Guo, J.T.; Ye, R.C.; Yin, Q.L.; Xu, W.Y.; Yuan, Z.M. Experimental study of an ocean surface cleaning system. Ocean. Eng. 2022, 249, 110937. [Google Scholar] [CrossRef]
  11. Yang, C.; Pan, J.; Wei, K.; Lu, M.; Jia, S. A Novel Unmanned Surface Vehicle Path-Planning Algorithm Based on A* and Artificial Potential Field in Ocean Currents. J. Mar. Sci. Eng. 2024, 12, 285. [Google Scholar] [CrossRef]
  12. Chen, S.; Feng, L.; Bao, X.; Jiang, Z.; Xing, B.; Xu, J. An Optimal-Path-Planning Method for Unmanned Surface Vehicles Based on a Novel Group Intelligence Algorithm. J. Mar. Sci. Eng. 2024, 12, 477. [Google Scholar] [CrossRef]
  13. Yu, J.; Chen, Z.; Zhao, Z.; Yao, P.; Xu, J. A Traversal Multi-Target Path Planning Method for Multi-Unmanned Surface Vessels in Space-Varying Ocean Current. Ocean. Eng. 2023, 278, 114423. [Google Scholar] [CrossRef]
  14. Liu, Y.; Bucknall, R.W.G. A survey of formation control and motion planning of multiple unmanned vehicles. Robotica 2018, 36, 1019–1047. [Google Scholar] [CrossRef]
  15. Biagiotti, L.; Melchiorri, C. Trajectory Planning for Automatic Machines and Robots; Springer: Berlin/Heidelberg, Germany, 2010. [Google Scholar] [CrossRef]
  16. Egerstedt, M.; Hu, X. Formation constrained multi-agent control. In Proceedings of the 2001 ICRA, IEEE International Conference on Robotics and Automation (Cat. No.01CH37164), Seoul, Republic of Korea, 21–26 May 2001; Volume 4, pp. 3961–3966. [Google Scholar]
  17. Lyu, L.; Chu, Z.J.; Lin, B.; Dai, Y.; Cheng, N. Fast Trajectory Planning for UAV-Enabled Maritime IoT Systems: A Fermat-Point Based Approach. IEEE Wirel. Commun. Lett. 2022, 11, 328–332. [Google Scholar] [CrossRef]
  18. Song, L.; Xu, K.; Shi, X.; Sun, H.; Chai, W.; Guo, R. Multiple USV cooperative algorithm method for hunting intelligent escaped targets. Chin. J. Ship Res. 2023, 18, 52–59. [Google Scholar] [CrossRef]
  19. Girón-Sierra, J.M.; Gheorghita, A.T.; Jiménez, J.F. Fully automatic boom towing by unmanned ships: Experimental study. In Proceedings of the OCEANS 2015—MTS/IEEE Washington, Washington, DC, USA, 19–22 October 2015; pp. 1–10. [Google Scholar]
  20. Girón-Sierra, J.M.; Gheorghita, A.T.; Angulo, G.; Jiménez, J.F. Preparing the automatic spill recovery by two unmanned boats towing a boom: Development with scale experiments. Ocean. Eng. 2015, 95, 23–33. [Google Scholar] [CrossRef]
  21. Pengxiang, Z.; Peizheng, L.; Sainan, M.; Caofei, L.; Yong, M. Research on Cooperative Control of Surface Unmanned System Platform. Unmanned Syst. Technol. 2022, 5, 88–97. [Google Scholar] [CrossRef]
  22. Wen, J. Research on Collaborative Planning and Controlmethod of Double-USVs for Oil Spill Containment. Master’s Thesis, Harbin Engineering University, Harbin, China, 2020. [Google Scholar]
  23. Kong, S.; Wu, Z.; Qiu, C.; Tian, M.; Yu, J. An FM*-Based Comprehensive Path Planning System for Robotic Floating Garbage Cleaning. IEEE Trans. Intell. Transp. Syst. 2022, 23, 23821–23830. [Google Scholar] [CrossRef]
  24. Gao, F.; Hao, W.; Wu, Y.; Sun, C. Research on Robot Obstacle Avoidance Path Planning Based on Improved Artificial Potential Field Method. Comput. Simul. 2023, 40, 431–436+442. [Google Scholar]
  25. Zhang, D.; Liu, W.; Miu, C.; Yu, Y. Dynamic obstacle avoidance method for omnidirectional mobile robots. J. Beijing Univ. Aeronaut. Astronaut. 2021, 47, 1115–1123. [Google Scholar] [CrossRef]
  26. Li, Y. Research on the Autonomous Cooperative Control of a Flexible Joint Dual Unmanned Surface Vehicles. Master’s Thesis, Harbin Engineering University, Harbin, China, 2017. [Google Scholar]
  27. Sun, Y.; Tang, W.; Tan, X.; Gu, J.; Lang, J. Path Planning of Material Transmission Platform Based on IACSPF. Comput. Eng. Appl. 2023, 59, 323–330. [Google Scholar]
  28. Yang, S.; Huang, J.; Li, W.; Xiang, X. A Novel Discrete Group Teaching Optimization Algorithm for TSP Path Planning with Unmanned Surface Vehicles. J. Mar. Sci. Eng. 2022, 10, 1305. [Google Scholar] [CrossRef]
  29. Deckerová, J.; Kucerová, K.; Faigl, J. On Improvement Heuristic to Solutions of the Close Enough Traveling Salesman Problem in Environments with Obstacles. In Proceedings of the 2023 European Conference on Mobile Robots (ECMR), Coimbra, Portugal, 4–7 September 2023; pp. 1–6. [Google Scholar]
  30. Sang, H.; You, Y.; Sun, X.J.; Ying, Z.; Liu, F. The hybrid path planning algorithm based on improved A* and artificial potential field for unmanned surface vehicle formations. Ocean. Eng. 2021, 223, 108709. [Google Scholar] [CrossRef]
  31. Song, J.; Hao, C.; Su, J. Path planning for unmanned surface vehicle based on predictive artificial potential field. Int. J. Adv. Robot. Syst. 2020, 17. [Google Scholar] [CrossRef]
  32. Dong, J. Research on AUV Obstacle Avoidance Strategy for Marine Cable Inspection Based on Fuzzy Artificial Potential Field Method. Master’s Thesis, Hangzhou Dianzi University, Harbin, China, 2023. [Google Scholar]
  33. Xu, C.; Xu, Z.; Xia, M. Obstacle Avoidance in a Three-Dimensional Dynamic Environment Based on Fuzzy Dynamic Windows. Appl. Sci. 2021, 11, 504. [Google Scholar] [CrossRef]
Figure 1. Garbage cleaning scenarios.
Figure 1. Garbage cleaning scenarios.
Jmse 12 00739 g001
Figure 2. Floating-rope-connected DUSVs and the scene model for water-surface garbage cleaning. (a) DUSVs connected by a floating rope; (b) Scene model of garbage cleaning task by DUSVs connected by a floating rope.
Figure 2. Floating-rope-connected DUSVs and the scene model for water-surface garbage cleaning. (a) DUSVs connected by a floating rope; (b) Scene model of garbage cleaning task by DUSVs connected by a floating rope.
Jmse 12 00739 g002
Figure 3. Garbage target area model. (a) Circular garbage target; (b) elliptical garbage target.
Figure 3. Garbage target area model. (a) Circular garbage target; (b) elliptical garbage target.
Jmse 12 00739 g003
Figure 4. Schematic diagram of the area enclosed by floating-rope-connected DUSVs. (a) Desired state of DUSVs; (b) undesired state of DUSVs.
Figure 4. Schematic diagram of the area enclosed by floating-rope-connected DUSVs. (a) Desired state of DUSVs; (b) undesired state of DUSVs.
Jmse 12 00739 g004
Figure 5. Relationships between b, x d , and S. (a) Relationships between b and x d ; (b) relationships between b and S.
Figure 5. Relationships between b, x d , and S. (a) Relationships between b and x d ; (b) relationships between b and S.
Jmse 12 00739 g005
Figure 6. Flowchart of the proposed trajectory planning method.
Figure 6. Flowchart of the proposed trajectory planning method.
Jmse 12 00739 g006
Figure 7. Garbage target area approaching. (a) Circular garbage target; (b) elliptical garbage target.
Figure 7. Garbage target area approaching. (a) Circular garbage target; (b) elliptical garbage target.
Jmse 12 00739 g007
Figure 8. Potential field in garbage capture area.
Figure 8. Potential field in garbage capture area.
Jmse 12 00739 g008
Figure 9. Potential field in obstacle avoidance area.
Figure 9. Potential field in obstacle avoidance area.
Jmse 12 00739 g009
Figure 10. Schematic diagram of velocity repulsive potential field.
Figure 10. Schematic diagram of velocity repulsive potential field.
Jmse 12 00739 g010
Figure 11. Cooperative trajectories of the DUSVs for surface garbage cleaning in the mixed obstacle environment. (a) Trajectories under TAPF method; (b) Trajectories under IAPF method.
Figure 11. Cooperative trajectories of the DUSVs for surface garbage cleaning in the mixed obstacle environment. (a) Trajectories under TAPF method; (b) Trajectories under IAPF method.
Jmse 12 00739 g011
Figure 12. Variation of cooperative variables of the DUSVs as functions of time. (a) Speed of DUSVs under the proposed speed control strategy; (b) Speed of DUSVs under simple speed compensator; (c) Distance between the DUSVs; (d) Area demand, S t , and current enclosed area, S.
Figure 12. Variation of cooperative variables of the DUSVs as functions of time. (a) Speed of DUSVs under the proposed speed control strategy; (b) Speed of DUSVs under simple speed compensator; (c) Distance between the DUSVs; (d) Area demand, S t , and current enclosed area, S.
Jmse 12 00739 g012
Table 1. Fuzzy rules for the speed control method.
Table 1. Fuzzy rules for the speed control method.
NumberInput L dif Output λ
1NS
2MM
3FB
4VFVB
Table 2. Configurations parameters of the simulation scenarios.
Table 2. Configurations parameters of the simulation scenarios.
ScenceCentric PositionLong Half Shaft × Short Half Shaft/mRadius/mBevel Angle/°Time StepVelocity/m/s
S(10, 0)
E(40, 0)
T 1 (16, 20)1.5 × 1 90t = 0[−0.1, −0.1]
T 2 (25, 30) 1 t = 16[0.1, −0.2]
T 3 (44, 10) 1.5 t = 38[0.3, 0]
T 4 (38, 36) 1 t = 25[0, −0.1]
T 5 (46, 25) 1.5 t = 31[0.1, 0]
Table 3. Parameters of static and dynamic obstacles.
Table 3. Parameters of static and dynamic obstacles.
ObstaclesStart PointRadius/mVelocity/m/s
Environment O 1 (17, 28)2[0.2, −0.2]
O 2 (17, 10)3
O 3 (38, 18)2[0.2, 0]
Table 4. Parameter settings for the simulations.
Table 4. Parameter settings for the simulations.
Parameter NameParameter Setting
Problem modelThe length of the floating rope, l p 16 m
The lower bound on distance between DUSVs, L min 2 m
Total garbage area8 π
The maximum enclosed area of the floating rope39.5 m 2
Dynamic obstacle avoidance phaseAttractive proportional coefficient, ξ 1
The distance of influence, ρ o , of the garbage target, T i 4 m
Repulsion gain coefficient, η 400
The distance of influence, ρ O , of the obstacle, O i 4 m
Relative velocity repulsion field coefficient, ς 2
Relative velocity repulsion field range, ρ O 6 m
Garbage capturing phaseAttractive proportional coefficient, ξ 1
The distance of influence, ρ t , of the garbage target, T i + 1 5 m
Repulsion gain coefficient, η 400
The distance of influence, ρ T , of the garbage target, T i 0.2 m
Table 5. Algorithm data in dynamic environment under different algorithms.
Table 5. Algorithm data in dynamic environment under different algorithms.
Simulation EnvironmentAlgorithmTrajectory LengthNavigation Time
EnvironmentTAPF177 m55 s
IAPF174.3 m54 s
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

Zhang, M.; Zheng, X.; Wang, J.; Pan, Z.; Che, W.; Wang, H. Trajectory Planning for Cooperative Double Unmanned Surface Vehicles Connected with a Floating Rope for Floating Garbage Cleaning. J. Mar. Sci. Eng. 2024, 12, 739. https://doi.org/10.3390/jmse12050739

AMA Style

Zhang M, Zheng X, Wang J, Pan Z, Che W, Wang H. Trajectory Planning for Cooperative Double Unmanned Surface Vehicles Connected with a Floating Rope for Floating Garbage Cleaning. Journal of Marine Science and Engineering. 2024; 12(5):739. https://doi.org/10.3390/jmse12050739

Chicago/Turabian Style

Zhang, Mengdi, Xiang Zheng, Jianhua Wang, Zijun Pan, Wenbo Che, and Haozhu Wang. 2024. "Trajectory Planning for Cooperative Double Unmanned Surface Vehicles Connected with a Floating Rope for Floating Garbage Cleaning" Journal of Marine Science and Engineering 12, no. 5: 739. https://doi.org/10.3390/jmse12050739

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