Next Article in Journal
Mechanical Characteristics of Prestressed Concrete Curved Transition Section of Composite Bucket Foundations for Offshore Wind Turbines
Previous Article in Journal
Constructal Design of an Overtopping Wave Energy Converter Incorporated in a Breakwater
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Reactive Collision Avoidance of an Unmanned Surface Vehicle through Gaussian Mixture Model-Based Online Mapping

Department of Naval Architecture and Ocean Systems Engineering, Korea Maritime and Ocean University, Busan 49112, Korea
*
Author to whom correspondence should be addressed.
J. Mar. Sci. Eng. 2022, 10(4), 472; https://doi.org/10.3390/jmse10040472
Submission received: 7 February 2022 / Revised: 6 March 2022 / Accepted: 25 March 2022 / Published: 27 March 2022
(This article belongs to the Section Ocean Engineering)

Abstract

:
With active research being conducted on maritime autonomous surface ships, it is becoming increasingly necessary to ensure the safety of unmanned surface vehicles (USVs). In this context, a key task is to correct their paths to avoid obstacles. This paper proposes a reactive collision avoidance algorithm to ensure the safety of USVs against obstacles. A global map is represented using a Gaussian mixture model, formulated using the expectation–maximization algorithm. Motion primitives are used to predict collision events and modify the USV’s trajectory. In addition, a controller for the target vessel is designed. Mapping is performed to demonstrate that the USV can implement the necessary avoidance maneuvers to prevent collisions with obstacles. The proposed method is validated by conducting collision avoidance simulations and autonomous navigation field tests with a small-scale autonomous surface vehicle (ASV) platform. Results indicate that the ASV can successfully avoid obstacles while following its trajectory.

1. Introduction

In the fourth industrial revolution era, characterized by big data, artificial intelligence, and autonomous driving, technologies in all domains are being rapidly advanced through innovation and fusion. At present, unmanned transport vehicles are being actively researched in the fields of automobiles and aviation. Furthermore, in the shipbuilding and offshore domains, the realization of vessel autonomy, remote control systems, and fault diagnosis systems is being focused on, according to the global trend to reduce human intervention. An unmanned surface vehicle (USV) refers to a ship that is operated remotely or automatically without an active crew. Unmanned ships can perform dangerous missions such as reconnaissance patrol and mine clearing. Furthermore, in the private sector, such ships can be used to realize passenger transport, coast guarding, marine exploration, and rescue. In such applications, cost effectiveness and work efficiency can be enhanced through the automation of ships, and the number of casualties can be minimized by preventing human intervention.
A key technology for unmanned ships is collision avoidance, aimed at ensuring the safety of a sailing vessel while maintaining its course when the vessel encounters other ships or obstacles. Research on collision avoidance technology has been performed since before the development of USV, and many collision avoidance techniques have been established. To determine the collision risk of a ship, a ship domain can be introduced using the relative distance between the ship and other ships [1,2]. Moreover, AIS data and probabilistic approaches can be applied [3,4,5,6,7]. According to an alternative theory, a moving robot can be expressed as a dynamic obstacle [8,9,10]. Certain methods for collision avoidance use the direction priority sequential selection algorithm; International Regulations for Preventing Collisions at Sea (COLREGs), defined by the International Maritime Organization [11]; and virtual vector fields [12]. In terms of the control method, collision avoidance methods can be divided into deliberative and reactive control methods. Although deliberative control methods exhibit a high performance in tasks, their reaction speed is low, and these methods cannot effectively adapt to environmental changes. In contrast, although reactive control can promptly respond to changes in the external environment, accurate control is challenging to realize. Overall, although various methods can be used for identifying the collision risk of a vessel and performing collision avoidance, the vessel may not be able to promptly respond to unfamiliar obstacles or obstacles that suddenly appear during a voyage. In such situations, reactive collision avoidance methods are highly effective. In particular, in very urgent situations, the vessel may maneuver in a way that does not comply with COLREGs to avoid a collision situation. Coping methods in emergency situations are described in Rule 2(b) of COLREGs [13]. Several researchers have attempted to realize the collision avoidance of autonomous surface vehicles (ASVs) and unmanned aerial vehicles by using the control barrier function [14] and real-time local Gaussian Mixture Model (GMM) maps [15]. A commonly used technique for local collision avoidance is based on a conceptual force known as the potential field, which is exerted by the obstacle on a robot [16]. This concept has been extended to propose the virtual force field (VFF) concept [12]. Notably, in these methods, a local minima occurs in the process of force composition. Consequently, the robot cannot follow its trajectory or traverse a narrow path. In this context, it is necessary to establish a simple method that can allow a vessel to follow its trajectory while effectively avoiding obstacles.
Considering these aspects, this study is focused on establishing a reaction control-based system to ensure the safety of an unmanned ship. Mapping is performed through the GMM by using the LiDAR information of an unmanned ship, and collision avoidance is performed in a reactive manner.
The remaining paper is organized as follows. Section 2 describes the global mapping technique based on GMM to create a map of the surrounding environment of a USV. Section 3 describes the proposed reactive collision avoidance method to realize real-time collision avoidance based on the GMM-based global map. Section 4 describes the reactive collision avoidance simulations performed using the proposed technique to evaluate its performance. Section 5 presents the conclusions.

2. GMM-Based Mapping

2.1. GMM

