Next Article in Journal
Phase Synchronisation for Tonal Noise Reduction in a Multi-Rotor UAV
Previous Article in Journal
A Highly Robust Terrain-Aided Navigation Framework Based on an Improved Marine Predators Algorithm and Depth-First Search
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

A Voronoi–A* Fusion Algorithm with Adaptive Layering for Efficient UAV Path Planning in Complex Terrain

1
School of Electronics and Information Engineering, Nanjing University of Aeronautics and Astronautics, Nanjing 211106, China
2
AVIC Aviation Electronics Co., Ltd., Beijing 100081, China
*
Author to whom correspondence should be addressed.
Drones 2025, 9(8), 542; https://doi.org/10.3390/drones9080542 (registering DOI)
Submission received: 18 June 2025 / Revised: 22 July 2025 / Accepted: 29 July 2025 / Published: 31 July 2025

Abstract

Highlights

This paper proposes a Voronoi–A* fusion algorithm for UAV path planning in complex terrain. A DEM layering method based on obstacle density is introduced to decompose complex 3D terrain into multiple horizontal flight planes, significantly reducing computational complexity while maintaining 3D flexibility. Within each plane, a greedy Voronoi algorithm constructs a sparse vertex network as path nodes. A weighting function incorporates start/goal proximity, heading consistency, and altitude safety. The algorithm employs greedy heuristics to prioritize high-weight vertices, enabling the rapid generation of safe paths.
What are the main findings?
  • A DEM layering method based on obstacle density.
  • A greedy Voronoi algorithm applied within each flight plane.
What is the implication of the main finding?
  • Computational complexity is minimized, and efficiency is enhanced.
  • Generated paths closely approximate the optimal path.

Abstract

Unmanned Aerial Vehicles (UAVs) face significant challenges in global path planning within complex terrains, as traditional algorithms (e.g., A*, PSO, APF) struggle to balance computational efficiency, path optimality, and safety. This study proposes a Voronoi–A* fusion algorithm, combining Voronoi-vertex-based rapid trajectory generation with A* supplementary expansion for enhanced performance. First, an adaptive DEM layering strategy divides the terrain into horizontal planes based on obstacle density, reducing computational complexity while preserving 3D flexibility. The Voronoi vertices within each layer serve as a sparse waypoint network, with greedy heuristic prioritizing vertices that ensure safety margins, directional coherence, and goal proximity. For unresolved segments, A* performs localized searches to ensure complete connectivity. Finally, a line-segment interpolation search further optimizes the path to minimize both length and turning maneuvers. Simulations in mountainous environments demonstrate superior performance over traditional methods in terms of path planning success rates, path optimality, and computation. Our framework excels in real-time scenarios, such as disaster rescue and logistics, although it assumes static environments and trades slight path elongation for robustness. Future research should integrate dynamic obstacle avoidance and weather impact analysis to enhance adaptability in real-world conditions.

1. Introduction

In recent years, Unmanned Aerial Vehicles (UAVs) have been widely deployed in complex operational environments, such as localized warfare, post-disaster rescue, and mountainous logistics, due to their high maneuverability, cost-effectiveness, and reusability [1,2]. As a core technology for autonomous UAV missions, path planning algorithms play a critical role in ensuring mission success [3]. However, existing classical path planning methods (e.g., Artificial Potential Field (APF), Particle Swarm Optimization (PSO), enhanced A* algorithm) fail to achieve universally optimal performance for all real-world scenarios due to the inherent complexity, dynamism, and diversity of UAV operating environments [4,5]. For instance, APF is prone to local minima in cluttered environments; simultaneously, PSO and A* struggle with real-time performance in highly dense obstacle fields [6]. To address these limitations, a viable solution lies in the integration and combination of multiple path planning algorithms that are tailored to specific environmental conditions and optimization objectives [7].
Under complex environmental conditions, the combination of various UAV path planning algorithms allows the planning task to fully leverage the advantages of each algorithm, enabling the efficient generation of low-energy, obstacle-free, and real-time flight paths [8,9]. This combination is not a fusion of multiple algorithms but a combination of flight strategies and mechanisms that are based on the environment [10]. One algorithm combination method is the traditional multi-algorithm approach, which is based on classical graph search. Mengying and others, by analyzing the advantages, disadvantages, and applicable scenarios of online algorithms such as APF and the improved A*, concluded that a combined algorithm framework can overcome the limitations of single algorithms in real time and achieve better performance [11]. Lai Rongshen proposed an A* algorithm combined with the Dynamic Window Method (DWM) for flight safety in path planning algorithms [12]. Gómez Arnaldo and others, based on 3D terrain mapping applications, achieved reasonable building shooting angle coverage via the rapidly exploring random tree (RRT) combined with angle information guidance, optimizing routes and calculation speeds [13]. Longyan Xu and others proposed a strategy integrating the expanded A*, circular path optimization, and APF methods, balancing global and dynamic planning scenarios and avoiding local optimal situations. However, none of the verifications were conducted in complex environments [14]. The advantage of such algorithms is that route consumption and solution efficiency are generally superior to a single algorithm, but as the size of the global graph and the scene’s complexity increase, the increase in computational load after 3D expansion can affect the real-time performance of the algorithm.
Another approach is based on biomimetic intelligence methods for algorithm integration. Yan and others combined various heuristic strategies, such as genetic algorithms and PSO, optimizing multiple objectives, including time and cost, and making the strategies suitable for complex scenarios in post-disaster resource scheduling [15]. Zhen et al. enhanced planning efficiency in complex scenarios by integrating PSO with vibration functions and introducing a Reference Point Method (RPM), achieving optimal paths, although the results depend heavily on initial parameter settings [16]. Chen et al. transformed the inertia parameter w and learning parameters c1 and c2 in the PSO algorithm from fixed values to nonlinear values that are related to iteration counts, enabling adaptive parameters and accelerating convergence [17]. Hao et al. divided the population into multifunctional subgroups and introduced a migration mechanism to increase diversity, effectively alleviating homogenization. However, local search capabilities remain limited, and high computational costs are still incurred [18]. Li Xianqiang combined the Ant Colony Algorithm (ACA) with the APF method and achieved efficient three-dimensional trajectory planning. This approach produces smoother paths compared to ACA alone but comes at the expense of higher computational complexity [19]. The A* algorithm combined with the Gray Wolf Optimizer (A*-GWO) proposed by Haidar Ahmad et al. can produce safer and shorter paths in environments where wind influence is considered compared to the traditional A* algorithm. However, it cannot guarantee superiority over the A* algorithm in all scenarios [20]. Deng et al. proposed the Sand Cat Swarm Optimization (SCSO) algorithm, which combines spiral search, Lévy flight [21], tent chaotic mapping [22], and mechanisms such as adaptive sparrow warnings—among other random search strategies—to adapt to dynamic environmental changes [23]. The advantage of this type of algorithm lies in its ability to further optimize the performance of a single intelligent algorithm through algorithmic combinations. It enables dynamic obstacle avoidance in complex environments and supports the optimization of multiple planning objectives. However, its convergence performance is highly sensitive to initial parameter settings, resulting in suboptimal real-time performance.
There is another approach that combines neural-network-based algorithms with reward designs to adapt to specific scene applications. Lee et al., using a Deep Reinforcement Learning (DRL) framework combined with Independent Proximal Policy Optimization (IPPO) and employing Reference Signal Receiving Power (RSRP) as a criterion, planned UAV trajectories suitable for complicated scenarios; however, this algorithm is specifically designed for communication applications [24]. Chen achieved autonomous UAV flight trajectory planning in unknown environments by designing the current reward value and state-action value selection strategy, combined with DRL algorithms; however, the scenarios are limited to indoor settings [25]. Liu et al. used a residual convolutional network to learn environmental features offline and predict heading in real time, improving online planning speed; however, this method heavily depends on training data, and its generalization capability still requires validation [26]. Yan et al. used a Dual Double Deep Q-Network (D3QN) algorithm, combining a greedy strategy, heuristic search rules, and contextual graph Q-values for flight action selection. The method considers safe flights in a radar-detected but threat-prone environment, although it has high computational costs [27]. Castro et al. proposed an online adaptive path planning solution based on the fusion of RRT and DRL algorithms, achieving fast planning and dynamic obstacle avoidance. It has been successfully applied in the agricultural monitoring field, but flight verification is limited to small-scale areas, requiring further resolutions of real-world scenario generalization and computational efficiency issues [28]. Algorithms based on DRL perform exceptionally well in dynamic adaptability and autonomous decision-making. However, they are currently constrained by data and perform poorly with respect to computational power, generalization ability, and explainability. As a result, they are more suitable for a specific scenario as supplements rather than a complete replacement of traditional route planning methods.
The review demonstrates that effective UAV path planning requires careful algorithm selection and combination tailored to specific mission scenarios. For time-critical applications, like disaster rescue and logistics delivery, the computational efficiency of path planning algorithms becomes a paramount performance metric.
Recent studies have demonstrated the effectiveness of Voronoi diagrams as a fundamental tool in path planning, serving both as a tool for initial route generation and as a basis for hybrid algorithms. For instance, in urban low-altitude logistic UAV path planning, Zhang et al. utilized Voronoi diagrams to construct initial route networks, which were subsequently optimized through the A* algorithm for obstacle avoidance, demonstrating significant reductions in total route length and improvements in airspace coverage; however, this method is based on 2D maps [29]. Similarly, in energy-efficient path planning for unmanned surface vehicles (USVs), the integration of Voronoi diagrams and Dijkstra’s algorithm effectively minimized navigation energy consumption [30]. Furthermore, Voronoi diagrams have been innovatively applied to enhance optimization algorithm initialization. Ayawli et al. developed a multi-frequency vibrational genetic algorithm (mVGA) that incorporates Voronoi diagrams to improve population diversity, substantially reducing computational time for 3D path planning [31]. In complex dynamic environments, Voronoi diagrams have been synergistically combined with reinforcement learning techniques, such as Q-learning for multi-UAV obstacle avoidance path optimization [32], and enhanced through morphological dilation (MVDRM algorithm) to improve real-time obstacle avoidance capabilities for mobile robots [33]. These applications collectively highlight Voronoi diagrams’ versatility and computational efficiency across autonomous systems.
The A* algorithm serves as a core algorithm in the field of UAV route planning and is widely adopted due to its unique advantages in balancing global optimality and efficient search capabilities. By employing a heuristic search mechanism, it significantly reduces computational complexity while ensuring path quality, making it an essential tool for path planning in complex environments. However, when confronted with dynamic environments and challenging terrain, the standalone A* algorithm still exhibits limitations in real-time performance and local adaptability. As shown in Table 1, A* is often applied in combination with other methods to preserve its inherent advantages in path optimality while leveraging complementary strengths from other approaches, thereby substantially enhancing the overall system stability and scenario adaptability [34,35,36].
Building upon the algorithmic analysis, we propose a hybrid approach that synergistically combines Voronoi diagrams’ environmental abstraction capability with A*’s optimal search properties for UAV 3D path planning in complex mountainous terrain. First, by combining the key feature points of the Voronoi diagram with the vertex heuristic function, an initial flight path network is quickly generated. For paths that cannot be directly generated, A* is used to close gaps, and path points are optimized to ensure the generation of efficient, flyable paths. Secondly, building upon the hierarchical flight concept of UAVs [37], an adaptive layering strategy is designed based on drone flight performances and Digital Elevation Model (DEM) data, transforming 3D planning into a layer-switching method between adjacent planes and significantly reducing computational complexity. Furthermore, a flight path point optimization mechanism is introduced to avoid terrain obstacles while enhancing both path efficiency and safety. The simulation of real mountain scenarios with multiple sets of test cases shows that, compared to traditional methods such as A*, PSO, and RRT, this method has significant advantages in terms of planning success rates, path lengths, and computation times.
The remainder of this study is organized as follows: Section 2 reviews the foundational methodologies relevant to the proposed algorithm, encompassing DEM-based adaptive layering strategies, regional Voronoi vertex search diagrams, A* searches, and their hybrid integration for trajectory planning. Section 3 elaborates on the framework and operational workflow of the proposed algorithm, which enables rapid trajectory planning through a combination of multiple algorithms. Section 4 presents simulation experiments that validate the efficacy and computational efficiency of the fusion algorithm in mountainous terrain. The subsequent sections comparatively analyze algorithmic performance and explore potential research extensions. Finally, the conclusive findings are summarized.

