Next Article in Journal
Light-Weight Classification of Human Actions in Video with Skeleton-Based Features
Next Article in Special Issue
Exploring Zero-Shot Semantic Segmentation with No Supervision Leakage
Previous Article in Journal
Embedding Soft Thresholding Function into Deep Learning Models for Noisy Radar Emitter Signal Recognition
Previous Article in Special Issue
Hierarchical Collaborated Fireworks Algorithm
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Distributed Multi-Mobile Robot Path Planning and Obstacle Avoidance Based on ACO–DWA in Unknown Complex Terrain

Faculty of Information Engineering and Automation, Kunming University of Science and Technology, Kunming 650093, China
*
Authors to whom correspondence should be addressed.
Electronics 2022, 11(14), 2144; https://doi.org/10.3390/electronics11142144
Submission received: 9 June 2022 / Revised: 30 June 2022 / Accepted: 6 July 2022 / Published: 8 July 2022
(This article belongs to the Special Issue Advances in Swarm Intelligence, Data Science and Their Applications)

Abstract

:
Multi-robot systems are popularly distributed in logistics, transportation, and other fields. We propose a distributed multi-mobile robot obstacle-avoidance algorithm to coordinate the path planning and motion navigation among multiple robots and between robots and unknown territories. This algorithm fuses the ant colony optimization (ACO) and the dynamic window approach (DWA) to coordinate a multi-robot system through a priority strategy. Firstly, to ensure the optimality of robot motion in complex terrains, we proposed the dual-population heuristic functions and a sort ant pheromone update strategy to enhance the search capability of ACO, and the globally optimal path is achieved by a redundant point deletion strategy. Considering the robot’s path-tracking accuracy and local target unreachability problems, an adaptive navigation strategy is presented. Furthermore, we propose the obstacle density evaluation function to improve the robot’s decision-making difficulty in high-density obstacle environments and modify the evaluation function coefficients adaptively by combining environmental characteristics. Finally, the robots’ motion conflict is resolved by combining our obstacle avoidance and multi-robot priority strategies. The experimental results show that this algorithm can realize the cooperative obstacle avoidance of AGVs in unknown environments with high safety and global optimality, which can provide a technical reference for distributed multi-robot in practical applications.

1. Introduction

Mobile robots have been increasingly widely used in many fields, such as logistics and transportation, daily services, and industrial manufacturing, for their autonomous navigation and flexible movement. Path planning is an integral and essential part of many technologies for mobile robots [1], aiming to plan a safe optimal or suboptimal route, from the starting point to the endpoint, for the robot in a complex environment. We divide it into global and local path-planning algorithms depending on the robot’s perception of the environment during the movement.

1.1. Global Path-Planning Algorithm

The global path-planning algorithms can be divided into traditional and intelligent algorithms according to their development. Traditional methods include the A* algorithm [2], simulated annealing algorithm [3], fast random tree method [4], etc.; intelligent methods mainly include the ant colony algorithm, particle swarm algorithm [5], genetic algorithm [6], etc. The ant colony algorithm [7] is a kind of bionic algorithm that is based on ant foraging; it has the advantages of positive feedback, better adaptability, robustness, and strong optimization ability. The practical application in path planning is prone to problems such as blindness of the preliminary search, low search efficiency, and easily falling into local optimum and deadlock. Accordingly, the initial pheromone distribution rule, heuristic information function, and pheromone update rule are the improvements that have received a lot of attention. Luo et al. [8] improved the initial pheromone assignment method based on the starting and ending points, as well as the ant location relationship, not only avoiding the initial search blindness of the algorithm but also further improving the search speed. Inspired by the A* algorithm, Dai et al. [9] used the A* algorithm as the heuristic information for path search to improve the convergence speed of ACO and reduce the cumulative number of turning points and cumulative bending angle by adding a bending suppression operator to this heuristic function. Miao et al. [10] proposed a high-quality ant pheromone update rule which only updated pheromones for those ants that could reach the target point successfully and discarded the ants stuck in a deadlock. Heuristic information and adaptive pheromone volatility factor adaptive adjustment strategies were introduced to balance the convergence and global search ability of ACO. Wang et al. [11] solved the ant deadlock problem of 3D path planning with a fallback strategy and set the pheromone of the deadlocked region to 0, which was simple and effective. Zhang et al. [12] designed a free pathfinding-pruning strategy for the complex environment with severe ant colony deadlock, allowing ants to reselect the next grid when a deadlock occurs and removing the redundant paths if they escape from the deadlocked region.

1.2. Local Path-Planning Algorithm

Some local path-planning algorithms that receive much attention include the Artificial Potential Field (APF) [13] and the Dynamic Window Approach (DWA). The APF drives the robot motion by the gravitational and repulsive forces of the virtual potential field, which is widely used in real-time obstacle-avoidance research, as it has a simple structure and good real-time performance; however, it is prone to dilemma near the force equilibrium point. DWA is a classical method proposed by Fox et al. [14] that converts the position constraint of a mobile robot into a velocity constraint problem and obstacle avoidance into an optimal velocity execution problem. Chang et al. [15] made improvements to the unreasonable dynamic window approach by Q-learning and modified and extended the original evaluation function to improve the navigation action, thus demonstrating the higher navigation efficiency and success rate of this method in an unknown environment. In some cases, there is a contradictory relationship between the heading angle evaluation function and the velocity evaluation function, and this leads to problems such as frequent direction changes and untimely evasion when the robot is on the optimal trajectory selected. For this reason, Liu et al. [16] introduced a direction-change-suppression evaluation factor into the evaluation function of DWA that significantly reduced the excessive influence of environmental factors on the evaluation function and the unnecessary steering frequency generated by the robot.

1.3. Fusion Algorithm Applied to Single-Robot Path Planning

Based on the above studies and discussions, the global path-planning algorithm combined with the local obstacle avoidance algorithm has been a fascinating topic for many scholars, enhancing robot path optimality and obstacle-avoidance capability. Zhong et al. [17] combined the secure A* algorithm with DWA to perform path-planning experiments in a large-scale dynamic environment, which achieved real-time motion planning of the robot with both path tracking and obstacle avoidance. Gao et al. [18] combined adaptive DWA with the A* algorithm to achieve robot motion planning, while avoiding DWA from falling into local optimal solutions by using the globally optimal path as a guide and adaptively adjusting the weights of the evaluation function. Fewer scholars have focused on the combined effects of dynamic obstacles and sea state conditions on USVs. Chen [19] et al. proposed an A* hybrid DWA path-planning algorithm. In contrast to most studies, the evaluation coefficients of the robot are adaptively adjusted according to the sea state, where the weights of velocity are reduced and the weights of distance are increased, as the sea state is poor; for example. Lin et al. [20] proposed a two-layer path-planning method based on the improved APF for global path planning and the enhanced DWA with fuzzy control for local path planning. The collision-risk index and relative distance of the robot and the obstacle are considered to dynamically adjust the weights of the evaluation function and finally obtain a reasonable motion path. Kashyap et al. [21] proposed a strategy to fuse DWA with teaching and learning optimization algorithms with promising results in a multi-robot system under dynamic environments.

1.4. Fusion Algorithm Applied to Multi-Robot Path Planning

With the development of technology, it has become difficult for a single mobile robot to complete numerous tasks in the face of more demanding requirements and more complex environments, and multi-mobile robots have entered the vision of researchers. Compared with single robots, multi-mobile robotic systems (MRSs) have the advantages of good flexibility and a wide exploration range, and they can accomplish complex tasks faster and better than a single robot. Therefore, they are used in various environments widely, such as performing sea rescue, formation patrol, mapping tasks, cargo handling, area search, etc.
Planning an optimal motion path for every mobile robot is essential to improve efficiency, but it is more important to ensure the autonomy and coordination of multiple robots during motion [22]. Nazarahari et al. [23] presented a novel multi-objective Enhanced Genetic Algorithm (EGA) to find the optimal path in terms of path length, smoothness, and safety in a continuous environment that is not limited by the grids in a discrete gridded environment. Moreover, an innovative Artificial Potential Field (APF) method was presented to build a set of feasible initial paths in an efficient deterministic fashion. Finally, a new version of the proposed algorithm was introduced to handle the multi-robot cooperative path problem. Bae et al. [24] proposed a deep Q-learning combined with CNN for a multi-robot path-planning algorithm, where the CNN was used for analyzing the relevant image information of the environment and the robot navigated based on deep Q-learning, experimentally demonstrating the flexibility and efficiency of the robot in various settings. Inspired by multi-objective particle swarm optimization, Thabit et al. [25] proposed a new method for multi-robot path planning in unknown environments, with the objectives of path optimality, safety, and smoothness to find the best path for the robot, also introducing probabilistic window combined with sensors to obtain motion information as a way to select a higher adaptive path. Yang et al. [26] proposed a multi-robot path-planning method for ACO that fuses the leader–follower approach, establishes a formation model for leader and follower ants, and updates the pheromone based on the overall characteristics of the formation; the effectiveness of the method was verified based on simulation experiments in MATLAB and ROS. Das et al. [27] added the consideration of path deviation and energy consumption optimization by embedding the social and cognitive behavior of an improved particle swarm algorithm (IPSO) into the Newtonian gravity of an enhanced gravity search algorithm (IGSA). They proposed IPSO–IGSA to implement path planning for multiple robots in dynamic environments and improve search capability by simultaneously updating particle positions, using IPSO velocity and IGSA acceleration. In subsequent research, the authors [27] also investigated the multi-robot collision-free planning problem by mixing improved particle swarm optimization (IPSO) and evolutionary operators (EOPs) [28]. In addition, some scholars [29] set different priorities for each robot by prioritization methods, thus reducing the possibility of robot collisions.
Most scholars have focused on multi-robot navigation methods mostly in relation to reinforcement learning, neural networks, and deep learning [24,30,31,32], which suffer from harsh data sets and training models. More important, the robot dynamics constraints are ignored. Given this, this paper proposes a real-time motion-planning method for distributed multi-robots based on the ant colony algorithm fused with the dynamic windowing approach, without over-reliance on a priori information to decision-making, with the following main contributions:
(1)
Global path phase of ACO: Firstly, the concept of obstacle occupancy ratio is introduced to the initial pheromone allocation principle, avoiding the blindness of the ant’s search. We use the dual-population collaboration strategy with different heuristic functions to improve planning efficiency in complex environments. The sort strategy of the ant is proposed in the pheromone update rule to make full use of the quality of ants to improve the search speed and adjust the pheromone volatility coefficient adaptively to avoid local optimum. Considering the motion characteristics of the robot, the optimal navigation path is obtained by removing redundant path nodes.
(2)
Local path phase of DWA: Firstly, we construct a kinematic model of the robot with kinematic constraints and obstacle environment constraints based on DWA. Secondly, an adaptive navigation strategy is proposed to guide the mobile robot to move regarding the global path reasonably, improving the robot’s safety and path-tracking accuracy significantly in complex environments. Then, based on the traditional evaluation function, we propose a new obstacle density evaluation function to guide the robot reasonably through the complex terrain with high-density obstacles. In addition, to regulate the multiple indicator conflict problem rationally during robot motion and improve the judgment of an optimal path, we adjust the weight of the heading angle evaluation function and the speed evaluation function by combining the obstacle environment effectiveness.
(3)
Priority strategy to coordinate the multi-robot motion: We combine the above single-robot navigation and obstacle-avoidance strategies with the mainstream multi-robot priority strategy, resolving the conflicts between robots and robots, and between robots and unknown static obstacles.
This paper is organized as follows: Section 3 describes our ACO. Section 4 performs the DWA improvement. Section 5 describes the obstacle-avoidance rules among multiple robots. Section 6 discusses the conducted experiments. Section 7 concludes the whole paper and discusses future work.