The GMM is used to detect obstacles and express them on the global map. In the GMM approach, an irregular distribution is expressed as several normal distributions (Gaussian distributions). In a one-dimensional environment, it is assumed that the data points are distributed on a straight axis. The points correspond to a normal distribution, which can be characterized by parameters such as the mean ( μ ), standard deviation ( δ ), and weight ( π ). The GMM refers to the model in which these Gaussian distributions are linearly combined. If the data are expanded in two dimensions, a GMM with a three-dimensional shape is created, and an ellipse can be obtained when a part of the GMM is projected onto a two-dimensional plane. Figure 1a shows the case in which points are distributed in one dimension, and the corresponding GMM is expressed as a graph. Figure 1b shows an example of a 3D GMM corresponding to 2D data.
GMM has the advantage of having a fast calculation speed while expressing obstacle information with a probabilistic distribution. In addition, if the number of components and parameter values are properly provided, accurate modeling is possible. However, as a disadvantage, it requires advance information on the encounter environment to determine parameters for the algorithm, and local maxima problems can arise.
The probability that a data point x R 2 belongs to a specific Gaussian distribution is defined as Equation (1) [17]. M is the number of Gaussian distributions. Generally, the Gaussian distribution is determined by the parameters μ , covariance ( Σ ), and π . The GMM is defined by a set of parameters Θ = μ 1 , μ 2 , , μ M , Σ 1 , Σ 2 , , Σ M , π 1 , π 2 , , π M .
p ( x | Θ ) = k = 1 M π k N ( x | μ k , Σ k )
The expectation–maximization (EM) algorithm is used to estimate the unknown parameter ( Θ ) [17,18,19]. The EM algorithm consists of two steps:
  • E-step
    The data are labeled using the given parameters. In the initial stage, random parameters are assigned because the parameters are not known.
  • M-step
    The parameters of each group are recalculated through maximum likelihood estimation (MLE). In general, the MLE method can be used to obtain the parameters of a random variable by sampling a random variable. The likelihood is expressed as in Equation (2).
    L ( Θ | x ) = k = 1 n P ( x k | Θ )
    Specifically, the likelihood is calculated by multiplying a given parameter by all probability density values of n data. L ( Θ | x ) means the degree to which the parameter is consistent with the observed data x . The right-hand side of the equation means multiplying all the probabilities of the data x for a specific parameter. The resulting expression is termed the likelihood function. For ease of calculation, the log-likelihood function is used, as defined in Equation (3).
    ln L ( Θ | x ) = k = 1 n ln P ( x k | Θ )
    The MLE function aims to maximize the likelihood. To identify the maximum value, partial differentiation is performed with respect to Θ , and the Θ that leads to a zero value is determined, as indicated in Equation (4).
    Θ L ( Θ | x ) = k = 1 n Θ ln P ( x k | Θ ) = 0
The E-step and M-step are repeated until the distribution converges to yield the optimal parameter.

2.2. Global Map Creation

The discharge map is generated as follows. First, the global map in which obstacles are registered is initialized. Subsequently, point cloud information is received from the 3D LiDAR. The points only have raw information that is not clustered, and the reference coordinate system of the points is the object coordinate system fixed to the ship. If GMM fitting is performed with the points received through the EM algorithm, the confidence ellipse corresponding to each distribution can be obtained.
In the xy coordinate system, the equation of an ellipse with major and minor axes a and b (a ≥ b), respectively, parallel to the coordinate axes, can be expressed as in Equation (5).
x a 2 + x b 2 = 1
In this case, the axis of the confidence ellipse can be expressed by scale factor s and the standard deviations ( σ x , σ y ), as indicated in Equation (6).
x σ x 2 + y σ y 2 = s
s is determined by the confidence level, and the sum of the squares of the Gaussian distribution data corresponds to the chi-square distribution. s can be easily obtained using the chi-square table [20]. In the GMM, the confidence ellipse is determined by the mean and covariance of the Gaussian distribution. Figure 2 shows the confidence ellipse determined by the mean and covariance. The mean of the GMM determines the center of the ellipse, and the covariance determines the size of the ellipse. μ 1 and μ 2 are the mean values of the GMM, which become the center of the ellipse. λ is the Eigenvalue of the covariance ( λ 1 and λ 2 are Eigenvalues corresponding to the semi-major axis and the semi-minor axis, respectively), and α = tan 1 v 1 x v 2 y is the angle between the semi-major axis of the ellipse and x-axis ( v 1 is the Eigenvector about the major axis).
After drawing ellipses for each Gaussian distribution element, the information of the obstacles is expressed on the global map. The process of updating the map is illustrated in Figure 3. All the registered ellipses have position and size information and update time information. d G M M denotes the distance between each GMM, corresponding to the Euclidean distance. t G M M represents the time at which the GMM is updated. Because GMM fitting is performed by the point cloud received in real time, it can be newly registered even for obstacles that have already been mapped. To prevent this problem, if the distance between two ellipses ( d G M M ) is less than 1 m, the other ellipse is regarded as the same obstacle and update is not performed. Instead, the update time ( t G M M ) of the previously registered obstacle is updated. In addition, obstacles registered on the global map are designed to disappear after a certain period because the obstacles are considered to be dynamic. In particular, if a registered obstacle is continuously maintained, the obstacle will continue to remain on the path through which the dynamic obstacle has passed. In this case, proper obstacle map expression and collision avoidance cannot be realized.