2. Methodology

2.1. Adaptive DEM Flight Space Layering Model

DEM is a mathematical expression of the true three-dimensional shape of Earth’s surface. It is a type of physical ground model that represents ground elevation information through a set of ordered numerical arrays. In the field of UAV flight path planning, it serves as fundamental data. It can intuitively and realistically depict the geographical features of the UAV’s flight environment. The DEM represents terrain surface features through a discrete elevation data matrix, and its mathematical expression can be defined as follows:
D E M = Z i j i = 1,2 , , m j = 1,2 , , n
In this context, Z i j represents the height value of the grid points i and j in the matrix, and m   a n d   n represent the spatial resolution of the regular grid. Compared to Digital Terrain Models (DTMs), DEMs specifically refer to elevation datasets without features, whereas DTMs also include derived terrain parameters, such as the slope and aspect. This distinction is particularly important in complex navigation, as pure elevation data are more conducive to geometric calculations for real-time path planning.
By incorporating DEM data, three-dimensional path planning can be achieved. However, due to the expansion of the search space dimensions, a significant increase in computational load occurs. In cases in which the scale of regional drones is controllable or the flying altitude is substantially higher than the obstacle requirements, DEM layering operations can transform the three-dimensional planning into two-dimensional planning, thereby simplifying the computational load. However, when drones fly through complex mountainous environments, this simplification results in increased path searching consumption due to insufficient two-dimensional information. Based on this, this study combines the flight performance of drones with an adaptive optimal flight level selection method, using adjacent higher layers as alternative obstacle avoidance layers to enable three-dimensional planning. This approach can minimize the computational load while retaining the advantages of three-dimensional paths.
For a given drone flight altitude range [ H m i n , H m a x ] and the stratified altitude H , a set of drone flight stratification thresholds is defined as follows:
H = { H p | H p = H m i n + p × H } p = 0 N
As indicated by the formula, the selection of H directly determines the number of vertical layers. This parameter should be maximized under the constraint that the aircraft’s inter-layer transition capability must be satisfied within a unit distance, thereby minimizing the computational and memory overhead caused by excessive layering, as shown in Figure 1.
Among them, N represents the number of layers, and its mathematical expression is shown as follows:
N = r o u n d ( H m a x H m i n H )
If the drone is flying at the k-th level, this means its flight altitude D i , j lies between two adjacent height planes.
L k = i , j H k D ( i , j ) < H k + 1 , k = 1,2 , , N 1
The mathematical expression for the set of terrain obstacles at flight level k is as follows:
O b s k = i , j | O b s k i , j = 1 , 0 , Z i j H k Z i j < H k , k = 1,2 , , N 1
There are two criteria for selecting the flight level: on the one hand, the flight level should be as low as possible to minimize energy consumption; on the other hand, obstacles should be avoided. However, these two points are contradictory in real-world scenarios. To solve this problem, this study proposes selecting the optimal drone cruising altitude based on the obstacle density value. The definition of obstacle density at a given altitude is as follows:
D e n s k = i = 0 m j = 0 n O b s k i , j m × n , k = 1,2 , , N 1
The physical meaning of the above equation refers to the percentage of the obstacle occupying the assigned cruising altitude.
The D e n s threshold parameter exhibits the following trade-offs:
A higher D e n s threshold prioritizes stealth by selecting flight planes closer to the terrain base, but this increases obstacle density and may render path planning infeasible.
A lower D e n s threshold improves path optimality by selecting higher-altitude flight planes (reducing obstacles) at the cost of increased detection risks.
By reasonably selecting the D e n s threshold, the corresponding optimal fly_plane L b can be obtained, with b representing the serial number of the best cruising level. The next higher level serves as the backup_plane used for obstacle avoidance when crossing mountainous terrain. To reduce the computational load, the layered obstacle density calculation begins at H m a x and approaches H m i n in increments of H .

2.2. Voronoi Vertex-Based Search Model Based on Weight-Based Heuristic