2. Problem Description

2.1. Environment Modeling

Building an environment map that provides accurate robot motion information (mainly containing starting point, endpoint, obstacle information, etc.) is essential. The grid method is one of the most widely used methods in environmental modeling. The main idea is to divide the entire free space into a grid of uniform cells of the same size, where the model’s accuracy is determined by the actual environment. The grid method divides robots’ workspace into a passable free area and an impassable obstacle area, represented by the matrix M A P , with “0” representing the free grid, “1” representing the obstacle grid, and “2” representing the dynamic obstacle, as in Equation (1).
M A P = 1 0 0 2 1 0 2 2 1 n × n
As shown in Figure 1, each cell represents a kind of basic environment information, where white grid, Γ f , and black grid, Γ o , are both global environments known to the robot a priori, indicating the area with the free passage and the region with obstacles, respectively. In contrast, the red grid, Γ b , is a local environment with a piece of unknown prior information. To make sure that the robot can obtain the global information, the sequence method is used to mark each grid, and the actual coordinates of the environment corresponding to the grid with serial number N are as follows:
x = m o d N , M 0.5                             i f   m o d N , M ! = 0 M + m o d N , M 0.5                 o t h e r w i s e y = M + 0.5 c e i l ( N M )

2.2. Multi-Robot Motion Statement

First, considering a multi-robot model with kinematic constraints and environmental constraints R O B 1 ,   R O B 2 , ,   R O B n , we set the starting grid, S, and the target grid, E, for each robot in the map, M A P , and defined a set of paths of motion R O U T 1 ,   R O U T 2 , ,   R O U T n . This means that, in a static environment with known a priori information, our improved ant colony algorithm gradually generates a safe and passable initial path I n i t i a l _ R O U T 1 ,   I n i t i a l _ R O U T 2 , ,   I n i t i a l _ R O U T n from the starting grid, S, to the target grid, E, and uses the redundancy point deletion strategy to optimize the paths to obtain the most suitable routes R O U T 1 ,   R O U T 2 , R O U T n for multi-robot motion in this environment. Then we randomly set several unknown obstacles U N _ O b s t a c l e 1 ,   U N _ O b s t a c l e 2 , ,   U N _ O b s t a c l e m , which were then guided by our improved dynamic window approach in R O U T 1 ,   R O U T 2 , , . R O U T n to refer R O B 1 ,   R O B 2 , ,   R O B n to their respective target points, E, and ensure that each robot did not collide with any obstacle during the motion. Moreover, we defined the priority of robot motion, which is necessary to solve the conflict problem with multi-robot systems.

3. Ant Colony Optimization

3.1. Principle of Ant Colony Optimization

Ant colony optimization (ACO) is a stochastic heuristic algorithm that simulates ants’ foraging. Ants select the next node by the pheromone concentration in the path, and the higher the pheromone concentration, the more likely the path is selected. As the ants keep searching, the ants will converge to the optimal path with the highest pheromone concentration. The probability of ant k moving from node i to node j in t iterations is shown in Equation (3).
P i j k t = τ i j t α η i j t β j a l l o w e d τ i j t α η i j t β , j a l l o w e d 0 , otherwise
where α is the information heuristic factor, and the larger the value, the less random the algorithm; β is the expectation heuristic factor, and the value must be limited to a small range to avoid optimum local problems; allowed is the set of subsequent selectable nodes for ant; P i j k t is the node transfer probability; τ i j k t is the pheromone concentration on the path; η i j k t is the heuristic function; d i j is the Euclidean distance from node i to node j , and the relationship between η i j and d i j can be defined as the following Equation (4):
η i j t = 1 d i j
After all ants complete one iteration, the pheromones on the path are updated and volatilized according to Equation (5):
τ i j t + 1 = 1 ρ τ i j t + Δ τ i j t , t + 1
In the above equation, the increment of pheromone from t iterations to t + 1 iterations can be expressed by Equation (6):
Δ τ i j t , t + 1 = Q L , A n t   k   p a s s e d   t h r o u g h   p a t h   i , j 0 ,       o t h e r w i s e
where ρ is the pheromone volatility coefficient, Δ τ i j is the pheromone increment in ant pathfinding, Q is the pheromone intensity, and L denotes the total path length of ant K .

3.2. Improved Ant Colony Optimization

3.2.1. The Principle of Initial Pheromone Assignment

The pheromone distribution of the traditional ACO initial stage environment is the same value, which will lead to certain blindness of the ants in the initial path search, lowering the algorithm’s search efficiency and search time to a certain extent. We propose an improved initial pheromone distribution method to avoid the blindness of the ant colony’s initial search path, which reasonably assigns the pheromone values on the cell grid according to the percentage of obstacles around the node. Our method is implemented as follows:
τ i j 0 = ε f j
f j = 1 C U allowed j 8
where ε is the enhancement factor of the initial pheromone, f j denotes the obstacle avoidance factor, C U is the complementary set symbol, and U represents the set of neighboring grids of the current grid I . Using the f j function, the percentage of free grids in the eight neighboring grids of the current grid can be calculated. When the number of obstacle grids in the neighboring is less, the initial pheromone of this grid is more significant, and conversely, the initial pheromone is smaller. In this way, the ants are guided to move forward, avoiding too much terrain pathfinding by the ants for obstacles and speeding up the convergence of our algorithm.
As shown in Figure 2, the lower initial pheromone concentration for the map edges is set to avoid the ants’ pathfinding toward the edges, leading to deviation from the target point. The initial pheromones of our grids are calculated according to Equation (7) and Equation (8), and it can be seen that the initial pheromone concentration is high at the locations with more minor obstacle grids (areas with high luminance in the figure). On the contrary, the initial pheromone concentration is low in the areas with more obstacles (regions with low luminance in the figure).

3.2.2. Double-Species Colony Heuristic Function

A two-layer ant colony was proposed in the literature [12,13] to enable the ant colony to find the optimal path quickly and efficiently. Accordingly, we divided the original number of m ant colonies in the traditional ACO into ordinary layer ants with the numbers of 2 / 3 m and 1 / 3 m , respectively, and planning layer ants, where the ordinary layer ant colonies perform first and the planning layer ant colonies achieve the final path. The heuristic function of traditional ACO is shown in Equation (4), which considers only the local Euclidean distance between node i and node j , and there is an optimum local problem. Therefore, we expanded the distance relationship between the node to be selected and the target point of the common layer ants and designed a new heuristic function so that our pathfinding operation has a high capability even on a map without initial pheromone assignment. Combined with our rules for multi-robot motion description in Section 2.2, it is necessary to plan more suitable paths for R O B 1 ,   R O B 2 , ,   R O B n . We designed a corner suppression factor, T , to the heuristic function of the planning layer ants to make the planning paths smoother. The heuristic functions of the ordinary layer ant colony and the planning layer ant colony are shown in Equations (9)–(11), respectively.
η 1 = max d i s min d i s d J E min d i s
η 2 = d S J d J E · T
T = 1 ,       t J = t J 1 1 2 , o t h e r w i s e
where . and . are the round-down and round-up operations, respectively; m a x d i s and m i n d i s are the maximum and minimum distances from all the nodes to be selected to the end point, respectively; d S J is the distance from the starting point to the current node; and d J E is the distance from the node to be selected to the end point. We propose a suppression factor, T , for the heuristic function of the planning layer in order to reduce the number of turning points of the path. When the direction of the grid to be selected is the same as the direction of the ant’s transfer at the previous moment, T is 1; otherwise, T is 1 / 2 0.5 .

3.2.3. The Pheromone Update Strategy

The traditional pheromone update strategy of ACO ignores the problem of differences in ant quality and adopts an undifferentiated update treatment, which may lead to the negative impact of pheromones updated by poorer ants on the subsequent algorithm seeking. Therefore, we improved both local and global pheromone updates with the following main contributions:
We introduced a ranking strategy to reward and penalize the local pheromone update in the local pheromone update. We sorted all ants in each iteration by path length L 1 L 2 L M , and the contribution of ants to the hormone trajectory volume update was also weighted according to the ranking. If the current path length, L k m , is smaller than the contemporary mean path length, m e a n L , the pheromone is rewarded according to Equation (13); if L k m is larger than m e a n L , the pheromone is penalized according to Equation (14). In addition, to prevent ants from falling into local optimum during the path search, we divided the pheromone volatile coefficient values and differential global pheromone update rules, as shown in Equation (12) to (14).
τ i j t + 1 = 1 ρ 0 1 e t T τ i j t + Δ τ i j t
Δ τ i j t + 1 = Δ τ i j t + L k m m e a n L M m + 2 Q L k m
Δ τ i j t + 1 = Δ τ i j t L k m m e a n L M m + 2 Q L k m
where M is the total number of ants; m is the ant ranking; t is the number of current iterations; T is the total number of iterations; and ρ 0 is the initial value, which is taken as 0.9.

