Next Article in Journal
Evolution of Unmanned Surface Vehicle Path Planning: A Comprehensive Review of Basic, Responsive, and Advanced Strategic Pathfinders
Previous Article in Journal
A Fault-Tolerant Multi-Agent Reinforcement Learning Framework for Unmanned Aerial Vehicles–Unmanned Ground Vehicle Coverage Path Planning
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

A Dynamic Path Planning Method for UAVs Based on Improved Informed-RRT* Fused Dynamic Windows

1
School of Automation and Information Engineering, Xi’an University of Technology, Xi’an 710048, China
2
Shaanxi Key Laboratory of Intelligence Coordination Networks, Xi’an 710018, China
3
Test and Training Base, National University of Defense Technology, Xi’an 710106, China
*
Author to whom correspondence should be addressed.
Drones 2024, 8(10), 539; https://doi.org/10.3390/drones8100539
Submission received: 21 August 2024 / Revised: 24 September 2024 / Accepted: 26 September 2024 / Published: 1 October 2024

Abstract

:
In recent years, navigating rotor drones in complex and dynamic environments has been a significant challenge. This paper proposes an improved path planning method by integrating the enhanced Informed-RRT* algorithm with the Dynamic Window Approach (DWA) algorithm. Firstly, the probability weight function for sampling direction is dynamically adjusted based on the Euclidean distance between the start and goal points to obtain higher-quality sampling points. Secondly, the Artificial Potential Field (APF) concept is introduced during the generation of new nodes, applying the improved APF method to the elliptical sampling area to guide the direction of new node generation. This significantly reduces the number of redundant nodes, enhances the convergence speed, and improves the obstacle avoidance efficiency. Then, a polynomial fitting method is employed to optimize the path, yielding a smoother trajectory. Finally, the improved DWA algorithm is integrated. Initially, the Informed-RRT* algorithm generates an optimal path from the starting point to the goal point in the global space, which is then provided as an initial reference path to the DWA algorithm. During actual operation, the DWA algorithm dynamically adjusts control inputs based on the current position, speed, and reference path of the drone, ensuring that the drone can avoid dynamic obstacles and unknown static obstacles in real time while staying as close to the reference path as possible.

1. Introduction

With the rapid advancement of UAV technology, the application scope of UAVs is becoming increasingly extensive, encompassing military reconnaissance, logistics distribution, disaster relief, and other fields. As the foundation of autonomous UAV flight, UAV path planning is crucial in ensuring flight safety, efficiency, and stability. Traditional path planning methods often encounter challenges such as high-dimensional state space, dynamic environments, and real-time requirements; therefore, more efficient and flexible algorithms are required to address these issues.
In recent years, numerous path planning methods have been proposed by both academia and industry. For instance, path planning can be categorized into global path planning and local path planning based on the level of environmental information comprehension. Global path planning necessitates a comprehensive understanding of all environmental information to devise paths using the entire environment map, such as the A* algorithm [1], the Dijkstra algorithm [2], and the sampling-based rapidly exploring Random Trees (RRT) algorithm [3]. The Dijkstra algorithm is a single-source shortest path algorithm that operates by identifying the closest unvisited node to the starting point and marking it as visited. Subsequently, it updates the distance values of other nodes through this node until all nodes are reached, providing an optimal route from start to finish. Algorithm A* enhances Dijkstra’s approach by incorporating a heuristic function that evaluates a node’s estimated distance to guide the search towards the end point. However, an improper design of the heuristic function may result in erroneous findings or prolonged search times in complex environments, despite aiding in effective pruning and accelerating the search times for finding faster optimal paths.
Steven M. LaValle proposed a sampling-based global path planning algorithm, the Rapid Exploration Randomized Tree (RRT), in 1998. It explores high-dimensional space by constructing a tree structure that starts from a starting point and gradually expands to a goal point. The basic idea of the RRT algorithm is to randomly sample points in the space and connect these points to the existing nodes in the tree, thus gradually expanding the coverage of the tree until a feasible path from the starting point to the end point is found. Since this algorithm is not limited by spatial dimensions, it can find better paths in higher-dimensional spaces and has a probabilistic completeness. Compared with other algorithms, RRT has the advantages of fewer parameters, a simple structure and the ability to cope with complex constraints, and its adaptability and real-time performance can meet the complex path planning needs of UAVs. However, due to the generation of redundant nodes as a result of the global sampling method, the convergence speed of RRT is relatively slow, thus, it cannot guarantee finding the optimal path.

1.1. Related Work