A Voronoi diagram is used to divide space into several regions based on the principle of minimum distance. The core idea is that any point within a region should be closer to its corresponding generating object than to any other generating object [38]. In this design, obstacles within the flight layer selected through the adaptive DEM method are utilized as Voronoi objects for vertex generation. The Voronoi vertex generation algorithm proceeds through the following steps.
In the corresponding 2D terrain profile of the flight level, obstacles are classified according to their position G = { g 1 , g 2 , , g n } , and Voronoi vertices are generated at loci equidistant to multiple obstacles, which are defined by the following.
For any pixel p in the image,
D T p = min q G p q
where p q is the Euclidean distance between p and obstacle pixel q .
The vertex v satisfies
g i , g j G i j : D T v , g i = D T v , g j   D T v 0
v is equidistant to at least two obstacles and lies at the local maxima of DT.
D T = ( D T x , D T y ) is the gradient field at point x , y .
Candidate vertices, V c a n d i d a t e , are then identified, where the gradient magnitude approaches zero, shown as follows:
V c a n d i d a t e = p D T p < ε }   ( ε 10 3 )
Finally, vertices that only retain the local maxima in D T are filtered as follows:
V f i n a l = { v V c a n d i d a t e | D T v > D T q , q N 8 ( v ) }
where N 8 ( v ) denotes the 8-neighborhood value of v .
The proposed method’s advantage in trajectory planning is a result of its ability to generate a trajectory in a two-dimensional plane with distances equal to the obstacles, a feature that is particularly important in mountainous environments. Typically, there are valleys and plains between two mountain peaks, which means that the generated route points will have the maximum distance from the obstacles, thus avoiding collisions and ensuring higher safety in the generated flight path.
There are two key elements in the planar image processed using the Voronoi algorithm. One is the set of edges that divides the obstacles, and the other is the set of vertices where these edges intersect. In the field of route planning, the traditional approach is to generate trajectories along the Voronoi edges, followed by turn optimization. This method often results in longer and less-direct routes. We construct a new discrete search space based on the vertices of the Voronoi diagram formed at the flight altitude, assigning weights to all points within this search space and then performing a ranked search. The discrete search space V e c is defined as follows:
V e c = { s t a r t , v 1 , v 2 , v p , e n d }
Among them, s t a r t represents the starting point of the flight plan, e n d represents the ending point of the flight plan, and p refers to the number of vertices in the set after Voronoi processing.
Based on the current step’s starting and ending point information, the heuristic weight values for all vertices, v p , are calculated. Then, all feature points that have no obstacles along the line connecting them to the current starting point are filtered out, and they are subsequently sorted according to their weights. The feature point with the highest weight is selected, and it is connected to the starting point, rendering this vertex the new starting point for the next iteration.
The heuristic weight value h p of each Voronoi vertex v p in the computational graph is calculated, and verification is carried out to ensure that there is no obstruction in the line connecting the vertices and the current planning starting point. The weight formula is defined as follows:
h p = w 1 × d s p d m a x + w 2 × e x p 1 × d g p d m a x + w 3 × e x p 1 × t h e t a p p i + w 4 × h v e c p H m a x  
If there is any obstruction, then h p = 0 .
Among them, d s p represents the distance from the current vertex to the planned starting point, d m a x represents the distance between the start and end points, d g p represents the distance from the vertex to the end point, and t h e t a p represents the angle between the vector from the current vertex to the starting point and the vector from the current vertex to the ending point. pi is a constant, h _ v e c p represents the height from the vertex to the ground, and H m a x represents the maximum flying height of the drone.
The weighting parameters are defined as follows:
w 1 : Path proximity-to-origin weight.
Increasing this value prioritizes waypoints closer to the starting point, preventing premature deviations from the initial heading.
w 2 : Path proximity-to-goal attenuation weight.
Higher values emphasize feature points near the destination, accelerating the terminal approach.
w 3 : Path directional consistency weight.
Enhanced weighting selects waypoints that maintain heading alignments, reducing course oscillations.
w 4 : Flight altitude safety margin weight.
Increased weighting favors waypoints with greater vertical clearance from terrain/obstacles.
The sum of the four weights is designed to equal 1. In this algorithm, w 1 is 0.1, w 2 is 0.3, w 3 is 0.5, and w 4 is 0.1.
The Voronoi vertex h m a x corresponding to the largest value in the sequence is selected, and h p is the next waypoint connected to the current starting point. The Euclidean distance between this vertex and the planned endpoint is recorded as D = | v m a x e n d | . Then, this vertex is updated as the new search starting point, the original starting point is removed from the search space, the weights are recalculated, and the vertex with the decreased D   v a l u e is selected; this process is then repeated until the planned endpoint is found.
The schematic of the rapid path search method using Voronoi vertices is shown in Figure 2. By iteratively selecting s t a r t , v 4 , v 3 , a n d   e n d as waypoints, a quick generation of the UAV’s trajectory within the flight plane is achieved.

2.3. A* Algorithm for Route Segment Connection

By utilizing Voronoi-vertex-based search models, drones can already plan feasible flight routes in certain scenarios. For instance, in Figure 3, a flyable path can be determined using only three line segments. However, as the complexity of obstacles increases, situations where it is impossible to quickly generate paths using existing vertices may arise. In such cases, all Voronoi vertices within the known search space have a weight value of 0, or the distance values, D , no longer decrease. Typically, at this point, the starting point has advanced closer to the planned endpoint from its initial position, necessitating an extension of the trajectory to obtain new connectable Voronoi vertices and thereby transforming the problem into a local trajectory search method.
The A* algorithm is a classic heuristic search algorithm. The heuristic function is calculated based on the minimum objective function value from the starting point to the current node combined with the estimated function value from the current node to the target point [39]. The entire trajectory search relies on this heuristic function. In a two-dimensional plane, the search space of the A* algorithm typically consists of the 8 pixels surrounding the current point. For each pixel in the search space, the cost is computed, and the node with the lowest cost is selected and added to the path as the new starting point. The cost function for node M in the search space is defined as follows:
f M = g M + h ( M )
where, g M represents the heuristic factor, indicating the true cost from the initial node to the current node M, and h ( M ) represents the minimum cost estimate from the current node M to the target node. The search principle is to prioritize expanding nodes with lower f M values, which guarantees finding the optimal path. Generally, the A* algorithm demonstrates superior pathfinding performance and high robustness. However, in global route planning, due to the increase in search area, obtaining an optimal path requires a long convergence time and substantial memory space. However, by introducing a quick search strategy based on Voronoi vertices, the search and computation time can be significantly reduced. At this point, the A* algorithm serves as a localized searching algorithm for existing segments. As the search principle of the A* algorithm is well-established, this study does not elaborate on this topic further. We only provide an example of the initiation timing of the A* algorithm as a connection algorithm for route segments.
The connection of flight route segments using the A* algorithm is shown in Figure 4. After the UAV reaches the point v 3 by rapidly searching the path through the Voronoi vertices, with point v 3 as the new starting point, the only directly connectable Voronoi vertices are v 1 ,   v 2 ,   a n d   v 4 . By comparing the distance to the endpoint vector, point v 3 is already the nearest connectable Voronoi vertex to the end point. At this point, the A* search mechanism is introduced, and the local path toward the endpoint is generated as a connection path, continuing until a new starting point appears in the A* path, where a new quick connection path can be generated in the search space.

2.4. Optimization of Flight Path

The standard process for general UAV flight path planning typically consists of the following three steps: (1) modeling the flight environment space, (2) connecting the starting point and endpoint using a routing algorithm to form an initial flight path, and (3) further optimizing the initial flight path [40].
  • Interpolation Optimization of Flight Path
The fast search based on Voronoi vertices is a sparse search process with the advantage of high search speeds; this is highly practical when the UAV has sufficient endurance. However, the disadvantage is that it cannot compare with heuristic algorithms in generating flight paths with optimization goals. However, the waypoints based on the fast search model still have significant optimization potential.
The flight path generated after the search is as follows:
P = i = 1 n P i 1 P i ¯
where P i 1 P i ¯ is the line segment connecting the points P i 1 and P i .
Fixed-distance interpolation is performed on this segment to generate a new set of interpolation points, as follows:
Q i = q i , k = P i 1 + k · δ · u i k = 0,1 , m i }
where u i = P i P i 1 P i P i 1 represents the direction of the unit vector, and m i = P i P i 1 δ represents the number of points after the interpolation of the line segment.
The sequence of the flight path segment Q i is followed to detect the point q i , k in the area. If there is no collision in q i , k P i + 1 ¯ , then point q i , k is added to list P . If no q i , k values meet the conditions, then P i is retained and added to the P list.
The value of P i is updated to P i , and interpolation searches are continually performed on P i P i + 1 ¯ until the endpoint P n is added to P .
Compared to the initial flight path, this optimization method allows for the reconstruction of the path, ensuring that the new trajectory connects both the starting and ending points, with each segment of the sub-path avoiding obstacles; moreover, the total path is as short as possible, as illustrated in Figure 5.
2.
Optimization of the Position of Voronoi Vertices
In theory, the vertices obtained after Voronoi division are the farthest from obstacles in the horizontal space, providing a higher safety margin. However, this approach does not take into account the altitude relative to the ground when UAVs fly in complex mountainous environments. Height measurements can be carried out at the vertices and their neighbors using planar detection, and the point with the largest height margin can be selected as the optimized point for use.
The vertex optimization method involves generating a candidate set P i j for each initial vertex P i V e c by performing a plane rasterization process.
P i j = P i j   j 1 , N , N = r o u n d ( R ÷ L 2 ) }
Here, R represents the neighborhood search radius, L represents the elevation data scale, and N represents the number of search points.
The safety margin for elevation is calculated at each point in the search area as follows:
h i j = h h i j
where h i j is the height value corresponding to the point in the DEM, while h denotes the height of the current flight plane.
The principle of safety margin maximization is adopted as follows:
P i = max h i j , j { j | h i j > 0 }
The optimized vertices are then updated to the new Voronoi vertex set. By establishing the vertex optimization mechanism, the altitude margin for drone flights is significantly improved, making the flight path more reliable. However, the optimization process is computationally intensive and dependent on the search design, introducing additional computational loads. In time-sensitive planning scenarios, this optimization option can be disabled.