3. Reactive Collision Avoidance

3.1. Reactive Collision Avoidance Algorithm

The USV identifies the target point by following the target psi through the pure pursuit guidance algorithm. That algorithm is one of the ways of generating guidance commands so that the bow of the USV always aims for the target point. A detailed explanation is given in Figure 4. The state of an object can be expressed by three components representing the position ( X o s , Y o s ) and heading angle ( ψ o s ) and two components representing the surge speed ( v x ) and angular speed ( ω ). Assuming that X g o a l and Y g o a l are the position of the destination, the angle between the X-axis and the destination is defined as Equation (7).
ψ d = tan 1 ( Y g o a l Y o s X g o a l X o s )
The algorithm aims to make the error of angle ψ o s and angle ψ d zero. The USV uses the error to input a control command. At this time, a PD controller is used.
ψ e r r = ψ o s ψ d
If there is no risk of collision, waypoint tracking is performed as above, but when an obstacle is detected, the control of the USV is performed in a different way. Collision avoidance of the USV is implemented as follows. The USV has a virtual local trajectory list based on n yawrates, defined by motion primitives. Therefore, the motion of the vessel pertaining to each yawrate can be predicted. While the USV is moving forward, local trajectories that do not collide with obstacles are determined from numerous motion primitives, and obstacle avoidance and path following is realized by adopting the yawrate that most accurately follows the desired psi. Figure 5 shows the procedure by which the USV avoid collisions. Finally, the yawrate is entered as a steering command of the ship.

3.2. Motion Primitives

Motion primitives are motions of an object calculated in advance to predict the movement path of the vessel according to the actuator command based on the current position of the vessel. In certain cases, motion primitives have been used for collision avoidance of autonomous ground vehicles (AGVs) [21] or vessel path planning [22]. In this study, the ship behavior is predicted using the unicycle model. The unicycle model is a kinematic model used to simply express the motion of an object moving on a two-dimensional plane. In the model, the motion of an object is expressed only with forward speed ( v x ) and heading angle ( ψ ). The representative variables related to the unicycle model are expressed in Figure 6. The motion primitives of the unicycle model can be approximated as in Equation (9) [23]. In particular, motion primitives are paths created by accumulating vessel positions at time t [ 0 , T ] . T refers to a specific elapsed time, used to express the trajectory. x t = ( x t , y t , ψ t ) represents the position of the USV at a specific time, and x 0 is the initial position.
x t = x 0 + v x ω ( s i n ( ω t + θ ) s i n ( θ ) ) v x ω ( c o s ( θ ) c o s ( ω t + θ ) ) ω t
Motion primitives have K × N discretized points corresponding to K [ 0 , T ] time parameters and N yawrate variables, as shown in Figure 7. Each point is compared with M Gaussian distribution elements to determine whether a collision may occur. For discrete motion primitives, if the left-hand side of Equation (6) is smaller than the right-hand side, the point is considered to collide with the obstacle because the point exists in the circle.
Algorithm 1 describes the process of judging whether a collision occurs, as a pseudocode. μ m x and μ m y are the mean values of the mth Gaussian distribution elements, that is, the x and y coordinates of the confidence ellipse, respectively, and λ m 1 and λ m 2 are the first and second Eigenvalues, respectively.
Algorithm 1 Examining whether a collision occurs, based on the GMM model and motion primitives
1:
Generate M GMM & N local trajectories
2:
Discretize local trajectories as K multiple points
3:
for  m = 1 : M do
4:
    Obtain mean( μ m ) & covariance( Σ m )
5:
    Obtain Eigenvalue( λ m ) & Eigenvector( ν m ) of Σ m
6:
    Perform rotational transformation of multiple points in the global coordinate system
7:
    for  n = 1 : N  do
8:
        for  k = 1 : K  do
9:
           if  f ( x k ) = x k μ m x λ m 1 2 + y k μ m y λ m 2 2 s  then
10:
               Delete trajectory
11:
           end if
12:
        end for
13:
    end for
14:
end for

4. Collision Avoidance Simulation

4.1. Simulation Environment