Researchers and academics have improved the RRT algorithm in path planning in light of its shortcomings. The Optimal Rapidly Exploring Random Trees (RRT*) technique is an enhanced algorithm with asymptotic optimality that was presented by Karaman and Frazzoli [4]. By adding a node reconnection technique and a parent node selection step, this algorithm improves path quality. Stated differently, the optimization module makes sure that, after an infinite number of rounds of the RRT* method, the best solution is discovered. The algorithm’s lengthy convergence time and sluggish initial path search are its drawbacks. Gammell [5] et al. proposed the Informed-RRT* algorithm in an effort to speed up the RRT algorithm’s convergence. This technique reduces the search for unneeded regions by limiting the sampling space to an elliptical region and gradually decreasing it as the path length is lowered. By limiting the sample range, this algorithm increases the search efficiency; nonetheless, it suffers from unequal elliptical area sampling, which leaves inadequate nodes surrounding the target location. Furthermore, the algorithm’s performance is highly dependent on how the ellipsoidal region parameters are configured; in order to produce the best possible results, these parameters need to be regularly changed across a range of scenarios. Thus, this makes practical applications a little more complicated.
The RRT*-Connect proposed by Huang et al. [6] works by constructing two fast-exploring randomized trees based on origin and target configurations. Using a straightforward greedy heuristic, each tree investigates its surroundings and grows in tandem with the others. On this basis, Fan et al. [7] employed the bidirectional RRT* algorithm to construct two alternating random search trees for exploration, thereby enhancing the convergence rate of the algorithm. Additionally, they utilized a goal bias strategy to direct the generation of random sample points. Furthermore, through integrating the enhanced artificial potential field algorithm, they reduced the number of iterations required for bidirectional tree expansion.
In terms of UAV path planning, Sadaf [8] et al. proposed two UAV trajectory planning algorithms based on RSAND and K-means center of mass under disaster conditions. It considered how UAVs can quickly find trajectories to build network services under disaster conditions, but did not consider the problem of obstacle avoidance, which makes it difficult to adjust accordingly under unexpected conditions. Zhu [9] et al. proposed UAV trajectory planning for wireless sensor networks based on deep reinforcement learning. The problem of UAV trajectory design in clustered sensor networks was studied to minimize the total energy consumption of the UAV sensor network system. However, the algorithm is a DRL-based approach, which requires the training of the dataset during trajectory planning, which is time-consuming and requires a lot of hardware. S. Papaioannou [10] et al. proposed a new probabilistic robust controller for Unmanned Aerial Vehicle (UAV) coverage planning mission guidance, which optimizes the UAV’s motion and the camera control inputs simultaneously to achieve the 3D coverage of a given target. However, it fails to demonstrate a good performance in complex environments.
Although many researchers have achieved considerable success in limiting the sampling space of RRT algorithms and improving efficient search strategies, these improved algorithms achieve globally optimal path planning. Still, it is difficult to perform effective obstacle avoidance when facing dynamic obstacles. The Artificial Potential Field (APF) algorithm [11], proposed by Khatib in 1985, and the Dynamic Window algorithm (DWA) [12] are typical local obstacle avoidance algorithms. The principle of the APF algorithm is that it assumes that there exists a joint force which is composed of the repulsive force of the obstacle and the attractive force of the target point. Although it is widely used in path smoothing control and can achieve better obstacle avoidance, APF still has the problem of local minima. The core principle of the DWA, on the other hand, is to evaluate the potential velocity in order to determine the most suitable trajectory for a robot in a short period.
Feng et al. [13] proposed a novel path planning approach for drones that integrates the APF and RRT* algorithms. Initially, they introduced a new direction-biased variable step size sampling strategy into the RRT* algorithm to rapidly generate initial paths. Subsequently, by integrating global random sampling and key area sampling strategies, they effectively enhanced the global search capabilities and optimized the quality of the optimal path. Furthermore, the incorporation of the artificial potential field (APF) method improved obstacle avoidance capabilities, addressing the issue of high randomness in the RRT algorithm. Dai et al. [14] addressed the issues of a poor path quality and low navigation efficiency in robot autonomous navigation by proposing an improved method. In order to reduce the number of nodes that need to be searched and increase the navigation efficiency, they first implemented a greedy algorithm to improve the path planning process. They then modified the search range of possible ideal parent nodes from the node tree to the constructed path. Additionally, they combined the improved algorithm with the dynamic window approach (DWA) to achieve path planning and obstacle avoidance. However, in complex scenarios, this algorithm may still face the problem of local optimal solutions and cannot guarantee that the path quality is optimal. Wang et al. [15] proposed a hybrid algorithm that combines the improved RRT algorithm with the dynamic window approach to solve the path planning problem for robots in dynamic or unknown obstacle environments.

1.2. Motivation and Contributions

However, autonomous navigation missions for UAVs, such as reconnaissance or transportation missions, not only have high requirements regarding path quality and runtime, but also need to ensure path safety. Although many researchers have achieved considerable success in RRT algorithm improvement and fusion with other algorithms, and despite there being many advanced UAV path planning methods, some of them are costly and some of these algorithms are more complex, so there is an urgent need to find a simple and efficient UAV path method. Therefore, this paper proposes an improved fusion algorithm. Firstly, the algorithm can obtain higher-quality samples and shorten the convergence time. Secondly, the algorithm fuses the improved artificial potential field method with the Informed-RRT algorithm with a high-quality sampling strategy, significantly reducing redundant points and further improving path quality. Then, the polynomial fitting optimization method is used to obtain a smoother path. Finally, when fused with the improved DWA algorithm, it not only meets the static obstacle avoidance requirements, but also shows a good safety performance in the face of moving obstacles. Moreover, the algorithm significantly shortens the computational time required for global path planning, and more importantly, it has a good robustness and is suitable for complex and changing real environments. Compared with the RRT* algorithm and Informed-RRT* algorithm, the proposed algorithm generates more superior paths and exhibits excellent global path planning and dynamic obstacle avoidance capabilities. Some details are omitted to highlight the main point.
The structure of this paper is as follows: Section 2 discusses the problem definition; Section 3 introduces the RRT*, Informed-RRT*, and APF algorithms; Section 4 elaborates on the proposed fusion and improvement algorithm; Section 5 describes the simulation environment and provides a comparative analysis of the simulation results; and Section 6 concludes the paper by summarizing the research findings and suggesting directions for future work.

2. Problem Definition

Mathematical notation is utilized to describe the trajectory planning problem for UAVs. A path planning algorithm is capable of devising a collision-free path for an aircraft from its initial position to a designated target point. This paper specifically delves into the intricacies of path planning for UAVs in intricate environments, taking into account both static and dynamic obstacles.
This section presents three problems that need to be addressed. In this paper, we define X as the entire space, mapping the three-dimensional space onto a two-dimensional plane. X o b s represents the regions occupied by obstacles. X f r e e = X/ X o b s denotes the free space, that is, the obstacle-free regions. The drone can move freely within X f r e e and generate feasible paths. X s t a r t X f r e e is the starting point of the drone. X g o a l X f r e e is the target point. A path is defined as a continuous function with bounded variables φ :[0, 1] → X. ∀τ∈[0,1], σ(τ) X f r e e , then the path σ is a collision-free path.
Definition 1
(Feasible Path Planning): Feasible path planning is the process of identifying a solution set for a path planning problem (X, X s t a r t , X g o a l ), such that there exists a collision-free path with φ(0) =  X s t a r t   and φ(1) =  X g o a l . If no solution is found, the process returns a failure.
Definition 2
(Optimal Path Planning): Optimal path planning for a given path planning problem (X, X s t a r t , X g o a l ) involves finding a solution from the set of all feasible paths such that c(φ∗) = min{c(φ): φ∈feasible paths}, where c(φ) represents the cost of the path. If no solution is found, the result is failure.
Definition 3
(Avoidance of Dynamic and Static Obstacles): After identifying the globally optimal path, the UAV can safely and efficiently navigate from  X s t a r t    X g o a l , ensuring the avoidance of newly appearing dynamic obstacles, as well as previously undetected obstacles along the planned global path.

3. Basic Principles of Algorithm

3.1. RRT*