2.5. Complexity Analysis

According to the algorithm’s design, the proposed method primarily consists of the following key components: Voronoi vertex acquisition, heuristic-based vertex selection, A* connection, and interpolation-based path optimization. The theoretical computational complexity analysis of these components is as follows.
The computational complexity of Voronoi vertex acquisition is O ( M × N · l o g ( M × N ) ) , where M and N denote the width and height of the flight plane map, respectively, corresponding to a space complexity of O ( M × N ) .
Assuming that the number of vertices in the Voronoi diagram on the map is Q , the heuristic-based vertex selection method exhibits a computational complexity of O ( Q · l o g Q ) and a space complexity of O ( Q ) .
The A* connection algorithm exhibits a computational and space complexity of O ( b ^ d ) , where b denotes the branching factor (number of expanded nodes per level) and d represents the depth of the optimal path segment. The proposed Voronoi–A* framework strategically applies A* only to short path segments, where the limited depth d guarantees low computational complexity.
The interpolation-based path optimization has a computational complexity of O ( P ) and a space complexity of O ( P ) , where P denotes the number of interpolation points along the path.
The algorithm demonstrates well-bounded computational and space complexity. The Voronoi vertex acquisition stage dominates the overall cost with a time complexity of O ( M × N · l o g ( M × N ) ) and a space complexity of O ( M × N ) . Subsequent heuristic-based vertex selection operates at O ( Q · l o g Q ) time complexity and O ( Q ) space complexity, while localized A* connections maintain manageable O ( b ^ d ) complexity through constrained path segments. The final path optimization only requires linear O ( P ) time/space complexity. This phased complexity design ensures efficient scalability, while initial map processing requires more computation, with subsequent steps slowly increasing in computational demands, maintaining high efficiency even when handling large-scale problems.

3. Algorithm Design: Hybrid Voronoi–A* Framework and Pseudocode

After the above research, a combined Voronoi–A* algorithm is designed to meet the route planning needs of drones in complex mountainous environments. The main steps of the proposed algorithm are as follows: (1) By utilizing the obstacle density information from the DEM layer, the drone’s primary flight level and a higher backup obstacle avoidance layer are adaptively selected, producing a three-dimensional trajectory. (2) The Voronoi method is applied to process the flight level, and the Voronoi vertex set of that level is obtained, serving as a point set for fast path search space. (3) Based on weight designs, the weight of each Voronoi vertex is calculated, and after sorting, the highest-weighted point is added to the path. (4) If no additional Voronoi vertex can be connected at the current flight level, then the algorithm attempts to switch to a higher level to query Voronoi vertices, continuing the fast connection. If it fails, then A* is activated at the flight level to expand the route. Then, steps (3) and (4) are repeated until the destination is added to the route points. (5) To address redundant sparse path points and excessive turning angles, interpolation and optimization are performed on the route. (6) The optimized route is then output as the primary flight route for drones in mountainous terrain. Due to the use of a combined layered obstacle avoidance and A* expansion strategy, this path can quickly generate flyable routes while avoiding obstacles in complex mountainous environments, and the algorithm exhibits a high degree of safety and robustness. The pseudocode and flowchart for the hybrid Voronoi–A* algorithm are presented in Algorithm 1 and Figure 6, respectively.
Algorithm 1 Voronoi and A* hybrid algorithm pseudocode
Three-Dimensional UAV Path Planning via Hybrid Voronoi and A* Approach
Input:
DEM Z R H × W ,   Start   point   p s = ( x s , y s )   Goal   point   p g = ( x g , y g )
Parameters :   Obstacle   dense   threshold   β = 0.25 ,   Scale   factor   α = 0.2 ,
DEM   Layer   Number   L = 20 ,   Safe   Window   Size   w = 0.25 ,
Max   iteration   number   I t e r _ m a x = 20
Output:
Optimized   path   P = { p s , p 1 , p 2 , p n , p g }
1: Preprocessing
2: Z r e s i z e Z , α : S c a l e   m a p
3: Z m a x max Z , Z m i n min Z
4: H ( Z m a x Z m i n ) / L
5: f o r k = 1 t o   L d o
6: O b s k i , j Z i , j Z min + k 1 H : O b s t a c l e   s e t
7: i f   O b s k / ( H W ) < β   t h e n
8: h f l y Z m i n + k 1 H : S e l e c t   p r i m a r y   f l i g h t   h e i g h t
9: h b a k Z m i n + k H : S e l e c t   b a c k u p   f l i g h t   h e i g h t
10: break
11: Voronoi Vertex Extraction
12: V V o r o n o i O b s k   : G e n e r a t e   V o r o n o i   d i a g r a m
13: V e x { p s , p g } : I n i t i a l i z e   w i t h   s t a r t / g o a l
14: f o r   e a c h   v e r t e x   v i V   d o
15: i f v i i s   i n s i d e   m a p   a n d c l e a r a n c e v i , w t h e n   d o
16: V e x V e x v i
17: Hybrid Path Search
18: f o r i = 1 t o   I t e r _ m a x d o
19: P q u i c k G r e e d y C o n n e c t V e x , O b s k : V o r o n o i v e r t e x   p r i m a r y   f a s t   p a t h
20: P q u i c k G r e e d y C o n n e c t V e x , O b s k + 1 : V o r o n o i v e r t e x   b a c k u p   f a s t   p a t h
21: i f P q u i c k d o e s   n o t   r e a c h p g t h e n
22: P A s t a r A l a s t P q u i c k , p g , O b s k : A s t a r   s e a r c h   i n   2 D   p r i m a r y   p l a n e
23: i f l a s t P A s t a r d o e s   n o t   r e a c h p g   a n d
24: G r e e d y C o n n e c t J u d g e l a s t ( P A s t a r ) , V e x , O b s k = = t r u e   t h e n
25: P P q u i c k P A s t a r : P a t h   c o n c a t e n a t i o n
26: e l s e   P P q u i c k P A s t a r ;   b r e a k
27: e l s e   P P q u i c k ;   b r e a k
28: Path Optimization
29: P R e m o v e D u p l i c a t e s P
30: f o r j = 1 t o P 1 d o
31: i f p i p i + 1 > δ   t h e n  
32: Insert intermediate points via linear interpolation
33: i f   L O S p i , p i + 1 , O b s k t h e n : Check all the points with LOS (Line-of-Sight)
34: Update   P with first collision-free point
35: Output   P = { p s , p 1 , p 2 , p n , p g }

4. Implementation and Results

The algorithm’s simulation environment is configured on a laptop equipped with an Intel Core i9-10900K CPU and 64 GB of memory, using Windows 10 as the operating system and MATLAB R2023a as the programming environment for simulation experiments.
To evaluate the performance of the newly proposed Voronoi–A* fusion algorithm, we carry out a comparison with the following algorithms in simulation tests across several complex mountainous environments: APF, traditional A*, and RRT. The three real elevation map scenarios include mountainous, hilly, and canyon terrain, which represent typical complex mountainous features. In each of the three terrains, a drone uses different algorithms to plan the flight path from the same starting point to the same destination. The comparison is based on factors such as the success of path planning, the number of waypoints, path length, and planning time, evaluating the performance of each algorithm in different terrains and obstacle environments. All DEM data employed in the experiments were obtained through Global Mapper v19.1.
To ensure experimental design fairness, we conducted 20 repeated trials for each comparative method under the same scenario and statistically analyzed the key performance metrics, including the success rate of the flight path’s generation, the planned path length, the number of critical waypoints, and the required computational time.
For a consistent comparison, all algorithms (A*, RRT, APF, etc.) were simplified to 2D trajectory planning by adopting the same flight altitude level as the proposed method. The computational time measurement started after DEM-based layered 2D flight-level map generation (a preprocessing step that can be performed offline) and ended upon the completion of the planning process.