To verify the proposed algorithm, VRX Simulation, a Gazebo robot operating system (ROS) simulation platform, is used. In general, the ROS is used to develop robot applications, with functionalities of hardware abstraction, low-level device control, message transfer between devices, and library provision. VRX is a type of subpackage of the Gazebo simulation, which corresponds to a virtual ship simulation developed in cooperation with the Naval Postgraduate School, Office of Naval Research and Open Robotics. In the simulation, a wave adaptive modular vessel (WAM-V) is used, and the shape and specifications are presented in Figure 8 and Table 1, respectively. WAM-V is a twin-propelled ship equipped with two thrusters in the stern. It is a differential thruster-type vessel that changes direction by generating a steering control moment caused by the difference in rpm. The steering command is defined as Equations (10) and (11) [24]. δ m e a n refers to the average RPM of both thrusters and δ c m d is the difference in the RPM of the thrusters, which are normalized to have a value between −1 and 1 by divided by the maximum speed. n p o r t , n s t b d , n m a x refer to RPM of the left/right thruster and the maximum RPM of the thruster respectively.
δ m e a n = ( n p o r t + n s t b d ) / 2 n m a x
δ c m d = ( n p o r t n s t b d ) / 2 n m a x
In VRX, Fossen’s 6-DOF vectorial model was adopted to express the motion of WAM-V. The equation of motion is expressed in Equation (12) [25].
M R B ν ˙ + C R B ( ν ) ν + M A ν ˙ r + C A ( ν r ) ν r + D ( ν r ) ν r + g ( η ) = τ p r o p u l s i o n + τ w i n d + τ w a v e s r i g i d b o d y f o r c e s h y d r o d y n a m i c f o r c e s h y d r o s t a t i c f o r c e s
where
η = x , y , z , ϕ , θ , ψ T ν = u , v , w , p , q , r T
η and ν stand for position and velocity vectors for surge, sway, heave, roll, pitch, and yaw, respectively. ν r means the relative speed of the vessel with respect to the fluid. On the right-hand side, the terms mean the forces and moments generated by the thruster, wind, and waves, in order. However, in this study, the effects of wind and waves are not considered, so τ w i n d and τ w a v e s can be omitted. The hydrodynamic force term includes added mass. The hydrodynamic derivatives follow the SNAME (1950) notation. The simplified added mass term is expressed as Equation (14).
M A = X u ˙ 0 0 0 0 0 0 Y v ˙ 0 0 0 Y r ˙ 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 N v ˙ 0 0 0 N r ˙
where N v ˙ = Y r ˙ .
The Coriolis-centripetal matrix is expressed as Equation (15).
C A ( ν r ) = 0 0 0 0 0 Y v ˙ v r + Y r ˙ r 0 0 0 0 0 X u ˙ u r 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 Y v ˙ v r Y r ˙ r X u ˙ u r 0
As in Equation (16), the hydrodynamic damping matrix D ( ν r ) consists of the sum of the linear term D l and the quadratic term D n ( ν r ) . Each term is expressed in Equations (17) and (18).
D ( ν r ) = D l + D n ( ν r )
D l = X u 0 0 0 0 0 0 Y v 0 0 0 Y r 0 0 Z w 0 0 0 0 0 0 K p 0 0 0 0 0 0 M q 0 0 N v 0 0 0 N r
D n ( ν r ) = X u | u | | u r | 0 0 0 0 0 0 Y v | v | | v r | + Y | r | v | r | 0 0 0 Y | v | r | v r | + Y | r | r | r | 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 0 N | v | v | v r | + N | r | v | r | 0 0 0 N | v | r | | v r | + N r | r | | r |
The control method of the WAM-V is as follows. After calculating the desired psi considering the locations of the vessel and target point, the desired yawrate and delta command are sequentially obtained through the psi controller and yawrate controller. Subsequently, the delta command is transmitted to the actuator to drive the thrusters. The controller has a double-loop control structure, and the gains of the controller are calculated through trial and error. The flow of control is presented as a block diagram in Figure 9.
The simulation environment is as follows. Obstacles are placed in the path of the WAM-V, which is set to sail toward a target point. No external force such as winds or currents are introduced. Collision avoidance is considered to fail when a maneuvering vessel and an obstacle come into contact, and the obstacle deviates by a certain distance. To verify the validity of the collision avoidance algorithm, two scenarios are considered.

4.1.1. Scenario with Multiple Fixed Obstacles

The objective is to avoid multiple fixed obstacles. Many obstacles were placed at random positions. Figure 10 shows the arrangement of the fixed obstacles and moving direction of the ship. The target point is 150 m ahead of the ship. The obstacles are spherical buoys with a diameter of 1 m, randomly placed in a 110 m × 30 m space on the path.

4.1.2. Scenario with Fixed and Mobile Obstacles

This situation involves multiple obstacles and two vessels whose routes cross with that of the ship. First, an obstacle ship approaches the front of the own vessel. Subsequently, the other obstacle ship approaches from the port side of the own vessel. Figure 11 shows the arrangement of the fixed and moving obstacles and the desired path of the own ship and obstacle ships. The obstacle ships move only in the surge direction at a speed of approximately 1.4 kn (1 kn = 0.51 m/s).
The performance of the proposed method based on GMM is compared with that of the method based on the VFF. The success/failure of collision avoidance is evaluated by calculating the minimum distance between the obstacle and the own ship. The sum of half the width of the ship and radius of the obstacle buoy is set as the threshold for collision judgment. A collision is considered to occur when the minimum distance is smaller than the threshold.

4.2. Simulation Results

The information obtained from the simulation is visualized through the RViz program. RViz is a 3D visualization tool that can be used to visualize and examine the data in the ROS environment. For example, using the shape of a ship, LiDAR point cloud information, GMM data calculated from obstacles, and trajectories of motion primitives in a virtual space, the progress can be conveniently evaluated. The following subsections describe the results of the simulations.

4.2.1. Scenario with Multiple Fixed Obstacles