The algorithm constructs a tree by randomly sampling within the search space X s e a r c h and expanding the search tree from the initial point to the target point. In each iteration of the algorithm, the RRT algorithm randomly generates a point x r a n d in the X s e a r c h space, finds the nearest node x n e a r in the tree to x r a n d , takes a fixed step from the nearest node x n e a r towards the x r a n d node, and obtains a new node x n e w . If there are no obstacles between x n e a r and x n e w , x n e w is added to the tree; otherwise, the iteration is repeated. The above steps are repeated until a feasible path is found. The process of node expansion in RRT is shown in Figure 1.
The RRT* algorithm, introduced in 2010 as an enhanced version of the original RRT algorithm, maintains the probabilistic completeness of RRT while adding asymptotic optimality. By randomly sampling the reachable space of the UAV and ensuring collision detection and non-integrity constraint detection for each new node before connecting to the tree, this improved version can converge to an optimal solution with sufficient iterations.
Although capable of producing higher-quality paths, the RRT* algorithm requires additional computational effort due to the two following key processes when generating new nodes: re-selecting the parent node and path rerouting. These steps are designed to minimize the path cost for newly generated nodes and reduce redundant paths within the random tree, but they also result in an increased search time. Subsequently, we present the pseudo-code of the RRT* algorithm [16], as depicted in Algorithm 1.
Algorithm 1 RRT*
1: V ← { x s t a r t }; E ;
2: for each iter ∈ [1,Maxiter]  do
3:       x r a n d Sample(iter);
4:       x n e a r Nearest (V, x r a n d );
5:       x n e w Steer ( x r a n d , x n e a r );
6:      if   Collisionfree ( x n e a r , x n e w , X o b s ) then
7:           X n e a r Near (V, x n e w );
8:           x p a r e n t CooseParent ( X n e a r , x n e w , x n e a r e s t );
9:          VV ∪ { x n e w };
10:     EE ∪ {( x n e w , x p a r e n t )};
11:     GRewire(G, X n e a r , x n e w );
12:    end if;
13: end for
14: Return G = (V, E);
x s t a r t represents the initial point, while x g o a l denotes the target point. The variable x r a n d signifies a randomly sampled point within the space, and x n e a r refers to the node closest to x r a n d in the random tree. Additionally, x n e w is extended along a straight line between x n e a r and x r a n d , with step representing the step size used for this extension.
The primary distinction between the RRT* algorithm and the RRT algorithm lies in the rediscovery of the parent node for a new node in Algorithm 2, as well as the updating of child nodes in Algorithm 3, which leads to an enhanced quality of the selected tree nodes. The path cost of the RRT* algorithm is considerably lower than that of the RRT algorithm.
Algorithm 2 Choose Parent ( X n e a r , x n e a r e s t , x r a n d )
1: x m i n x n e a r e s t ;
2: C m i n d e s t Cost ( x n e a r ) + dist( x n e a r e s t , x n e w );
3: for each x n e a r X n e a r do
4:   CdistC( x n e a r ) + dist( x n e a r , x n e w );
5:   if Collisionfree ( x n e a r e s t , x n e w , X o b s ) then
6:       if Cmindist < Cdist then
7:        Cmindist = Cdist;
8:         x m i n x n e a r ;
9:      end if;
10:   end if;
11: end for
12: Return x m i n ;
Algorithm 3 Rewire (G, x n e w   X n e a r )
1: for each x n e a r X n e a r do
2:   if C ( x n e w ) + dist ( x n e w , x n e a r ) < C ( x n e a r ) then
3:   qparentParent( x n e a r );
4:   EReconnect( x n e w , x n e a r );
5:   end if;
6: end for
7: Return G = (V, E);
In the above pseudo-code, the relevant function is explained as follows:
  • Sample: A random sampling function that obtains random sampling points in the X s e a r c h space.
  • Nearest: Returns a point x n e a r e s t in the search tree with the shortest distance from a random point x r a n d .
  • Steer: Returns a new node x n e w that is x r a n d along the direction of the nearest point x n e a r e s t , extended with a fixed step size.
  • Cost: Assuming a random tree generates a node, it returns the path length from the starting point to that node.
  • dist: Calculates the Euclidean distance between two points.
  • Near: Returns the set of parent nodes for the new node.
  • Collisionfree: Detects the presence of an obstacle between two points.
  • Reconnect: The function to connect a new node to a new parent node.

3.2. Informed-RRT*

The Informed RRT algorithm represents a further improvement and extension of the RRT algorithm. The two algorithms are not different until the initial solution is found. However, once the Informed RRT* algorithm obtains the initial solution, it begins to use the optimization costs of the starting point x s t a r t , the ending point x g o a l , and the best path C b e s t obtained in the current iteration to guide its subsequent exploration. For this purpose, please refer to Figure 2. the algorithm creates an ellipsoidal sampling space and performs further sampling and exploration only within this particular ellipsoidal histogram subset region to optimize the paths more efficiently and reduce the computational consumption of extraneous regions, constructing the following ellipsoidal histogram subset region of:
x rand   x start   + x rand   x goal   C best  
where C m i n is the distance between the two foci, x s t a r t and x g o a l are the hyperelliptic region’s foci, and C b e s t is the region’s long axis. This region enhances the algorithm’s efficiency by decreasing the sampling area and raising the likelihood that a valid node will be sampled. Additionally, as the path is increasingly optimized, C b e s t is shortened and the hyperelliptic region shrinks. This accelerates the algorithm’s convergence speed and speeds up the convergence to the optimal solution. The process is shown in Algorithm 4. The main improvement of the Informed-RRT * algorithm is to reduce the sampling range of x r a n d by using the SampleInformed function, as shown in Algorithm 5:
Algorithm 4 Informed-RRT*
1: V ← { x s t a r t };
2: E ;
3: X s o l n ← ∅;
4: for each iter ∈ [1,Maxiter] do
5:    C b e s t minqsoln X s o l n {Cost( X s o l n )};
6:    x r a n d InformedSample ( x s t a r t , x g o a l , C b e s t );
7:    x n e a r e s t Nearest (V, x r a n d );
8:    x n e w Steer ( x n e a r e s t , x r a n d );
9:     if Collisionfree ( x n e a r e s t , x n e w , X o b s ) then
10:      X n e a r Near(V, x n e w , Rnear);
11:      x m i n ChooseParent( X n e a r , x n e w , x n e a r e s t );
12:       VV ∪ { x n e w }
13:       EE ∪ {( x n e a r , x n e w )}
14:       GRewire(G, x n e w , x n e a r );
15:   end if;
16:   if   InGoalRegion ( x n e w ) then
17:           X s o l n X s o l n ∪ { x n e w }
18:   end if;
19: end for
20: Return G = (V, E)
Algorithm 5 Sample Informed( x s t a r t , x g o a l , c m a x )
1: if c m a x ← ∞ then
2:    c m i n | | x g o a l x s t a r t | | 2 ;
3:    x c e n t e r ← ( x s t a r t + x g o a l )∕2;
4:   CRotationToWorldFrame( x s t a r t , x g o a l );
5:    r 1 V c m a x ∕2;
6:   { r i }i=2,⋅⋅⋅,n ← ( c m a x 2 c m i n 2 )∕2;
7:     Ldiag{ r 1 , r 2 , ⋅ ⋅ ⋅, r n };
8:    x b a l l SampleUnitNBall;
9:    x r a n d ← (CL x b a l l + x c e n t e r ) ∩ X;
10: else
11:     x r a n d U(X);
12: return x r a n d ;
The following explains the new function in Informed-RRT*:
  • RotationToWorldFrame: Utilized for converting the input data into the global coordinate system.
  • InGoalRegion: Determines whether the target region contains the input node. It returns True if it is within the target point’s region. If not, False is returned.