4.1. Scene 1: Mountainous Terrain

The same starting and ending points are set with a map scale of 1:0.2. In the simulation, the position of the UAV is represented by discrete coordinates. The top-left corner of the top–down view serves as the coordinate’s origin, and the bottom-left corner of the 3D view also serves as the coordinate’s origin. Therefore, the sum of the Y-coordinate values of the same point in both views corresponds to the image’s width. The simulation results of five algorithms under this terrain are as follows.
(a)
The planning path under the Voronoi–A* fusion algorithm simulation environment, as shown in Figure 1, features a UAV flight path with DEM cross-layer flights, enabling 3D obstacle traversal and successfully overcoming a mountain peak obstacle. This scenario’s planning process includes all steps, such as Voronoi vertex selection, A* search expansion, cross-layer flight, and interpolation optimization. Figure 7a illustrates the first step of the algorithm’s search for Voronoi vertices, while Figure 7b describes the algorithm’s rapid path search from the starting point to the endpoint. In this step, an A* expansion search is performed after crossing layers, resulting in the unoptimized search path. The blue line indicates a climb during this segment of the flight, the red * marks the start of the flight, and the green * marks the endpoint. Figure 7c shows the optimized flight path after interpolation optimization. Figure 7d presents the final 3D flight path.
(b)
The APF algorithm’s planned path in the simulation environment is shown in Figure 8, where the algorithm’s attraction coefficient is 15, the repulsion coefficient is 5, and the influence radius is 10 pixels. Due to the potential field balance issue in complex environments, it is clearly evident that the aircraft’s flight path directly passes through high mountains, resulting in a crash. Therefore, in terrains with complex topography and numerous three-dimensional obstacles, this method is not feasible.
(c)
The planned path of the RRT algorithm in the simulation environment is shown in Figure 9. Compared to the Voronoi–A* fusion algorithm, the path is noticeably more winding and complex. Additionally, due to the introduction of random factors, the consistency of the path planning is poor each time.
(d)
The planned path of the A* algorithm in the simulation environment is shown in Figure 10. It can be observed that the A* algorithm successfully plans a path that bypasses obstacles. In comparison to Figure 7, due to the influence of the A* search range, the number of planned path points increases, which results in higher computational complexity, longer calculation times, and a significantly longer total flight distance.
The test results of the four algorithms in this scenario, in addition to the start point (5, 177) and end point (351, 51), are compared, with statistics shown in Table 2. ± represents the average value of the statistical results of 20 tests carried out for each algorithm.
Figure 11a shows 2D simulation results, with four algorithms’ paths color-coded, while Figure 11b presents the statistical analysis results of 20 RRT trials, comparing time, waypoint count, and path length against their respective averages. The green line represents the self-developed Voronoi–A* fusion algorithm, the red line represents the A* algorithm, the magenta line represents the APF algorithm, and the blue line represents the RRT algorithm. The red * above the magenta line indicates the position where the obstacle was hit.
The simulation results of the mountainous terrain clearly show that the Voronoi–A* fusion algorithm has significant advantages in path planning. By combining Voronoi layering with A* search, inter-layer flights are enabled. The number of path points is only 4.9% of that of the A* algorithm (17 vs. 349), and the planning time is reduced by 96.1% (3.36 s vs. 85.14 s). This is the only method that fully implements three-dimensional obstacle avoidance.
Limitations of Traditional Algorithms: APF causes collisions with mountains due to the imbalance of the potential field; RRT has high path complexity and unstable path costs.

4.2. Scene 2: Hilly Terrain

The same starting and ending points are set with a map scale of 1:0.2. The simulation results of the four algorithms under this terrain are as follows.
(a)
The planned path in the Voronoi–A* fusion algorithm simulation environment is shown in Figure 12. It can be observed that the aircraft’s flight path includes an alternate flight level after climbing, enabling it to cross mountainous terrain and successfully avoid obstacles.
(b)
The APF algorithm’s planned path in the simulation environment is shown in Figure 13. The algorithm sets initial parameters with a gravity coefficient of 15, a repulsion coefficient of 5, and an influence of 10 pixels. In a complex environment with mountainous terrain and numerous obstacles, it is clearly evident that the aircraft’s flight path directly passes through the mountains, causing the plane to crash. Moreover, the algorithm is sensitive to parameter settings. Therefore, the simulation results in this scenario indicate that the APF method is not feasible.
(c)
The RRT algorithm’s planned path in the simulation environment is shown in Figure 14. In comparison to the self-developed Voronoi–A* fusion algorithm, the path is noticeably more convoluted and complex. Moreover, across multiple simulation scenarios, the outcome of planning—success or failure—is uncertain. In cases of successful planning, the path is complex, and computational efficiency is relatively low.
(d)
The planned path of the A* algorithm’s simulation environment is shown in Figure 15. In this scenario, the A* algorithm has an advantage over the Voronoi–A* fusion algorithm in terms of the total path length. However, the number of planned path points and the computation time are both inferior to those of the Voronoi–A* fusion algorithm. In practical engineering applications, in terrain with relatively more obstacles, the flight complexity of the A* algorithm increases.
The test results of the four algorithms in this scenario with start point (50, 55) and end point (200, 120) are compared, with statistical data shown in Table 3. ± represents the average value of the statistical results of the 20 tests carried out on each algorithm.
The 2D simulation planning path in this scenario is shown in Figure 16.
From the hilly terrain simulation results, it is evident that the path planning efficiency of the Voronoi–A* hybrid algorithm is significantly superior, with the number of path points being only 2.6% of that in the A* algorithm (4 vs. 151), and the planning time is reduced by 76.3% (0.81 s vs. 3.42 s). Additionally, the path length is nearly optimal (159.72 vs. 155.37). The failure of the APF is due to its sensitivity to parameters (gravitational coefficient of 15/repulsive coefficient of 5), which results in the flight path’s collision with obstacles, rendering it ineffective in a complex scenario.

4.3. Scene 3: Canyon Terrain

The same starting and ending points are set with a map scale of 1:0.2, and the test results of the four algorithms are as follows.
(a)
The planned path in the Voronoi–A* fusion algorithm simulation environment is shown in Figure 17. It can be observed that the aircraft only requires three key waypoints to successfully navigate over obstacles at the same flight altitude, realizing successful path planning.
(b)
The APF algorithm’s planned path in the simulation environment is shown in Figure 18. The parameter settings are consistent with those of the previous scene’s setup. As the middle portion of the canyon terrain is relatively open, the APF computes the gravitational field to guide obstacle avoidance. Path planning is successful. The planned path is short, and time costs are relatively low. Therefore, the APF algorithm is also applicable in certain open environments.
(c)
The path planning of the RRT algorithm in the simulation environment is shown in Figure 19. Compared to the Voronoi–A* fusion algorithm, the path is noticeably more winding and complex, resulting in higher computational complexity and longer computation times for real-world applications.
(d)
The planned path for the A* algorithm simulation environment is shown in Figure 20. The traditional A* algorithm can successfully navigate around obstacles. Compared to Figure 17, the number of planned path points increases, resulting in longer computation times.
The test results of the four algorithms in this scenario with start point (10, 74) and end point (128, 170) are compared, with data summarized in Table 4. ± represents the average value of the statistical results of the 20 tests carried out on each algorithm.
The 2D simulation planning path in this scenario is shown in Figure 21.
From the simulation results of the canyon terrain, it can be observed that the Voronoi–A* fusion algorithm for path planning has the advantage of producing extremely simplified paths. Voronoi–A* enables horizontal obstacle avoidance using only three key points, and its planning time is 13.8% of that of the RRT algorithm (0.81 s vs. 5.88 ± 3.47 s), demonstrating its efficiency in open scenarios. The APF algorithm is sporadically applicable, successfully navigating only in canyon scenes with sparse obstacles, but the number of path points is 63 times greater than that of Voronoi–A* (190 vs. 3).

4.4. Analysis of Simulation Results in Multiple Scenarios