Figure 12 shows the simulation screen for the scenario with fixed obstacles. Figure 12a shows the trajectory of the USV toward the target point in intervals of 8 s. The USV successfully arrives at the target point while avoiding the obstacles. Figure 12b shows the virtual information around the ship, expressed in RViz. ➀, ➁, and ➂ in (b) indicate the GMM mapping at ship positions shown in (a). The red dots represent the LiDAR point cloud information and the yellow ellipse is the confidence ellipse determined based on the point cloud information, that is, the obstacle information captured by the USV to avoid collision. The curve located in front of the USV represents the local trajectories generated by the unicycle model. The blue and red curves are trajectories in the direction in which the USV does not collide and does collide with other obstacles, respectively. The vessel controls the direction by adopting the optimal path closest to the desired psi among the trajectories that do not lead to a collision, and the optimal path is displayed as a green curve on RViz. The shortest path to the waypoint is indicated by a pink dotted line. As shown in the bottom part of the figure, a path with a range larger than the actual obstacle size corresponds to a collision. In other words, a safety margin for the collision prediction is set to ensure the safety of the ship.
Figure 13a shows the state variables of the USV, which vary in the simulation. The horizontal axis t indicates the elapsed time, and the vertical axis of each graph is the state variable of the USV. u represents the surge speed of the ship. The ship progresses while maintaining an operating speed of 2.3 kn. ψ and r denote the heading angle and yawrate of the USV, respectively. The solid red line represents r d , which is the desired yawrate when the optimal path is selected in motion primitives, and the solid blue line is the current yawrate. Except in a certain section, the desired yawrate is suitably followed. δ c m d is the steering command. The thruster command value is T c m d [0, 1]. When the USV advances, the left and right thrusters receive a command value of 0.5. While turning hard to the port and starboard sides, the left and right thrusters receive values of 0 and 1 and values of 1 and 0, respectively. Therefore, a positive and negative delta command is transmitted when turning left and right, respectively. Figure 13b shows the distance to the closest obstacle to determine whether the USV collides with the obstacle. d o b s is the distance between the USV and the nearest obstacle, corresponding to the Euclidean distance. d o b s is defined as in Equation (19), where ( x o b s , y o b s ) are the obstacle coordinates.
d o b s = m i n x o s x o b s + y o s y o b s
In Figure 13b, the critical distance at which the ship collides with the obstacles is 1.72 m and the minimum distance between the USV and the obstacle is 2.64 m. Therefore, the USV can proceed toward the destination without any collision.
Next, to verify the effectiveness of the GMM·MP-based collision avoidance method, it is compared with the VFF theory. Figure 14 shows representative trajectories of GMM·MP method and VFF method for fixed obstacles. The simulation for each method was performed 10 times, and the average values of the results presented in Table 2.
The finish time is the time elapsed from the initial movement of the unmanned ship to when it is 5 m from the target point. The finish time of the GMM·MP method is 3.83 s smaller than that of the VFF method. On average, the distance from the nearest obstacle for the GMM·MP method is 0.02 m smaller than that for the VFF method. The GMM·MP method and VFF method can successfully avoid collision with obstacles, as indicated by the number of collisions and percentage of success (number of simulations completed without any collisions). The cross-track error indicates the degree of deviation of the USV from the virtual straight line connecting the starting and destination points. The error of the GMM·MP method is 2.74 m smaller than that for the VFF method. To provide the information more intuitively, the deviation of the avoidance performance of the two collision avoidance methods is expressed as a box plot in Figure 15. T f is the finish time of the USV, and E c r s is the cross-track error. In the first graph, although the standard deviation of T f for the GMM·MP method is greater than that for the VFF method, the GMM·MP method exhibits a smaller finish time than the VFF method in all simulations. For the GMM·MP method, the maximum and minimum finish time are 127.92 and 126.18 s, respectively. The corresponding values for the VFF method are 131.14 s and 130.66 s. As shown in the second graph, the distance from the obstacle is smaller for the GMM·MP method than that for the VFF method. The standard deviation for the GMM·MP method and the VFF method are 0.12 m and 0.07 m, respectively. The VFF method yields more stable results, likely because the vessel in this case does not pass through the narrow space between the obstacles. The standard deviation of the cross-track error is 0.06 m for the GMM·MP method, corresponding to a higher stability than that for the VFF method (0.1 m).

4.2.2. Scenario with Fixed and Mobile Obstacles

Figure 16 shows the trajectory for the case in which the USV performs collision avoidance for fixed and mobile obstacles, in intervals of 8 s. The simulation environment is shown in Figure 16a, and the GMM mapping and local trajectories are shown in Figure 16b. In (a), the path of the target ships is marked by faint lines. The point at which the ship starts to avoid the target ships is highlighted in orange. ➀, ➁, and ➂ in the (b) represent the results of GMM mapping of obstacles at positions shown in (a). As indicated in (a), the ship first encounters an obstacle ship at point ➀ in a head-on situation and turns to starboard. At point ➁, the ship encounters the second obstacle ship in the crossing situation, and thus, collision avoidance is implemented. At point ➂, collision avoidance for fixed obstacles is performed.
Figure 17 shows the state variables of the USV in the scenario with fixed and mobile obstacles. Figure 17a shows the state variables of the USV during collision avoidance in the form of a graph. The first graph shows that the average ship speed is maintained at 2.3 kn. The ship speed rapidly increases after 70–80 s. This phenomenon occurs because δ c m d is maximized while avoiding dynamic obstacles. Moreover, as shown in the third graph, the yawrate is effectively tracked. However, the control response becomes slower in the section in which the desired yawrate rapidly changes. Figure 17b shows the distance between the USV and nearest obstacle. The minimum distance is 2.36 m, which is greater than the collision distance threshold (1.72 m).
Ten simulations are performed to verify the collision avoidance performance of the USV against dynamic obstacles. Figure 18 shows representative trajectories of GMM·MP method and VFF method in mobile obstacle scenario. Table 3 summarizes the results of the different collision avoidance methods for dynamic obstacles. The finish time for the GMM·MP method is approximately 2.67 s smaller than that of the VFF method, although the distance from the nearest obstacle is approximately 0.32 m larger for the VFF method. Using the GMM·MP method, all 10 simulations were successfully completed without collisions. However, when using the VFF method, collisions occurred once in two simulations.
Figure 19 shows the deviation in the avoidance performance of the USV for dynamic obstacles as a box plot. The standard deviation of the finish time is 0.37 s and 0.55 s for the GMM·MP method and VFF method, respectively. Therefore, the GMM·MP method exhibits a fast and stable response. The distance to the nearest obstacle is 0.54 m and 0.42 m for the GMM·MP and VFF methods, respectively. Therefore, the VFF method is slightly more stable. However, the standard deviations of the cross-track error are 0.08 m and 0.61 m for the GMM·MP and VFF, respectively. Therefore, the GMM method is more stable. This finding can be explained by the fact that a collision occurs when using the VFF method, and an outlier exists in the cross-track error.