3.3. APF

In complex environments, path planning remains a formidable task, even with drones having access to global map information. The drone must navigate towards the target position while avoiding obstacles. The essence of the APF method [17] lies in the generation of attractive and repulsive potential fields by the target point and obstacles, respectively. By superimposing these two potential fields, the potential energy at any point can be determined, enabling path planning based on minimizing this energy. This approach does not rely on global obstacle information and allows for local obstacle detection and avoidance. The working principle is illustrated in Figure 3, where F r e p denotes the repulsive force exerted by obstacles on the UAV and F a t t represents the attraction of the target point to the UAV.
In order to calculate the gravitational and repulsive forces of the UAV, the field functions for gravity and repulsion are initially defined. By taking the negative gradient of these potential field functions, we can obtain the gravitational and repulsive force functions. The classical expressions for these force fields are as follows.
The common gravitational field function is as follows:
U a t t ( P ) = 1 2 k a d 2 P , P goal  
where P represents the current coordinates of the UAV, P g o a l represents the coordinates of the goal point, and k a is the attraction gain coefficient.
The common repulsive field function is as follows:
U rep   ( P ) = 1 2 k r 1 d P , P o b 1 Q ,   if   d P , P o b Q 0 ,   if   d P , P o b > Q
where P is the current coordinates of the UAV and P o b is the coordinates of the obstacle for which the potential function is being computed; Q is the obstacle action range, outside of which obstacles will not affect the UAV flight; and k r is the repulsive force gain coefficient.
U = U a t t + U rep  
Under the above definition of the potential function, the gravitational potential produced by the goal point decreases as an object approaches it, while the repulsive potential produced by the obstacle increases with an object’s proximity to it.
The object moves to the position with a smaller potential, so it can approach the target point and move away from the obstacle.
F att   = k a d P , P goal  
F r e p = k r 1 d P , P o b 1 Q ,   if   d P , P o b Q 0 , if   d P , P o b > Q
F = F att   + F rep  

4. Algorithm Convergence and Improvement

Although the Informed-RRT* algorithm has strong search capabilities, it often fails to generate safe paths when faced with unknown static and dynamic obstacles. On the other hand, the DWA algorithm has the advantages of a good real-time performance and compatibility with drone motion characteristics, but it often encounters issues such as overly long paths, getting stuck in local optima, and failing to reach the target point.
To address these issues, this paper proposes a path planning method that combines the improved Informed-RRT algorithm with the DWA. Firstly, the improved Informed-RRT algorithm is used to plan the globally optimal path, and key points along this path are extracted as intermediate nodes for the DWA algorithm. Then, the dynamic window approach is employed to perform local path planning between each pair of adjacent nodes, dynamically avoiding obstacles and adjusting and optimizing the path. Specifically, the algorithm iteratively optimizes the global path and combines the DWA algorithm to perform real-time adjustments in local areas, adapting to dynamic changes in the environment and ensuring the safety and effectiveness of the path. The advantage of this fusion algorithm lies in fully utilizing the global search capabilities of Informed-RRT* and the real-time performance of the DWA, dynamically adjusting both the global and local paths to effectively deal with obstacles and dynamic changes in complex environments, thereby improving the success rate and efficiency of path planning. The specific algorithm improvements and fusion are as follows:
  • High-quality sampling strategies: An adaptive factor is added to adjust the sampling strategy based on the Euclidean distance between the target point and the algorithm, which enhances the randomness at the beginning of the sampling process and accelerates the convergence near the end of the path, avoiding falling into the local optimum too early and improving the efficiency of finding the effective path, which accelerates the sampling speed.
  • Efficient Search Strategies: In order to ensure that the target point and random sampling point of each tree have an attractive force toward the nearest node and that the obstacle has a repulsive force toward the nearest node, respectively, the APF notion is added during the process of generating new nodes. Trajectory search and obstacle avoidance become more efficient when the total direction of the three forces is used as the new node’s growth direction.
  • Path Optimization: The updated algorithm’s path is still convoluted, despite a relative gain in sampling quality and running performance. Reducing the path’s distortion is, therefore, essential to prevent issues like flying at an excessively high speed and angle. This study uses the cubic spline interpolation approach to further optimize the generated path, making it smoother and taking into account the UAV’s turning radius restriction, making it more appropriate for UAV flight in real-world scenarios.
  • Addition of the Dynamic Window Approach: The Informed-RRT* algorithm first generates a collision-free path from the starting point to the target point in the global space. This path is provided as an initial reference path to the DWA algorithm. During actual operation, the DWA algorithm dynamically adjusts control inputs based on the current position, speed, and reference path of the UAV, ensuring that the UAV can avoid dynamic obstacles in real time while maintaining its proximity to the reference path as much as possible.
The flowchart of the whole algorithm is shown in Figure 4:

4.1. Improved Informed-RRT*

The random sampling point selection can be improved. In the elliptic search space, x r a n d is randomly obtained in the original Informed-RRT* algorithm. Here, an adaptive function is introduced, which dynamically adjusts the probability weights of the sampling directions according to the Euclidean distance between the starting point and the target point as follows:
  S   = 1 norm   ( X goal   X start   ) / n  
where S computes the normalized value of the distance from the starting point to the endpoint. In this paper, it is assumed that the maximum considered distance is n = 1000 units in length. This value decreases as the distance between the starting point and the endpoint increases. By subtracting 1 − norm ( X g o a l X s t a r t )/n, it can be transformed into a heuristic adjustment factor, such that the closer the distance, the larger this value becomes. When the adaptive value is small, indicating a shorter distance between the starting point and the endpoint (e.g., 100 units in length), such as when the adaptive value approaches 0.9, the algorithm is more likely to choose a strategy leaning towards the direction of the target during sampling by multiplying with m (the existing sampling probability control parameter).
x rand   =   Rand ,     if   rand   ( ) <   S   ×   m X goal   ,   else  
where rand () represents a random number ranging from 0 to 1 and m is the controlling parameter for the sampling probability. The growth direction of new nodes in the random tree is determined by m. If rand () < m × S, then the tree will grow randomly within the sampling space; otherwise, it will extend towards the target point of each growth tree.
When the distance between the starting and end points is short, the factor value approaches 1, increasing the probability of direct sampling towards the target direction, thereby accelerating the final convergence of the path. Conversely, if the distance between the starting and end points is long, the adaptive value approaches 0, reducing the proportion of direct target sampling and adopting more random sampling. This enhances the algorithm’s random exploration characteristics, helping to avoid prematurely falling into local optima and ensuring the comprehensiveness of path exploration.

