Next Article in Journal
Dynamic Characteristics of a Segmented Supercritical Driveline with Flexible Couplings and Dry Friction Dampers
Previous Article in Journal
Coupling Hadron-Hadron Thresholds within a Chiral Quark Model Approach
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

A Fuzzy Gain-Based Dynamic Ant Colony Optimization for Path Planning in Dynamic Environments

by
Viswanathan Sangeetha
1,
Raghunathan Krishankumar
1,
Kattur Soundarapandian Ravichandran
1,
Fausto Cavallaro
2,*,
Samarjit Kar
3,
Dragan Pamucar
4 and
Abbas Mardani
5
1
School of Computing, SASTRA Deemed University, Thanjavur 613401, India
2
Department of Economics, University of Molise, Via De Sanctis, 86100 Campobasso, Italy
3
Department of Mathematics, National Institute of Technology, Durgapur 713209, India
4
Department of Logistics, Military Academy, University of Defence in Belgrade, 11000 Belgarde, Serbia
5
Department of Marketing, Muma College of Business, University of South Florida, Tampa, FL 33813, USA
*
Author to whom correspondence should be addressed.
Symmetry 2021, 13(2), 280; https://doi.org/10.3390/sym13020280
Submission received: 13 January 2021 / Revised: 29 January 2021 / Accepted: 3 February 2021 / Published: 6 February 2021
(This article belongs to the Section Computer)

Abstract

:
Path planning can be perceived as a combination of searching and executing the optimal path between the start and destination locations. Deliberative planning capabilities are essential for the motion of autonomous unmanned vehicles in real-world scenarios. There is a challenge in handling the uncertainty concerning the obstacles in a dynamic scenario, thus requiring an intelligent, robust algorithm, with the minimum computational overhead. In this work, a fuzzy gain-based dynamic ant colony optimization (FGDACO) for dynamic path planning is proposed to effectively plan collision-free and smooth paths, with feasible path length and the minimum time. The ant colony system’s pheromone update mechanism was enhanced with a sigmoid gain function for effective exploitation during path planning. Collision avoidance was achieved through the proposed fuzzy logic control. The results were validated using occupancy grids of variable size, and the results were compared against existing methods concerning performance metrics, namely, time and length. The consistency of the algorithm was also analyzed, and the results were statistically verified.

1. Introduction

Modern technical and scientific advancements have propelled the proliferation of autonomous vehicle systems. Our everyday life has become almost inseparable from the need for autonomous vehicle systems. Such autonomous systems require four capabilities, namely: (1) world perception, (2) cognitive learning, (3) map building, and pathfinding (4) navigation. Pathfinding is a vital component for the robust working of autonomous vehicle systems. On the other hand, handling the complexity and uncertainty of real-time scenarios is a significant challenge to be addressed by the algorithms. Path planning can be conventionally classified, based on the environment’s nature, as static or dynamic path planning. Static path planning scenarios are those where the obstacles are static and not moving. In the case of dynamic scenarios, there are moving obstacles at different speeds within a scenario. There will be no prior knowledge of the environment and position of obstacles. Real-time scenarios are dynamic. The class of algorithms for solving real-time scenarios are broadly classified as exact and approximate approaches. Exact algorithms may fail to produce good quality solutions because of the uncertainty in the scenario. Over the years, there has been tremendous research on the use of approximate algorithms for path planning in dynamic and real-time scenarios [1]. Metaheuristics belong to the approximate approaches, and are widely used in various optimization problems because of their ability to produce good quality quasi-optimal solutions [2]. A proper tradeoff between their exploration and exploitation would result in good quality solutions after a thorough iterative search of the solution space. There are many words in the existing literature on dynamic path planning. Some of the prominent investigations from the literature are given in Table 1. A new mutation operator was proposed for dynamic path planning by Adem Tuncer and Mehmet Yildirim [3] to enable faster convergence. They validated their approach by applying it to simulated scenarios and comparing it with the literature.
Zhang et al. [25] made an extensive survey on path planning approaches for mobile robots. In their work, they emphasized the advantages of using a genetic algorithm, particle swarm optimization, ant colony optimization, and artificial potential fields in path planning with future directions. Mac et al. [26] developed a multi-objective approach based on particle swarm optimization for path planning. They proposed a new accelerated update methodology and tested it in cluttered environments. Jun-Hao Liang and Ching-Hung Lee [27] proposed a nature-inspired optimization-based algorithm for collision-free path planning of multiple mobile robots. They developed an efficient artificial bee colony algorithm, and applied it to cluttered simulated scenarios. A Markov decision process-based path planning algorithm for humanoid robots was developed by Mahdi Fakoor et al. [28]. Das et al. [29] hybridized an improved particle swarm optimization and a gravitational search algorithm to develop a path planning algorithm for multiple robots. Simulations were performed in the Khepera environment [19] to test the efficiency.
From the above literature analysis, the following challenges were identified:
  • In the case of dynamic scenarios, there tends to be more uncertainty. Meta-heuristic approaches tend to converge more slowly to avoid a collision. Faster convergence of approximate algorithms while handling dynamic scenarios is a significant challenge.
  • Maintaining the consistency of the algorithm when dealing with dynamic scenarios is another challenge to be addressed. The algorithms must be robust and stable in the unknown scenario.
  • Though there are many algorithms in the literature for finding the collision-free shortest path, there is still a need for more intelligent algorithms with clear approximate and syllogistic reasoning.
Motivated by the challenges in the literature, and to address them, the following contribution is made in this work to efficiently plan a safe and smooth path in dynamic scenarios:
  • A fuzzy gain based dynamic ant colony optimization (FGDACO) for collision-free path planning in dynamic scenarios is proposed. The improved pheromone enhancement in the ant system will curtail unwanted traversals during the search.
  • A fuzzy logic-based collision avoidance strategy based on approximate reasoning is proposed, in addition to the pheromone enhancement. This collision avoidance strategy is combined with gain enhanced ant colony optimization for safe path planning.
  • The proposed algorithm was observed to converge faster with the improved pheromone enhancement and no local optima trap.
  • The proposed algorithm was observed to be stable in all the scenarios with a lower deviation among the independent runs.

2. Preliminaries