3.2.4. Redundant Point Deletion Strategy

The improved ACO described above improves the algorithm search efficiency and path quality, but there are still many unnecessary turns on the path that are not conducive to the robot for trajectory tracking. To improve the actual motion efficiency of our multi-robot system, we adopted the strategy of removing redundant points, eliminating redundant nodes, and keeping only the necessary turning points, as follows:
Eliminate the redundant points on the same line: Figure 3 shows the original path O r i _ R o u t e node sequence for P 1 P 2 P 3 P 4 P 5 and the node P 2 with the front node, P 1 , and the back node P 3 in the same line. If you eliminate node P 2 , the path becomes P 1 P 3 P 4 P 5 . Then start from node P 3 to determine the relationship with the front node, P 1 , and back node, P 4 , and then repeat the above process until traversing all nodes to get M i d _ R o u t e .
Eliminate redundant points: the nodes in the path M i d _ R o u t e for { P k |   k = 1 ,   2 ,   ,   n } . Take Figure 3b as an example. From the starting point, P 1 is connected to the endpoint, P 4 ; the line segment P 1 P 4 distance is d i s P 1 , P 4 < d i s P 1 , P 3 + d i s P 3 , P 4 , and it crosses the obstacle obstacle and gives up the connection. Then connect node P 1 and node P 3 ; line segment P 1 P 3 distance is d i s P 1 , P 3 < d i s P 1 , P 2 + d i s P 2 , P 3 , and it does not cross the obstacle. Then eliminate all the intermediate nodes in the path M i d _ R o u t e , that is, P 2 . Then connect to the endpoint P 4 with P 3 as the starting point and repeat the above distance judgment and obstacle relationship judgment until all the nodes of the path M i d _ R o u t e are traversed and obtain the N e w _ R o u t e .

4. Improved the Dynamic Window Approach

4.1. Principle of Dynamic Window Approach

The dynamic window approach (DWA) is a mainstream method in local path planning. This algorithm refers to sampling multiple sets of velocities in the velocity search space based on the motion model of the robot. The robot’s trajectory is analyzed and predicted for each group of velocities over a while. Then the velocity group corresponding to the optimal trajectory is selected according to the evaluation function, and the mobile robot is driven for local motion planning according to the velocity corresponding to the optimal trajectory.

4.1.1. Robot Motion Model