4.2. Improved APF–Informed-RRT*

Building upon the enhanced Informed-RRT* algorithm, a refined APF algorithm [18] is incorporated into the x n e w direction generation process within the sampling interval. This fusion assists in guiding the expansion of the random tree towards the target point while mitigating excessive randomness. In the first step of the specified step, x n e w grows along the combined direction of the tree, where the target point, the random sampling point, and the obstacle exert attractive and repulsive forces, respectively, on x n e a r . The combined direction of the tree is the direction of x n e w generation. Figure 5 displays the schematic diagram of the x n e a r force.
(1)
Introduction of gravitational components
Reducing the unpredictability of tree growth, the random tree’s growth direction can be regulated to grow towards the target location by adding attractive force components to its random nodes. In this study, an attractive force function F a t t (x) is introduced into each new node nn to change the resultant force direction of growth.
F ( x )   = R a ( x ) + F a t t ( x )
In Equation (10), F ( x ) is the function determining new nodes for the random tree during the search process, R a ( x ) is the function for the random growth of new nodes, and F a t t ( x ) is the function for adding target attraction.
The target attraction function F a t t ( x ) is as follows:
F a t t ( x ) = 1 2 × k a × x g o a l x n e a r x g o a l x n e a r
where x g o a l is the target position vector and x g o a l x n e a r represents the absolute value of the geometric distance between node x g o a l and x n e a r .
The random growth function for new nodes is as follows:
R a ( x ) = x r a n d x n e a r | x r a n d x n e a r |
(2)
Introducing the repulsive component:
The concept of obstacle repulsion from Artificial Potential Fields can be integrated into the improved Informed-RRT* algorithm to guide the growth of the local random tree away from obstacles. Specifically, during the expansion process of the local random tree search, a repulsive force function F r e p ( x ) is introduced for each newly generated node n. The expression of this function is as follows:
F ( x ) = R a ( x ) + F r e p ( x )
In Equation (13), F( x ) is the function that determines new nodes in the random tree during the search process, R a ( x ) is the random growth function for new nodes, and F r e p ( x ) is the repulsive force function from obstacles to the new nodes.
The obstacle repulsion function F r e p ( x ) is as follows:
F r e p ( x ) = k r 1 d P , P o b 1 Q 1 d P , P o b 2 ( P   P o b ) ( P ) ,   if   d P , P o b Q 0 , if   d P , P o b > Q
However, the local minima problem arises when the UAV is about to approach the target because of nearby obstacles and a repulsive force of the UAV that is stronger than the gravitational pull. This makes it difficult for the UAV to fly to the target. Therefore, in this paper, a stochastic perturbation function is introduced, while the step size is increased to provide the UAV with more chances to escape when it falls into a local minimum.
random = a   ×   rand ( 1 , 2 )
S t e p 1 = b × s t e p
where a and b are the scale factor.
So, finally, the combined force on the drone is as follows:
F t = R a + F a t t + F r e p + r a n d o m

4.3. Path Optimization

Although these fused and improved algorithms introduce relative improvements in terms of sampling tuning and operating speed, the paths are still tortuous. This is very unfavorable for UAVs performing autonomous navigation tasks. Therefore, in order to avoid problems such as an insufficient smoothness and excessive angle when a UAV flies to the target point, it is necessary to continue to optimize the path in order to reduce its distortion.
Cubic spline interpolation [19] interpolates the collected data. The interpolation is similar in shape, and every known point passes through, generally using piecewise interpolation. In order to prevent the turning radius of the UAV from being too large when moving at a high speed, the curvature of each point is considered in the interpolation, and the curvature is restricted and constrained. The curvature k i describes the degree of the curvature of the path at a certain point, and the specific calculation formula is as follows:
k i ( t ) = x ( t ) y ( t ) y ( t ) x ( t ) ( ( x ( t ) 2 ) + ( y ( t ) 2 ) ) 3 2
x and y represent the tangent vector components of the curve. x and y represent the acceleration components of the curve.
R min = v 2 F max × sin ϕ max × 1 m
where v is the speed of the drone, F max is the maximum thrust of the drone, ϕ max is the maximum tilt angle of the drone, and m is the mass of the drone.
G = C max | k i |
C max = 1 R min
x i = x ( i ) + d x ( i ) × G
y i = y ( i ) + d y ( i ) × G
C max represents the maximum curvature, and when the curvature k of a point exceeds the maximum curvature C max , the interpolation point needs to be adjusted to reduce the curvature. G is the scaling factor used to scale the displacements d x and d y , thereby reducing the curvature. x i and y i denote the adjusted interpolation coordinates. The curvature of the interpolation points should be adjusted to meet the requirements so that the curvature of the path does not exceed the set maximum value at all points.

4.4. Dynamic Window Algorithms

Based on predictive control theory, the Dynamic Window Approach (DWA) [20] is a suboptimal method that may safely and effectively avoid obstacles in unfamiliar situations while maintaining a modest computation, fast response times, and a good operability. Planning local paths is the primary use for the Dynamic Window method [21]. The action trajectory moments of the subsequent set of velocity values are simulated using velocity values that are sampled from several sets in the velocity space. Simultaneously, the best trajectory is obtained for path planning and the anticipated trajectory is reasonably evaluated. The three following primary components make up the entire algorithmic procedure [22]: the trajectory assessment function, the velocity sample acquisition, and the motion model establishment.

4.4.1. Knematics Model

The Dynamic Window’s primary purpose is to confine the velocity sampling space to a workable dynamic range depending on the UAV’s acceleration and deceleration characteristics.
The following is the basic idea behind motion trajectory simulation [23]. Projecting the UAV’s motion distance on the x and y axes of the ground coordinate system and assuming that the motion trajectory is approximated as a straight line due to the short neighboring moments when calculating the motion trajectory, the trajectory at the moment of t+1 is obtained to be represented as follows:
x t + 1 = x t + v x Δ t + 1 2 a x ( t ) Δ t 2 y t + 1 = y t + v y Δ t + 1 2 a y ( t ) Δ t 2 v x , t + 1 = v x ( t ) + a x ( t ) Δ t v y , t + 1 = v y ( t ) + a y ( t ) Δ t θ t + 1 = θ t + w t Δ t + 1 2 α ( t ) Δ t 2
In the equations, x t and y t represent the x and y coordinates of the UAV at time t, v t and w t represent the linear velocity and angular velocity of the UAV at time t, and t is the time step representing the time elapsed for each update. a x and a y are the accelerations in the x and y directions, respectively. θ t represents the yaw angle of the UAV at time t.