2.1. Fuzzy Logic and Definitions

The concept of fuzziness was introduced by Zadeh et al. [30] in 1965 as a derivation from a common set. Fuzzy sets, unlike common sets, are those whose elements have certain degrees of membership. Membership refers to the probability of an element belonging to the set. In this work, the triangular membership function was used for path planning.
Definition 1
[30]: The triangular membership function for a fuzzy set A on the universe of discourse X:[0,1], is defined by three parameters, a, b, c; where a is the lower limit, c is the upper limit, and b is a value such that a ≤ b ≤ c. a and c form the base of triangle whereas b is the peak of the triangle. The triangular membership function is thus defined by Equation (1)
μ A ( x ) = { 0 , x a ( x a b a ) , a < x b ( c x c b ) , b x < c 0 , x c
where x is the crisp value that needs to be fuzzified, and a , b , c are the triangular membership function values with a b c . Figure 1 shows a pictorial representation of Equation (1). In Figure 1, the x-axis is the universe of discourse, and the y-axis is the corresponding membership values.
A fuzzy inference system (FIS) is a vital part of fuzzy logic control. Mamdani and Assilian [31] proposed that complex processes could be controlled using fuzzy logic rather than the conventional strict models. A fuzzy logic control uses conditional sentences, called inferences, to illustrate the logic characterized by membership functions. Figure 2 shows the fuzzy logic control system. Initially, the crisp values are taken as inputs. The three essential components of FIS are (i) fuzzification, (ii) fuzzy inference engine, and (iii) defuzzification.
(i).
Fuzzification: the process of transforming a crisp value to a fuzzy value is called fuzzification. This transformation is realized using the membership function. As shown in Figure 1, triangular membership functions are used in this work. Each linguistic variable will have its fuzzy variable values defined in its universe of discourse. The fuzzy variables are characterized by the membership function, with their values in (0,1). In this work, the linguistic variables are relative distance to the target, angle towards the target, and distance towards the nearest obstacle. The fuzzy variable set for each linguistic variable is (low, medium, and high).
(ii).
Fuzzy Inference Engine: this is the critical unit of a fuzzy logic controller. The role of the fuzzy inference engine is to make decisions using the IF…THEN rules. The rules are represented as given below:
R U L E   I :   i f   D   i s   a 1   a n d   E   i s   b 1 ,   t h e n   F   i s   c 1   R U L E   I I :   i f   D   i s   a 2   a n d   E   i s   b 2 ,   t h e n   F   i s   c 2 R U L E   N :   i f   D   i s   a i   a n d   E   i s   b i ,   t h e n   F   i s   c i
Here D and E are conditional variables, F is the response variable, and a i , b i , c i are the fuzzy variables defined by triangular membership functions. Once the decisions are made, a fuzzy inference system is used to evaluate the decisions made with the rules. In this work, the Mamdani fuzzy inference system is used for rule evaluation, as given by
R U L E   I   :   μ 1 = μ a 1 ( d )   μ b 1 ( e ) R U L E   I I   :   μ 2 = μ a 2 ( d )   μ b 2 ( e ) R U L E   N   :   μ i = μ a i ( d )   μ b i ( e )  
(iii).
Defuzzification: the fuzzy variables are converted to crisp outputs using the defuzzification phase. In this work, the centroid method is used for defuzzification. The defuzzified output x* obtained from the centroid method can be represented as the Equation (2)
x =   μ A   ( x )   x d x   μ A   ( x ) d x

2.2. Ant Colony Algorithm

The ant colony optimization proposed by Marco Dorigo et al. [32] is a nature-inspired population-based swarm intelligence algorithm, inspired by the foraging behavior of ants in obtaining their food. Ants’ natural tendency is to search out an optimal path between the food source and the ant nest. Ants deposit a chemical, named pheromone, as they move in search of food. A frequently used path will have more pheromone on it, while the amount of pheromone on a less frequently used path will be less. Figure 3 shows the foraging behavior of ants. Ants exhibit stigmergy by depositing pheromone on their trails. The process of adding up the amount of pheromone on a trail is called pheromone reinforcement. This reinforcement is the positive feedback indicating to the other ants to follow the trail. Artificial ants are the counterparts of natural ants. Unlike natural ants, artificial ants possess memory. In addition, to mimic natural ants’ stigmergy, pheromone on the less frequently used trails decreases using the pheromone evaporation process. This evaporation is the negative feedback of the system preventing the other ants from following the trial. Similar to other meta-heuristics, ant colony optimization exhibits both exploration and exploitation. Pheromone evaporation realizes the exploration process, thus avoiding convergence to local optima. Without evaporation, all ants will follow the path left by the first ant without exploring the solution space. Performing a local search of the ants’ current neighborhood window will lead to exploitation, thus working on a current solution to exploit the goodness. In this work, a pheromone enhancement mechanism to determine the current best path was adopted from [33] and combined with fuzzy logic for safe path planning. There are many ant colony optimization (ACO) variants, like the ant colony system, elitist ants, ant density model, and so on [34]. In this work, the ant system was used because of its simplicity and robustness.
The notations and parameters used in ant colony optimization are as given in Table 2.

3. Materials and Methods

3.1. Problem Definition and Formulation

Given a start, S, and destination, D, the problem of path planning in dynamic scenarios can be formulated as a minimization problem given by Equation (3) as
M i n i m i z e   h ( x ) =   W ( f ( x ) ) ( 1 W ) ( g ( x ) )
M i n i m i z e   f ( x ) =   i = 1 r j = 1 r x i j d i j
M a x i m i z e   g ( x ) =   i = 1 r j = 1 r x i j d i o
subject to
i = 1 r j > i , i j r x i j = 1 , i ,   j = 1   . . r
x i j =   { 1 f o r   a   p a t h   b e t w e e n   i   a n d   j 0 o t h e r w i s e
where r is the total size of the scenario, d i j =   ( v i v j ) 2 , d i o =   ( v i v o ) 2 .
In the above formulation, Equation (4) indicates the minimization of the total distance to the target during the path search indicating the target seeking behavior. Equation (5) indicates the maximization of distance concerning the obstacles indicating the obstacle avoidance behavior. Equation (6) indicates that at a time, only one node can be visited. Equation (7) indicates that a path can be included or discarded based on its existence. Equation (3) is obtained from Equations (4) and (5) with a weightage factor. Balancing the weighting between target seeking and obstacle avoidance can solve path planning. In this work, both Equations (4) and (5) are given equal weightage. The value of w is considered as 0.5.

3.2. Fuzzy Logic-Based Obstacle Avoidance

Designing a fuzzy logic control for obstacle avoidance includes creating a rule base for collision avoidance. Multiple rules can be fed into the rule base. In this work, three input parameters were considered: relative distance to the target, angle towards the target, and distance towards the nearest obstacle. The corresponding fuzzy values for the linguistic input variables were considered high, medium, and low, respectively, and characterized using a triangular membership function, with the range of [0,1]. Figure 4 shows the fuzzy variables characterized by the triangular membership function.
The values are normalized to [0, 1] to reduce the computational complexity, since the final defuzzified value is given priority to the forward phase of ant colony optimization. The priority to be given to the node during the next node selection in ant colony optimization is considered an output parameter. The universe of discourse for the fuzzy variables is provided in Table 3. The values were considered intuitively, with expert opinion.
The centroid method, as given in Equation (2), is the defuzzification method. The IF-THEN rules’ surface plots are shown in Figure 5a–c. Figure 5d shows the fuzzy rules characterized by the triangular membership function. Table 4 shows some of the rules considered for the fuzzy logic controller.
The fuzzy logic controller used in FGDACO for collision avoidance is given in Figure 6. This fuzzy logic controller was adopted during the process of path planning.

3.3. Gain Based Path Planning

The pheromone trail, τ i j , and the heuristic,   η i j , are two essential aspects that guide ant colony optimization. These two aspects are related to the exploration and exploitation of ant colony optimization. Heuristics are used to perform an extensive search of the solutions space to construct solutions. Upon construction of solutions, a pheromone update is performed on the most used trails to identify good quality solutions. In this work, the process of pheromone update was enhanced using a relative distance based gain function. Gain is a sigmoid function-based local heuristic designed, based on the neighbor’s relative distance to target and distance to the nearest obstacle. This function will update the pheromone on the locally best trails, thus avoiding unnecessary traversal, and enabling faster convergence of the algorithm.

Calculating Gain

To enable quicker pathfinding, an amount of pheromone is added to the locally found best path. This enhancement is called pheromone gain. Thus the new quantity added will enable quicker pathfinding by eliminating unwanted traversals during the local search. Pheromone gain is given by (8).
  G a i n i j k =   1 ( 1 + e λ P r o g r e s s j D e s t k )  
Here   P r o g r e s s j D e s t k =   δ j D e s t   +   d i o d i D e s t
where D e s t = destination vertex, j = neighbor vertex ( V j ) , and i = current vertex ( V i ) . The values of learning parameter, λ, lie from 0 to 1; δ j D e s t =   d j D e s t = euclidean distance between j and dest; for j = 1, 2, 3, …8; d i o is the distance between the current node and nearest obstacle. Sigmoidal function is used because of its natural smoothing character.
Consider a configuration space of 20 × 20, as shown in Figure 7.
The algorithm begins from S. To proceed further, the algorithm searches for the next node to be visited from V i   (current position). According to the gain-based sigmoid function, the neighbor node with minimum δ j D e s t and maximum d i o is marked as the next node to be visited. The corresponding pheromone trail is updated. The gain based local heuristic will enable pheromone enhancement on the local best path. During the pheromone update of ant colony optimization, G a i n i j is added to τ i j n e w of V i , j 3 ,(considering j3 has minimum δ j D e s t ) and subtracted from the τ i j n e w of V i , j 1 and V i , j 2 . Mathematically the procedure can be written as given in Equation (9)
τ i j n e w = { ( 1 ρ ) τ i j o l d + k = 1 N Δ τ i j k + G a i n i j k f o r   m i n ( δ j D e s t ) and m a x ( d i o ) ( 1 ρ ) τ i j o l d + k = 1 N Δ τ i j k G a i n i j k o t h e r w i s e
Using Equation (9), τ i j n e w is calculated and used in Equation (10).
According to Equation (8),   G a i n i j k of kth ant is added to the node’s trail with min δ j D e s t and subtracted from other trails. This subtraction will decrease the pheromone on other trails and increase pheromone on the current best path. This pheromone update will enable the ants to settle down in the current best trail with less latency, leading to faster convergence.

3.4. Proposed FGDACO for Target Seeking and Obstacle Avoidance

3.4.1. Environment Perception

The scenario for path planning is initially perceived and transformed into grids computationally suitable for the process. Occupancy grids were used in this work to perceive the environment for path planning. The grid resolution was one cell per meter, i.e., each cell was 1 m in size. Each grid has two probabilities, namely free space or obstacle space.

3.4.2. Ant Colony Parameters Initialization

Once the environment is perceived, the parameters of the ACO are initialized. Initially, τ o is set to 0. α , β , ρ , start node, and destination node are initialized subsequently.

3.4.3. Node Transition and Cost Calculation

After the parameter initialization, ants start moving around the search space. This search is the onward movement of map exploration. Using the node transition probability, the next node to be visited is chosen. Equation (10) was used for the forward move. Once ants reach a node, the tabu list v i s i t k will be checked to see if the node is allowed to be visited.
N T P i j k ( t ) = { ( τ i j k ) α ( Π f ϵ p a r a m e t e r s η i j f k ) β h v i s i t k ( τ i h k ) α ( Π f ϵ p a r a m e t e r s η i j f k ) β i f j v i s t k 0 o t h e r w i s e
In Equation (10), η i j f is the fuzzy cost of edge (i, j), and f is the set of parameters defined in fuzzy logic control for collision avoidance. τ i j is the pheromone intensity in (i, j) and is calculated by (9) through the backward movement. η i j f is defined by Equations (11)–(13). The parameters, f, used in this work are target distance, distance to nearest obstacle, and angle to be turned.
  • Distance to target
η i j t a r g e t _ d i s t a n c e   = 1 d i d e s t k
2.
Nearest obstacle distance
  η i j o b s t a c l e _ d i s t a n c e   = d i o k
3.
Angle to be turned
η i j o b s t a c l e _ d i s t a n c e   = tan 1 ( d i d e s t k d i o k )
where d i d e s t k =   ( v i k v d e s t k ) 2 ; d i o k =   ( v i k v o k ) 2 ; v o is the obstacle node.
η i j f is the defuzzified output from the fuzzy logic control. During the calculation of τ i j k in Equation (9), the corresponding G a i n i j k is calculated using Equation (14).
G a i n i j k   1 ( 1 + e λ p r o g r e s s j d e s t k )
where p r o g r e s s j d e s t k = δ j D e s t k + d i o k d i D e s t k .
Here δ j D e s t k =   d j D e s t k ; d j D e s t k =   ( V j k V D e s t k ) 2 ;   d i D e s t k =   ( V i k V D e s t k ) 2 .
The sigmoid function is used here to determine the pheromone enhancement. Sigmoid functions have a natural ‘S’ shaped curve, with an interval from 0 to 1. From mechanical observations, it could be inferred that the sigmoid function curve was similar to that of a path with smooth turns [35]. An example of the sigmoid function is shown in Figure 8.

3.4.4. Path Selection

The path selection phase is the final phase. Once the forward phase is completed, the ants start retreating by tracing their path using their memory. In this stage, the pheromone update rule is used to find the current pheromone quantity. The intensity of pheromone is updated using (15). The usability of the path is either increased by pheromone reinforcement, or decreased through pheromone evaporation.
The quantity of Δ τ i j k is given by (15),
Δ τ i j k = { 1 d i j k + d i o k     i f   k t h   a n t   p a s s e s   i   a n d   j 0     o t h e r w i s e    
By Equation (15), a pheromone update is made on the trail, which has a minimum distance to the next node, and maximum distance from the nearest obstacle.
The pseudo-code for FGDACO is given in Algorithm 1.
Algorithm 1 Framework for fuzzy gain-based dynamic ant colony optimization (FGDACO)
Input: G, N, S, D, α ,   β ,   ρ
Output: best_path
1.
begin
2.
Initialize τ o , α ,   β ,   ρ , S, D, N, b e s t _ p a t h c o s t = 0, path = [], best_path = [],   p a t h c o s t
3.
while (max_number_of_iterations_not_reached) do
4.
  for each kϵN do
5.
       P a t h i j k ( t ) = { ( τ i j k ) α ( Π f ϵ p a r a m e t e r s η i j f k ) β h v i s i t k ( τ i h k ) α ( Π f p a r a m e t e r s η i j f k ) β i f   j v i s i i k 0 o t h e r w i s e
6.
    Update v i s i t k ;
7.
     If ( p a t h i j k < b e s t _ p a t h c o s t )
8.
            b e s t _ p a t h c o s t     p a t h i j c o s t k
9.
           best_path p a t h i j k
10.
    end if
11.
    If(target_reached)
12.
        Update v i s i t k for all N
13.
    break
14.
    end if
15.
  end for
16.
  for each P a t h i j k   do
17.
   τ i j n e w = { ( 1 ρ ) τ i j o l d + k = 1 N + Δ τ i j k + G a i n i j k f o r   m i n ( δ i j ) a n d   m a x ( d i o ) ( 1 ρ ) τ i j o l d + k = 1 N + Δ τ i j k G a i n i j k o t h e r w i s e
18.
    // Compute G a i n i j k
19.
   δ j D e s t = d j D e s t , j = 1, 2 … 8
20.
  for all V j of V i   do
21.
     p r o g r e s s j d e s t k = δ j D e s t k + d i o d i D e s t k
22.
     G a i n i j k =   1 ( 1 + e λ p r o g r e s s j d e s t k )
23.
  end for
24.
   Δ τ i j k = { 1 d i j k + d i o k     i f   k t h a n t   p a s s e s   i   a n d   j 0     o t h e r w i s e
25.
   end for
26.
end while
27.
return best_ path
28.
end
The algorithm continues until either of the following conditions is achieved: the shortest path is obtained, or predetermined iterations have been completed. The framework for FGDACO is as given in Figure 9.

4. Experimental Results and Discussion

4.1. Experimental Setup and Dataset Description

Simulations of the proposed algorithms were implemented in MATLAB® 2019b [36]. Three different occupancy grids of size 100 × 100, with moving and static obstacles were used for the simulations. Obstacles of different shapes were also simulated. The details of the simulations are given in Table 5. The following assumptions were considered for the simulations:
  • The start and destinations were considered to be the same during the whole process of path planning, but they differed with each scenario.
  • The speed of the moving obstacles was considered as random between 0.5–1.5 m/s.

4.2. Performance Measures:

The performance of the proposed method was evaluated using the following performance measures. Each algorithm was run 30 times, and the analysis was made using the following metrics.
  • Standard Deviation: The consistency of the proposed method was verified using standard deviation. The method was stable when there was less variation in the performance between independent runs.
  • Median of path length and computation time: The median of the computational time and the length of path computed for 30 independent runs were compared and analyzed.

4.3. Parameter Setting:

The simulations were performed under different conditions like different iterations, varying α, β, and ρ. The values of parameters that were used for the simulations are given in Table 6.
An optimal value for α, β, ρ was essential for the algorithm’s adequate performance since pheromone enhancement is a significant part of FGDACO. The value of α, β, ρ was varied from 0.1 to 0.9, and the results are shown in Figure 10. Figure 10 shows that the variation in length values was the least when α = 0.5, β = 0.5, and ρ = 0.5. Thus, the algorithm is stable with less deviation among its independent runs, and no outliers, when α = 0.5, β = 0.5, and ρ = 0.5.
From the parameter setting simulation in Figure 10a–c, it can be seen that the value of length was minimum when α = 0.5, β = 0.5, and ρ = 0.5. Thus α = 0.5, β = 0.5, and ρ = 0.5 were set for performance evaluation.

4.4. Performance Evaluation

The performance of the FGDACO was compared with existing methods, like the cuckoo optimization algorithm (COA), fuzzy-genetic algorithm (Fuzzy-GA), and fuzzy logic based ant colony optimization (FLACO), in three sample scenarios, with a varying number of obstacles. The performance results in terms of path length and computation time taken are summarized in Table 7. It is evident from Table 7 that, the proposed FGDACO computed the shortest path with minimum time when compared to the others. Moreover, FGDACO was found to be stable, with a minimum standard deviation. In dynamic path planning, one of the essential objectives is to find a collision-free safe path. The mechanism of collision avoidance is illustrated in Figure 11a–c, with sample scenarios. The direction of the moving obstacle (orange color) is shown with the help of directed arrows.
From Figure 11a–c, the obstacle avoidance behavior of FGDACO can be inferred. In Figure 11a, the process of path planning begins from the start position. The search proceeds further after encountering the static obstacles. Upon encountering moving obstacles, the next node’s priority is determined from the FIS engine’s fuzzy rules. The next nodes’ priorities are assigned based on the obstacles’ distance and relative distance to the target. In Figure 11b, it can be seen that the path is planned such that it is farther from the oncoming obstacle. Once the moving obstacles are encountered and the search has passed through them, the rest of the static obstacles are encountered. Figure 11c shows the final path planned.
The paths planned by FGDACO and the existing algorithms are shown in Figure 12a–c. It could be inferred from the literature that paths with fewer sharp turns are favored for real-time traversal. From Figure 12a–c, it can be seen that in all scenarios, the path planned by FGDACO had a smaller number of sharp turns when compared with the paths planned by the other algorithms. The path planned by FGDACO was efficient in all three scenarios, irrespective of the number and shape of obstacles.
Convergence plots of FGDACO and other existing methods are given in Figure 13a–c. Figure 13a–c shows that the proposed FGDACO converged faster than COA, Fuzzy-GA, and FLACO with regard to length. FGDACO was also less likely to get trapped in local optima because of the enhanced pheromone update. The gain based sigmoid function improved the current best path, thereby leading to better exploitation.
Box plots are the standard graphical representation of the distribution of values in a range. The consistency of the proposed FGDACO was analyzed using standard deviation. The standard deviation of the proposed FGDACO and existing algorithms could be graphically analyzed using a box plot. Figure 14a–c shows the box plots of FGDACO and existing algorithms for all three scenarios. It can be seen that FGDACO exhibited the least variation in the converged length values among the independent runs. It can also be seen that in all three scenarios, the box plots of FGDACO are almost symmetric, without outliers.
A performance comparison of FGDACO with COA, Fuzzy-GA, and FLACO is summarized in Table 7.

4.5. Discussion

From the above performance evaluation and Table 7, the following summarization can be made:
  • The proposed FGDACO outperformed COA, Fuzzy-GA, and FLACO by 6%, 11%, and 3%, respectively, in terms of length in scenario 1.
  • The proposed FGDACO outperformed COA, Fuzzy-GA, and FLACO by 15%, 10%, and 4%, respectively, in terms of length in scenario 2.
  • The proposed FGDACO outperformed COA, Fuzzy-GA, and FLACO by 8%, 10%, and 2%, respectively, in terms of length in scenario 3.
  • With regard to consistency, FGDACO exhibited higher consistency, with a deviation of 2% on average among its independent runs.
From the above discussion, it is evident that FGDACO effectively planned the shortest path in the least time in the tested scenarios. Furthermore, FGDACO was efficient, irrespective of the shape and number of obstacles in a real-time environment.

5. Conclusions

A fuzzy gain-based dynamic ant colony optimization was proposed for safe and smooth collision-free path planning. The pheromone update mechanism of ant colony optimization was improved with a relative distance based local heuristic. This improved mechanism helped in curtailing unwanted traversals during the search. To avoid collision with moving obstacles, fuzzy logic based collision avoidance was proposed. A rule base with syllogistic reasoning was created and evaluated using the Mamdani fuzzy inference system. The output of FIS was considered the node’s priority during the next node selection in ant colony optimization. Simulations were performed on occupancy grids, and evaluated using path length and time taken metrics. From Table 7, it can be seen that the proposed FGDACO outperformed the existing methods, COA, Fuzzy-GA, and FLACO, in terms of length by 9.6%, 10.3%, and 3% in the tested scenarios. The proposed algorithm also converged more quickly (Figure 13a–c with high consistency with a deviation of 2% among its independent runs). There was less deviation among its independent runs (Figure 14a–c). The results were also statistically significant at a 95% level of confidence. From the discussions and investigations, it is evident that the proposed FGDACO is robust, stable, reasonable, and safe, with faster convergence. In the future, the algorithm can be applied in real-time road networks and on variants of vehicle routing problems.

Author Contributions

The contributions and responsibilities of the authors were as follows. V.S. has contributed to conceptualization, formal analysis, literature analysis, coding, validation, and writing. R.K. has contributed to conceptualization, formal analysis, literature analysis, validation, writing. F.C., D.P., A.M., K.S.R. and S.K. have contributed to overall administration and curation, resources acquisition, conceptualization, formal analysis, reviewing, and editing. All authors have read and agreed to the published version of the manuscript.

Funding

Authors thank the funding agencies viz., Defence Research & Development Organization, India; and Department of Science & Technology, India for their financial aid from grant nos. (ERIP/ER/1203080/M/01/1569; and SR/FST/ETI-349/2013) respectively.

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

Not applicable.

Acknowledgments

The authors thank the editor and the anonymous reviewers for their valuable comments, which improved our research quality.

Conflicts of Interest

Authors hereby declare that there is no conflict of interest.

References

  1. Yang, X.S. Nature-Inspired Algorithms and Applied Optimization; Springer: Berlin/Heidelberg, Germany, 2017; Volume 744. [Google Scholar]
  2. Boussaïd, I.; Lepagnot, J.; Siarry, P. A survey on optimization metaheuristics. Inf. Sci. 2013, 237, 82–117. [Google Scholar] [CrossRef]
  3. Tuncer, A.; Yildirim, M. Dynamic path planning of mobile robots with improved genetic algorithm. Comput. Electr. Eng. 2012, 38, 1564–1572. [Google Scholar] [CrossRef]
  4. Son, C. Intelligent rule-based sequence planning algorithm with fuzzy optimization for robot manipulation tasks in partially dynamic environments. Inf. Sci. 2016, 342, 209–221. [Google Scholar] [CrossRef]
  5. Bakdi, A.; Hentout, A.; Boutami, H.; Maoudj, A.; Hachour, O.; Bouzouia, B. Optimal path planning and execution for mobile robots using genetic algorithm and adaptive fuzzy-logic control. Robot. Auton. Syst. 2017, 89, 95–109. [Google Scholar] [CrossRef]
  6. Pandey, A.; Parhi, D.R. Optimum path planning of mobile robot in unknown static and dynamic environments using Fuzzy-Wind Driven Optimization algorithm. Def. Technol. 2017, 13, 47–58. [Google Scholar] [CrossRef]
  7. Hu, X.; Chen, L.; Tang, B.; Cao, D.; He, H. Dynamic path planning for autonomous driving on various roads with avoidance of static and moving obstacles. Mech. Syst. Signal. Process. 2018, 100, 482–500. [Google Scholar] [CrossRef]
  8. Chen, P.; Zhang, X.; Chen, X.; Liu, M. Path planning strategy for vehicle navigation based on user habits. Appl. Sci. 2018, 8, 407. [Google Scholar] [CrossRef] [Green Version]
  9. Wei, K.; Ren, B. A method on dynamic path planning for robotic manipulator autonomous obstacle avoidance based on an improved RRT algorithm. Sensors 2018, 18, 571. [Google Scholar] [CrossRef] [PubMed] [Green Version]
  10. Wang, M.; Liu, J.N. Fuzzy logic-based real-time robot navigation in unknown environment with dead ends. Robot. Auton. Syst. 2008, 56, 625–643. [Google Scholar] [CrossRef]
  11. Wu, Q.; Chen, Z.; Wang, L.; Lin, H.; Jiang, Z.; Li, S.; Chen, D. Real-Time Dynamic Path Planning of Mobile Robots: A Novel Hybrid Heuristic Optimization Algorithm. Sensors 2020, 20, 188. [Google Scholar] [CrossRef] [Green Version]
  12. Alomari, A.; Phillips, W.; Aslam, N.; Comeau, F. Dynamic fuzzy-logic based path planning for mobility-assisted localization in wireless sensor networks. Sensors 2017, 17, 1904. [Google Scholar] [CrossRef] [PubMed] [Green Version]
  13. Salehinejad, H.; Talebi, S. Dynamic fuzzy logic-ant colony system-based route selection system. Appl. Comput. Intell. Soft Comput. 2010, 2010, 1–13. [Google Scholar] [CrossRef] [Green Version]
  14. Purian, F.K.; Sadeghian, E. Mobile robots path planning using ant colony optimization and Fuzzy Logic algorithms in unknown dynamic environments. In Proceedings of the 2013 International Conference on Control, Automation, Robotics and Embedded Systems (CARE), Jabalpur, India, 16–18 December 2013; pp. 1–6. [Google Scholar]
  15. Song, Q.; Zhao, Q.; Wang, S.; Liu, Q.; Chen, X. Dynamic Path Planning for Unmanned Vehicles Based on Fuzzy Logic and Improved Ant Colony Optimization. IEEE Access 2020, 8, 62107–62115. [Google Scholar] [CrossRef]
  16. Hosseininejad, S.; Dadkhah, C. Mobile robot path planning in dynamic environment based on cuckoo optimization algorithm. Int. J. Adv. Robot. Syst. 2019, 16, 1729881419839575. [Google Scholar] [CrossRef]
  17. Bai, X.; Wen, W.; Hsu, L.T. Robust Visual-Inertial Integrated Navigation System Aided by Online Sensor Model Adaption for Autonomous Ground Vehicles in Urban Areas. Remote Sens. 2020, 12, 1686. [Google Scholar] [CrossRef]
  18. Singh, S.J.; Roy, S.; Singh, K.M.; Khelchandra, T. Motion planning of mobile robot using Fuzzy-GA method along with three path concept in dynamic environment. J. Intell. Fuzzy Syst. 2018, 35, 1445–1457. [Google Scholar] [CrossRef]
  19. 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]
  20. Solak, S.; Yakut, Ö.; Dogru Bolat, E. Design and Implementation of Web-Based Virtual Mobile Robot Laboratory for Engineering Education. Symmetry 2020, 12, 906. [Google Scholar] [CrossRef]
  21. Bi, M. Control of Robot Arm Motion Using Trapezoid Fuzzy Two-Degree-of-Freedom PID Algorithm. Symmetry 2020, 12, 665. [Google Scholar] [CrossRef] [Green Version]
  22. Li, S.; Xie, J.; Wang, X.; Ren, F.; Zhang, X.; Bao, Q. Path Planning of Hydraulic Support Pushing Mechanism Based on Extreme Learning Machine and Descartes Path Planning. Symmetry 2021, 13, 97. [Google Scholar] [CrossRef]
  23. Zagradjanin, N.; Pamucar, D.; Jovanovic, K. Cloud-Based Multi-Robot Path Planning in Complex and Crowded Environment with Multi-Criteria Decision Making Using Full Consistency Method. Symmetry 2019, 11, 1241. [Google Scholar] [CrossRef] [Green Version]
  24. Sangeetha, V.; Krishankumar, R.; Ravichandran, K.S.; Kar, S. Energy-efficient green ant colony optimization for path planning in dynamic 3D environments. Soft Comput. 2021, 1, 21. [Google Scholar]
  25. Zhang, H.-Y.; Lin, W.-M.; Chen, A.-X. Path Planning for the Mobile Robot: A Review. Symmetry 2018, 10, 450. [Google Scholar] [CrossRef] [Green Version]
  26. Mac, T.T.; Copot, C.; Tran, D.T.; De Keyser, R. A hierarchical global path planning approach for mobile robots based on multi-objective particle swarm optimization. Appl. Soft Comput. 2017, 59, 68–76. [Google Scholar] [CrossRef]
  27. Liang, J.H.; Lee, C.H. Efficient collision-free path-planning of multiple mobile robots system using efficient artificial bee colony algorithm. Adv. Eng. Softw. 2015, 79, 47–56. [Google Scholar] [CrossRef]
  28. Fakoor, M.; Kosari, A.; Jafarzadeh, M. Humanoid robot path planning with fuzzy Markov decision processes. J. Appl. Res. Technol. 2016, 14, 300–310. [Google Scholar] [CrossRef] [Green Version]
  29. 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]
  30. Zadeh, L.A. Fuzzy sets (PDF). Inf. Control 1965, 8, 338–353. [Google Scholar] [CrossRef] [Green Version]
  31. Mamdani, E.H. Application of fuzzy algorithms for control of simple dynamic plant. Proc. Inst. Electr. Eng. 1974, 121, 1585–1588. [Google Scholar] [CrossRef]
  32. Dorigo, M.; Maniezzo, V.; Colorni, A. Ant system: Optimization by a colony of cooperating agents. IEEE Trans. Syst. Man Cybern. Part B 1996, 26, 29–41. [Google Scholar] [CrossRef] [Green Version]
  33. Sangeetha, V.; Ravichandran, K.S.; Shekhar, S.; Tapas, A.M. An Intelligent Gain-based Ant Colony Optimisation Method for Path Planning of Unmanned Ground Vehicles. Def. Sci. J. 2019, 69, 167–172. [Google Scholar]
  34. Padhy, N.P. Artificial Intelligence and Intelligent Systems; Oxford University Press: Oxford, UK, 2005. [Google Scholar]
  35. Ravankar, A.; Ravankar, A.A.; Kobayashi, Y.; Hoshino, Y.; Peng, C.C. Path smoothing techniques in robot navigation: State-of-the-art, current and future challenges. Sensors 2018, 18, 3170. [Google Scholar] [CrossRef] [PubMed] [Green Version]
  36. MATLAB® (2019). 9.7.0.1261785 (R2019b); The MathWorks Inc.: Natick, MA, USA.
Figure 1. Pictorial representation of the triangular membership function.
Figure 1. Pictorial representation of the triangular membership function.
Symmetry 13 00280 g001
Figure 2. Fuzzy logic controller.
Figure 2. Fuzzy logic controller.
Symmetry 13 00280 g002
Figure 3. Foraging behavior of ants.
Figure 3. Foraging behavior of ants.
Symmetry 13 00280 g003
Figure 4. Triangular membership function of (a) distance to target, (b) angle to be turned, and (c) nearest obstacle distance. X axis is the value of fuzzy variable, and Y axis is the corresponding membership.
Figure 4. Triangular membership function of (a) distance to target, (b) angle to be turned, and (c) nearest obstacle distance. X axis is the value of fuzzy variable, and Y axis is the corresponding membership.
Symmetry 13 00280 g004
Figure 5. Surface plots of IF...THEN rules of: (a) target distance, obstacle distance, and priority; (b) angle to be turned, obstacle distance, and priority; (c) angle to be turned, target distance, and priority; (d) fuzzy rules characterized using triangular membership function.
Figure 5. Surface plots of IF...THEN rules of: (a) target distance, obstacle distance, and priority; (b) angle to be turned, obstacle distance, and priority; (c) angle to be turned, target distance, and priority; (d) fuzzy rules characterized using triangular membership function.
Symmetry 13 00280 g005aSymmetry 13 00280 g005b
Figure 6. Fuzzy logic controller adapted for collision avoidance.
Figure 6. Fuzzy logic controller adapted for collision avoidance.
Symmetry 13 00280 g006
Figure 7. Illustration of Pheromone gain.
Figure 7. Illustration of Pheromone gain.
Symmetry 13 00280 g007
Figure 8. An example of the sigmoid function.
Figure 8. An example of the sigmoid function.
Symmetry 13 00280 g008
Figure 9. Framework for FGDACO.
Figure 9. Framework for FGDACO.
Symmetry 13 00280 g009
Figure 10. (a) Variation of α, (b) variation of β, and (c) variation of ρ.
Figure 10. (a) Variation of α, (b) variation of β, and (c) variation of ρ.
Symmetry 13 00280 g010
Figure 11. (ac) Collision avoidance behavior of FGDACO.
Figure 11. (ac) Collision avoidance behavior of FGDACO.
Symmetry 13 00280 g011
Figure 12. Path planned by the proposed FGDACO and other existing algorithms in (a) scenario 1, (b) scenario 2, and (c) scenario 3.
Figure 12. Path planned by the proposed FGDACO and other existing algorithms in (a) scenario 1, (b) scenario 2, and (c) scenario 3.
Symmetry 13 00280 g012
Figure 13. The convergence of the proposed FGDACO and existing methods in (a) scenario 1, (b) scenario 2, and (c) scenario 3.
Figure 13. The convergence of the proposed FGDACO and existing methods in (a) scenario 1, (b) scenario 2, and (c) scenario 3.
Symmetry 13 00280 g013aSymmetry 13 00280 g013b
Figure 14. Box plots of the proposed FGDACO and existing methods in (a) scenario 1, (b) scenario 2, and (c) scenario 3.
Figure 14. Box plots of the proposed FGDACO and existing methods in (a) scenario 1, (b) scenario 2, and (c) scenario 3.
Symmetry 13 00280 g014aSymmetry 13 00280 g014b
Table 1. Investigations from the existing literature.
Table 1. Investigations from the existing literature.
Ref #MethodDatasetOptimality Achieved
[4]Rule-based sequence planning algorithm with fuzzy optimizationSimulated scenariosFlexibility and adaptability
[5]Genetic algorithm and adaptive fuzzy logic controlRobuTER robot Smooth collision-free path
[6]Fuzzy wind-driven optimizationReal-time navigation using Khepera III mobile robotCollision free path
[7]Dynamic path plannerSimulated single and multi-lane roadsStatic and dynamic safety, comfortability, appropriate acceleration and speed for the vehicle
[8]Personalized path planner with fuzzy c-means clusteringSimulated grids, road simulation model in ChangshaImproved personalization of existing path planning
[9]Improved rapidly exploring random tree (RRT) algorithmSimulated and real-time implementation using MATLAB and robot operating system(ROS)Correctness, effectiveness, and practicability
[10]Fuzzy logicReal-time navigation using mobile robot on long u shape, large concave, cluttered, maze-like dynamic environmentsMinimum risk and global convergence
[11]Hybrid heuristic optimization algorithm (Beetle antennae search)Virtual map and the real mapAccelerated convergence speed
[12]Dynamic Fuzzy logic based path planningWireless sensor networks in MATLABLocalization ratio and localization accuracy
[13]Dynamic fuzzy-logic-ant colony systemRegions of London, United KingdomEfficient route selection
[14]Ant colony and fuzzy logicSimulated maps in MATLABShortest path in minimum time
[15]Fuzzy logic ant colony optimizationSimulated road networksShortest path length
[16]Cuckoo optimization algorithmSimulated scenarios of size 20 × 20, 100 × 100 and 200 × 200Safe, smooth, and collision-free path
[17]A visual-inertial navigation systemUrban areas of Hong KongEffective mitigation of dynamic objects and improved accuracy
[18]Fuzzy- genetic algorithm (GA) with three path conceptSimulated mapsComputationally efficient
[19]Improved gravitational searchReal-time navigation using Khepera III mobile robotThe safe and shortest path
[20]Genetic algorithm Web based virtual mobile robot laboratoryUsability of remote controlled robot laboratory
[21]Trapezoid fuzzy 2 DOF algorithmSimulated proportional integral derivative (PID) control systemFaster response with low position tracking error
[22]Extreme Learning Machine and DescartesVirtual simulation in Unity3DReduced local error and correction error
[23]Full Consistency method with D* LiteSimulated occupancy mapsConsistent determination of weight factors for effective risk management during motion
[24]Improved Ant colony optimizationElevation data from international society for photogrammetry and remote sensing (ISPRS) and United States geological survey (USGS)Faster convergence
Table 2. Parameters of the ant colony algorithm.
Table 2. Parameters of the ant colony algorithm.
ParameterDescription
NNumber of ants
τ o Initial pheromone
τ i j Quantity of pheromone deposited while traversing from i to j
η i j Heuristic function indicating the visibility of route between i and j;
d i j k Cost of the route (i,j) obtained by kth ant
αImpact of pheromone on the choice of next node
βImpact of heuristic function on the selection of next node
ρ Rate of pheromone evaporation; 0 < ρ < 1
v i s i t k A table containing nodes that are feasible to be visited by kth ant
QConstant related to the pheromone increment
Table 3. The universe of discourse for fuzzy variables.
Table 3. The universe of discourse for fuzzy variables.
Linguistic Variable U l o w U m e d i u m U h i g h
relative distance to the target(0,0.4)(0.3,0.7)(0.6,1)
angle towards the target(0,0.4)(0.3,0.7)(0.6,1)
distance towards the nearest obstacle(0,0.3)(0.2,0.7)(0.6,1)
Note: Values are normalized for ethical reasons and to maintain data integrity.
Table 4. Sample rules used in fuzzy control for obstacle collision avoidance.
Table 4. Sample rules used in fuzzy control for obstacle collision avoidance.
IFIFIFThen
Relative distance to the targetAngle to be turnedDistance to the nearest obstacleThe priority of the node during next node selection in ant colony
MediumHighlowLow
LowMediumLowLow
LowHighLowLow
LowLowMediumHigh
LowMediumMediumMedium
HighMediumMediumLow
Low LowHighHigh
LowMediumHighHigh
HighMediumHighMedium
MediumMediumLowLow
HighHighHighMedium
HighLowMediumLow
Note: All rules pose an AND relation, as all factors are essential to be satisfied.
Table 5. Description of obstacles in the scenarios used for the simulations.
Table 5. Description of obstacles in the scenarios used for the simulations.
ScenarioStatic ObstacleMoving Obstacle
133
243
323
Table 6. Parameters and their values used for simulation of FGDACO.
Table 6. Parameters and their values used for simulation of FGDACO.
ParameterValue
α0.5
β0.5
ρ0.5
Time interval3 ∆t
Sampling interval 10 s
Number of iterations100
Number of independent runs of the algorithm30
Number of ants (N)20
Table 7. Performance comparison of FGDACO against the other methods. A median of 30 independent runs was considered.
Table 7. Performance comparison of FGDACO against the other methods. A median of 30 independent runs was considered.
Scenario #AlgorithmTime (s)Length (m)
MedianSDMedianSD
1Proposed FGDACO28.972.24126.651.37
COA37.944.35134.573.48
Fuzzy-GA41.794.58141.245.69
FLACO31.473.77129.642.78
2Proposed FGDACO38.741.97135.962.37
COA51.764.69158.964.99
Fuzzy-GA48.613.47149.676.35
FLACO43.782.07141.273.78
3Proposed FGDACO74.332.54197.692.77
COA84.954.77214.685.78
Fuzzy-GA81.313.18219.966.35
FLACO77.122.11201.434.69
SD: standard deviation. COA: cuckoo optimization algorithm. Fuzzy-GA: fuzzy-genetic algorithm. FLACO: fuzzy logic based ant colony optimization. The Wilcoxon signed-rank test at 95% confidence is conducted and verified to compare FGDACO with others.
Publisher’s Note: MDPI stays neutral with regard to jurisdictional claims in published maps and institutional affiliations.

Share and Cite

MDPI and ACS Style

Sangeetha, V.; Krishankumar, R.; Ravichandran, K.S.; Cavallaro, F.; Kar, S.; Pamucar, D.; Mardani, A. A Fuzzy Gain-Based Dynamic Ant Colony Optimization for Path Planning in Dynamic Environments. Symmetry 2021, 13, 280. https://doi.org/10.3390/sym13020280

AMA Style

Sangeetha V, Krishankumar R, Ravichandran KS, Cavallaro F, Kar S, Pamucar D, Mardani A. A Fuzzy Gain-Based Dynamic Ant Colony Optimization for Path Planning in Dynamic Environments. Symmetry. 2021; 13(2):280. https://doi.org/10.3390/sym13020280

Chicago/Turabian Style

Sangeetha, Viswanathan, Raghunathan Krishankumar, Kattur Soundarapandian Ravichandran, Fausto Cavallaro, Samarjit Kar, Dragan Pamucar, and Abbas Mardani. 2021. "A Fuzzy Gain-Based Dynamic Ant Colony Optimization for Path Planning in Dynamic Environments" Symmetry 13, no. 2: 280. https://doi.org/10.3390/sym13020280

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