The DWA can sample the mobile robot’s linear velocity v t and angular velocity ω t within the window, so we built the kinematic modeling of the two-wheel differential speed mobile robot, as shown in Figure 4. Assuming that the robot trajectory can be decomposed into multiple time slices, and within each time slice, Δ t , the robot makes uniform linear motion, at which time the kinematic model of the robot can be expressed as follows:
x t = x t 1 + v t Δ t c o s θ t 1 y t = y t 1 + v t Δ t s i n ( θ t 1 θ t = θ t 1 + ω t Δ t
where x t ,   y t ,   and   θ t denote the position and angle of the robot in the x   and   y directions at the time, t , respectively; the linear velocity v t range of variation depends on the nearest distance to the obstacle and the maximum linear deceleration; and the content of angular velocity ω t variation is determined by both the closest distance to the obstruction and the maximum angular deceleration.

4.1.2. Robot Speed Constraint

In the velocity space, DWA describes the robot’s obstacle avoidance problem as an optimization problem with constraints, including incomplete motion constraint on the differential robot, dynamics constraint on the robot structure, and environmental constraints.
(1)
The maximum and minimum speed constraints for the robot are as follows [33]:
v s = v , ω | v v m i n , v m a x , ω ω m i n , ω m a x
(2)
Motor acceleration and deceleration constraints: Because different motors have different performances, the acceleration of the robot is also different, and the robot is constrained by the speed that can be reached in the next time interval.
v d = v , ω | v v c a v m i n Δ t , v c + a v m a x Δ t , ω ω c a ω m i n Δ t , ω c + a ω m a x Δ t
where v c   and   w c are the linear velocity and angular velocity of the robot at the current moment, respectively; a v m i n   and   a w m i n are the minimum linear deceleration and minimum angular deceleration, respectively; a v m a x   and   a w m a x are the maximum linear acceleration and maximum angular acceleration, respectively; and Δ t is the sampling time.
(3)
Braking distance constraint: The entire robot trajectory can be subdivided into several linear or circular motions. To ensure the robot’s safety, the current speed should decelerate to 0 before hitting the obstacle in the maximum deceleration conditions.
v a = v , ω | v 2 d i s t v , ω a v m i n , ω 2 d i s t ( v , ω ) a ω m i n
where d i s v , w is the distance between the simulated trajectory and the nearest obstacle. From the expression 0 v a 2 = 2 d i s t v , w a v m i n and 0 w a 2 = 2 d i s t v , w a w m i n , the simulated velocity must satisfy the condition of Equation (19) to ensure the safety of the robot in motion to a greater extent.
As an example, as shown in Figure 5, the above constraints limit the robot to a certain speed of motion, which we can represent by a velocity set as follows:
v r = v s v d v a

4.1.3. Evaluation Function

After velocity space search and sampling, DWA generates predicted motion trajectories for the robot within N s based on the sampled multiple sets of v e l o c i t y   v , ω simulations and then scores each trajectory according to the appropriate objective function. The part of traditional DWA contains three evaluation functions, v e l o c i t y , h e a d i n g , and d i s t , as shown in Equation (20).
G v , ω = σ A · h e a d i n g v , ω + B · d i s t v , ω + C · v e l o c i t y v , ω
where G v , ω is the evaluation value of the simulated trajectory, and the simulated trajectory group with the most significant value that corresponds to the optimal speed group v , ω ; h e a d i n g v , ω is used to evaluate the consistency of the robot and the target direction, and there is a maximum value when the mobile robot travels straight to the target point, h e a d i n g v , ω = π θ , where θ is used to indicate the angle between the robot heading and the target line; d i s t v , ω is the distance between the robot and the nearest obstacle, and the more significant this value is, the smaller the risk of collision; v e l o c i t y v , ω is used to evaluating the robot’s motion performance, and the greater the speed, the higher the score; A ,   B ,   and   C are the weight factor of the corresponding evaluation function; and σ is the normalization factor.

4.2. Improved DWA

Traditional DWA inevitably has the following problems:
(1)
In a complex terrain map with U-traps and so on, the robot is easily caught in the local optimum without global planning guidelines and cannot go to the endpoint.
(2)
Currently, the global algorithm hybrid DWA is the most widely studied, and the robot’s navigation, in the traditional way, depends on the turning points of the global path. However, the tracking accuracy of the robot will be low when more unknown static obstacles exist.
(3)
The evaluation function of traditional DWA is unreasonable, which leads to the robot’s obstacle-avoidance performance in complex environments not being optimal. To ensure the heading and speed, the traditional evaluation function will have a higher probability of selecting the motion trajectory with excessive speed, which makes the robot’s motion too close to the edge of the obstacle, and the robot’s safety is not guaranteed.
(4)
The evaluation function weight value of traditional DWA is fixed and does not change the size in real-time according to the environmental conditions around the robot. This will lead to the robot choosing to go around the periphery when it is in a dense cluster of obstacles, and the inability to pass between the dense obstacles will lead to more extended robot movement and time [34].
To solve the problems of traditional DWA, we propose the following improvement strategies to enable our multi-mobile robot to achieve efficient and safe motion in complex static and dynamic environments.

4.2.1. Fusion with Improved ACO

In maps with U-traps, traditional DWA planning paths lack guidance from global planning and tend to fall into local optimum. To address this drawback, we combined the global path information of the improved ACO planning with the robot motion to ensure that the local action follows the global path basically. The ACO hybrid DWA approach considers the advantages of both ACO and DWA, and it can be seen from Figure 6 that the robot has better safety and smoothness under the fusion algorithm and can finally reach the target point smoothly.

4.2.2. Adaptive Tracking of Target Points

Most scholars have based improved global path-planning algorithms, such as A* [35] and Dijkstra [36], on a hybrid with traditional DWA to simulate robot motion, which is the most popular approach. These studies mentioned above [17,18,35] have mentioned critical points of the global path to guide the robot for local motions, but most refer to the turning points of the global way. Considering turn points as local navigation points simply is not applicable for the environment with dense obstacles and complex unknown obstacles that we are conducting in the following paper. The main problems include the following:
  • Using turn points as local target points does not sufficiently utilize the global path information, and the robot is prone to deviate and lose the correct direction in the dense obstacle environment.
  • It is difficult to guarantee a high tracking accuracy for robots with slight deviations from the global path, especially for robots that need to strictly ensure global routes’ tracking accuracies, such as electronic inspection robots [37] and fire rescue robots [38]. More significant path deviations may produce more severe safety hazards.
  • The traditional method does not consider the case that the robot is unreachable when a large number of unknown obstacles block the local target point.
  • Furthermore, for our multi-robot system, we need to ensure that the multiple robots can continue to complete the accurate tracking motion of the local target point after completing mutual obstacle avoidance. Therefore, we propose an adaptive tracking method for local target points, as shown in the following equation:
    N e w _ p a t h = i = 2 m R e m a k e [ O l d _ p a t h i , O l d _ p a t h i 1 , n d s ]
    l o c a l _ t a r g e t = N e w _ p a t h j , d i s _ r o b o t < 1.7 m   o r   d i s _ l a c a l < 1.5 m   o r   d i s _ o b s t a c l e < 0.7 m g o a l ,   o t h e r w i s e
    where O l d _ p a t h is the global path optimized by Section 3.2.4, n d s is the node distance of the global path expected to be optimized, and R e m a k e . is the function designed in this paper. Firstly, the adjacent path turning points O l d _ p a t h i and O l d _ p a t h i 1 are concatenated one by one to form a straight line equation, and the sequence of nodes on the straight line is solved from the starting point, O l d _ p a t h i 1 , according to the expected node, n d s , starting. The path N e w _ p a t h is obtained by looping through all the linear equations of the path O l d _ p a t h ; m is the number of critical nodes of O l d _ p a t h (including starting point, ending point, and turning point); d i s _ r o b o t is the distance between the robot and the local target point; d i s _ l a c a l is the distance from the end of the simulated trajectory to the local target point; and d i s _ o b s t a c l e is the closest distance from the local target point to that obstacle. When the robot and the local target point satisfy the relationship of Equation (22), the path node is extracted from N e w _ p a t h as the local navigation point, l o c a l _ t a r g e t , where j is the node sequence of N e w _ p a t h ; when the condition of Equation (22) is not satisfied, the final target point goal is selected as the navigation information point.
The improved local target point tracking method is shown in Figure 7. Firstly, the global path is divided into n points of equal distance, and if an unknown obstacle (red obstacle in the figure) is encountered, the surrounding situation needs to be judged: when the distance between the robot and the local target point is less than 1.7 m, or the distance from the endpoint of the simulated trajectory to the local target point is less than 1.5 m, or the distance from the local target point to the nearest obstacle is less than 0.7 m. When one of these three conditions is satisfied, it is determined that the point is desirable as the local target point; otherwise, the endpoint is set as the local target point.

4.2.3. New Obstacle Density Evaluation Function I v , ω

We found through a large number of experiments that, when the mobile robot takes the traditional DWA for movement in complex terrain, as in Figure 8, for example, assuming that the robot gets five simulated trajectories with similar ratings, it is easy to choose the blue trajectory in the figure for movement. The robot has the risk of collision with obstacles. A reasonable trajectory (in red) is preferred by the robot if it considers the distribution of surrounding obstacles comprehensively during its movement. It not only makes the robot keep a certain safety distance from the obstacles, but also improves the degree of freedom of movement.
In reality, it is meaningful to avoid the collision problem when the robot turns or obstacle avoidance to significantly increase the safety of robot motion. Therefore, we propose a new evaluation function, I v , ω , concerning obstacle density based on the three evaluation functions of traditional DWA. Consequently, we propose a new evaluation function regarding obstacle density based on the three evaluation functions of traditional DWA. It takes the end of the trajectory as the circle’s center, with a detection radius of R . The number and occupied area of the free grid within this detection range are considered comprehensively, and the distance index between the robot and obstacles is also added. In the environment, as shown in Figure 8, the robot with the added obstacle density evaluation function action is more inclined to choose the red simulated trajectory that can improve motion safety. The evaluation functions are expressed as follows:
I v , ω = k 1 · N + k 2 · S a l l S o b s t a c l e S a l l + k 3 · 1 d i s r , o b s
where N is the number of free grids in the detection area; S a l l denotes the area of the detection area; S o b s t a c l e is the area of obstacles in the detection area; dis · means the closest distance between the robot, r , and obstacle, o b s , in the detection circle; and k 1 ,   k 2 ,   and   k 3 are the weight of each component. The robot will score each simulated trajectory through the obstacles as a density function, I v , ω , and the larger the value, the sparser the distribution of obstacles within the sensing window, and thus the more suitable the trajectory is for the robot to pass.

4.2.4. Adaptive Evaluation Function Weights

The conventional DWA prioritizes the trajectory that is further from the obstacle to ensure safety. As shown in Figure 9, when the robot approaches the target point, the algorithm prefers the trajectory far away from the obstacle since the distance between the target point and the obstacle is too close. However, it can be clearly seen that the trajectory close to the target point is the optimal trajectory. Considering that when the robot moves in a dense environment, the simulated trajectory without obstacles is retained, our newly added obstacle density evaluation function, I v , ω , with navigation function, h e a d i n g v , ω , and velocity evaluation function, v e l o c i t y v , ω , will have multi-objective optimality-seeking constraints in this class of environment [39].
According to the experiment shown in Figure 9, we sacrificed the robot’s movement speed for the benefit of higher path tracking accuracy. Regarding the actual path length traveled by the robot, ours is 12.3806 m, which is 2% less than the conventional 12.6720 m. As for the global path-tracking error, the traditional robot is 0.5381 m, and ours is only 0.4179 m, which is 22.34% less. For the average motion speed, the conventional one is 0.4267 m/s, and ours is 0.3825 m/s.
To coordinate the robot seeking problem, this paper improves the weights A and C of the h e a d i n g v , ω function and v e l o c i t y v , ω function into an adaptive adjustment strategy, respectively, so that the robot adjusts the relationship between A and C according to the situation of obstacles in the environment it is in. When there are many obstacles, the trajectory point whose heading angle points to the direction of the target point is preferred, and the robot will not pick the trajectory far from the obstacles to form a detour before arriving at the target point. With few obstacles, the trajectory with superior speed evaluation is preferred to make the overall path smoother and the distance shorter. The adjustment method is shown as follows:
A = S o b s t a c l e S a l l + μ · A
C = κ m e a n S a l l S o b s t a c l e S a l l + λ · C
where μ , λ , and κ are the augmented weight coefficients, as obtained by experimental testing; and m e a n · is the average of the area occupied by the free grid within the probe circle for all simulated trajectories.

4.3. Fusion of Ant Colony Algorithm and Dynamic Window Approach

As a classical heuristic search algorithm, the ACO has good adaptability and robustness to a complex environment and is easy to integrate with other algorithms. The DWA fully considers the limitations of the mechanical characteristics of the mobile robots and the environments. The hybrid strategy of ACO–DWA has been well reported in some papers [40,41] recently. Based on the consideration of environmental characteristics, we propose a new fusion strategy and apply a multi-robot system. Firstly, the global path is obtained by improving the ACO, and the adaptive navigation scheme is proposed to use the global path as the motion information point of the robot. To make the robot fit the global path in local motion and consider the safety of movement, the obstacle density evaluation function, I v , ω , is proposed, and the final evaluation function of robot obstacle avoidance is as follows:
G v , ω = σ A · h e a d i n g v , ω + B · d i s t v , ω + C v e l o c i t y v , ω + D · I v , ω
where D is the weight of the obstacle density evaluation function, I v , ω . The flowchart of the fusion algorithm is shown in Figure 10.

5. Prioritized Obstacle Avoidance Strategy for Multi-Mobile Robots

The path-planning problem of multiple mobile robots is extended from the single robot, for which we improved the ACO to preplan a globally optimal path for each mobile robot in the grid environment. The DWA obstacle-avoidance strategy is mainly applicable to static environments or local small-scale dynamic environments (low-speed motion with disturbing obstacles, etc.) [42], but it works poorly for solving the phenomenon of motion conflict among multiple robots [43]. The prioritization method [44], as one of the current mainstream techniques for coordinated collision avoidance, can dissipate local conflicts to achieve collision avoidance coordination. To achieve a better result in global multi-robot motion planning, we combined the improved ACO, improved DWA strategy, and multi-robot priority strategy to simplify the path-planning problem into a dynamic path-planning problem with sequential order, which simplifies the complexity of the algorithm.
We set a corresponding priority level for each mobile robot. When a low-priority robot encounters a high-priority robot during its motion and a motion conflict is about to occur, the low-priority robot stops its action, and the high-priority robot performs obstacle-avoidance motion based on DWA. For example, as shown in Figure 11, three mobile robots are assigned priority, where Robot 1 has the highest priority, Robot 2 has the second-highest priority, and Robot 3 has the lowest priority. When three robots meet and potential motions conflict, Robot 1 maintains its activity without considering the movements of the other robots because it has the highest priority, while Robots 2 and 3 need to stop to give way. When Robot 1 leaves the conflict zone, the state of Robot 3 remains unchanged, and the conflict is wholly resolved after Robot 2 leaves the conflict zone.
The constraints introduced by the robot’s kinematic model and the environmental obstacles were considered in our study, making the challenge of the multi-machine priority obstacle-avoidance strategy focus on judging the conflict and coordinating the move. Taking two robots, AGV1 with higher priority, and AGV2 with lower priority, as an example, we investigated multiple conflict types in Table 1 and obtained the following collision conflict judgments and solutions:
Step 1: If the actual distance, d 12 , of two robots is less than the desired obstacle-avoidance distance, d , there is a potential collision risk.
Step 2: Establish a local coordinate axis with the lower-priority robot, AGV2, as the center; calculate the angle, α , between the line of the two robots and the positive direction of the x-axis; and then calculate the relationship between the magnitude of α and the directional angle, β , of AGV1.
Step 3: Determine whether α β is less than 90°; if this condition is satisfied, the risk of collision is extremely high. To significantly ensure the safety of multi-robot motion, the AGV2, which has lower priority, decelerates and stops in a short time. The AGV1, which has higher priority, treats AGV2 as an unknown static obstacle and performs obstacle-avoidance motion through DWA. When the distance relationship between the two robots is d 12 > d and α β 90 ° , AGV2 resumes motion.
In conjunction with the research presented in this paper, most of the experiments we have conducted show that the proposed prioritized obstacle-avoidance strategy applies to most situations. This is mainly attributed to the fact that robots are defined as conflicting motions only when the above conditions are satisfied in both distance and angle relationships, and robots not in the conflict range perform the corresponding obstacle-avoidance strategies based on our DWA. What is worth mentioning is that our definition of the conflict range is consistent with the detection range of the obstacle density evaluation function, I v , ω , proposed in Section 4.2.3.

6. Simulation Experiment and Result Analysis

The experimental conditions of this paper are shown in Table 2 and Table 3. MATLAB 2019a was used for the experiment, and the experimental environment was Windows 11 64-bit; processor, R5-5600H; and memory, 16 GB.

6.1. Comparative Experimental Analysis of Improved Ant Colony Algorithm

(1)
20 × 20 environment
To verify the relative superiority of our improved ACO and the improved strategy of Luo et al. [8] in a conventional environment, a comparison experiment was conducted on a 20 × 20 environment map. The parameter values of our ACO are shown in Table 2, the experimental results are shown in Table 4, and the path-planning results and convergence curve trends of the two algorithms are shown in Figure 12, where the experimental data of Luo et al. [8] are from the original literature.
The results show that the optimal path length achieved by the improved ACO of Luo et al. [8] is 30.968 m and converges to the optimal path after six generations of population search, with the number of turns of the route being 15. The original path planned by our algorithm is the same as Luo et al. [8], with several turns of 13, but it undergoes only four population iterations to converge quickly, and after later optimization, the path length is 30.7924 m. The number of turning points was also reduced by one. The beneficial effect of the post-optimization is to break through the eight domain directions of the path in the grid environment and make the path more suitable for mobile robot motion. Our improved ACO is superior to the improved strategy of Luo et al. [8] in terms of population convergence speed and path quality.
(2)
30 × 30 environment
We conducted comparative experiments on a 30 × 30 environmental map, and the experimental results are shown in Table 5, and the path planning results and convergence curves are shown in Figure 13.
The results show that the optimal path length achieved by the algorithm of Luo et al. [8] was 44.522 m, which converges to the optimal path after 13 iterations, and the number of path turning points is 14. Our ACO achieved an optimal path with 44.522 m, and after spending 0.4374s of late optimization time, the path length was reduced by 0.9299 m, and the number of path turning points was reduced by three compared to the path length of Luo et al. [8]. In a 30 × 30 environment, our algorithm took only nine populations to converge quickly to the optimal path, optimizing 2.1% and 22.3% in path length and number of turning points, respectively, compared to the literature [8]. The path validation of the robot based on two-wheel differential kinematics in several complex terrain environments will be performed in the experiments to be carried out subsequently.

6.2. Comparative Experimental Analysis of Improved DWA

We referred to the experiments of Yang et al. [45] to design seven more complex environments with high obstacle density for implementing the algorithm test to validate the positive effect of our improved DWA strategy on the robot’s obstacle avoidance. The parameters of our improved ACO and robot are shown in Table 2, where the traditional DWA and our DWA have the same global path and various parameters. The unknown static obstacles are randomly selected and added to the global path planned by our improved ACO for the experiments, and the experimental results are shown in Figure 14, Figure 15, Figure 16, Figure 17, Figure 18, Figure 19 and Figure 20. The blue dashed line in the figure indicates the global path, the red solid line in is the actual route of the conventional robot, and the pink solid line is the actual path of our robot. The green solid line is the linear velocity of the conventional robot, the dark blue solid line is the linear velocity of our robot, the purple solid line is the tracking error of the conventional robot, and the light blue solid line is the tracking error of our robot. The red grid and gray grid indicate unknown static obstacles. To reflect the effectiveness of our algorithm designed for the robot for complex terrain, the line-speed comparison graph and tracking-error comparison graph are added under each map.
What we can clearly conclude from Figure 14, Figure 15, Figure 16, Figure 17, Figure 18, Figure 19 and Figure 20 and Table 6 is that benefiting from our improved DWA motion strategy results in a robot that takes into account the distance traveled, the stability of the motion, the degree of global path maintenance, and the safety of obstacle avoidance during the action, as analyzed below:
In the X-shape environment of Figure 15 and the Complex2 environment of Figure 16, the target point is set at a location closer to the surrounding obstacles. The mechanism of the evaluation function used for the traditional DWA forces the robot to choose a simulated trajectory away from the obstacles, which leads to a detour when the robot approaches the target point, and even in the X-shape environment, as in Figure 15, it fails to get to the endpoint. In contrast, our improved DWA benefits from the newly obstacle density evaluation function, the adapted weighting coefficients enable this robot to have a successful movement, and the path length of our robot is optimized by 15.8% compared to the Complex2 environment in Figure 16. The average error of our global path is only 0.1176 m, which is 0.4656 m less deviation than the traditional robot.
For the double U-shape environment in Figure 17, the traditional robot deviates from the global path after coming out of the narrow area to a more significant extent, resulting in a much less accurate trajectory tracking than our robot and a travel distance 1.5961 m more than our robot.
The Corridor environment in Figure 18 is a demonstration of how the traditional robot chooses trajectories with the fixed rating function to perform motion and results in collisions. What we can see from Figure 18c is that the traditional robot decelerates abruptly only when an obstacle is detected ahead at control point 350, failing to coordinate the trajectory rating function with the obstacle environment and causing a collision. Taking into account the robot’s motion-speed data in Table 6, it can be seen that, under the same parameters and kinematic and environmental constraints, the average speed of the conventional robot is 0.5488 m/s, while ours is only 0.4403 m/s. In addition, it can be seen from Figure 18c that our robot’s low uniform speed motion in a complex environment is better guaranteed in terms of safety than traditional robot motion.
As for the Clasps and Z-type environments in Figure 19 and Figure 20, both the traditional robot and ours reached the destination correctly. Although the passage time of the traditional robot is shorter than ours, the length of the movement distance of our robot is better than that of the traditional robot, mainly because of the excellent follow ability of our robot with the global path at the turns and when performing obstacle avoidance.
In addition, we found from the motion of robots in seven types of complex environments that our robot is better than the path-tracking error of the traditional one. Although the line speed of the traditional robot is incredible, our robot is more stable, which is more beneficial to reducing energy consumption in practice. The experimental data of the robot in complex terrain are shown in Table 6, with the data missing in Map1 and Map2 because the traditional robot broke down. In terms of the path length, our improved DWA outperforms the traditional DWA. Take the traditional DWA of Map3 as an example; the optimal path length is shortened by 15.9% compared to the traditional DWA. In terms of robot passage time, the traditional DWA is slightly better than our DWA, with a difference of about 10 s. Most of the differences are in the evaluation metrics, three for traditional DWA and four for ours, as shown in Equations (20) and (26), respectively. The complexity of our algorithm is greater, and the robot movement takes a longer time. The average linear speed of traditional DWA is better than our DWA, but the smoothness is poor. In addition, the tracking error of the global path was set to evaluate the robot’s tracking accuracy of the global path, and the tracking error with our improved algorithm was significantly better than the conventional DWA. Taking Map3 as an example, the tracking error was reduced by 79.84% compared with the traditional. In summary, we achieved an algorithm that takes into account the four metrics of the robot’s travel length, stability of motion, degree of global path retention, and obstacle avoidance safety with the above analysis and comparison of the metrics.

6.3. Multi-Mobile Robot Path Planning Experiment

To verify the ability of our above fusion algorithm with the priority method to solve conflict avoidance in the path planning of multi-mobile robots, experiments were conducted in environments with known a priori information and unknown factors. Considering that the primary research of this paper is to solve the conflict problem of multi-mobile robots during motion, three mobile robots were designed while considering the kinematic model constraint and obstacle environment constraint, where the priority is AGV 1 > AGV 2 > AGV 3 . The optimal paths were planned in the global static environment, the environment with unknown static obstacles, and the large-scale environment with unknown static obstacles by improving ACO, respectively. The following three experiments were conducted by constructing the multi-robot kinematic model, using the improved DWA. In addition, every robot was equipped with a circular detection circle of radius, R, which achieves both conflict detection and obstacle density detection.

6.3.1. Environments Containing Known Static Obstacle

As shown in Figure 21a and Table 7, we planned a globally optimal path for each robot with the improved ACO, where the blue, pink, and red lines are the global paths of AGV1, AGV2, and AGV3, respectively, with the starting and ending points of AGV1 being (1.5, 30.5) and (30.5, 1.5), AGV2 being (1.5, 1.5) and (30.5, 30.5) for AGV2, and (30.5, 15.5) and (1.5.5, 15.5) for AGV3; the initial direction angles of the robots are −0.7854, 0.7266, and 2.6422 m, respectively. Moreover, the robot motion parameters are shown in Table 2; the black grid is a static obstacle with a priori information. Figure 21b shows the changes of the robot in real-time during the planning process, Figure 22a,b shows the linear velocity and angular velocity variation curves of the robot, and Figure 22c shows the deviation of the robot’s local path planning from the global path, where AGV1 is the solid blue line, AGV2 is the solid pink line, and AGV3 is the solid red line.
What can be seen in Figure 21b and Figure 22 is that, when there is a motion conflict between the lowest-priority AGV3 and the highest-priority AGV1, AGV3 starts to decelerate at the 305th motion control node, stops entirely at 307th, and resumes motion at 342th, with the conflict released. Then AGV1 reencounters the lower-priority AGV2. AGV2 starts to decelerate from the 346th control node to a complete stop at 349th and resumes motion with the conflict resolved at 407th. AGV1 performs a reasonable obstacle avoidance based on our DWA avoidance strategy by treating AGV2 and AGV3 as unknown static obstacles.
With the highest priority, AGV1 performs more obstacle-avoidance processes than the lower-priority AGV2 and AGV3, and this produces more pronounced angular velocity changes and global path deviations, as seen in Figure 22, but the velocity fluctuations are not significant. In addition, combined with our study of multi-robot motion conflict in Section 4, the directional angle relationship between AGV2 and AGV3 is always greater than 90°, which corresponds to Case_4 of Table 1 and does not satisfy the motion conflict relationship. This multi-robot motion experiment takes 438.85 s. What can be seen in Table 7 is that the global path lengths of AGV1, AGV2, and AGV3 are 41.0609, 40.9754, 31.6413 m; the final travel distances are 40.898, 40.74, and 29.494 m, respectively; and the average error of motion deviation from the global path at each motion moment (0.1 s) is 0.1238, 0.0937, and 0.0938 m, respectively.

6.3.2. Environments Containing Unknown Static Obstacle

As shown in Figure 23a and Table 8, the safe and optimal path is planned for each robot based on our improved ACO, and then four unknown static obstacles are added to these paths, where the blue, pink, and red lines are the path cases of three robots, AGV1, AGV2, and AGV3, respectively; the linear velocity, angular velocity, and tracking deviation of each robot are presented in Figure 24, with the solid blue line indicating AGV1, the solid pink line AGV2, and the solid red line AGV3. The starting and ending points of AGV1 are (1.5, 30.5) and (30.5, 1.5), respectively; the starting and ending points of AGV2 are (1.5, 1.5) and (30.5, 30.5), respectively; and the starting and ending points of AGV3 are (30.5, 29.5) and (1.5, 2.5), respectively. The black grids are static obstacles that the robots have a priori information about, and the red grids are static obstacles without a priori information; the initial direction angles of the robots are −0.7854, 0.7266, and −2.3562 m, respectively. Figure 23b shows a real-time variation of the robot during its motion; Figure 24a,b show the linear and angular velocity variation curves of the robot, respectively; and Figure 24c shows the deviation of the robot’s local path from the global path.
What we can see from Figure 23b and Figure 24 is that the motion of AGV1, which has the highest priority, and AGV2, which has a lower priority, near the unknown red obstacle, is rough, as follows: AGV2 travels from the lower left to the upper right, and AGV1 travels from the upper left to the lower right. When the distance between these two robots is less than the conflict detection radius, AGV2 starts to decelerate at the 350th motion control node and stops altogether at the 351st. Then AGV1 exits the conflict detection radius within a short time, and AGV2 immediately returns to the motion state. AGV1 continues to move toward the target point without conflict with AGV3, so each robot makes reasonable obstacle avoidance based on DWA for unknown obstacles and reaches its respective endpoints safely.
The velocity-change curve in Figure 24 shows that only a brief conflict occurred between AGV2 and AGV1, so the velocity of AGV2 drops to 0. The change of movement angle is the most obvious, and the global path deviation is the largest, but the whole movement is relatively smooth. What can be seen in Table 8 is that the multi-robot motion experiment takes 432.5953 s, and the global path lengths of AGV1, AGV2, and AGV3 are 41.0609, 40.9694, and 39.6227 m. The travel distances of AGV1, AGV2, and AGV3 are 41.16, 41.39, and 39.858 m, respectively, and the average error of motion deviation from the global path for each moment (0.1 s) is 0.2226, 0.2874, and 0.2710 m, respectively.

6.3.3. Marine Environment with Unknown Static Obstacles

As shown in Figure 25a and Table 9, the blue, pink, and red lines are the paths of AGV1, AGV2, and AGV3, respectively, where the starting and ending points of AGV1 are (20.5, 45.5) and (44.5, 85.5), respectively; the starting and ending points of AGV2 are (44.5, 21.5) and (72.5, 84.5), respectively; and the starting and ending points of AGV3 are (65.5, 85.5) and (49.5, 16.5), respectively. The black grid is a static obstacle for which the robot has a priori information, and the red grid is an unknown obstacle; the initial direction angle of the robots are −0.7854, 0.7266, and −2.3562 m, respectively. Figure 25b shows the obstacle avoidance of the robot during the motion, Figure 26a,b shows the linear and angular velocity variations, and Figure 26c shows the deviation of the robot’s motion path from the global path during the single-step motion time, where the blue solid line is AGV1, the pink solid line is AGV2,and the red solid line is AGV3. Since we sampled a larger-scale sea area map in this example experiment, we made the following changes to improve the robot motion efficiency and program running time: the robot speed evaluation weight, C , is increased from 0.3 to 0.5; the robot sampling time, τ t (also the robot’s single-step motion time of Equation (16)), is changed from 0.1 to 0.3 s; the trajectory simulation prediction time is increased from 3 to 5 s; the maximum angular velocity is increased from 70 to 80 rad/s; and the angular velocity resolution is reduced from 5 to 2.
Figure 25b and Figure 26 show that the higher-priority AGV2 and the lowest-priority AGV3 are in a conflict during their motion. AGV3 starts to decelerate at the 183rd motion control node, stops entirely at the 185th, and resumes its motion after the conflict is released. In addition, we put a large number of unknown obstacles on each robot’s global path to interfere significantly with the action in this example, where the degree of interference is the greatest for AGV2. However, with our proposed adaptive navigation strategy, all the robots achieve obstacle avoidance and reach their respective endpoints safely.
We can find from Figure 26 that only a brief conflict occurred between AGV2 and AGV3, resulting in AGV3’s velocity decreasing to 0. The path of AGV2 is disturbed by unknown obstacles to the greatest extent, so the degree of deviation from the global path during the motion is the greatest, but there is still a relatively smooth robot motion velocity. Finally, the whole experiment of multi-robot action takes 705.8052 s, and Table 9 shows that the global path lengths of AGV1, AGV2, and AGV3 are 42.7139, 69.8566, 72.1761 m, and the travel distances are 47.328, 71.022, and 71.15 m, respectively. The average error of motion deviation from the global path for each moment (0.3 s) is 0.3319, 0.7673, and 0.5376 m, respectively.

7. Conclusions

To solve the navigation and obstacle avoidance problems of distributed multi-mobile robots in unknown complex environments, we fused ant colony optimization (ACO) with the dynamic window approach (DWA) to enhance the obstacle-avoidance capability of robots and introduce a priority strategy to coordinate path planning and motion navigation among multiple robots and unknown regions.
Improvements were made to solve the blindness of early search, slow convergence, and local optimal solutions of the ACO. Accordingly, the principle of non-uniform initial pheromone assignment, dual-population heuristic functions, weighting sort ant pheromone update rule, and pheromone volatile coefficient self-adjustment strategy were proposed. Finally, the global path was optimized by our redundant point streamlining approach to make the global path more compatible with robot motion. The simulations demonstrated the effectiveness of our improved ACO in global path planning.
We investigated the problems of poor global path-tracking ability and obstacle-avoidance effect of the robot in high-density obstacle and large-scale unknown static obstacle environments, as well as unreasonable obstacle-avoidance mechanisms. Accordingly, we propose an adaptive navigation strategy to enhance the guidance for robots by selecting reasonable local target points. Considering the effects of local environmental changes on robot motion comprehensively, a new obstacle density evaluation function and an adaptive weighting strategy based on the original evaluation functions were presented to smooth out the robot motion path. Finally, the effectiveness of this improvement was verified in seven complex environments.
The distributed multi-robot system was extended from our single-robot obstacle-avoidance algorithm. Then we discussed the situation of motion conflict among multi-mobile robots, proposed conflict judgment rules, and introduced a priority strategy to solve the collision problem. Finally, the effectiveness of our method was verified in three scenarios.
In this study, high-density obstacles and unknown static obstacles were the environments we focused on, and more complex factors (non-flat terrain, dynamic obstacles, etc.) will be gradually considered in future work. In addition, we can extend our study to a 3D environment; build accurate models based on sensor acquisition information (including environment model, complex oceanic factors, dynamic obstacle factors, etc.); and add evaluation functions, such as energy consumption and ocean currents, to the DWA to better coordinate the multi-agent system.

Author Contributions

Conceptualization, L.Y. and Z.Y.; methodology, Q.W. and L.Y.; software, Q.W.; data curation, G.X.; writing—original draft preparation, Q.W. and L.Y.; writing—review and editing, Q.W. and J.L.; supervision, P.L. All authors have read and agreed to the published version of the manuscript.

Funding

This research was funded by the National Key R&D Program of China, grant number 61163051.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Cheng, C.; Kia, F.; Leung, H.; Tse, C.K. An AUVs Path Planner using Genetic Algorithms with a Deterministic Crossover Operator. In Proceedings of the International Conference on Robotics and Automation, Anchorage, AK, USA, 3–8 May 2010. [Google Scholar] [CrossRef]
  2. Ducho, F.; Babinec, A.; Kajan, M.; Beo, P.; Florek, M.; Fico, T.; Juriica, L. Path planning with modified A star algorithm for a mobile robot. Procedia Eng. 2014, 96, 59–69. [Google Scholar] [CrossRef] [Green Version]
  3. Miao, H.; Tian, Y. Dynamic robot path planning using an enhanced simulated annealing approach. Appl. Math. Comput. 2013, 222, 420–437. [Google Scholar] [CrossRef] [Green Version]
  4. Viseras, A.; Losada, R.O.; Merino, L. Planning with ants: Efficient path planning with rapidly exploring random trees and ant colony optimization. Int. J. Adv. Robot. Syst. 2016, 13, 1–16. [Google Scholar] [CrossRef]
  5. Nie, Z.; Yang, X.; Gao, S.; Zheng, Y.; Wang, J.; Wang, Z. Research on autonomous moving robot path planning based on improved particle swarm optimization. In Proceedings of the IEEE Congress on Evolutionary Computation, Vancouver, BC, Canada, 24–29 July 2016. [Google Scholar] [CrossRef]
  6. Panda, R.K.; Choudury, B.B. An effective path planning of mobile robot using genetic algorithm. In Proceedings of the IEEE International Conference on Computational Intelligence & Communication Technology, Ghaziabad, India, 13–14 February 2015. [Google Scholar] [CrossRef]
  7. Dorigo, M.; Gambardella, L.M. Ant colony system: A cooperative learning approach to the traveling salesman problem. IEEE Trans. Evol. Comput. 1997, 1, 53–66. [Google Scholar] [CrossRef] [Green Version]
  8. Luo, Q.; Wang, H.; Zheng, Y.; He, J. Research on path planning of mobile robot based on improved ant colony algorithm. Neural Comput. Appl. 2020, 32, 1555–1566. [Google Scholar] [CrossRef]
  9. Dai, X.; Long, S.; Zhang, Z.; Gong, D. Mobile robot path planning based on ant colony algorithm with A* heuristic method. Front. Neurorobot. 2019, 13, 15. [Google Scholar] [CrossRef]
  10. Miao, C.; Chen, G.; Yan, C.; Wu, Y. Path planning optimization of indoor mobile robot based on adaptive ant colony algorithm. Comput. Ind. Eng. 2021, 156, 107230. [Google Scholar] [CrossRef]
  11. Wang, L.; Kan, J.; Guo, J.; Wang, C. 3D path planning for the ground robot with improved ant colony optimization. Sensors 2019, 19, 815. [Google Scholar] [CrossRef] [Green Version]
  12. Zhang, H.; HE, L.; Yuan, L.; Ran, T. Mobile robot path planning using improved double-layer ant colony algorithm. Control Decis. (China) 2022, 37, 303–313. [Google Scholar] [CrossRef]
  13. Zhou, L.; Li, W. Adaptive artificial potential field approach for obstacle avoidance path planning. In Proceedings of the Seventh International Symposium on Computational Intelligence and Design, Hangzhou, China, 13–14 December 2014. [Google Scholar] [CrossRef]
  14. Fox, D.; Burgard, W.; Thrun, S. The dynamic window approach to collision avoidance. IEEE Robot. Autom. Mag. 1997, 4, 23–33. [Google Scholar] [CrossRef] [Green Version]
  15. Chang, L.; Shan, L.; Jiang, C.; Dai, Y. Reinforcement based mobile robot path planning with improved dynamic window approach in unknown environment. Auton. Robot. 2021, 45, 51–76. [Google Scholar] [CrossRef]
  16. Liu, T.; Yan, R.; Wei, G.; Sun, L. Local path planning algorithm for blind-guiding robot based on improved DWA algorithm. In Proceedings of the Chinese Control and Decision Conference (CCDC), Nanchang, China, 3–5 June 2019; pp. 6169–6173. [Google Scholar] [CrossRef]
  17. Zhong, X.; Tian, J.; Hu, H.; Peng, X. Hybrid path planning based on safe A* algorithm and adaptive window approach for mobile robot in large-scale dynamic environment. J. Intell. Robot. Syst. 2020, 99, 65–77. [Google Scholar] [CrossRef]
  18. Gao, H.; Ma, Z.; Zhao, Y. A fusion approach for mobile robot path planning based on improved A* algorithm and adaptive dynamic window approach. In Proceedings of the 4th International Conference on Electronics Technology (ICET 2021), Chengdu, China, 7–10 May 2021; pp. 882–886. [Google Scholar] [CrossRef]
  19. Chen, Z.; Zhang, Y.; Zhang, Y.; Nie, Y.; Zhu, S. A hybrid path planning algorithm for unmanned surface vehicles in complex environment with dynamic obstacles. IEEE Access 2019, 7, 126439–126449. [Google Scholar] [CrossRef]
  20. Lin, Z.; Yue, M.; Chen, G.; Sun, J. Path planning of mobile robot with PSO-based APF and fuzzy-based DWA subject to moving obstacles. Trans. Inst. Meas. Control 2022, 44, 121–132. [Google Scholar] [CrossRef]
  21. Kashyap, A.K.; Parhi, D.R.; Muni, M.K.; Pandey, K.K. A hybrid technique for path planning of humanoid robot NAO in static and dynamic terrains. Appl. Soft Comput. 2020, 96, 106581. [Google Scholar] [CrossRef]
  22. Kala, R. Multi-robot path planning using co-evolutionary genetic programming. Expert Syst. Appl. 2012, 39, 3817–3831. [Google Scholar] [CrossRef]
  23. Nazarahari, M.; Khanmirza, E.; Doostie, S. Multi-objective multi-robot path planning in continuous environment using an enhanced genetic algorithm. Expert Syst. Appl. 2019, 115, 106–120. [Google Scholar] [CrossRef]
  24. Bae, H.; Kim, G.; Kim, J.; Qian, D.; Lee, S. Multi-robot path planning method using reinforcement learning. Appl. Sci. 2019, 9, 3057. [Google Scholar] [CrossRef] [Green Version]
  25. Thabit, S.; Mohades, A. Multi-robot path planning based on multi-objective particle swarm optimization. IEEE Access 2018, 7, 2138–2147. [Google Scholar] [CrossRef]
  26. Yang, L.; Fu, L.; Li, P.; Mao, J.; Guo, L.; Du, L. LF-ACO: An effective formation path planning for multi-mobile robot. Math. Biosci. Eng. 2022, 19, 225–252. [Google Scholar] [CrossRef]
  27. Das, P.K.; Behera, H.S.; Jena, P.K.; Panigrahi, B.K. Multi-robot path planning in a dynamic environment using improved gravitational search algorithm. J. Electr. Syst. Inf. Technol. 2016, 3, 295–313. [Google Scholar] [CrossRef] [Green Version]
  28. Das, P.K.; Behera, H.S.; Panigrahi, B.K. A hybridization of an improved particle swarm optimization and gravitational search algorithm for multi-robot path planning. Swarm Evol. Comput. 2016, 28, 14–28. [Google Scholar] [CrossRef]
  29. Das, P.K.; Jena, P.K. Multi-robot path planning using improved particle swarm optimization algorithm through novel evolutionary operators. Appl. Soft Comput. 2020, 92, 106312. [Google Scholar] [CrossRef]
  30. Li, Q.B.; Gama, F.; Ribeiro, A.; Prorok, A. Graph neural networks for decentralized multi-robot path planning. In Proceedings of the 2020 IEEE RSJ International Conference on Intelligent Robots and Systems (IROS), Las Vegas, NV, USA, 24 October 2020–24 January 2021. [Google Scholar] [CrossRef]
  31. Li, H.; Yang, S.X.; Seto, M.L. Neural-network-based path planning for a multirobot system with moving obstacles. IEEE Trans. Syst. Man Cybern. Part C (Appl. Rev.) 2009, 39, 410–419. [Google Scholar] [CrossRef]
  32. Madridano, Á.; Al-Kaff, A.; Martín, D.; Escalera, A. Trajectory planning for multi-robot systems: Methods and applications. Expert Syst. Appl. 2021, 173, 114660. [Google Scholar] [CrossRef]
  33. Lima, D.A.D.; Pereira, G.A.S. Navigation of an autonomouscar using vector fields and the dynamic window approach. J. Control Autom. Electr. Syst. 2013, 24, 106–116. [Google Scholar] [CrossRef]
  34. Trautman, P.; Ma, J.; Murray, R.M.; Krause, A. Robot navigation in dense human crowds: The case for cooperation. In Proceedings of the 2013 IEEE International Conference on Robotics and Automation, Karlsruhe, Germany, 6–10 May 2013. [Google Scholar] [CrossRef]
  35. Lao, C.; Li, P.; Feng, Y. Path Planning of Greenhouse Robot Based on Fusion of Improved A* Algorithm and Dynamic Window Approach. Nongye Jixie Xuebao/Trans. Chin. Soc. Agric. Mach. (China) 2021, 52, 14–22. [Google Scholar] [CrossRef]
  36. Liu, L.; Lin, J.; Yao, J.; He, D.; Zheng, J.; Huang, J.; Peng, S. Path planning for smart car based on Dijkstra algorithm and dynamic window approach. Wirel. Commun. Mob. Comput. 2021, 2021, 8881684. [Google Scholar] [CrossRef]
  37. Katrasnik, J.; Pernus, F.; Likar, B. A Survey of Mobile Robots for Distribution Power Line Inspection. IEEE Trans. Power Deliv. 2010, 25, 485–493. [Google Scholar] [CrossRef]
  38. Suresh, J. Fire-fighting robot. In Proceedings of the International Conference on Computational Intelligence in Data Science (ICCIDS 2017), Chennai, India, 2–3 June 2017; pp. 1–4. [Google Scholar] [CrossRef]
  39. Wang, Y.; Tian, Y.; Li, X.; Li, L. Self-adaptive dynamic window approach in dense obstacles. Control Decis. (China) 2019, 34, 27–36. [Google Scholar] [CrossRef]
  40. Yang, L.; Fu, L.; Li, P.; Mao, J.; Guo, N. An Effective Dynamic Path Planning Approach for Mobile Robots Based on Ant Colony Fusion Dynamic Windows. Machines 2022, 10, 50. [Google Scholar] [CrossRef]
  41. Jin, Q.; Tang, C.; Cai, W. Research on Dynamic Path Planning Based on the Fusion Algorithm of Improved Ant Colony Optimization and Rolling Window Method. IEEE Access 2021, 10, 28322–28332. [Google Scholar] [CrossRef]
  42. Li, W.; Wang, L.; Fang, D.; Li, Y.; Huang, J. Path planning algorithm combining A* with DWA. Syst. Eng. Electron. (China) 2021, 43, 3694–3702. [Google Scholar] [CrossRef]
  43. Liu, J.; Anavatti, S.; Garratt, M.; Abbass, H.A. Modified continuous Ant Colony Optimisation for multiple Unmanned Ground Vehicle path planning. Expert Syst. Appl. 2022, 196, 116605. [Google Scholar] [CrossRef]
  44. Zhang, Y.; Wang, F.; Fu, F.; Su, Z. Multi-AGV Path Planning for Indoor Factory by Using Prioritized Planning and Improved Ant Algorithm. J. Eng. Technol. Sci. 2018, 50, 534–547. [Google Scholar] [CrossRef] [Green Version]
  45. Yang, H.; Qi, J.; Miao, Y.; Sun, H.; Li, J. A new robot navigation algorithm based on a double-layer ant algorithm and trajectory optimization. IEEE Trans. Ind. Electron. 2018, 66, 8557–8566. [Google Scholar] [CrossRef] [Green Version]
Figure 1. Schematic diagram of the grid.
Figure 1. Schematic diagram of the grid.
Electronics 11 02144 g001
Figure 2. The case of our initial pheromone distribution.
Figure 2. The case of our initial pheromone distribution.
Electronics 11 02144 g002
Figure 3. Redundancy point deletion strategy. (a) Step 1. (b) Step 2.
Figure 3. Redundancy point deletion strategy. (a) Step 1. (b) Step 2.
Electronics 11 02144 g003
Figure 4. Robot kinematic model.
Figure 4. Robot kinematic model.
Electronics 11 02144 g004
Figure 5. Schematic diagram of robot velocity constraints.
Figure 5. Schematic diagram of robot velocity constraints.
Electronics 11 02144 g005
Figure 6. Comparison of robot behaviors. (a) DWA. (b) ACO–DWA.
Figure 6. Comparison of robot behaviors. (a) DWA. (b) ACO–DWA.
Electronics 11 02144 g006
Figure 7. Schematic diagram of the improved local target point tracking method.
Figure 7. Schematic diagram of the improved local target point tracking method.
Electronics 11 02144 g007
Figure 8. Trajectory analysis.
Figure 8. Trajectory analysis.
Electronics 11 02144 g008
Figure 9. Comparison of robots’ paths. (a) Our robot. (b) The conventional robot. The global path (blue dotted line and black dotted line), the conventional DWA planning path (red line), the improved DWA planning path (blue line).
Figure 9. Comparison of robots’ paths. (a) Our robot. (b) The conventional robot. The global path (blue dotted line and black dotted line), the conventional DWA planning path (red line), the improved DWA planning path (blue line).
Electronics 11 02144 g009
Figure 10. Fusion algorithm flow.
Figure 10. Fusion algorithm flow.
Electronics 11 02144 g010
Figure 11. Schematic diagram of multiple mobile robot encounters.
Figure 11. Schematic diagram of multiple mobile robot encounters.
Electronics 11 02144 g011
Figure 12. Comparison experiment 1. (a) Path planning. (b) Convergence curve.
Figure 12. Comparison experiment 1. (a) Path planning. (b) Convergence curve.
Electronics 11 02144 g012
Figure 13. Comparison experiment 2. (a) Path planning. (b) Convergence curve.
Figure 13. Comparison experiment 2. (a) Path planning. (b) Convergence curve.
Electronics 11 02144 g013
Figure 14. Map 1’s experimental results. (a) Traditional robot. (b) Our robot. (c) Two-coordinate plot of linear velocity and tracking deviation.
Figure 14. Map 1’s experimental results. (a) Traditional robot. (b) Our robot. (c) Two-coordinate plot of linear velocity and tracking deviation.
Electronics 11 02144 g014
Figure 15. Map 2’s Experimental results. (a) Traditional robot. (b) Our robot. (c) Two-coordinate plot of linear velocity and tracking deviation.
Figure 15. Map 2’s Experimental results. (a) Traditional robot. (b) Our robot. (c) Two-coordinate plot of linear velocity and tracking deviation.
Electronics 11 02144 g015
Figure 16. Map 3’s experimental results. (a) Traditional robot. (b) Our robot. (c) Two-coordinate plot of linear velocity and tracking deviation.
Figure 16. Map 3’s experimental results. (a) Traditional robot. (b) Our robot. (c) Two-coordinate plot of linear velocity and tracking deviation.
Electronics 11 02144 g016
Figure 17. Map 4’s experimental results. (a) Traditional robot. (b) Our robot. (c) Two-coordinate plot of linear velocity and tracking deviation.
Figure 17. Map 4’s experimental results. (a) Traditional robot. (b) Our robot. (c) Two-coordinate plot of linear velocity and tracking deviation.
Electronics 11 02144 g017
Figure 18. Map 5’s experimental results. (a) Traditional robot. (b) Our robot. (c) Two-coordinate plot of linear velocity and tracking deviation.
Figure 18. Map 5’s experimental results. (a) Traditional robot. (b) Our robot. (c) Two-coordinate plot of linear velocity and tracking deviation.
Electronics 11 02144 g018
Figure 19. Map 6’s experimental results. (a) Traditional robot. (b) Our robot. (c) Two-coordinate plot of linear velocity and tracking deviation.
Figure 19. Map 6’s experimental results. (a) Traditional robot. (b) Our robot. (c) Two-coordinate plot of linear velocity and tracking deviation.
Electronics 11 02144 g019
Figure 20. Map 7’s experimental results. (a) Traditional robot. (b) Our robot. (c) Two-coordinate plot of linear velocity and tracking deviation.
Figure 20. Map 7’s experimental results. (a) Traditional robot. (b) Our robot. (c) Two-coordinate plot of linear velocity and tracking deviation.
Electronics 11 02144 g020
Figure 21. Multi-robot path planning 1. (a) Global path planning. (b) Robot local motion.
Figure 21. Multi-robot path planning 1. (a) Global path planning. (b) Robot local motion.
Electronics 11 02144 g021
Figure 22. Multi−robot parameter comparison. (a) Comparison of linear velocity. (b) Comparison of angular velocity. (c) Comparison of tracking deviation.
Figure 22. Multi−robot parameter comparison. (a) Comparison of linear velocity. (b) Comparison of angular velocity. (c) Comparison of tracking deviation.
Electronics 11 02144 g022
Figure 23. Multi-robot path planning 2. (a) Global path planning. (b) Robot local motion.
Figure 23. Multi-robot path planning 2. (a) Global path planning. (b) Robot local motion.
Electronics 11 02144 g023
Figure 24. Multi−robot parameter comparison. (a) Comparison of linear velocity. (b) Comparison of angular velocity. (c) Comparison of tracking deviation.
Figure 24. Multi−robot parameter comparison. (a) Comparison of linear velocity. (b) Comparison of angular velocity. (c) Comparison of tracking deviation.
Electronics 11 02144 g024
Figure 25. Multi-robot path planning 3. (a) Global path planning. (b) Robot local motion.
Figure 25. Multi-robot path planning 3. (a) Global path planning. (b) Robot local motion.
Electronics 11 02144 g025
Figure 26. Multi−robot parameter comparison. (a) Comparison of linear velocity. (b) Comparison of angular velocity. (c) Comparison of tracking deviation.
Figure 26. Multi−robot parameter comparison. (a) Comparison of linear velocity. (b) Comparison of angular velocity. (c) Comparison of tracking deviation.
Electronics 11 02144 g026
Table 1. Multi-robot motion conflict detection and resolution scenarios.
Table 1. Multi-robot motion conflict detection and resolution scenarios.
CaseMovement StatusAngle RelationshipPotential Conflict or Not-Conflict Resolution Strategies
1 Electronics 11 02144 i001 α β 90 ° NO——
2 Electronics 11 02144 i002 α β 90 ° NO——
3 Electronics 11 02144 i003 α β < 90 ° YESAGV1 passes first,
AGV2 stops the movement
4 Electronics 11 02144 i004 α β 90 ° NO——
5 Electronics 11 02144 i005 α β < 90 ° YESAGV1 passes first,
AGV2 stops the movement
6 Electronics 11 02144 i006 α β < 90 ° YESAGV1 passes first,
AGV2 stops the movement
Table 2. Description of the simulation experiment.
Table 2. Description of the simulation experiment.
ChaptersType of ExperimentMethodPurpose
6.1Global path planningImproved ACOVerifying our improved ACO
6.2Single robot Improved ACO–DWAVerifying the single-robot obstacle avoidance
6.3Multi-robotACO–DWA combined with priority strategyVerifying the distributed multi-robot
obstacle avoidance
Table 3. Main parameters of simulation experiment.
Table 3. Main parameters of simulation experiment.
ParameterValueParameterValueParameterValueParameterValue
N m a x 50 k 1 0.3 λ 1 B 0.1
M 50 k 2 0.5 v m a x 1 C 0.3
α 1 k 3 0.5 ω m a x 70 D 0.1
β 8 n d s 0.09 v ˙ m a x 0.2Velocity resolution0.02
ρ 0.1 μ 2 ω ˙ m a x 50Angular velocity resolution5
Q 10 κ 2 A 0.15Simulated prediction time3
Table 4. Comparison of the results of the two algorithms in global path planning.
Table 4. Comparison of the results of the two algorithms in global path planning.
Indicators of the Optimal PathLuo et al. [8]This Paper
Before Optimization
(Initial Path)
After Optimization
(Optimized Path)
Optimal path length/m30.96830.96830.7924
Number of iterations64
Runtime/s1.53011.23771.4918
Number of turns151312
Table 5. Comparison of the results of the two algorithms in global path planning.
Table 5. Comparison of the results of the two algorithms in global path planning.
Indicators of the Optimal PathLuo et al. [8]This Paper
Before Optimization
(Initial Path)
After Optimization
(Optimized Path)
Optimal path length/m44.52244.52243.5921
Number of iterations139
Runtime/s16.95956.08136.5187
Number of turns141311
Table 6. Comparison of the results of the two algorithms in local path planning.
Table 6. Comparison of the results of the two algorithms in local path planning.
Indicators of the Optimal PathMap No.Map NameOptimal Path LengthRobot Travel TimeAverage VelocityTracking Deviation
Traditional DWA1Complex1N/A
2X-shapeN/A
3Complex249.596085.39660.58080.5832
4Double U-shape66.3800133.288240.49690.3977
5Corridor42.532077.49640.54880.5645
6Clasps23.298045.29610.51430.3007
7Z-type50.606081.79680.61870.4670
Our DWA1Complex149.3986114.30480.43220.8473
2X-shape42.243796.38810.43830.2609
3Complex241.710593.44320.44640.1176
4Double U-shape64.7839152.28200.42540.1697
5Corridor38.888788.32860.44030.2295
6Clasps23.198254.81970.42320.1799
7Z-type44.986499.29840.45300.2671
Table 7. Multi-robot path planning results in a known static environment.
Table 7. Multi-robot path planning results in a known static environment.
Indicators of the PathAGV1AGV2AGV3
Global path length/m41.060940.975431.6413
Local path length/m40.898040.740029.4940
The initial direction angle of robot/rad−0.78540.72662.6422
Tracking deviation/m0.12380.09370.0938
Table 8. Multi-robot path planning results in an unknown static environment.
Table 8. Multi-robot path planning results in an unknown static environment.
Indicators of the PathAGV1AGV2AGV3
Global path length/m41.060940.969439.6227
Local path length/m41.1641.390039.8580
The initial direction angle of robot/rad−0.78540.7266−2.3562
Tracking deviation0.22260.28740.2710
Table 9. Multi-robot path planning results in an unknown static marine environment.
Table 9. Multi-robot path planning results in an unknown static marine environment.
Indicators of the PathAGV1AGV2AGV3
Global path length/m42.713969.856672.1761
Local path length/m47.328071.022072.1500
The initial direction angle of robot/rad1.03041.2490−1.5994
Tracking deviation0.33190.76730.5376
Publisher’s Note: MDPI stays neutral with regard to jurisdictional claims in published maps and institutional affiliations.

Share and Cite

MDPI and ACS Style

Wang, Q.; Li, J.; Yang, L.; Yang, Z.; Li, P.; Xia, G. Distributed Multi-Mobile Robot Path Planning and Obstacle Avoidance Based on ACO–DWA in Unknown Complex Terrain. Electronics 2022, 11, 2144. https://doi.org/10.3390/electronics11142144

AMA Style

Wang Q, Li J, Yang L, Yang Z, Li P, Xia G. Distributed Multi-Mobile Robot Path Planning and Obstacle Avoidance Based on ACO–DWA in Unknown Complex Terrain. Electronics. 2022; 11(14):2144. https://doi.org/10.3390/electronics11142144

Chicago/Turabian Style

Wang, Qian, Junli Li, Liwei Yang, Zhen Yang, Ping Li, and Guofeng Xia. 2022. "Distributed Multi-Mobile Robot Path Planning and Obstacle Avoidance Based on ACO–DWA in Unknown Complex Terrain" Electronics 11, no. 14: 2144. https://doi.org/10.3390/electronics11142144

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