4.3. Overview of the Results

The GMM·MP generally outperforms the VFF method. When the VFF theory is applied, the vessel tends to avoid obstacles by taking a detour without passing through the narrow space between obstacles. In contrast, the GMM·MP method allows the vessel to pass through narrow passages. Nevertheless, because the GMM·MP method implements obstacle mapping based on probability, obstacle mapping is performed differently even in the same simulation environment, and thus, the standard deviation of the avoidance performance is larger than that associated with the VFF method. In terms of the maintenance of distance from the obstacles, the VFF method exhibits more stable results.

5. Conclusions

According to collision avoidance simulations, the vessel implementing the proposed algorithm can arrive at the target point without colliding with an obstacle. Notably, the method based on GMM mapping and the unicycle model does not yield the exact position of obstacles or vessel behavior compared to the model that considers dynamics. However, using the GMM, the location of the obstacles can be approximated, and the trajectory of the vessel can be corrected through prompt calculation to avoid a collision situation. In addition, the stability of the proposed method was verified by confirming that the USV can safely avoid obstacles in ROS simulations. The proposed technique, which can correct the local trajectory according to obstacles while maintaining the current route, is expected to enhance the reliability of path planning and collision avoidance when used in combination with existing deliberative control methods. Finally, this technology is expected to be useful when performing the USV formation control by preventing collision close USVs or obstacles while maintaining their formation.

Author Contributions

Conceptualization, D.L. and J.W.; methodology, D.L. and J.W.; software, D.L.; validation, J.W.; formal analysis, D.L. and J.W.; investigation, D.L.; resources, D.L. and J.W.; data curation, D.L.; writing—original draft preparation, D.L.; writing—review and editing, D.L.; visualization, D.L.; supervision, J.W.; project administration, J.W.; funding acquisition, J.W. All authors have read and agreed to the published version of the manuscript.

Funding

This work was supported by the National Research Foundation of Korea(NRF) grant funded by the Korea government(MSIT) (No. 2021R1G1A1095671).

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