4.4.2. Velocity Sampling Device

(1)
Based on the constraint of the maximum value.
Firstly, the UAV’s motion is subject to its own maximum and minimum speed constraints, which are specifically represented as follows:
V = { v [ v min , v max ] , w [ w min , w max ] }
(2)
In light of the acceleration and deceleration constraints.
The UAV’s acceleration and deceleration capabilities also limit it simultaneously, and the maximum movement speed that it can achieve within a Dynamic Window period is indicated as follows:
V d = ( v , w ) v v c v b Δ t , v c + v a Δ t , w w c w b Δ t , w c + w a Δ t
In the equation, v b and v a represent the maximum and minimum velocity accelerations, respectively, while w b and w a represent the maximum and minimum angular velocity accelerations.
(3)
Based on the constraint of safety distance.
To ensure the drone stops safely when encountering obstacles, a speed limit range is established.
V w = ( v ¯ , w ¯ ) v 2 × d i s t ( v , w ) × v b , w 2 × d i s t ( v , w ) × w b
d i s t ( v , w ) is the distance from the nearest obstacle on the trajectory predicted by the velocity.

4.4.3. Trajectory Evaluation Subfunction

After obtaining many sets of velocity numbers, each trajectory must be carefully reviewed in order to determine which is the best expected trajectory. The specific technique is to thoroughly assess each trajectory’s performance using the designated evaluation function in order to choose the trajectory that has the highest priority. The following is the improved evaluation function:
C ( v , w ) = σ [ α × heading   ( v , w ) + β × o b s d i s t ( v , w ) + γ × v e l o c i t y ( v , w ) + δ × s m o o t h n e s s ( a ) ]
  • heading ( v , w ) : The angle difference between the UAV’s orientation at the end of its trajectory and the target is assessed using the heading assessment function. A smaller angle difference results in a higher evaluation score.
  • o b s d i s t ( v , w ) : This is a function for evaluating distance that is primarily used to calculate how far a UAV is from the closest obstacle along its current route. The higher the evaluation score, the further away from the obstacle the UAV is.
  • v e l o c i t y ( v , w ) : This represents the velocity evaluation function, which is mostly used to assess the current trajectory’s velocity in an effort to maintain the UAV’s maximum speed.
  • s m o o t h n e s s ( a ) : This is a function for evaluating the smoothness of a path, while acceleration serves as the foundation for judgment. The calculation method is s m o o t h n e s s ( a ) = ( a x   2 + a y   2 + α 2 ) .

5. Simulation Result Analysis

To validate the efficacy of the proposed enhanced fusion algorithm, three distinct environments are initially formulated. A comparative analysis is conducted between the proposed improved Informed-RRT*, RRT*, and Informed RRT* algorithms using three evaluation metrics. To mitigate the stochastic nature of sample-based algorithms, each algorithm is independently executed 30 times with a maximum of 800 iterations. Uniform simulation parameters are set for all algorithms to ensure an equitable comparison. Subsequently, dynamic obstacles and those not present in the global path are introduced into the original map to assess real-time obstacle avoidance post DWA integration. The simulation platform and its configuration include Matlab R2021a; a 64-bit Windows 10 operating system; Processor 12th Gen Intel(R) Core (TM) i5-12400F 2.50 GHz; and a running memory of 32 GB.
The three following test environments were designed: general, narrow, and cluttered. These environments are based on common working conditions for drones in real life and are shown in Figure 6. In these environments, red circles represent starting points, red circles represent target points, light green rectangles and circles represent static obstacles, and green circles represent dynamic obstacles. The dimensions of these three environments are all 100 by 100.

5.1. In Environment A

The simulation results for Environment A are shown in Figure 7, where the blue line indicates the drone flight trajectory planned by the algorithm. In Figure 7a, due to the large sampling space used by the RRT* algorithm, the trajectory contains many turning points, resulting in a longer path and an increased computation time. The simulation results of the Informed-RRT* algorithm are shown in Figure 7b. Compared to the original RRT* algorithm, by limiting the sampling interval, it can generate better paths in the same number of iterations, and the growth of the random tree is faster, thus reducing the required time. Although the Informed-RRT* algorithm has an improved search efficiency, it lacks obstacle repulsion, leading to many redundant points around obstacles. Compared to the Informed-RRT* algorithm, Figure 7c shows the improvements made to the original Informed-RRT*. The generation of new nodes includes an improved APF, and the generated paths are smoothed. These enhancements further improve the search efficiency of the algorithm; the improved algorithm not only makes the planned path smoother and shorter, but also better meets the flight requirements of the drone.
In order to confirm the stability of the algorithms, this article performs 30 tests in the same environment for each algorithm, noting the number of nodes, trajectory length, and execution time for each. Table 1 displays the simulation data for Environment A.
By examining the data shown in Table 1, the trajectory planning algorithm suggested in this work shortens the trajectory by 3.86% when compared to the Informed-RRT* algorithm. Both the number of nodes and the average operating time drop by 75.95% and 81.65%, respectively. The outcomes show that this method demonstrates stability, speeds up the algorithm’s convergence, and drastically cuts down on the amount of redundant points. Its success rate is also much higher.

5.2. In Environment B

The trajectories planned by the three algorithms in Environment B are shown in Figure 8. Figure 8c displays the flight trajectory of the novel algorithm presented in this paper. The flight path is smoother, straighter, and produces fewer redundant points than other algorithms, better fulfilling the requirements for UAV flight.
Based on the data analysis in Table 2, the average trajectory length generated by the algorithm in this paper is 6.71% shorter than the average trajectory length of the Informed-RRT* algorithm; the average running time is shortened by 75.65%; and the average number of nodes is lowered by 66.99%. The success rate is also much higher. These results suggest that the algorithm is more stable and has a higher search efficiency in more complex environments.

5.3. In Environment C

The benefits of the algorithm presented in this study are even more evident for Environment C, which has more intricate impediments. In this intricate setting, the algorithm finds smoother and shorter pathways. As seen in Figure 9c, it also greatly shortens the search time and removes a great deal of unnecessary points. By comparing the new algorithm to the Informed-RRT* algorithm and analyzing the data in Table 3, the average path length is reduced by 7.36%. The average running time is 71.71% less than the algorithm, while the average number of nodes is 64.53% shorter. As a result, this algorithm’s stability can be demonstrated by its capacity to significantly lower the number of redundant points.
In Figure 10, we compare the path length, execution time, number of nodes traversed, and obstacle avoidance rate of the trajectories generated by each algorithm across three different environments. The results clearly indicate that the algorithm proposed in this paper outperforms the others.

5.4. Path Optimization