The comprehensive performance comparison of the simulation results across multiple scenarios is shown in Table 5.
The summary in Table 5 indicates that the Voronoi–A* fusion algorithm significantly outperforms traditional algorithms in path planning performance within complex mountainous environments, as evidenced in the following aspects.
Path Planning Success Rate: The Voronoi–A* fusion algorithm successfully avoided obstacles and had no collisions in all test scenarios, while the APF algorithm failed to handle three-dimensional obstacles, resulting in crashes in mountainous and hilly terrain (success rate of only 33%). The RRT algorithm exhibited unstable performance, with planning failures occurring.
Path Efficiency:
(a)
Path Length: The Voronoi–A* path length is shorter than that of the traditional A* algorithm. For example, in mountainous terrain, the length is reduced by 0.5% (373.78 vs. 375.56 units), and in canyon terrain, it remains more efficient (132.12 vs. 134.28 units).
(b)
Number of Waypoints: The number of waypoints is reduced by an average of 92% compared to the A* algorithm (for example, in mountainous terrain, only 17 points are needed, whereas the A* algorithm requires 349 points), significantly reducing flight complexity.
Computational Efficiency:
The path planning time of Voronoi–A* is significantly superior to that of all the comparison algorithms:
(a)
Voronoi–A* has a faster average of 96.1% compared to the A* algorithm (e.g., in mountainous terrain, 3.36 s vs. 85.14 s).
(b)
It is 7.2 times faster than the RRT algorithm in canyon terrain (0.81 s vs. 5.88 ± 3.47 s).
(c)
The APF algorithm is fast (2.41 s) in open areas (such as canyons), but it completely fails in complex environments with dense obstacles.
Three-Dimensional Adaptability:
Voronoi–A* enables 3D obstacle avoidance through multi-layered flights, whereas APF and RRT only support 2D planning in certain scenarios. For example, in mountainous terrain, APF fails to cross peaks, causing the path to collide with obstacles, while Voronoi–A* successfully navigates around them in 3D.
In summary, the Voronoi–A* fusion algorithm, by combining the hierarchical strategy of Voronoi diagrams with the A* heuristic search, demonstrates significant advantages in path planning success rates, path optimality, computational efficiency, and three-dimensional obstacle avoidance. It provides an efficient and reliable solution for drone path planning in complex mountainous environments.

5. Conclusions

This study proposes a UAV trajectory planning method that is suitable for complex terrain. The method adopts a combined strategy comprising “Voronoi vertex-based quick trajectory generation + A* supplementary expansion of the trajectory.” Specifically, the algorithm first simplifies 3D route planning hierarchically using an adaptive DEM stratification strategy. Then, it uses the Voronoi vertex set within the flight plane as a sparse point network and employs a greedy heuristic search strategy for rapid trajectory planning, attempting to cross obstacles through backup planes. For obstacles that cannot be avoided, the traditional A* algorithm is used to locally connect 2D trajectories at the flight level. Finally, interpolation search is used to optimize the UAV’s flight trajectory. In the three specifically designed simulation scenarios, this combined algorithm significantly outperforms traditional single algorithms in terms of path planning success rates, computational efficiency, and adaptability to 3D terrain.
It should be noted that the Voronoi–A* fusion algorithm can quickly generate suitable and flyable paths by employing a global sparse search strategy via greedy optimization. However, this method exhibits the following three inherent limitations: (1) it cannot guarantee distance-optimal routes due to discrete DEM-based path planning, particularly in complex terrain; (2) its dependency on pre-existing DEM data restricts deployment in unmapped or dynamically changing environments; (3) the static environment assumption provides no inherent capability to handle unexpected obstacles such as complex weather conditions.

6. Future Research

Our preliminary validation in simulation environment has demonstrated the algorithm’s effectiveness, and our next step will involve deploying the proposed algorithm to ground control stations in order to command UAVs in mountainous terrain. Through the collection of real flight data, we will further validate the algorithm’s adaptability. Additionally, we plan to enhance global planning trajectories by integrating comprehensive environmental information from sensors and data links to advance research on dynamic obstacle avoidance algorithms. For instance, we will explore incorporating local-range mechanisms, such as the APF and Deep Q-Network (DQN), to enable dynamic obstacle avoidance and trajectory replanning. Furthermore, we aim to generalize the framework by modularizing the A* algorithm (used for route segment connection) and implementing it as one of several selectable algorithms (Dijkstra, PRM, APF, etc.). This modular approach will allow for combinatorial testing to improve applicability across diverse flight scenarios.

Author Contributions

Conceptualization, B.D. and P.Y.; methodology, B.D.; resources, B.D.; software, Y.Y. and S.L.; supervision, G.Z.; validation, Y.Y.; writing—original draft, B.D.; writing—review and editing, G.Z., P.Y. and S.L. All authors have read and agreed to the published version of the manuscript.

Funding

This research received no external funding.

Data Availability Statement

The data presented in this study are available upon request from the corresponding author due to proprietary constraints related to ongoing product development under institutional intellectual property agreements.

Conflicts of Interest

Author Yan Yang, Peiyuan Yuan, Shuntong Lu are employed by AVIC Aviation Electronics Co., Ltd. The remaining authors declare that the research was conducted in the absence of any commercial or financial relationships that could be construed as a potential conflict of interest.