The data that support the findings of this study are available from the corresponding author upon reasonable request.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Fujii, Y.; Tanaka, K. Traffic capacity. J. Navig. 1971, 24, 543–552. [Google Scholar] [CrossRef]
  2. Goodwin, E.M. A statistical study of ship domains. J. Navig. 1975, 28, 328–344. [Google Scholar] [CrossRef] [Green Version]
  3. Zhu, X.; Xu, H.; Lin, J. Domain and its model based on neural networks. J. Navig. 2001, 54, 97–103. [Google Scholar] [CrossRef]
  4. Wang, N. An intelligent spatial collision risk based on the quaternion ship domain. J. Navig. 2010, 63, 733–749. [Google Scholar] [CrossRef]
  5. Hansen, M.G.; Jensen, T.K.; Lehn-Schiøler, T.; Melchild, K.; Rasmussen, F.M.; Ennemark, F. Empirical ship domain based on AIS data. J. Navig. 2013, 66, 931–940. [Google Scholar] [CrossRef] [Green Version]
  6. Liu, J.; Zhou, F.; Li, Z.; Wang, M.; Liu, R.W. Dynamic ship domain models for capacity analysis of restricted water channels. J. Navig. 2016, 69, 481–503. [Google Scholar] [CrossRef] [Green Version]
  7. Zhang, L.; Meng, Q. Probabilistic ship domain with applications to ship collision risk assessment. Ocean. Eng. 2019, 186, 106130. [Google Scholar] [CrossRef]
  8. Snape, J.; Van Den Berg, J.; Guy, S.J.; Manocha, D. The hybrid reciprocal velocity obstacle. IEEE Trans. Robot. 2011, 27, 696–706. [Google Scholar] [CrossRef] [Green Version]
  9. Kuwata, Y.; Wolf, M.T.; Zarzhitsky, D.; Huntsberger, T.L. Safe maritime navigation with COLREGS using velocity obstacles. In Proceedings of the 2011 IEEE/RSJ International Conference on Intelligent Robots and Systems, San Francisco, CA, USA, 25–30 September 2011; pp. 4728–4734. [Google Scholar]
  10. Huang, Y.; Van Gelder, P.; Wen, Y. Velocity obstacle algorithms for collision prevention at sea. Ocean. Eng. 2018, 151, 308–321. [Google Scholar] [CrossRef]
  11. Naeem, W.; Irwin, G.W.; Yang, A. COLREGs-based collision avoidance strategies for unmanned surface vehicles. Mechatronics 2012, 22, 669–678. [Google Scholar] [CrossRef]
  12. Borenstein, J.; Koren, Y. Real-time obstacle avoidance for fast mobile robots. IEEE Trans. Syst. Man Cybern. 1989, 19, 1179–1187. [Google Scholar] [CrossRef] [Green Version]
  13. International Maritime Organization (IMO). Convention on the International Regulations for Preventing Collisions at Sea, 1972 (COLREGs); International Maritime Organization (IMO): London, UK, 1972. [Google Scholar]
  14. Thyri, E.H.; Basso, E.A.; Breivik, M.; Pettersen, K.Y.; Skjetne, R.; Lekkas, A.M. Reactive collision avoidance for ASVs based on control barrier functions. In Proceedings of the 2020 IEEE Conference on Control Technology and Applications (CCTA), Montreal, QC, Canada, 24–26 August 2020; pp. 380–387. [Google Scholar]
  15. Dhawale, A.; Yang, X.; Michael, N. Reactive collision avoidance using real-time local gaussian mixture model maps. In Proceedings of the 2018 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Madrid, Spain, 1–5 October 2018; pp. 3545–3550. [Google Scholar]
  16. Khatib, O. Real-time obstacle avoidance for manipulators and mobile robots. In Proceedings of the 1985 IEEE International Conference on Robotics and Automation, St. Louis, MO, USA, 25–28 March 1985; Volume 2, pp. 500–505. [Google Scholar]
  17. Reynolds, D.A. Gaussian mixture models. Encycl. Biom. 2009, 741, 659–663. [Google Scholar]
  18. Xuan, G.; Zhang, W.; Chai, P. EM algorithms of Gaussian mixture model and hidden Markov model. In Proceedings of the 2001 International Conference on Image Processing (Cat. No. 01CH37205), Thessaloniki, Greece, 7–10 October 2001; Volume 1, pp. 145–148. [Google Scholar]
  19. Biernacki, C.; Celeux, G.; Govaert, G. Choosing starting values for the EM algorithm for getting the highest likelihood in multivariate Gaussian mixture models. Comput. Stat. Data Anal. 2003, 41, 561–575. [Google Scholar] [CrossRef]
  20. Gordon, M.H.; Loveland, E.H.; Cureton, E.E. An extended table of chi-square for two degrees of freedom, for use in combining probabilities from independent samples. Psychometrika 1952, 17, 311–316. [Google Scholar] [CrossRef]
  21. Gray, A.; Gao, Y.; Lin, T.; Hedrick, J.K.; Tseng, H.E.; Borrelli, F. Predictive control for agile semi-autonomous ground vehicles using motion primitives. In Proceedings of the 2012 American Control Conference (ACC), Montreal, QC, Canada, 27–29 June 2012; pp. 4239–4244. [Google Scholar]
  22. Bergman, K.; Ljungqvist, O.; Linder, J.; Axehill, D. A COLREGs-Compliant Motion Planner for Autonomous Maneuvering of Marine Vessels in Complex Environments. arXiv 2020, arXiv:2012.12145. [Google Scholar]
  23. Yang, X.; Sreenath, K.; Michael, N. A framework for efficient teleoperation via online adaptation. In Proceedings of the 2017 IEEE International Conference on Robotics and Automation (ICRA), Singapore, 29 May–3 June 2017; pp. 5948–5953. [Google Scholar]
  24. Woo, J.; Park, J.; Yu, C.; Kim, N. Dynamic model identification of unmanned surface vehicles using deep learning network. Appl. Ocean. Res. 2018, 78, 123–133. [Google Scholar] [CrossRef]
  25. Bingham, B.; Agüero, C.; McCarrin, M.; Klamo, J.; Malia, J.; Allen, K.; Lum, T.; Rawson, M.; Waqar, R. Toward maritime robotic simulation in gazebo. In Proceedings of the OCEANS 2019 MTS/IEEE SEATTLE, Seattle, WA, USA, 27–31 October 2019; pp. 1–10. [Google Scholar]