The path optimization results in the three environments shown in Figure 11. Although the route generated by the original path is feasible, it contains many trajectory points and the path length is long, which is difficult to adapt to the flight requirements of the actual UAV environment. To address this problem, the proposed method adopts the cubic spline interpolation method and considers the steering radius of the UAV to optimize the path generated by the improved algorithm. In the figure, the red path represents the original path and the blue path represents the optimized path. It can be seen that, after optimization, the redundant points in the path are reduced and the trajectory is smoother, which better meets the flight requirements of UAVs in real scenarios.

5.5. In Dynamic Environment

As shown in Figure 12, Figure 13 and Figure 14, dynamic obstacles and obstacles that are not on the initial path are added to these three environments, and facing these two kinds of unknown obstacles can be used to form a suitable obstacle avoidance speed of the UAV by the speed relative to the dynamic obstacles, which ensures that the obstacles are avoided while trying to stay near the original path. A comparison is also made between the DWA and the improved algorithm, with the improved fused algorithm performing better in complex dynamic environments.

6. Conclusions

This paper proposes a UAV path planning method that combines an improved Informed-RRT* algorithm with an enhanced DWA algorithm to address the path planning problems faced by UAVs in environments with dynamic or unknown static obstacles. Compared to the traditional Informed-RRT* algorithm, the improved Informed-RRT* algorithm reduces the path length and planning time and eliminates a large number of redundant nodes, demonstrating its effectiveness and superiority. Firstly, the Informed-RRT* algorithm generates a collision-free path from the starting point to the goal point in the global space, which serves as the initial reference path for the DWA algorithm. During actual operation, the DWA algorithm dynamically adjusts control inputs based on the UAV’s current position, speed, and reference path, ensuring that the UAV can avoid dynamic obstacles and unknown static obstacles in real time while staying as close to the reference path as possible. This combined method not only improves path planning efficiency, but also enhances the UAV’s adaptability in complex and dynamic environments, making it more consistent with real UAV flight scenarios. The next step in the work is to adapt the algorithm by adding the dynamics constraints of the UAV considering a three-dimensional case, which would make it more consistent with real flight scenarios.

Author Contributions

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

Funding

Information and Communication Business Cost Project of JSCMC, Grant/Award Number: SXJD-XXTXF-202303. Scientific Research Plan of JSLLKYJH, Grant/Award Number: 23-JSLLKY011.

Data Availability Statement

No new data were created. Data are contained within the article.

Conflicts of Interest

The authors declare no conflicts of interest.

References

  1. Fransen, K.; van Eekelen, J. Efficient path planning for automated guided vehicles using a* (astar) algorithm incorporating turning costs in search heuristic. Int. J. Prod. Res. 2023, 61, 707–725. [Google Scholar] [CrossRef]
  2. Husain, Z.; Al Zaabi, A.; Hildmann, H.; Saffre, F.; Ruta, D.; Isakovic, A.F. Search and rescue in a maze-like environment with ant and dijkstra algorithms. Drones 2022, 6, 273. [Google Scholar] [CrossRef]
  3. LaValle, S.M. Rapidly-Exploring Random Trees: A New Tool for Path Planning; Annual research report; Iowa State University: Ames, IA, USA, 1998. [Google Scholar]
  4. Karaman, S.; Frazzoli, E. Sampling-based algorithms for optimal motion planning. Int. J. Robot. Res. 2011, 30, 846–894. [Google Scholar] [CrossRef]
  5. Gammell, J.D.; Srinivasa, S.S.; Barfoot, T.D. Informed RRT*: Optimal sampling-based path planning focused via direct sampling of an admissible ellipsoidal heuristic. In Proceedings of the 2014 IEEE/RSJ International Conference on Intelligent Robots and Systems, Chicago, IL, USA, 14–18 September 2014; pp. 2997–3004. [Google Scholar]
  6. Huang, J.; Sun, W. A method of feasible trajectory planning for UAV formation based on bi-directional fast search tree. Optik 2020, 221, 165213. [Google Scholar] [CrossRef]
  7. Fan, J.; Chen, X.; Liang, X. UAV trajectory planning based on bi-directional APF-RRT* algorithm with goal-biased. Expert Syst. Appl. 2023, 213, 119137. [Google Scholar] [CrossRef]
  8. Javed, S.; Hassan, A.; Ahmad, R.; Ahmed, W.; Alam, M.M.; Rodrigues, J.J.P.C. UAV trajectory planning for disaster scenarios. Veh. Commun. 2023, 39, 100568. [Google Scholar] [CrossRef]
  9. Zhu, B.; Bedeer, E.; Nguyen, H.H.; Barton, R.; Henry, J. UAV Trajectory Planning in Wireless Sensor Networks for Energy Consumption Minimization by Deep Reinforcement Learning. IEEE Trans. Veh. Technol. 2021, 70, 9540–9554. [Google Scholar] [CrossRef]
  10. Papaioannou, S.; Kolios, P.; Theocharides, T.; Panayiotou, C.G.; Polycarpou, M.M. Unscented Optimal Control for 3D Coverage Planning with an Autonomous UAV Agent. In Proceedings of the 2023 International Conference on Unmanned Aircraft Systems (ICUAS), Warsaw, Poland, 6–9 June 2023; pp. 703–712. [Google Scholar]
  11. Keyu, L.; Yonggen, L.; Yanchi, Z. Dynamic obstacle avoidance path planning of UAV Based on improved APF. In Proceedings of the 2020 5th International Conference on Communication, Image and Signal Processing (CCISP), Chengdu, China, 13–15 November 2020; pp. 159–163. [Google Scholar]
  12. Bai, X.; Jiang, H.; Cui, J.; Lu, K.; Chen, P.; Zhang, M. UAV Path Planning Based on Improved A and DWA Algorithms. Int. J. Aerosp. Eng. 2021, 2021, 4511252. [Google Scholar] [CrossRef]
  13. Feng, Z.; Zhou, L.; Qi, J.; Hong, S. DBVS-APF-RRT*: A global path planning algorithm with ultra-high speed generation of initial paths and high optimal path quality. Expert Syst. Appl. 2024, 249, 123571. [Google Scholar] [CrossRef]
  14. Dai, J.; Li, D.; Zhao, J.; Li, Y. Autonomous Navigation of Robots Based on the Improved Informed-RRT * Algorithm and DWA. J. Robot. 2022, 2022, 3477265. [Google Scholar] [CrossRef]
  15. Wang, G.; Jiang, C.; Tao, G.; Ye, C. Dynamic path planning based on the fusion of improved RRT and DWA algorithms. In Proceedings of the 2023 4th International Conference on Mechatronics Technology and Intelligent Manufacturing (ICMTIM), Nanjing, China, 26–28 May 2023; pp. 534–538. [Google Scholar]
  16. Ding, J.; Zhou, Y.; Huang, X.; Song, K.; Lu, S.; Wang, L. An improved RRT* algorithm for robot path planning based on path expansion heuristic sampling. J. Comput. Sci. 2023, 67, 101937, ISSN 1877-7503. [Google Scholar] [CrossRef]
  17. Diao, Q.; Zhang, J.; Liu, M.; Yang, J. A Disaster Relief UAV Path Planning Based on APF-IRRT* Fusion Algorithm. Drones 2023, 7, 323. [Google Scholar] [CrossRef]
  18. Huang, S. Path Planning Based on Mixed Algorithm of RRT and Artificial Potential Field Method. In Proceedings of the 2021 4th International Conference on Intelligent Robotics and Control Engineering (IRCE), Lanzhou, China, 18–20 September 2021; pp. 149–155. [Google Scholar]
  19. McKinley, S.; Levine, M. Cubic spline interpolation. Coll. Redw. 1998, 45, 1049–1060. [Google Scholar]
  20. Wang, W.; Ru, L.; Lu, B.; Hu, S. Path Planning of UAV Crossing Dense Obstacle Area Based on Improved Dynamic Window Approach. In Proceedings of the 2023 5th International Conference on Electronic Engineering and Informatics (EEI), Wuhan, China, 30 June–2 July 2023; pp. 468–473. [Google Scholar]
  21. Zhang, Y.; Xiao, Z.C.; Yuan, X.X. Obstacle avoidance of two-wheeled mobile robot based on DWA algorithm. In Proceedings of the 2019 Chinese Automation Congress (CAC), Hangzhou, China, 22–24 November 2019; pp. 5701–5706. [Google Scholar]
  22. Molinos, E.J.; Llamazares, A.; Ocana, M. Dynamic window based approaches for avoiding obstacles in moving. Robot. Auton. Syst. 2019, 118, 112–130. [Google Scholar] [CrossRef]
  23. Li, L.T.; Sheng, W. Collision Avoidance Dynamic Window Approach in Multi-agent System. In Proceedings of the 2020 Chinese Automation Congress (CAC), Shanghai, China, 6–8 November 2020; pp. 2307–2311. [Google Scholar]