References

  1. Yang, Y.; Xiong, X.; Yan, Y. UAV Formation Trajectory Planning Algorithms: A Review. Drones 2023, 7, 62. [Google Scholar] [CrossRef]
  2. Huang, G.; Hu, M.; Yang, X.; Lin, P. Multi-UAV Cooperative Trajectory Planning Based on FDS-ADEA in Complex Environments. Drones 2023, 7, 55. [Google Scholar] [CrossRef]
  3. Jones, M.; Djahel, S.; Welsh, K. Path-Planning for Unmanned Aerial Vehicles with Environment Complexity Considerations: A Survey. ACM Comput. Surv. 2023, 55, 234. [Google Scholar] [CrossRef]
  4. Li, B.; Song, C.; Bai, S.; Huang, J.; Ma, R.; Wan, K.; Neretin, E. Multi-UAV Trajectory Planning during Cooperative Tracking Based on a Fusion Algorithm Integrating MPC and Standoff. Drones 2023, 7, 196. [Google Scholar] [CrossRef]
  5. Debnath, D.; Vanegas, F.; Sandino, J.; Hawary, A.F.; Gonzalez, F. A Review of UAV Path-Planning Algorithms and Obstacle Avoidance Methods for Remote Sensing Applications. Remote Sens. 2024, 16, 4019. [Google Scholar] [CrossRef]
  6. Shen, Y.; Liu, J.; Luo, Y. Review of Path Planning Algorithms for Unmanned Vehicles. In Proceedings of the 2021 IEEE 2nd International Conference on Information Technology, Big Data and Artificial Intelligence (ICIBA), Chongqing, China, 17 December 2021; Volume 2, pp. 400–405. [Google Scholar]
  7. Sun, Y.; Yuan, Q.; Gao, Q.; Xu, L. A Multiple Environment Available Path Planning Based on an Improved A Algorithm. Int. J. Comput. Intell. Syst. 2024, 17, 172. [Google Scholar] [CrossRef]
  8. Debnath, S.K.; Omar, R.; Latip, N.B.A. A Review on Energy Efficient Path Planning Algorithms for Unmanned Air Vehicles. In Proceedings of the Computational Science and Technology, Kota Kinabalu, Malaysia, 29–30 August 2018; Alfred, R., Lim, Y., Ibrahim, A.A.A., Anthony, P., Eds.; Springer: Singapore, 2019; pp. 523–532. [Google Scholar]
  9. Ben Amarat, S.; Zong, P. 3D Path Planning, Routing Algorithms and Routing Protocols for Unmanned Air Vehicles: A Review. Aircr. Eng. 2019, 91, 1245–1255. [Google Scholar] [CrossRef]
  10. Zhu, Z.; Li, X.; Chen, H.; Zhou, X.; Deng, W. An Effective and Robust Genetic Algorithm with Hybrid Multi-Strategy and Mechanism for Airport Gate Allocation. Inf. Sci. 2024, 654, 119892. [Google Scholar] [CrossRef]
  11. Zhang, M.; Wang, H.; Cheng, F. Online Path Planning Algorithms for Unmanned Air Vehicle. In Proceedings of the 2017 IEEE International Conference on Unmanned Systems (ICUS), Beijing, China, 27–29 October 2017; IEEE: New York, NY, USA, 2017; pp. 116–119. [Google Scholar]
  12. Lai, R.; Dou, L.; Wu, Z.; Sun, S. Fusion of Improved A and Dynamic Window Approach for Mobile Robot Path Planning. J. Syst. Simul. 2024, 36, 1884–1894. [Google Scholar]
  13. Gómez Arnaldo, C.; Zamarreño Suárez, M.; Pérez Moreno, F.; Delgado-Aguilera Jurado, R. Path Planning for Unmanned Aerial Vehicles in Complex Environments. Drones 2024, 8, 288. [Google Scholar] [CrossRef]
  14. Xu, L.; Xi, M.; Gao, R.; Ye, Z.; He, Z. Dynamic Path Planning of UAV with Least Inflection Point Based on Adaptive Neighborhood A Algorithm and Multi-Strategy Fusion. Sci. Rep. 2025, 15, 8563. [Google Scholar] [CrossRef]
  15. Yan, T.; Lu, F.; Wang, S.; Wang, L.; Bi, H. A Hybrid Metaheuristic Algorithm for the Multi-Objective Location-Routing Problem in the Early Post-Disaster Stage. J. Ind. Manag. Optim. 2023, 19, 4663–4691. [Google Scholar] [CrossRef]
  16. Xu, Z.; Zhang, E.; Chen, Q. Rotary Unmanned Aerial Vehicles Path Planning in Rough Terrain Based on Multi-Objective Particle Swarm Optimization. J. Syst. Eng. Electron. 2020, 31, 130–141. [Google Scholar] [CrossRef]
  17. Chen, A.; Tang, K.; Li, T.; Chen, Z. Unmanned Aerial Vehicle 3D Path Planning Based on Improved Nonlinear Particle Swarm Optimization Algorithm. In Proceedings of the 2024 International Conference on Artificial Intelligence and Digital Technology (ICAIDT), Shenzhen, China, 7–9 June 2024; IEEE: New York, NY, USA, 2024; pp. 306–313. [Google Scholar]
  18. Hao, K.; Zhao, J.; Yu, K.; Li, C.; Wang, C. Path Planning of Mobile Robots Based on a Multi-Population Migration Genetic Algorithm. Sensors 2020, 20, 5873. [Google Scholar] [CrossRef]
  19. Li, X.; Pei, Y.; Ma, R.; Zhang, S.; Hou, Y. Improved Design of Ant Colony Algorithm and Its Application in Path Planning. ACTA Aeronaut. Astronaut. Sin. 2020, 41, 724381. [Google Scholar] [CrossRef]
  20. Haidar Ahmad, A.; Zahwe, O.; Nasser, A.; Clement, B. Path Planning for Unmanned Aerial Vehicles in Dynamic Environments: A Novel Approach Using Improved A and Grey Wolf Optimizer. World Electr. Veh. J. 2024, 15, 531. [Google Scholar] [CrossRef]
  21. Wu, Y.; Sun, D.; Zhang, M.; Zhao, J.; Wu, H. Beetle Swarm With Constrained Lévy Flight for Image Matching. IEEE Trans. Autom. Sci. Eng. 2025, 22, 3366–3376. [Google Scholar] [CrossRef]
  22. Xie, R.; Meng, Z.; Wang, L.; Li, H.; Wang, K.; Wu, Z. Unmanned Aerial Vehicle Path Planning Algorithm Based on Deep Reinforcement Learning in Large-Scale and Dynamic Environments. IEEE Access 2021, 9, 24884–24900. [Google Scholar] [CrossRef]
  23. Deng, W.; Feng, J.; Zhao, H. Autonomous Path Planning via Sand Cat Swarm Optimization With Multi-Strategy Mechanism for Unmanned Aerial Vehicles in Dynamic Environment. IEEE Internet Things J. 2025, 12, 26003–26013. [Google Scholar] [CrossRef]
  24. Lee, Y.; Syahran, R.M.; Spangenberger, M.; Yang, H.; Oh, J.; Choo, H. Optimizing 3D Flight Paths for Multiple UAVs with Connectivity Management in Urban Delivery Systems. In Proceedings of the 2025 19th International Conference on Ubiquitous Information Management and Communication (IMCOM), Bangkok, Thailand, 3–5 January 2025; IEEE: New York, NY, USA, 2025; pp. 1–4. [Google Scholar]
  25. Chen, J.; Li, X.; Xu, J.; Wang, Y. Deployment for NOMA-UAV Base Stations Based on Hybrid Sparrow Search Algorithm. IEEE Trans. Aerosp. Electron. Syst. 2023, 59, 6138–6149. [Google Scholar] [CrossRef]
  26. Liu, Y.; Zheng, Z.; Qin, F.; Zhang, X.; Yao, H. A Residual Convolutional Neural Network Based Approach for Real-Time Path Planning. Knowl.-Based Syst. 2022, 242, 108400. [Google Scholar] [CrossRef]
  27. Yan, C.; Xiang, X.; Wang, C. Towards Real-Time Path Planning through Deep Reinforcement Learning for a UAV in Dynamic Environments. J. Intell. Robot. Syst. 2020, 98, 297–309. [Google Scholar] [CrossRef]
  28. Castro, G.G.R.d.; Berger, G.S.; Cantieri, A.; Teixeira, M.; Lima, J.; Pereira, A.I.; Pinto, M.F. Adaptive Path Planning for Fusing Rapidly Exploring Random Trees and Deep Reinforcement Learning in an Agriculture Dynamic Environment UAVs. Agriculture 2023, 13, 354. [Google Scholar] [CrossRef]
  29. Zhang, H.; Tian, T.; Feng, O.; Wu, S.; Zhong, G. Research on Public Air Route Network Planning of Urban Low-Altitude Logistics Unmanned Aerial Vehicles. Sustainability 2023, 15, 12021. [Google Scholar] [CrossRef]
  30. Niu, H.; Lu, Y.; Savvaris, A.; Tsourdos, A. An Energy-Efficient Path Planning Algorithm for Unmanned Surface Vehicles. Ocean Eng. 2018, 161, 308–321. [Google Scholar] [CrossRef]
  31. Pehlivanoglu, Y.V. A New Vibrational Genetic Algorithm Enhanced with a Voronoi Diagram for Path Planning of Autonomous UAV. Aerosp. Sci. Technol. 2012, 16, 47–55. [Google Scholar] [CrossRef]
  32. Su, W.; Gao, M.; Gao, X.; Xuan, Z. Enhanced Multi-UAV Path Planning in Complex Environments With Voronoi-Based Obstacle Modelling and Q-Learning. Int. J. Aerosp. Eng. 2024, 2024, 5114696. [Google Scholar] [CrossRef]
  33. Ayawli, B.B.K.; Appiah, A.Y.; Nti, I.K.; Kyeremeh, F.; Ayawli, E.I. Path Planning for Mobile Robots Using Morphological Dilation Voronoi Diagram Roadmap Algorithm. Sci. Afr. 2021, 12, e00745. [Google Scholar] [CrossRef]
  34. Liu, L.; Wang, B.; Xu, H. Research on Path-Planning Algorithm Integrating Optimization A-Star Algorithm and Artificial Potential Field Method. Electronics 2022, 11, 3660. [Google Scholar] [CrossRef]
  35. 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]
  36. Zhou, Q.; Liu, G. UAV Path Planning Based on the Combination of A-Star Algorithm and RRT-Star Algorithm. In Proceedings of the 2022 IEEE International Conference on Unmanned Systems (ICUS), Guangzhou, China, 28–30 October 2022; IEEE: New York, NY, USA, 2022; pp. 146–151. [Google Scholar]
  37. Lei, H.; Yan, Y.; Liu, J.; Han, Q.; Li, Z. Hierarchical Multi-UAV Path Planning for Urban Low Altitude Environments. IEEE Access 2024, 12, 162109–162121. [Google Scholar] [CrossRef]
  38. Yang, V.A.; Dastoor, J.; Wei, X.; Bradley, J.; Elghorab, M.; Sudol, A.; Mavris, D.N. Heterogeneous Fleet Allocation and Route Planning Using Weighted Voronoi Diagrams. In Proceedings of the AIAA SCITECH 2023 Forum, AIAA SciTech Forum, National Harbor, MD, USA/Online, 23–27 January 2023; American Institute of Aeronautics and Astronautics: Reston, VA, USA, 2023. [Google Scholar]
  39. Zhen, R.; Gu, Q.; Shi, Z.; Suo, Y. An Improved A-Star Ship Path-Planning Algorithm Considering Current, Water Depth, and Traffic Separation Rules. J. Mar. Sci. Eng. 2023, 11, 1439. [Google Scholar] [CrossRef]
  40. Sang, H.; You, Y.; Sun, X.; Zhou, Y.; Liu, F. The Hybrid Path Planning Algorithm Based on Improved A* and Artificial Potential Field for Unmanned Surface Vehicle Formations. Ocean Eng. 2021, 223, 108709. [Google Scholar] [CrossRef]