Figure 1. Examples of GMM. (a) GMM based on 1D data; (b) GMM and ellipses based on 2D data.
Figure 1. Examples of GMM. (a) GMM based on 1D data; (b) GMM and ellipses based on 2D data.
Jmse 10 00472 g001
Figure 2. Confidence ellipse derived from the Gaussian distribution.
Figure 2. Confidence ellipse derived from the Gaussian distribution.
Jmse 10 00472 g002
Figure 3. Process flow of global map update.
Figure 3. Process flow of global map update.
Jmse 10 00472 g003
Figure 4. Coordinate system of the USV.
Figure 4. Coordinate system of the USV.
Jmse 10 00472 g004
Figure 5. Procedure of collision avoidance check and motion primitive adoption.
Figure 5. Procedure of collision avoidance check and motion primitive adoption.
Jmse 10 00472 g005
Figure 6. Unicycle model.
Figure 6. Unicycle model.
Jmse 10 00472 g006
Figure 7. Schematic process of collision detection and collision avoidance.
Figure 7. Schematic process of collision detection and collision avoidance.
Jmse 10 00472 g007
Figure 8. Appearance of WAM-V.
Figure 8. Appearance of WAM-V.
Jmse 10 00472 g008
Figure 9. Process flow of ship actuator control.
Figure 9. Process flow of ship actuator control.
Jmse 10 00472 g009
Figure 10. Scenario with multiple fixed obstacles.
Figure 10. Scenario with multiple fixed obstacles.
Jmse 10 00472 g010
Figure 11. Scenario with fixed and mobile obstacles.
Figure 11. Scenario with fixed and mobile obstacles.
Jmse 10 00472 g011
Figure 12. Results of ship trajectory and GMM mapping for stationary obstacles.(a) Trajectory of the USV expressed in Gazebo; (b) Virtual information around the USV expressed in RViz.
Figure 12. Results of ship trajectory and GMM mapping for stationary obstacles.(a) Trajectory of the USV expressed in Gazebo; (b) Virtual information around the USV expressed in RViz.
Jmse 10 00472 g012
Figure 13. Variables measured in the scenario with multiple fixed obstacles. (a) State variables of the USV; (b) distance to the closest obstacle.
Figure 13. Variables measured in the scenario with multiple fixed obstacles. (a) State variables of the USV; (b) distance to the closest obstacle.
Jmse 10 00472 g013
Figure 14. Comparison of GMM·MP and VFF trajectories for fixed obstacles.
Figure 14. Comparison of GMM·MP and VFF trajectories for fixed obstacles.
Jmse 10 00472 g014
Figure 15. Avoidance performance of the USV in the scenario with multiple fixed obstacles.
Figure 15. Avoidance performance of the USV in the scenario with multiple fixed obstacles.
Jmse 10 00472 g015
Figure 16. Results of ship trajectory and GMM mapping in the scenario with fixed and mobile obstacles. (a) Trajectory of the USV expressed in Gazebo; (b) Virtual information around the USV expressed in RViz.
Figure 16. Results of ship trajectory and GMM mapping in the scenario with fixed and mobile obstacles. (a) Trajectory of the USV expressed in Gazebo; (b) Virtual information around the USV expressed in RViz.
Jmse 10 00472 g016
Figure 17. Variables in the scenario with fixed and mobile obstacles. (a) State variables of the USV. (b) Distance to the closest obstacle.
Figure 17. Variables in the scenario with fixed and mobile obstacles. (a) State variables of the USV. (b) Distance to the closest obstacle.
Jmse 10 00472 g017
Figure 18. Comparison of GMM·MP and VFF trajectories for mobile obstacles.
Figure 18. Comparison of GMM·MP and VFF trajectories for mobile obstacles.
Jmse 10 00472 g018
Figure 19. Avoidance performance of the USV in the scenario with multiple fixed and mobile obstacles.
Figure 19. Avoidance performance of the USV in the scenario with multiple fixed and mobile obstacles.
Jmse 10 00472 g019
Table 1. Specifications of WAM-V.
Table 1. Specifications of WAM-V.
ParameterValue
Length4.85 m
Width2.44 m
Height1.27 m
Weight (No load)154 kg
Payload220 kg
Full load draft0.17 m
Operating speed2.3 kn
Table 2. Evaluation of obstacle avoidance performance for different collision avoidance methods in the scenario with multiple fixed obstacles.
Table 2. Evaluation of obstacle avoidance performance for different collision avoidance methods in the scenario with multiple fixed obstacles.
GMM·MP (Proposed)VFF
Finish time127.07 s130.9 s
Distance from nearest obstacle9.76 m9.78 m
Number of collisions00
Percentage of success100%100%
Cross-track error2.28 m5.02 m
Number of trials: 10.
Table 3. Evaluation of obstacle avoidance performance of different collision avoidance methods in the scenario with fixed and mobile obstacles.
Table 3. Evaluation of obstacle avoidance performance of different collision avoidance methods in the scenario with fixed and mobile obstacles.
GMM·MP (Proposed)VFF
Finish time132.74 s135.41 s
Distance from nearest obstacle9.55 m9.87 m
Number of collision02
Percentage of success100%80%
Cross-track error3.69 m3.58 m
Number of trials: 10.
Publisher’s Note: MDPI stays neutral with regard to jurisdictional claims in published maps and institutional affiliations.

Share and Cite

MDPI and ACS Style

Lee, D.; Woo, J. Reactive Collision Avoidance of an Unmanned Surface Vehicle through Gaussian Mixture Model-Based Online Mapping. J. Mar. Sci. Eng. 2022, 10, 472. https://doi.org/10.3390/jmse10040472

AMA Style

Lee D, Woo J. Reactive Collision Avoidance of an Unmanned Surface Vehicle through Gaussian Mixture Model-Based Online Mapping. Journal of Marine Science and Engineering. 2022; 10(4):472. https://doi.org/10.3390/jmse10040472

Chicago/Turabian Style

Lee, Dongwoo, and Joohyun Woo. 2022. "Reactive Collision Avoidance of an Unmanned Surface Vehicle through Gaussian Mixture Model-Based Online Mapping" Journal of Marine Science and Engineering 10, no. 4: 472. https://doi.org/10.3390/jmse10040472

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