Figure 1. RRT node expansion process.
Figure 1. RRT node expansion process.
Drones 08 00539 g001
Figure 2. Hyperellipsoidal sampling region of Informed-RRT*.
Figure 2. Hyperellipsoidal sampling region of Informed-RRT*.
Drones 08 00539 g002
Figure 3. Schematic of the forces on the UAV.
Figure 3. Schematic of the forces on the UAV.
Drones 08 00539 g003
Figure 4. Algorithm flow chart.
Figure 4. Algorithm flow chart.
Drones 08 00539 g004
Figure 5. Force analysis diagram of APF–RRT*.
Figure 5. Force analysis diagram of APF–RRT*.
Drones 08 00539 g005
Figure 6. Simulation environment.
Figure 6. Simulation environment.
Drones 08 00539 g006
Figure 7. Simulation in Environment A.
Figure 7. Simulation in Environment A.
Drones 08 00539 g007
Figure 8. Simulation in Environment B.
Figure 8. Simulation in Environment B.
Drones 08 00539 g008
Figure 9. Simulation in Environment C.
Figure 9. Simulation in Environment C.
Drones 08 00539 g009
Figure 10. Comparison chart of simulation data in three environments.
Figure 10. Comparison chart of simulation data in three environments.
Drones 08 00539 g010
Figure 11. Path optimization in three simulation environments.
Figure 11. Path optimization in three simulation environments.
Drones 08 00539 g011
Figure 12. Dynamic obstacle avoidance in Environment A.
Figure 12. Dynamic obstacle avoidance in Environment A.
Drones 08 00539 g012
Figure 13. Dynamic obstacle avoidance in Environment B.
Figure 13. Dynamic obstacle avoidance in Environment B.
Drones 08 00539 g013
Figure 14. Dynamic obstacle avoidance in Environment C.
Figure 14. Dynamic obstacle avoidance in Environment C.
Drones 08 00539 g014
Table 1. Simulation date in environment A.
Table 1. Simulation date in environment A.
AlgorithmsAvg Path
Nodes
Times (s)Avg Path LengthObstacle Avoidance Efficiency (%)
RRT*5668.9856127.316780
Informed RRT*5247.3331119.720083
Improve-Informed RRT*1261.3452115.088693
RRT*: An improved version of the RRT algorithm.
Table 2. Simulation date in Environment B.
Table 2. Simulation date in Environment B.
AlgorithmsAvg Path
Nodes
Times (s)Avg Path LengthObstacle Avoidance Efficiency (%)
RRT*5728.2394125.516276
Informed RRT*5067.4856123.784283
Improve-Informed RRT*1671.8220115.479290
RRT*: An improved version of the RRT algorithm.
Table 3. Simulation date in Environment C.
Table 3. Simulation date in Environment C.
AlgorithmsAvg Path
Nodes
Times (s)Avg Path LengthObstacle Avoidance Efficiency (%)
RRT*5728.2394125.516286
Informed RRT*5067.4856123.784290
Improve-Informed RRT*1671.8220115.479293
RRT*: An improved version of the RRT algorithm.
Disclaimer/Publisher’s Note: The statements, opinions and data contained in all publications are solely those of the individual author(s) and contributor(s) and not of MDPI and/or the editor(s). MDPI and/or the editor(s) disclaim responsibility for any injury to people or property resulting from any ideas, methods, instructions or products referred to in the content.

Share and Cite

MDPI and ACS Style

Wu, T.; Zhang, Z.; Jing, F.; Gao, M. A Dynamic Path Planning Method for UAVs Based on Improved Informed-RRT* Fused Dynamic Windows. Drones 2024, 8, 539. https://doi.org/10.3390/drones8100539

AMA Style

Wu T, Zhang Z, Jing F, Gao M. A Dynamic Path Planning Method for UAVs Based on Improved Informed-RRT* Fused Dynamic Windows. Drones. 2024; 8(10):539. https://doi.org/10.3390/drones8100539

Chicago/Turabian Style

Wu, Ting, Zheng Zhang, Feng Jing, and Mei Gao. 2024. "A Dynamic Path Planning Method for UAVs Based on Improved Informed-RRT* Fused Dynamic Windows" Drones 8, no. 10: 539. https://doi.org/10.3390/drones8100539

APA Style

Wu, T., Zhang, Z., Jing, F., & Gao, M. (2024). A Dynamic Path Planning Method for UAVs Based on Improved Informed-RRT* Fused Dynamic Windows. Drones, 8(10), 539. https://doi.org/10.3390/drones8100539

Article Metrics

Back to TopTop