Figure 1. Schematic diagram of the DEM flight stratification model.
Figure 1. Schematic diagram of the DEM flight stratification model.
Drones 09 00542 g001
Figure 2. Schematic of fast path search using Voronoi vertices.
Figure 2. Schematic of fast path search using Voronoi vertices.
Drones 09 00542 g002
Figure 3. Schematic diagram of Voronoi vertex generation.
Figure 3. Schematic diagram of Voronoi vertex generation.
Drones 09 00542 g003
Figure 4. Schematic of flight segment connections using the A* algorithm.
Figure 4. Schematic of flight segment connections using the A* algorithm.
Drones 09 00542 g004
Figure 5. Three scenarios of route interpolation optimization.
Figure 5. Three scenarios of route interpolation optimization.
Drones 09 00542 g005
Figure 6. The flowchart of the proposed approach (Voronoi–A*).
Figure 6. The flowchart of the proposed approach (Voronoi–A*).
Drones 09 00542 g006
Figure 7. Voronoi–A* algorithm simulation diagram for scene 1.
Figure 7. Voronoi–A* algorithm simulation diagram for scene 1.
Drones 09 00542 g007
Figure 8. APF algorithm simulation diagram for scene 1.
Figure 8. APF algorithm simulation diagram for scene 1.
Drones 09 00542 g008
Figure 9. RRT algorithm simulation diagram for scene 1.
Figure 9. RRT algorithm simulation diagram for scene 1.
Drones 09 00542 g009
Figure 10. A* algorithm simulation diagram for scene 1.
Figure 10. A* algorithm simulation diagram for scene 1.
Drones 09 00542 g010
Figure 11. Two-dimensional path planning using five algorithms for mountainous terrain.
Figure 11. Two-dimensional path planning using five algorithms for mountainous terrain.
Drones 09 00542 g011
Figure 12. Simulation diagram of the Voronoi–A* fusion algorithm for scene 2.
Figure 12. Simulation diagram of the Voronoi–A* fusion algorithm for scene 2.
Drones 09 00542 g012
Figure 13. Simulation diagram of the APF algorithm for scene 2.
Figure 13. Simulation diagram of the APF algorithm for scene 2.
Drones 09 00542 g013
Figure 14. Simulation diagram of the RRT algorithm for scene 2.
Figure 14. Simulation diagram of the RRT algorithm for scene 2.
Drones 09 00542 g014
Figure 15. Simulation diagram of the A* algorithm for scene 2.
Figure 15. Simulation diagram of the A* algorithm for scene 2.
Drones 09 00542 g015
Figure 16. Two-dimensional path planning using four algorithms for hilly terrain.
Figure 16. Two-dimensional path planning using four algorithms for hilly terrain.
Drones 09 00542 g016
Figure 17. Simulation of the Voronoi–A* fusion algorithm for scene 3.
Figure 17. Simulation of the Voronoi–A* fusion algorithm for scene 3.
Drones 09 00542 g017
Figure 18. APF algorithm simulation diagram for scene 3.
Figure 18. APF algorithm simulation diagram for scene 3.
Drones 09 00542 g018
Figure 19. Simulation diagram of the RRT algorithm for scene 3.
Figure 19. Simulation diagram of the RRT algorithm for scene 3.
Drones 09 00542 g019
Figure 20. A* algorithm simulation diagram for scene 3.
Figure 20. A* algorithm simulation diagram for scene 3.
Drones 09 00542 g020
Figure 21. Two-dimensional path planning using four algorithms for canyon terrain.
Figure 21. Two-dimensional path planning using four algorithms for canyon terrain.
Drones 09 00542 g021
Table 1. Comparison of typical algorithm combinations.
Table 1. Comparison of typical algorithm combinations.
Algorithm CategoryCombined MethodsComputational CapabilityAdvantagesDisadvantagesApplicable Scenarios
Traditional Graph Search CombinationsAPF + Improved A* [11]Moderate, good real-time performanceOvercomes real-time limitations of single algorithms; generates near-optimal pathsLimited adaptability in complex scenariosStatic or mildly dynamic environments
A* + Dynamic Function + DWM [12]ModerateEnhances flight safetyComputational load increases with dimensions3D environments with high safety requirements
RRT + Angle Guidance [13]High efficiencyFast computation; optimal coverage anglesPath may not be globally optimal3D terrain mapping
A* + Path Optimization + APF [14]ModerateBalances global and dynamic planning; avoids local optimaUntested in highly complex environmentsMixed global–dynamic scenarios
Bio-inspired Intelligent CombinationsGA + PSO [15]Low, slow convergenceMulti-objective optimization; adaptable to complex scenariosSensitive to initial parameters; poor real-time performanceMulti-objective optimization tasks
PSO + RPM [16]ModerateImproves planning efficiency in complex environmentsPerformance depends on parameter tuningStatic environments with adjustable parameters
ACA + APF [19]High complexityGenerates smoother 3D trajectoriesHigh computational costScenarios requiring smooth trajectories
A* + GWO [20]ModerateSafer paths in windy conditionsNot guaranteed to outperform A* in all scenariosWind-affected environments
Neural Network and DRL CombinationsDRL + IPPO [24]High, training-dependentOptimized for dynamic communication scenariosLimited to communication applicationsUAV communication networks
DRL + Residual CNN [26]High, fast online planningReal-time heading predictionPoor generalization; relies on training dataData-rich known environments
D3QN + Heuristic Search [27]HighHigh security against radar threatsExtremely high computational costMilitary or high-threat environments
RRT + DRL [28]ModerateFast planning and dynamic trackingLimited to small areasSmall-scale dynamic monitoring
Table 2. Mountainous terrain test comparison chart.
Table 2. Mountainous terrain test comparison chart.
MethodCollisionNumber of WaypointsLength (500 m)Time (S)
Voronoi–A*No17373.783.36 ± 1.67
A*No349375.5685.14 ± 12.21
APFYes469362.805.11 ± 1.3
RRTNo143 ± 20524.54 ± 7799.21 ± 86.76
Table 3. Hilly terrain test comparison chart.
Table 3. Hilly terrain test comparison chart.
MethodCollisionNumber of WaypointsLength (500 m)Time (S)
Voronoi–A*No4159.720.81 ± 0.18
A*No151155.373.42 ± 3.22
APFYes193138.611.51 ± 1.16
RRTNo62 ± 21201.69 ± 2375.96 ± 55.58
Table 4. Canyon terrain test comparison chart.
Table 4. Canyon terrain test comparison chart.
MethodCollisionNumber of WaypointsLength (500 m)Time (S)
Voronoi–A*No3132.120.81 ± 0.24
A*No120134.283.64 ± 2.13
APFNo190139.542.41 ± 1.56
RRTNo51 ± 11164.46 ± 255.88 ± 3.47
Table 5. Comprehensive performance comparison table (average).
Table 5. Comprehensive performance comparison table (average).
Voronoi–A*A*APFRRT
Success of Planning100%100%33%96.7%
Average Number of Waypoints820728485
Average Time (Seconds)1.6630.733.0160.35
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

Dong, B.; Zhang, G.; Yang, Y.; Yuan, P.; Lu, S. A Voronoi–A* Fusion Algorithm with Adaptive Layering for Efficient UAV Path Planning in Complex Terrain. Drones 2025, 9, 542. https://doi.org/10.3390/drones9080542

AMA Style

Dong B, Zhang G, Yang Y, Yuan P, Lu S. A Voronoi–A* Fusion Algorithm with Adaptive Layering for Efficient UAV Path Planning in Complex Terrain. Drones. 2025; 9(8):542. https://doi.org/10.3390/drones9080542

Chicago/Turabian Style

Dong, Boyu, Gong Zhang, Yan Yang, Peiyuan Yuan, and Shuntong Lu. 2025. "A Voronoi–A* Fusion Algorithm with Adaptive Layering for Efficient UAV Path Planning in Complex Terrain" Drones 9, no. 8: 542. https://doi.org/10.3390/drones9080542

APA Style

Dong, B., Zhang, G., Yang, Y., Yuan, P., & Lu, S. (2025). A Voronoi–A* Fusion Algorithm with Adaptive Layering for Efficient UAV Path Planning in Complex Terrain. Drones, 9(8), 542. https://doi.org/10.3390/drones9080542

Article Metrics

Back to TopTop