Next Article in Journal
Explorative Binary Gray Wolf Optimizer with Quadratic Interpolation for Feature Selection
Next Article in Special Issue
A Biomimetic Pose Estimation and Target Perception Strategy for Transmission Line Maintenance UAVs
Previous Article in Journal
Brain-Inspired Architecture for Spiking Neural Networks
Previous Article in Special Issue
A Novel Aerial-Aquatic Unmanned Vehicle Using Flapping Wings for Underwater Propulsion
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Path Planning of an Unmanned Aerial Vehicle Based on a Multi-Strategy Improved Pelican Optimization Algorithm

by
Shaoming Qiu
1,*,
Jikun Dai
1 and
Dongsheng Zhao
2
1
Key Laboratory of Network and Communications, Dalian University, Dalian 116622, China
2
School of Economics and Management, Ningxia University, Yinchuan 750021, China
*
Author to whom correspondence should be addressed.
Biomimetics 2024, 9(10), 647; https://doi.org/10.3390/biomimetics9100647
Submission received: 4 August 2024 / Revised: 21 September 2024 / Accepted: 19 October 2024 / Published: 21 October 2024

Abstract

:
The UAV path planning algorithm has many applications in urban environments, where an effective algorithm can enhance the efficiency of UAV tasks. The main concept of UAV path planning is to find the optimal flight path while avoiding collisions. This paper transforms the path planning problem into a multi-constraint optimization problem by considering three costs: path length, turning angle, and collision avoidance. A multi-strategy improved POA algorithm (IPOA) is proposed to address this. Specifically, by incorporating the iterative chaotic mapping method with refracted reverse learning strategy, nonlinear inertia weight factors, the Levy flight mechanism, and adaptive t-distribution variation, the convergence accuracy and speed of the POA algorithm are enhanced. In the CEC2022 test functions, IPOA outperformed other algorithms in 69.4% of cases. In the real map simulation experiment, compared to POA, the path length, turning angle, distance to obstacles, and flight time improved by 8.44%, 5.82%, 4.07%, and 9.36%, respectively. Similarly, compared to MPOA, the improvements were 4.09%, 0.76%, 1.85%, and 4.21%, respectively.

1. Introduction

With the rapid development of information technology, unmanned aerial vehicle (UAV) technology has attracted widespread attention across various application scenarios due to its flexibility and convenience [1]. UAVs are now extensively utilized in agriculture, disaster relief, transportation, and many other fields [2,3,4,5,6,7]. As UAV applications become more prevalent, the scenarios they encounter are increasingly complex and diverse. Figure 1 illustrates UAV flight scenarios, including traffic monitoring, express delivery, and urban inspection.
In urban environments, flight tasks such as delivery and inspection often prioritize finding shorter paths to improve efficiency. However, these flights inevitably encounter various obstacles, making effective trajectory planning essential. Currently, researchers are conducting extensive research on UAV path planning, utilizing traditional methods such as the Dijkstra algorithm [8], the A-star algorithm [9], and the rapidly expanding random tree (RRT) algorithm [10]. Due to the substantial computational time and resources required, this type of method is often difficult to apply in complex environments with significant terrain variations and diverse obstacle types. To address this multi-objective optimization problem, researchers have proposed intelligent optimization algorithms. Unlike traditional methods that rely on gradient information of the objective function, intelligent optimization algorithms search by directly computing the objective function values. They are not constrained by mathematical conditions such as continuous differentiability and can be easily applied to discrete optimization problems, such as integer programming [11]. The fundamental idea behind these algorithms is to simulate the collective behavior observed in nature and then quantify these characteristics to construct mathematical models applicable to a wide range of problems. Compared to traditional algorithms, intelligent optimization algorithms possess several advantages, including strong robustness, simplicity in computational logic, and powerful global search capabilities. Firstly, the individuals within the population of an intelligent optimization algorithm interact in a distributed manner, without a central control unit, ensuring that the failure of a few individuals does not compromise the overall problem-solving process, thus providing strong robustness. Secondly, by simulating collective behaviors found in nature, these algorithms effectively avoid being trapped in local optima, making it easier to find global optima. Additionally, each individual in the population perceives only local information and follows simple rules, resulting in a simple structure that is easy to implement.
The emergence of intelligent optimization algorithms has introduced new solutions to combinatorial optimization problems that traditional algorithms struggle to solve, and these algorithms have been successfully applied to optimize many complex engineering applications in practice [12,13,14]. Nevertheless, intelligent optimization algorithms still face several challenges in the context of UAV path planning. Firstly, although swarm intelligence optimization algorithms exhibit strong global search capabilities, they may still become trapped in local optima when dealing with complex multimodal problems, making it difficult to achieve global optima. Secondly, in certain cases, the convergence speed of intelligent optimization algorithms can be relatively slow, particularly when addressing complex problems, which may require a considerable amount of time to obtain a satisfactory solution. Additionally, although UAV task environments are primarily aerial, much of the research has focused on 2D scenarios. Even when 3D scenarios are considered, the simulations often involve simplistic obstacle models, lacking the detailed modeling and realistic flight simulations needed for more accurate representations of real-world environments.
The UAV path planning problem requires a comprehensive consideration of the algorithm, the map, and constraints. To address the aforementioned challenges, this paper proposes an improved Pelican Optimization Algorithm (IPOA). The main contributions of this paper are as follows:
(1).
Based on the Pelican Optimization Algorithm (POA), a multi-strategy improved Pelican Optimization Algorithm (IPOA) is proposed. Specifically, by incorporating the iterative chaotic mapping method with refracted reverse learning strategy, nonlinear inertia weight factors, the Levy flight mechanism, and adaptive t-distribution variation, the convergence accuracy and speed of the POA algorithm are enhanced.
(2).
Compared with the five intelligent optimization algorithms, the proposed algorithm reduces indicators such as the UAV flight path length, turning cost, iteration count, and distance from obstacles. The meanings of these indicators can be found in Table A2, Appendix A.
The rest of the paper is organized as follows: Section 2 introduces relevant research on intelligent optimization algorithms and UAV path planning. Section 3 describes the constraints of the UAV and our optimization goals. Section 4 presents our improved algorithm. In Section 5, five comparative algorithms are set up, and the performance of IPOA in different environments is validated from multiple perspectives using CEC2022 test functions and the Wilcoxon rank-sum test. In Section 6, complex three-dimensional terrains and emulated realistic terrain simulation experiments were conducted, and the results were analyzed. Finally, Section 7 summarizes the entire paper.

2. Related Studies

UAV path planning involves devising an optimal or satisfactory flight path from the initial point to the target point within a given flight area, taking into account flight constraints and the impact of algorithms. To ensure that the UAV safely reaches its destination, it is necessary to establish a practical mathematical model that considers factors such as flight distance, turning angles, and collision threats. In the context of complex maps and constrained mathematical models, developing an effective path planning algorithm remains a central focus of current research. This paper aims to advance the understanding of this field by focusing on two key research directions: traditional algorithms and intelligent optimization algorithms.

2.1. UAV Path Planning Based on Traditional Algorithms

Common traditional algorithms include the Dijkstra algorithm, A-star algorithm, rapidly exploring random tree (RRT), and Artificial Potential Field (APF). These algorithms are highly efficient in solving path planning problems in simple scenarios [15]. In Reference [16], a new Artificial Potential Field (D-APF) path planning algorithm was developed for UAVs following ground targets. This algorithm outperforms the conventional APF and is more suitable for UAV flying in environments with dynamic and unknown obstacles. In Reference [17], a method combining the Artificial Potential Field and an improved rapidly exploring random tree was introduced. This algorithm maintains computational efficiency while providing directional guidance for expanding nodes and has made progress in addressing issues such as slow convergence speed and unsmooth paths in UAV path planning. In Reference [18], a path planning algorithm based on obstacle Voronoi diagrams and the A-star algorithm was proposed for low-altitude UAV logistics scenarios. This algorithm successfully reduced the route length, flight time, and average network complexity while improving airspace coverage. However, when addressing path planning problems in complex environments, the large number of path nodes and the excessive computational load can expose the limitations of these algorithms. For example, while the A-star algorithm is relatively simple to implement, it has low search efficiency in large-scale, high-dimensional spaces and struggles to solve multi-constraint path planning problems [19]. Although RRT has a fast search speed, it is challenging to obtain an optimal flight path [20]. The APF algorithm, despite its fast planning speed and good real-time performance, can experience issues such as local oscillations and local minima in large-scale, high-dimensional spaces, which can render the flight path unusable [21]. Therefore, while traditional optimization algorithms can achieve good path planning results in simple environments, they are not efficient at solving autonomous UAV path planning problems in complex environments.

2.2. UAV Path Planning Based on Intelligent Optimization Algorithms

The optimization algorithm does not rely on the gradient information of the objective function but searches the solution space of the problem by defining a set of meta-heuristic operations and corresponding control strategies to find the optimal solution or a solution close to the optimal one. Therefore, in the face of complex multi-objective optimization problems, intelligent optimization algorithms can usually provide a higher-quality solution in a limited time. Common intelligent optimization algorithms include the genetic algorithm (GA) [22], particle swarm optimization (PSO) [23], ant colony optimization (ACO) [24], artificial bee colony (ABC) [25], gray wolf optimization (GWO) [26], and Harris Hawk Optimization (HHO) [27].
These algorithms have been applied to UAV path planning and have shown good results. Reference [28] proposed an algorithm that uses ACO, the Voronoi diagram, and clustering methods to enhance the GA initial population. This accelerates the convergence speed while significantly shortening the calculation time, providing an effective and feasible path for the UAV. Reference [29] improved the max–min ant colony algorithm using Cauchy mutants, enabling the algorithm to choose the shortest possible flight path for the UAV while avoiding collisions. Reference [30] proposed an improved artificial bee colony algorithm (IABC) based on multi-strategy synthesis, which allows UAV to quickly obtain the optimal path in complex environments. By comparing various traditional intelligent optimization algorithms, the feasibility and efficiency of the improved algorithm are verified. In Reference [31], the GWO algorithm was used to solve the trajectory planning problem of multiple UAVs in complex scenarios. The experimental results showed that the algorithm not only successfully plans a safe path but also minimizes the average flight time error between UAVs. To enhance the UAV performance in complex three-dimensional environments, Reference [32] introduced the Cauchy mutation strategy, adaptive weights, and the sine cosine algorithm (SCA) into the HHO algorithm, proposing an improved algorithm called SCHHO. Various simulation experiments showed that the proposed algorithm can generate more optimized UAV trajectory planning routes.
In recent years, several novel intelligent optimization algorithms have been proposed and successfully applied in many fields. These include the Beluga Optimization Algorithm (WOA) [33], which imitates the foraging behavior of beluga whales; the Sparrow Search Algorithm (SSA) [34], which imitates the foraging behavior of sparrows; the Sand Cat Swarm Optimization Algorithm (SCSO) [35], which imitates the living habits of sand cats; the Dung Beetle Optimization Algorithm (DBO) [36], which imitates the survival behavior of dung beetles; and the Subtractive Averaging Optimization Algorithm (SABO) [37], inspired by mathematical concepts. Inspired by pelican hunting, Pavel Trojovský and Mohammad Dehghani proposed the POA [38] in 2022, which has been successfully applied. However, POA still suffers from slow convergence and the inability to escape the local optima in path planning. A single deterministic intelligent optimization algorithm cannot adapt to all scenarios [39]. Therefore, to improve the efficiency of UAV path planning in complex environments, this paper proposes an improved Pelican Optimization Algorithm (IPOA) based on the POA.

3. Problem Model

UAV path planning is a constrained optimization problem, where the goal is to find a collision-free optimal path from the start point to the endpoint while satisfying all environmental and operational constraints. Due to the physical limitations of UAV power and flight, we typically have to consider optimization goals such as the UAV range cost, turning angle, and collision risk.

3.1. Three-Dimensional Terrain Model

During the flight of the UAV, the flight scene needs to be 3D modeled for path planning. The modeling formula can be expressed as:
z ( x , y ) = sin ( y + a ) + b · sin ( x ) + c · cos ( d y 2 + x 2 ) + e · cos ( y ) + f · sin ( f y 2 + x 2 ) + g · cos ( y ) ,
where ( x , y ) corresponds to a point on the plane; z corresponds to the height of the point coordinates; and a , b , c , d , e , f , and g represent constant coefficients. By adjusting the constant coefficients, some characteristic landforms can be obtained.
To enrich the terrain, this paper overlaps the mountain model on this benchmark landform, as shown below:
h ( x , y ) = i h i e [ ( x x i c ) 2 a i 2 ( y y i c ) 2 b i 2 ] + h o ,
where h 0 is the base landform, h i is the altitude of the i-th peak, ( x i c , y i c ) is the central coordinate of the i-th peak, a i is the slope of the i-th peak on the x-axis, and b i is the slope of the i-th peak on the y-axis. Then, the final terrain model can be defined as:
Z ( x , y ) = max [ z ( x , y ) , h ( x , y ) ] .

3.2. Flight Distance Cost

During the flight of a UAV, the length of the flight path will affect the UAV’s efficiency, so the flight distance cost is one of the important factors. Generally speaking, finding the shortest path can save a lot of time and resources. In this article, the flight distance is summarized by the Euclidean distance between each adjacent point, and its flight distance cost function can be expressed as:
W 1 = i x i + 1 x i 2 + y i + 1 y i 2 + z i + 1 z i 2 ,
where x i is the x-direction coordinate value of the UAV at the i-th step, y i is the y-direction coordinate value of the UAV at the i-th step, and z i is the height value of the UAV at the i-th step.

3.3. Turning Angle Cost

The UAV’s turning angle affects the smoothness and continuity of its path. Additionally, excessive turns can increase the energy consumption of the UAV. Therefore, the turning angle should be minimized during flight. The UAV can be regarded as a six-degree-of-freedom rigid body, and Figure 2 illustrates the UAV’s coordinate state during turns.
The turning angle φ k is the angle between two consecutive adjacent path segments. e 3 is the unit vector in the direction of the z-axis, and the formula for calculating the projection vector is as follows:
p k p k + 1 = e 3 × p k p k + 1 × e 3
The formula for calculating the turning angle is:
φ k = arctan p k p k + 1 × p k + 1 p k + 2 p k p k + 1 · p k + 1 p k + 2
where the notation · is a dot product, and × is a cross product.
The climbing angle ψ k is the angle between the ( p k p k + 1 ) and ( p k , p k + 1 , ) , and the calculation formula is as follows:
ψ k = arctan z k + 1 z k p k p k + 1
The turning cost W 2 can be expressed as:
W 2 = a 1 · k = 1 n 1 φ k + a 2 · k = 1 n 1 ψ k ψ k 1
where a 1 and a 2 are constants.

3.4. Collision Threat Cost

During the flight, the UAV may encounter obstacles. To ensure the UAV’s safety, the relationship between the UAV and obstacles needs to be incorporated into the cost function. The definition of obstacle cost in this paper is as follows:
W 3 = λ o b s × 1 d o b s d o b s < d safe   0 d o b s > d safe   d o b s = i = 1 n j = 1 S x i x o b s j 2 + y i y o s b j 2 + z i z o b s j 2 R u a v + R o b s
The variable d o b s denotes the distance between the current node and an obstacle, while n is the number of nodes, and S is the number of obstacles. The coordinates of the current node are expressed as ( x i , y i , z i ), and the coordinates of a specific obstacle are given as ( x o b s j , y o b s j , z o b s j ) . Additionally, R corresponds to the radius of the UAV, R o b s to the radius of the obstacle, d s a f e to the safety distance, and λ o b s to the penalty coefficient for the obstacles.

3.5. Optimize the Target

In the whole planning process, it is necessary to comprehensively consider the shortest track length, the smallest possible flight angle, and the smallest track threat. Therefore, the overall cost function of path planning can be defined as:
f ω i , W i = i = 1 3 ω i W i ,
where ω i is the weight parameter, and i = 1 3 ω i = 1 .

3.6. Path Smoothing

The path planning algorithm generates many discrete points, which cannot directly meet the flight requirements of the UAV. Therefore, these discrete and unsmooth sample points must be converted into a smooth path. In this paper, a cubic B-spline [40] interpolation algorithm is used to generate a smooth flight path:
S ( u ) = i = 0 n P i   ·   N i , p u , 0 u u max
where P i is the control point, and N i , p ( u ) is the basis function of the B-spline. The basis function N i , p ( u ) can be written as:
N i , 0 ( u ) = 1 , u i u u i + 1 0 , o t h e r s   N i , k ( u ) = u u i u i + k u i · N i , k 1 ( u ) + u i + k + 1 u u i + k + 1 u i + 1 · N i + 1 , k 1 ( u )

4. Improved Pelican Optimization Algorithm (IPOA)

4.1. Pelican Optimization Algorithm

4.1.1. Population Initialization

POA [38] operates as a population-based algorithm, with pelicans serving as its individuals. In swarm-based bio-inspired algorithms, each member of the swarm represents a candidate solution. These members propose values for optimization variables based on their positions in the search space. Initially, the population is randomly initialized within the problem’s defined lower and upper bounds, expressed as:
x i , j = l j + r a n d · ( u j l j ) , i , j = 1 ,   2 , , m
where x i , j represents the value of the j -th variable of the i -th candidate solution, N denotes the number of population members, m is the dimensionality of the problem variables, rand denotes a random number in the interval [0, 1], and l j and u j are the lower and upper bounds of the j -th problem variable, respectively.
Following this, the pelicans begin their hunting phase, which can be divided into two stages: pelicans moving towards prey (exploration phase) and pelicans gliding over the water surface (exploitation phase).

4.1.2. Exploration Phase

For each pelican, its new position is updated based on its current position and the position of its prey. If the objective function value at the new position is less than that of the prey, the pelican moves towards the prey; otherwise, it moves away from the prey. The position update formula is given by:
x i , j P 1 = x i , j + rand · p j I · x i , j , F p < F i x i , j + rand · x i , j p j , F p F i
where x i , j P 1 represents the new state of the i -th pelican in the j -th dimension during the exploration phase. p j denotes the position of the prey in the j -th dimension, and F p is its objective function value. The parameter I is a random integer that can be either 1 or 2. This parameter is randomly chosen for each iteration and each member. When I = 2, it increases the displacement of each individual, enabling them to explore new regions in the search space.
If the objective function value at the new position is less than that at the original position, then the new position is accepted; otherwise, the original position remains unchanged. This acceptance criterion can be expressed as:
x i = x i P 1 , F i P 1 < F i x i , F i P 1 F i

4.1.3. Exploitation Phase

After reaching the water surface, pelicans spread their wings and move upwards towards the fish before gathering them into their throat pouches. This strategy leads to capturing more fish in the targeted area. For each pelican, a new position is randomly generated nearby, and its objective function value is computed. The formula for updating the new position is:
x i , j P 2 = x i , j + R · 1 t T · ( 2   ·   rand   1 ) · x i , j
where x i , j p 2 represents the new state of the i -th pelican in the j -th dimension during the exploitation phase. Here, t is the iteration counter, and T is the maximum number of iterations. The term ( 1 t T ) denotes the neighborhood radius of x i , j , allowing for local searches around each member to converge towards better solutions within the population. R is a parameter that can be set between 0 and 1, and rand is a random number between 0 and 1.
If the objective function value at the new position is less than that at the original position, then the new position is accepted; otherwise, the original position remains unchanged. This can be expressed as:
x i = x i P 2 , F i P 2 < F i x i , F i P 2 F i

4.2. Multi-Strategy Improved Pelican Optimization Algorithm (IPOA)

4.2.1. Iterative Chaotic Mapping and Refracted Opposition-Based Learning

Chaotic mapping is a type of nonlinear dynamic behavior. The unpredictability and aperiodicity of chaos can effectively enhance the optimization efficiency of algorithms. The basic idea is to linearly map the optimization variables to chaotic variables through chaotic mapping, then conduct optimization searches based on the ergodicity and randomness of chaos and, finally, linearly transform the obtained solutions back to the optimization variable space [41]. The definition of iterative chaotic mapping is as follows:
z k + 1 = sin ( a π z k )
where a ( 0,1 ) is the control parameter. When a is set to 0.7 and the Iterative mapping is run for 300 iterations, the results are shown in Figure 3.
Opposition-Based Learning (OBL) [42], proposed by Tizhoosh H R, is an optimization strategy aimed at expanding the search range of the population. The core idea is to compute the opposite solution of the current solution and then select the better solution for iteration to find a more optimal solution for the given problem, thus improving the optimization performance of the algorithm. However, in later stages, the opposite solution may fall into a local optimum region.
To address this issue, Refracted Opposition-Based Learning (ROBL), which combines the principles of light refraction, was proposed. ROBL can improve the algorithm performance and expand the search space to various degrees. The principle is illustrated in Figure 4.
In Figure 4, the x-axis represents the search optimization range [ l , u ], and the y-axis represents the normal line. α and β represent the incident and refraction angles, respectively, while h and h * represent the lengths of the incident and refracted rays. O is the midpoint of the search optimization range.
According to the definition of the refractive index, we can obtain:
n = h * ( ( l + u ) / 2 x ) h x * ( l + u ) / 2
Let the scaling factor k = h / h * and substitute it into Formula (19) to obtain:
x * = l + u 2 + l + u 2 k n x k n
In this paper, the initial pelican population is generated using an iterative chaotic mapping method combined with the ROBL. This approach leverages the characteristics of the strategy to ensure a uniform distribution of search agents, allowing for a more comprehensive exploration of the search space within a certain range, making it easier to escape the local optima and enhancing the convergence speed. The mathematical formula is defined as:
x i , j = c h a o t i c _ m a p x i n i t , a x i , j = l j + u j 2 + l j + u j 2 k n x i , j k n
where x i n i t is the initial population.
The specific steps are as follows:
(1).
Randomly generate N candidate positions using iterative chaotic mapping to construct population S 1 .
(2).
Apply the ROBL to determine the refracted opposition population S 2 from population S 1 .
(3).
Integrate populations S 1 and S 2 . Sort the combined population in descending order based on individual fitness values and select the top N pelican individuals with the highest fitness values to form the initial pelican population.

4.2.2. Nonlinear Inertia Weight Factor

Due to the close correlation between the update of pelican individual positions and their current locations, to better balance the global exploration capability and local exploitation capability of the POA and to enhance the convergence accuracy, this paper employs a nonlinear inertia weight factor ω to adjust the relevance between pelican position updates and their current positions. The calculation method of the nonlinear inertia weight factor is shown:
ω = exp ( t T )
In the initial iterations of the algorithm, when ω is small, the update of individual positions is minimally affected by the current pelican’s position. This favors the algorithm to explore a larger range, thereby enhancing its global exploration capability. As the optimization progresses, ω gradually increases, amplifying the influence of the current pelican’s position on individual position updates. At this stage, the algorithm narrows its optimization scope, aiding in the search for the optimal solution. This strategy not only enhances the algorithm’s capability for local exploration but also accelerates its convergence speed. The improved pelican calculation formula is as follows:
x i , j P 1 = ω · x i , j + rand · p j I · x i , j , F p < F i ω · x i , j + rand · x i , j p j , F p F i

4.2.3. Levy Flight

As pelicans fly towards nearby prey, with increasing iterations, they are prone to getting trapped in local optima near the optimal solution. To address this issue, this study introduces a Levy flight during the developmental stage of pelicans, mutating individual pelicans to expand their search radius, enhance population diversity, avoid local optima, and strengthen global exploration capabilities.
The Levy flight is a random walk strategy applicable to natural behaviors such as group foraging. Here, the variable L e v y ( λ ) follows a Levy distribution with parameter λ , expressed as:
L e v y ( λ ) ~ u = t λ , 1 < λ < 3
where λ represents the exponent, which significantly complicates the computation. Therefore, the Mantegna algorithm is employed to compute the Levy flight path:
s = u v 1 β
where s denotes the Levy flight path factor, and β is a parameter controlling the step size, with 0 < β < 2. To balance global and local search capabilities, β is set to 1.5. u and v are random values from a Gaussian distribution, with u ~ N 0 , σ u 2 and v ~ N 0 , σ v 2 . The definitions of σ u and σ v are as follows:
σ u = Γ ( 1 + β ) sin β π 2 Γ 1 + β 2 β · 2 β 1 2 1 β σ v = 1
The improved calculation formula is as follows:
x i , j P 2 + 1 = s · x i , j P 2 + x i , j P 2

4.2.4. Adaptive t-Distribution Variation

T-distribution variation is an information perturbation strategy, which is defined as follows:
x i * = x i + x i · t ( v )
where x i represents the current position of the individual, while x i * represents the position of the individual after mutation. t ( v ) is a random variable drawn from a t-distribution with degrees of freedom v .
The parameter v dynamically adjusts with the number of iterations to balance global exploration and local exploitation and is defined as:
ν = ν min + ν max ν min × t T
where v m i n is the minimum degree of freedom at the beginning, v m a x is the maximum degree of freedom at the end, t is the current iteration number, and T is the maximum number of iterations.
The degree of freedom affects the shape of the curve: as v approaches infinity, the curve appears a Gaussian distribution N(0, 1); as v approaches 1, the curve appears a Cauchy distribution C(0, 1). The density functions of these three distributions are illustrated in Figure 5.
In the early stages of the algorithm’s execution, the degree of freedom is set to a smaller value due to the lower number of iterations, resulting in a flatter curve in the middle. At this point, the algorithm exhibits strong global exploration capabilities. As the number of iterations increases, v gradually increases, causing the middle of the curve to become more pronounced. At this stage, the algorithm demonstrates enhanced local exploitation abilities. Therefore, the t-distribution variation effectively combines the characteristics and advantages of both the Cauchy and Gaussian distributions, offering robust global exploration and local exploitation capabilities.
The adaptive t-distribution variation does not alter the original algorithm’s update principle. Therefore, the improved position formula is defined as follows:
x i , j t = x b e s t + x b e s t · t v
where x i , j t denotes the mutated state of the pelican individual, and x b e s t represents the current best position.

4.3. The Detailed Process of IPOA

At the beginning of the algorithm, the population is initialized using a strategy that combines chaotic mapping with Refraction Opposition-Based Learning (ROBL). Next, the fitness values of each individual are calculated, and the position representing the optimal solution, referred to as the prey position, is generated to guide the behavior updates of the pelican population. During the exploration phase, the adjustment of nonlinear inertia weights dynamically influences the pelicans’ search behavior, directly affecting the process of updating individual positions. In the exploitation phase, the Levy flight mechanism is introduced to extend the search radius, allowing pelicans to explore areas further from the prey, enhancing the algorithm’s global search capability. Finally, the adaptive t-distribution variation is applied to fine-tune the current positions of pelican individuals, generating new candidate solutions and exploring new boundary regions. These mutated individuals are then subjected to fitness recalculation, forming a closed iterative loop.
The steps of the proposed IPOA are presented in the form of a flowchart in Figure 6 and as pseudocode in Algorithm 1.
Algorithm 1: Pseudo-code of IPOA
Input: Maximum number of iterations T, population size N, Improve policy parameters:
   Chaotic mapping constant a, Nonlinear inertia weight factor ω, Levy mechanism
   constant β, degree of freedom v, etc.
Output: The best location xbest.
1  Input various parameters;
2  Use Formula (21) to initialize the population;
3  Calculating the fitness of the individual by the objective function;
4  for t = 1:T do
5Update the weight factor ω according to Formula (22), Update the degree of freedom v according to Formula (29);
6Generate the position of the prey at random.;
7for i = 1:N do
8 Phase 1: Moving towards prey (exploration phase);
9 for j = 1:m do
10 Calculate new status of the j-th dimension using Formula (23);
11 end
12 Update the i-th population member using Formula (15);
13 Phase 2: Winging on the water surface (exploitation phase);
14 for j = 1:m do
15 Calculate new status of the j-th dimension using Formula (27);
16 end
17 Update the i-th population member using Formula (17);
18end
19Get the current new location using Formula (30);
20  end
21  Output best candidate solution obtained.
POA has a time complexity of O(N × D × T), where N is the population size, D is the dimensionality, and T is the maximum number of iterations. IPOA incorporates four additional components. Iterative chaotic mapping involves a one-dimensional nonlinear mapping with a time complexity of O(N × D). ROBL is designed to select pelican individuals, so integrating this strategy with iterative chaotic mapping does not alter the original algorithm’s complexity. The introduction of a nonlinear inertia weight factor, the Levy flight mechanism, and adaptive t-distribution variation are intended to modify the position update mechanism, which does not change the original algorithm’s time complexity. Therefore, IPOA’s time complexity remains O(N × D × T) + O(N × D) = O(N × D × T), which is comparable to POA in terms of time complexity.

5. Algorithm Comparison Experiments

To ensure objectivity, all experiments were conducted on a 64-bit Windows 11 operating system, utilizing an i7-11800H CPU and an RTX 3060 GPU. Matlab R2017b served as the simulation software for the experiments.

5.1. Experimental Design

To assess the performance of the algorithms, this paper chose five as baselines: DBO [36], HHO [27], SSA [34], POA [38], and an improved algorithm, MPOA, which has been applied in reservoir porosity prediction [43]. These algorithms are all excellent intelligent optimization algorithms and have been widely applied in many fields. They were selected because each has different characteristics. HHO is an easy-to-implement and cost-effective algorithm, SSA is widely used in the field of path planning, DBO is a recent research achievement, POA is the prototype algorithm for IPOA, and MPOA represents another improvement approach from other literature. Choosing these algorithms as baseline models ensures that they can fairly reflect the advantages of the new algorithm while ensuring the rationality of the experimental design and the interpretability of the results.
These algorithms were evaluated using the CEC2022 test functions, detailed in Table 1. Table 2 summarizes the key parameter settings for each algorithm, with the meanings of the parameters referenced in Table A1, Appendix A. Each test function was executed independently 30 times, with a maximum of 1000 iterations, a population size of 30, and a dimensionality of 20.

5.2. Comparative Analysis of Algorithms

The performance of the algorithms was evaluated using the best value, mean, and standard deviation (SD). The best value refers to the result found by the algorithm that is closest to the global optimum across multiple runs. It reflects the best performance of the algorithm in solving a specific problem. The mean value refers to the average of all results obtained by the algorithm over multiple runs. It provides an overall view of the algorithm’s performance across multiple experiments. The standard deviation refers to the degree of dispersion of the results of the algorithm over multiple runs. Smaller best values and means indicate higher convergence accuracy, while smaller standard deviations suggest more stable optimization. Since these three metrics can evaluate and compare the performance and stability of different optimization algorithms, we selected them as evaluation criteria.
The numerical performance of the algorithms and their rankings are presented in Table 3. To provide a more intuitive observation and comparison of the algorithms’ convergence behavior, convergence curves for the six algorithms are plotted, as shown in Figure 7.
From Table 3 and Figure 7, it can be seen that IPOA achieves higher solution accuracy on the unimodal function f 1 , indicating that IPOA’s local search capability is significantly stronger than the comparison algorithms. Similarly, IPOA demonstrates the best performance and stability on the multimodal function f 5 and also leads on f 2 , f 3 , and f 4 , and although some metrics slightly lag behind MPOA, the numerical difference is minimal. In the hybrid functions, IPOA shows outstanding performance and stability on functions f 6 and f 7 while also leading on f 8 , with only a minor difference from the best result. In the composite functions, IPOA achieves the best optimization results and stability on functions f 10 and f 12 while also performing excellently on f 9 and f 11 . Overall, across 36 metrics in three categories, IPOA reaches the optimal performance in 25 metrics, proving its strong capabilities in various engineering applications.
To observe the performance of IPOA from more perspectives, we adjusted the dimensionality to 10, resulting in the box plots shown in Figure 8.
It can be observed that, in f 1 , f 3 , f 4 , f 5 , f 7 , and f 12 , IPOA has an obvious minimum value. In the other functions, IPOA either has an indistinct minimum value or is close to the minimum. In f 2 , f 3 , f 4 , f 5 , f 7 , f 8 , and f 12 , IPOA’s median value is also significantly the lowest. In the remaining functions, IPOA shows either an indistinct lowest median or one close to the minimum. Almost all the medians are located near the center of the box, indicating that the data distribution is roughly symmetrical. Except for f 8 , IPOA has the smallest box length in all the functions, indicating strong stability. From this analysis, it is evident that IPOA demonstrates high performance and robustness across various test environments.
To comprehensively assess the performance of the algorithm, the Wilcoxon rank-sum test was introduced for independent comparisons to verify if there are significant differences between IPOA and the other algorithms. The null hypothesis was set as there is no significant difference between the two algorithms being compared. If the significance level is less than 0.05, the null hypothesis is rejected, indicating a significant difference between the two algorithms and superior optimization by IPOA. If the result is greater than 0.05, the null hypothesis is not rejected, indicating no significant difference between the two algorithms, and their optimization effects are limited. The results of comparing IPOA with the other five algorithms are presented in Table 4.
From the data in Table 4, it can be seen that most of the significance level results are less than 0.05, indicating that IPOA is successful in most cases. However, in functions f 2 , f 8 , and f 11 , some algorithms have significance levels greater than 0.05. Additionally, in functions f 5 , and f 10 , many algorithms show significance levels mostly greater than 0.05. This suggests that no single algorithm excels in all scenarios. Therefore, for UAV path planning, further experiments are needed to validate the algorithm’s performance.

6. UAV Path Planning Experiment

6.1. Simulation Experiment Setup

To evaluate the IPOA’s path planning capability in a complex 3D environment, simulated flight experiments were conducted. The experimental setup was configured as described in Section 5. The map size was [100, 100, 350]. At the same time, we used DBO, POA, HHO, SSA, and MPOA as comparison algorithms. For fairness, the population size for all algorithms was set to 30, with a maximum of 1000 iterations, and each algorithm was run independently 10 times. The best value, mean value, and standard deviation were used as statistical metrics to assess the optimization performance.

6.2. Effect of the Cost Function Parameters

In path planning, each path is encoded as a set of vectors composed of cost functions. The lowest total cost value, calculated by the intelligent optimization algorithm, identifies the corresponding path. Therefore, the weight allocation of the components in the cost function has a significant impact on the path. In this section, three different weight combinations, labeled as { ω 1 = 0.7 , ω 2 = 0.15 , ω 3 = 0.15 }, { ω 1 = 0.15 , ω 2 = 0.7 , ω 3 = 0.15 }, and { ω 1 = 0.15 , ω 2 = 0.15 , ω 3 = 0.7 }, representing a focus on the path length, turning, and collision avoidance, respectively, explore the algorithm’s performance under these different weight configurations. The performance of the various functions is shown in Table 5.
It can be observed that IPOA achieved optimal results in seven out of nine metrics. In Experiment 1, IPOA reached the best performance across all three metrics among all algorithms. In Experiment 2, IPOA achieved the best results in both the optimal value and mean value, with the standard deviation being slightly behind MPOA but with a minimal difference. In Experiment 3, IPOA achieved the best mean value and standard deviation, and although the optimal value was second to MPOA, the difference was minimal. Overall, IPOA demonstrated excellent searchability and robustness across all test scenarios.

6.3. Random Map Experiment

In real-world situations, UAVs inevitably have to make turns during flight. Additionally, to absolutely prevent collisions, a sufficiently large safety distance is typically set. In practical missions, UAVs focus more on task efficiency. We believe that the weighting of turning costs and collision costs should be lower than the path cost. Therefore, we opted to assign the weights as { ω 1 = 0.7, ω 2 = 0.15, ω 3 = 0.15} for our experiments.
We set the number of obstacles to eight and randomly generated five different sets of maps for the experiments. To more clearly demonstrate the flight results, we presented both the front view (left) and top view (right) of the flight paths for each algorithm in Figure 9. Table 6 records the evaluation metrics, where “Distance” represents the average path length, “Iterations” indicates the average number of iterations of the algorithm, “Turn” denotes the average deflection angle difference between two adjacent nodes on the path, and “Dis-obs” represents the average distance between the current node and the nearest obstacle among the nodes on the path.
In Experiment 1, IPOA achieved the optimal average flight distance and the minimum average distance from obstacles. Its average convergence rate was second only to MPOA, with only a slight difference between the two. However, IPOA performed poorly in terms of the average turning angle. In Experiment 2, IPOA achieved the best average flight distance, and it ranked first among all algorithms in the average convergence rate and average turning angle. For the average distance from obstacles, IPOA and MPOA both ranked second, demonstrating similarly strong performances. In Experiment 3, IPOA achieved the best average flight distance and average turning angle. Its average convergence rate was second, just behind HHO. However, HHO’s early convergence resulted in a poorer path quality. Regarding the average distance from obstacles, IPOA performed nearly on par with MPOA and POA. In Experiment 4, apart from having a slightly less favorable turning angle compared to POA, IPOA outperformed all other algorithms in every other metric. In Experiment 5, IPOA achieved the optimal results in terms of average flight distance and average iteration count, while its performance in the average turning angle and average distance to obstacles was relatively average. Conversely, IPOA’s performance in the average turning angle was not as strong.
Overall, across 20 metrics in the five experiments, IPOA achieved the best results in 13. Compared to POA, IPOA improved in path length, algorithm iterations, turning angle, and distance from obstacles by 8.39%, 14.21%, 3.34%, and 3.40%, respectively. Compared to MPOA, the improvements were similarly 5.51%, 3.92%, 1.49%, and 0.66%. Notably, since this set of experiments places significant emphasis on the path length cost, the clear improvement in path length achieved by IPOA strongly indicates that the algorithm’s optimization is successful.

6.4. Experiment on the Number of Different Obstacles

The density of buildings in urban areas varies across different regions. To further evaluate IPOA’s path planning capabilities in complex environments, we conducted experiments on maps with obstacle counts of 6 and 10. Figure 10 illustrates the flight paths generated by each algorithm, showing both front views (left) and top views (right). To provide a comprehensive assessment of each algorithm’s performance, Table 7 presents a comparison of the evaluation metrics.
When the number of obstacles was six, compared to POA, IPOA improved the path length, algorithm iterations, turning angle, and distance to obstacles by 6.66%, 11.25%, 6.21%, and 3.22%, respectively. Compared to MPOA, the improvements were 3.69%, 7.28%, 0.22%, and 7.36%, respectively. When the number of obstacles was 10, compared to POA, IPOA improved the path length, algorithm iterations, turning angle, and distance to obstacles by 8.53%, 15.42%, 1.96%, and 2.58%, respectively. Compared to MPOA, the improvements were 5.57%, 8.41%, 0.39%, and 3.04%, respectively. Combined with the comparison data for eight obstacles in Section 6.3, it is evident that, as the number of obstacles increases, meaning the environment becomes more complex, the optimization efficiency of IPOA becomes more apparent in terms of path length and algorithm iterations. Overall, IPOA demonstrates excellent performance across various scenarios.

6.5. Simulation Experiment of Real Terrain

To evaluate the effectiveness of the algorithm in real-world environments, the RflySim simulation platform was used for UAV path planning experiments, simulating high-fidelity 3D modeling of real terrain. The RflySim platform, proposed by the Reliable Flight Control Group of Beihang University in 2021 [44], is an integrated simulation and development platform for UAV systems. RflySim adopts a model-based design approach and can be used for control and safety testing of unmanned systems. Quantitative analysis of the test platform’s results compared to actual experimental systems shows a high matching accuracy of over 90% (with 60% as the minimum required accuracy and 100% as a perfect match). Therefore, this simulation platform was chosen for the UAV application simulations in this study.
In the urban construction map, we modeled Dalian University as a 3D map. Dalian University is an interesting example, because it encompasses almost all elements of a modern city and has over ten thousand students and faculty members.
On the RflySim platform, to obtain more accurate data, each algorithm was run 20 times. Using path length as the benchmark, Figure 11 displays the route for each algorithm. Using path length, turning angle, distance to obstacles, and flight time as the evaluation metrics, we recorded the data comparisons in Table 8.
It can be seen that IPOA achieves the shortest path length and the fastest flight time, as well as near-optimal turning angles and distances to obstacles. Compared to POA, the path length, turning angle, distance to obstacles, and flight time improved by 8.44%, 5.82%, 4.07%, and 9.36%, respectively. Similarly, compared to MPOA, the improvements were 4.09%, 0.76%, 1.85%, and 4.21%, respectively. This demonstrates that, in real-world scenarios, IPOA can provide a reliable solution for UAV path planning in urban environments.

6.6. Discussion

Through test functions and various map experiments, IPOA has demonstrated excellent performance. First, in the CEC2022 test functions, Wilcoxon rank-sum test, and box plot experiments, IPOA showed strong competitiveness compared to the other algorithms. This indicates that IPOA can handle a wide range of optimization problems. Second, in the path planning experiments under different conditions, the IPOA algorithm demonstrated both excellent performance and stability, enabling the creation of feasible and safe optimal trajectory paths for UAVs during mission execution. Lastly, when compared specifically to POA, it is clear that the multi-strategy approach proposed in this paper integrates and adapts well with POA.
Comparing IPOA to MPOA, it can be seen that their improvement directions are similar, which is why MPOA performs better than POA. In practical tests, IPOA outperforms MPOA, likely due to two key reasons: First, IPOA utilizes an iterative chaotic mapping method combined with ROBL during the population initialization phase, which enhances the population’s randomness and diversity. Additionally, compared to Cauchy mutation, the adaptive t-distribution exhibits stronger local search capabilities and can dynamically adjust the mutation step size based on the number of iterations, allowing for better balancing of global and local search abilities.
Although, in practical applications, most scenarios focus more on the algorithm’s impact on path length, in certain specific scenarios, other costs should carry greater weight (such as stricter obstacle avoidance requirements in fire rescue situations). Therefore, when the scenario changes, the cost functions and algorithm adjustments should be dynamic, which requires further experimental validation. Additionally, in complex environments, there is often multi-UAV collaboration. These aspects represent the limitations of this research. In future studies, we will explore more complex scenarios and multi-UAV path planning to make our research more applicable to real-world situations.

7. Conclusions

In the CEC2022 test suite, we studied the performance of IPOA in solving various optimization problems. The results showed that IPOA outperformed all other competing algorithms in 69.4% of the 36 metrics across three categories. This demonstrates that the improvement strategies proposed in this paper help enhance the performance of the original algorithm and expand its applicability.
In the UAV path planning experiments, we considered flight distance, turning angle, and collision threat, conducting experiments under various conditions. Given that efficiency is a key consideration for UAV task execution in real-world scenarios, this paper focused more on path length, conducting experiments on random maps and real city simulations. The results demonstrated that IPOA not only found shorter paths but also reduced turning angle consumption and enhanced safety to some extent, effectively meeting the optimization requirements we proposed. This proves the effectiveness of IPOA in practical applications.
Despite the significant achievements of IPOA in algorithm performance and path planning, this study also has some limitations. In urban environments, many special scenarios require continuous adjustment of the constraints in the cost function according to specific needs. For example, in fire rescue operations, UAVs should prioritize higher safety performance. When energy is limited, UAVs must reduce the number and magnitude of turns in order to conserve battery power. In future research, we will attempt to integrate hardware and develop adaptive intelligent optimization algorithms. Additionally, to improve task efficiency, we plan to explore information sharing and collaboration among multiple UAVs. To increase the practical value of this research, more advanced technologies like Unreal Engine 5 should be employed to create path planning scenarios for a broader range of cities.

Author Contributions

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

Funding

This research received no external funding.

Institutional Review Board Statement

Not applicable.

Data Availability Statement

The raw data supporting the conclusions of this article will be made available by the authors on request.

Conflicts of Interest

The authors declare no conflicts of interest.

Appendix A

Table A1. Summary of the notations in IPOA.
Table A1. Summary of the notations in IPOA.
Module NameNotationMeaning of Notation
POANthe number of population members
mthe dimensionality counter of the problem variables
Dthe dimensionality of the problem variables
l i the lower bounds of the problem variable
u j the upper bounds of the problem variable
Irandom integer that can be either 1 or 2
tthe iteration counter
Tthe maximum number of iterations
Ra parameter that can be set between 0 and 1
Iterative chaotic mappingacontrol parameter
ROBLkrefraction scale factor
nindex of refraction
Nonlinear inertia weight factor ω nonlinear inertia weight factor
Levy flight β parameter controlling step size
sthe Levy flight path factor
Adaptive t-distribution variationvdegrees of freedom
Table A2. Summary of the notations in the evaluation metrics.
Table A2. Summary of the notations in the evaluation metrics.
Evaluation MetricsMeaning of Notation
Bestclosest to the global optimum
Meanthe average of all results
SDthe degree of dispersion of the results
Distancethe average path length
Iterationsthe average number of iterations of the algorithm
Turn/°the average deflection angle difference between two adjacent nodes on the path
Dis-obsthe average distance between the current node and the nearest obstacle
Timethe average flight time

References

  1. Deng, M.; Yang, Q.; Peng, Y. A Real-Time Path Planning Method for Urban Low-Altitude Logistics UAVs. Sensors 2023, 23, 7472. [Google Scholar] [CrossRef] [PubMed]
  2. Radoglou-Grammatikis, P.; Sarigiannidis, P.; Lagkas, T.; Moscholios, I. A Compilation of UAV Applications for Precision Agriculture. Comput. Netw. 2020, 172, 107148. [Google Scholar] [CrossRef]
  3. Wei, Z.; Zhu, M.; Zhang, N.; Wang, L.; Zou, Y.; Meng, Z.; Wu, H.; Feng, Z. UAV-Assisted Data Collection for Internet of Things: A Survey. IEEE Internet Things J. 2022, 9, 15460–15483. [Google Scholar] [CrossRef]
  4. Wang, G.; Chen, Y.; An, P.; Hong, H.; Hu, J.; Huang, T. UAV-YOLOv8: A Small-Object-Detection Model Based on Improved YOLOv8 for UAV Aerial Photography Scenarios. Sensors 2023, 23, 7190. [Google Scholar] [CrossRef]
  5. Li, A.; Hansen, M.; Zou, B. Traffic Management and Resource Allocation for UAV-Based Parcel Delivery in Low-Altitude Urban Space. Transp. Res. Part C Emerg. Technol. 2022, 143, 103808. [Google Scholar] [CrossRef]
  6. Xiaoning, Z. Analysis of Military Application of UAV Swarm Technology. In Proceedings of the 2020 3rd International Conference on Unmanned Systems (ICUS), Harbin, China, 27–28 November 2020; pp. 1200–1204. [Google Scholar]
  7. Mohamed, N.; Al-Jaroodi, J.; Jawhar, I.; Idries, A.; Mohammed, F. Unmanned Aerial Vehicles Applications in Future Smart Cities. Technol. Forecast. Soc. Change 2020, 153, 119293. [Google Scholar] [CrossRef]
  8. Wang, J.; Li, Y.; Li, R.; Chen, H.; Chu, K. Trajectory Planning for UAV Navigation in Dynamic Environments with Matrix Alignment Dijkstra. Soft Comput. 2022, 26, 12599–12610. [Google Scholar] [CrossRef]
  9. Li, J.; Liao, C.; Zhang, W.; Fu, H.; Fu, S. UAV Path Planning Model Based on R5DOS Model Improved A-Star Algorithm. Appl. Sci. 2022, 12, 11338. [Google Scholar] [CrossRef]
  10. Huang, H.; Savkin, A.V. Path Planning for a Solar-Powered UAV Inspecting Mountain Sites for Safety and Rescue. Energies 2021, 14, 1968. [Google Scholar] [CrossRef]
  11. Khan, A.H.; Cao, X.; Li, S.; Katsikis, V.N.; Liao, L. BAS-ADAM: An ADAM Based Approach to Improve the Performance of Beetle Antennae Search Optimizer. IEEE/CAA J. Autom. Sin. 2020, 7, 461–471. [Google Scholar] [CrossRef]
  12. Fathy, A.; Alanazi, T.M.; Rezk, H.; Yousri, D. Optimal Energy Management of Micro-Grid Using Sparrow Search Algorithm. Energy Rep. 2022, 8, 758–773. [Google Scholar] [CrossRef]
  13. Dong, J.; Dou, Z.; Si, S.; Wang, Z.; Liu, L. Optimization of Capacity Configuration of Wind–Solar–Diesel–Storage Using Improved Sparrow Search Algorithm. J. Electr. Eng. Technol. 2022, 17, 1–14. [Google Scholar] [CrossRef]
  14. Bao, X.; Jia, H.; Lang, C. A Novel Hybrid Harris Hawks Optimization for Color Image Multilevel Thresholding Segmentation. IEEE Access 2019, 7, 76529–76546. [Google Scholar] [CrossRef]
  15. Wang, Q.; Xu, M.; Hu, Z. Path Planning of Unmanned Aerial Vehicles Based on an Improved Bio-Inspired Tuna Swarm Optimization Algorithm. Biomimetics 2024, 9, 388. [Google Scholar] [CrossRef] [PubMed]
  16. Jayaweera, H.M.; Hanoun, S. A Dynamic Artificial Potential Field (D-APF) UAV Path Planning Technique for Following Ground Moving Targets. IEEE Access 2020, 8, 192760–192776. [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. 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]
  19. Zhang, Y.; Zhao, Y.; Wei, T. Improved A* Algorithm for Obstacle Avoidance Path Planning Strategy of the Blind. Aero Weapon. 2017, 3, 86–92. [Google Scholar]
  20. Gao, S.; Ai, J.L.; Wang, Z.H. Mixed Population RRT Algorithm for UAV Path Planning. Syst. Eng. Electron. 2020, 1, 101–107. [Google Scholar]
  21. Hao, G.; Lv, Q.; Huang, Z.; Zhao, H.; Chen, W. UAV Path Planning Based on Improved Artificial Potential Field Method. Aerospace 2023, 10, 562. [Google Scholar] [CrossRef]
  22. Kong, D.; Miyatake, M. Cooperative Application of Onboard Energy Storage and Stationary Energy Storage in Rail Transit Based on Genetic Algorithm. Energies 2024, 17, 1426. [Google Scholar] [CrossRef]
  23. Candia, D.A.; Játiva, P.P.; Azurdia Meza, C.; Sánchez, I.; Ijaz, M. Performance Analysis of the Particle Swarm Optimization Algorithm in a VLC System for Localization in Hospital Environments. Appl. Sci. 2024, 14, 2514. [Google Scholar] [CrossRef]
  24. Tang, K.; Wei, X.-F.; Jiang, Y.-H.; Chen, Z.-W.; Yang, L. An Adaptive Ant Colony Optimization for Solving Large-Scale Traveling Salesman Problem. Mathematics 2023, 11, 4439. [Google Scholar] [CrossRef]
  25. Liu, H.; Zhou, C.; Pang, Y.; Chen, X.; Pan, Z.; Wang, L.; Fan, D. Temperature Demodulation for an Interferometric Fiber-Optic Sensor Based on Artificial Bee Colony–Long Short-Term Memory. Photonics 2023, 10, 1157. [Google Scholar] [CrossRef]
  26. Nadimi-Shahraki, M.H.; Taghian, S.; Mirjalili, S. An Improved Grey Wolf Optimizer for Solving Engineering Problems. Expert. Syst. Appl. 2021, 166, 113917. [Google Scholar] [CrossRef]
  27. Alabool, H.M.; Alarabiat, D.; Abualigah, L.; Heidari, A.A. Harris Hawks Optimization: A Comprehensive Review of Recent Variants and Applications. Neural Comput. Applic 2021, 33, 8939–8980. [Google Scholar] [CrossRef]
  28. Pehlivanoglu, Y.V.; Pehlivanoglu, P. An Enhanced Genetic Algorithm for Path Planning of Autonomous UAV in Target Coverage Problems. Appl. Soft Comput. 2021, 112, 107796. [Google Scholar] [CrossRef]
  29. Ali, Z.A.; Zhangang, H.; Hang, W.B. Cooperative Path Planning of Multiple UAVs by Using Max–Min Ant Colony Optimization along with Cauchy Mutant Operator. Fluct. Noise Lett. 2021, 20, 2150002. [Google Scholar] [CrossRef]
  30. Lin, S.; Li, F.; Li, X.; Jia, K.; Zhang, X. Improved Artificial Bee Colony Algorithm Based on Multi-Strategy Synthesis for UAV Path Planning. IEEE Access 2022, 10, 119269–119282. [Google Scholar] [CrossRef]
  31. Zhang, C.; Liu, Y.; Hu, C. Path Planning with Time Windows for Multiple UAVs Based on Gray Wolf Algorithm. Biomimetics 2022, 7, 225. [Google Scholar] [CrossRef]
  32. Zhang, R.; Li, S.; Ding, Y.; Qin, X.; Xia, Q. UAV Path Planning Algorithm Based on Improved Harris Hawks Optimization. Sensors 2022, 22, 5232. [Google Scholar] [CrossRef] [PubMed]
  33. Mirjalili, S.; Lewis, A. The Whale Optimization Algorithm. Adv. Eng. Softw. 2016, 95, 51–67. [Google Scholar] [CrossRef]
  34. Xue, J.; Shen, B. A Novel Swarm Intelligence Optimization Approach: Sparrow Search Algorithm. Syst. Sci. Control Eng. 2020, 8, 22–34. [Google Scholar] [CrossRef]
  35. Seyyedabbasi, A.; Kiani, F. Sand Cat Swarm Optimization: A Nature-Inspired Algorithm to Solve Global Optimization Problems. Eng. Comput. 2023, 39, 2627–2651. [Google Scholar] [CrossRef]
  36. Xue, J.; Shen, B. Dung Beetle Optimizer: A New Meta-Heuristic Algorithm for Global Optimization. J. Supercomput. 2023, 79, 7305–7336. [Google Scholar] [CrossRef]
  37. Trojovský, P.; Dehghani, M. Subtraction-Average-Based Optimizer: A New Swarm-Inspired Metaheuristic Algorithm for Solving Optimization Problems. Biomimetics 2023, 8, 149. [Google Scholar] [CrossRef]
  38. Trojovský, P.; Dehghani, M. Pelican Optimization Algorithm: A Novel Nature-Inspired Algorithm for Engineering Applications. Sensors 2022, 22, 855. [Google Scholar] [CrossRef]
  39. Peres, F.; Castelli, M. Combinatorial Optimization Problems and Metaheuristics: Review, Challenges, Design, and Development. Appl. Sci. 2021, 11, 6449. [Google Scholar] [CrossRef]
  40. Han, X.; Liu, X.; Wu, G.; Song, X.; Cui, L. Research on Additive Manufacturing Path Planning of a Six-Degree-of-Freedom Manipulator. Actuators 2024, 13, 249. [Google Scholar] [CrossRef]
  41. Varol Altay, E.; Alatas, B. Bird Swarm Algorithms with Chaotic Mapping. Artif. Intell. Rev. 2020, 53, 1373–1414. [Google Scholar] [CrossRef]
  42. Tizhoosh, H.R. Opposition-Based Learning: A New Scheme for Machine Intelligence. In Proceedings of the International Conference on Computational Intelligence for Modelling, Control and Automation and International Conference on Intelligent Agents, Web Technologies and Internet Commerce (CIMCA-IAWTIC’06), Vienna, Austria, 28–30 November 2005; Volume 1, pp. 695–701. [Google Scholar]
  43. Qiao, L.; He, N.; Cui, Y.; Zhu, J.; Xiao, K. Reservoir Porosity Prediction Based on BiLSTM-AM Optimized by Improved Pelican Optimization Algorithm. Energies 2024, 17, 1479. [Google Scholar] [CrossRef]
  44. Dai, X.; Ke, C.; Quan, Q.; Cai, K.-Y. RFlySim: Automatic Test Platform for UAV Autopilot Systems with FPGA-Based Hardware-in-the-Loop Simulations. Aerosp. Sci. Technol. 2021, 114, 106727. [Google Scholar] [CrossRef]
Figure 1. UAV flight scenarios. Mainly include traffic monitoring, express delivery, city inspection, etc.
Figure 1. UAV flight scenarios. Mainly include traffic monitoring, express delivery, city inspection, etc.
Biomimetics 09 00647 g001
Figure 2. UAV flight 3D coordinate state during turns.
Figure 2. UAV flight 3D coordinate state during turns.
Biomimetics 09 00647 g002
Figure 3. Iterative chaotic mapping.
Figure 3. Iterative chaotic mapping.
Biomimetics 09 00647 g003
Figure 4. Refracted Opposition-Based Learning.
Figure 4. Refracted Opposition-Based Learning.
Biomimetics 09 00647 g004
Figure 5. The density distribution of the three functions.
Figure 5. The density distribution of the three functions.
Biomimetics 09 00647 g005
Figure 6. IPOA flowchart.
Figure 6. IPOA flowchart.
Biomimetics 09 00647 g006
Figure 7. Convergence curves of the algorithms.
Figure 7. Convergence curves of the algorithms.
Biomimetics 09 00647 g007aBiomimetics 09 00647 g007b
Figure 8. Box plots of the comparative algorithms.
Figure 8. Box plots of the comparative algorithms.
Biomimetics 09 00647 g008
Figure 9. Flight simulation experiment of random maps (obstacles = 8). (a) Experiment 1; (b) Experiment 2; (c) Experiment 3; (d) Experiment 4; (e) Experiment 5.
Figure 9. Flight simulation experiment of random maps (obstacles = 8). (a) Experiment 1; (b) Experiment 2; (c) Experiment 3; (d) Experiment 4; (e) Experiment 5.
Biomimetics 09 00647 g009aBiomimetics 09 00647 g009bBiomimetics 09 00647 g009c
Figure 10. Flight simulation experiment of random maps (obstacles = 6 and 10). (a) Experiment 1 (obstacles = 6); (b) Experiment 2 (obstacles = 10).
Figure 10. Flight simulation experiment of random maps (obstacles = 6 and 10). (a) Experiment 1 (obstacles = 6); (b) Experiment 2 (obstacles = 10).
Biomimetics 09 00647 g010
Figure 11. UAV flight trajectory at Dalian University.
Figure 11. UAV flight trajectory at Dalian University.
Biomimetics 09 00647 g011
Table 1. CEC2022 test suite.
Table 1. CEC2022 test suite.
Function TypeNo. F i * Functions
Unimodal function f 1 300Shifted and full Rotated Zakharov Function
Basic functions f 2 400Shifted and full Rotated Rosenbrock Function
f 3 600Shifted and full Rotated Expanded Schaffer Function
f 4 800Shifted and full Rotated Non-Continuous Rastrigin Function
f 5 900Shifted and full Rotated Levy Function
Hybrid functions f 6 1800Hybrid Function (N = 3)
f 7 2000Hybrid Function (N = 6)
f 8 2200Hybrid Function (N = 5)
Composition functions f 9 2300Composition Function (N = 5)
f 10 2400Composition Function (N = 4)
f 11 2600Composition Function (N = 5)
f 12 2700Composition Function (N = 6)
Search range: 100 ,   100 D
Table 2. Algorithm key parameter settings.
Table 2. Algorithm key parameter settings.
AlgorithmParametersValues
DBODeflection coefficient k 0.1
Ball-Rolling dung beetles parameter b 0.1
Stealing dung beetles parameter S 0.3
POAExploitation phase parameter R 0.2
HHOInitial energy E 0 1,1
Jump strength J (0, 2)
SSASafety threshold S T 0.6
Proportion of finders P D 0.7
Proportion of vigilante S D 0.2
MPOAfreedom parameter a 1
Proportion of vigilante S D 0.2
IPOAExploitation phase parameter R 0.2
Chaotic iterative mapping constant a 0.7
Levy flight step parameters β 1.5
Table 3. Evaluation metrics for the CEC2022 test.
Table 3. Evaluation metrics for the CEC2022 test.
FunctionsMetricsIPOADBO [36]POA [38]SSA [34]MPOA [43]HHO [27]
f 1 Best6989.6213,293.4314,564.8617,967.2310,699.8319,435.23
Mean8676.6816,612.7617,567.5521,293.4312,879.4224,783.45
SD544.851649.181293.821502.73975.752182.99
Ranking1 1 13 3 54 4 35 5 42 2 26 6 6
f 2 Best479.21582.19612.08771.05449.08762.19
Mean522.86673.45698.46820.58489.18872.11
SD33.1966.2055.7434.9431.8965.95
Ranking2 2 23 3 64 4 46 5 31 1 15 6 5
f 3 Best622.53625.79624.24635.64618.47641.46
Mean625.98634.85635.43646.26626.66658.25
SD3.996.157.619.257.8313.26
Ranking2 1 14 3 23 4 35 5 51 2 46 6 6
f 4 Best806.95813.71812.19815.09811.32828.73
Mean822.56825.58821.91825.28823.06844.89
SD5.289.966.474.226.049.08
Ranking1 2 34 5 63 1 45 4 12 3 26 6 5
f 5 Best1943.502498.452559.363285.232008.522946.31
Mean2159.242954.462856.123804.162287.563214.68
SD149.42296.45193.45256.01180.82369.14
Ranking1 1 13 4 54 3 36 6 42 2 25 5 6
f 6 Best3347.468757.5614,549.5412,755.585489.2416,763.65
Mean8480.6454,207.6866,946.34107,686.4512,657.65226,784.77
SD2365.1842,558.6760,092.9891,572.165469.12181,273.25
Ranking1 1 13 3 35 4 44 5 52 2 26 6 6
f 7 Best2009.652063.382088.242099.432018.232158.98
Mean2028.552148.332122.092176.612034.012176.38
SD13.9567.46528.3552.0718.4514.75
Ranking1 1 13 4 64 3 45 6 52 2 36 5 2
f 8 Best2207.082215.712219.552225.232204.252233.16
Mean2224.472231.362230.132237.662218.962266.65
SD9.1715.188.8910.288.8229.19
Ranking2 2 33 4 54 3 25 5 41 1 16 6 6
f 9 Best2526.982544.432533.382535.472539.182543.34
Mean2531.122591.282552.492588.452542.102579.63
SD2.2928.1718.1238.950.9119.26
Ranking1 1 26 6 53 3 33 5 64 2 15 4 4
f 10 Best2501.162813.103321.583049.192535.884216.39
Mean2862.443219.374044.544615.242912.135891.29
SD203.64285.56363.79625.50212.98598.75
Ranking1 1 13 3 35 4 44 5 62 2 26 6 5
f 11 Best2942.122912.463687.473572.673557.193524.56
Mean3118.913342.653916.184041.523898.963619.74
SD109.50252.14189.67244.29177.06178.11
Ranking2 1 11 2 66 5 45 6 54 4 23 3 3
f 12 Best2938.442999.953010.742946.782994.063012.13
Mean2947.183007.473029.252957.643009.083028.86
SD5.226.6410.1912.3810.4218.93
Ranking1 1 14 3 25 6 32 2 53 4 46 5 6
Table 4. Wilcoxon rank-sum test results.
Table 4. Wilcoxon rank-sum test results.
FunctionDBO [36]POA [38]SSA [34]HHO [27]MPOA [43]
f 1 1.4643 × 10−103.0810 × 10−083.0198 × 10−113.0198 × 10−116.8462 × 10−06
f 2 0.04150.05710.00130.00020.6683
f 3 0.00131.5422 × 10−071.6836 × 10−081.4478 × 10−074.9364 × 10−04
f 4 0.00610.03240.04636.9641 × 10−110.0489
f 5 0.34150.21860.50030.48010.7390
f 6 6.4213 × 10−080.00049.9851 × 10−042.2891 × 10−103.8936 × 10−05
f 7 3.1019 × 10−070.03982.1341 × 10−073.7621 × 10−090.0466
f 8 4.7173 × 10−050.35713.3146 × 10−086.2251 × 10−100.8701
f 9 3.3640 × 10−113.0815 × 10−094.7093 × 10−103.1467 × 10−114.2914 × 10−08
f 10 0.50830.64120.67211.9851 × 10−070.8827
f 11 1.2375 × 10−060.17390.03915.4226 × 10−090.2634
f 12 0.01430.01880.03360.00020.0296
Table 5. Performance of the algorithm under different weight combinations.
Table 5. Performance of the algorithm under different weight combinations.
Weight CombinationMetricsIPOADBOHHOPOAMPOASSA
Experiment 1 ω 1 = 0.7 , ω 2 = 0.15 , ω 3 = 0.15Best33.0443.96102.1745.5937.6479.35
Mean36.7850.39121.6252.6141.3397.91
SD2.993.9816.724.633.4814.82
Experiment 2 ω 1 = 0.15 , ω 2 = 0.7 , ω 3 = 0.15Best36.1047.17116.5543.3938.2676.94
Mean41.8455.32132.7452.1743.3792.38
SD4.156.2415.576.613.9616.67
Experiment 3 ω 1 = 0.15 , ω 2 = 0.15 ,   ω 3 = 0.7Best38.4141.09106.6543.6635.0275.28
Mean45.2558.63133.8755.8146.7797.96
SD5.7117.2515.076.806.4214.06
Table 6. Evaluation metrics for the random map flight experiment (obstacles = 8).
Table 6. Evaluation metrics for the random map flight experiment (obstacles = 8).
ExperimentMetricsIPOADBOHHOPOAMPOASSA
Experiment 1Distance219.67233.54241.56246.41234.43238.88
Iterations72.179.089.187.270.477.5
Turn/°52.943.144.151.848.148.8
Dis-obs46.156.452.050.948.454.5
Experiment 2Distance180.39199.24222.45204.76193.63208.65
Iterations60.669.377.273.566.980.1
Turn/°44.248.658.750.445.847.4
Dis-obs49.351.242.447.649.358.7
Experiment 3Distance187.66200.61208.30201.97195.24200.03
Iterations78.782.661.179.280.889.4
Turn/°49.956.777.157.253.158.1
Dis-obs44.743.141.343.642.843.5
Experiment 4Distance189.87202.62204.93200.94202.65203.56
Iterations86.195.399.4101.190.295.7
Turn/°46.246.961.043.349.453.8
Dis-obs59.765.264.866.964.166.4
Experiment 5Distance183.46194.73200.65196.48191.63192.42
Iterations62.373.266.471.465.970.5
Turn/°54.352.167.654.655.150.4
Dis-obs42.943.848.644.241.346.5
Table 7. Evaluation metrics for the random map flight experiment (obstacles = 6 and 10).
Table 7. Evaluation metrics for the random map flight experiment (obstacles = 6 and 10).
Number of ObstaclesMetricsIPOADBOHHOPOAMPOASSA
6Distance184.81192.14198.74198.01191.64199.42
Iterations53.064.367.963.160.472.5
Turn/°45.341.642.148.345.443.8
Dis-obs54.162.461.255.958.460.5
10Distance190.96205.37218.33208.79202.24210.23
Iterations72.986.7101.186.279.688.1
Turn/°49.950.747.150.950.154.6
Dis-obs41.443.441.742.542.745.6
Table 8. Evaluation metrics for the simulation experiment of real terrain.
Table 8. Evaluation metrics for the simulation experiment of real terrain.
MetricsIPOADBOHHOPOAMPOASSA
Distance (m)286.74318.88342.66313.19298.97322.81
Turn/°51.755.651.554.952.153.8
Dis-obs (m)2.112.042.132.242.162.42
Time (s)20.2322.7724.1622.3221.1222.91
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

Qiu, S.; Dai, J.; Zhao, D. Path Planning of an Unmanned Aerial Vehicle Based on a Multi-Strategy Improved Pelican Optimization Algorithm. Biomimetics 2024, 9, 647. https://doi.org/10.3390/biomimetics9100647

AMA Style

Qiu S, Dai J, Zhao D. Path Planning of an Unmanned Aerial Vehicle Based on a Multi-Strategy Improved Pelican Optimization Algorithm. Biomimetics. 2024; 9(10):647. https://doi.org/10.3390/biomimetics9100647

Chicago/Turabian Style

Qiu, Shaoming, Jikun Dai, and Dongsheng Zhao. 2024. "Path Planning of an Unmanned Aerial Vehicle Based on a Multi-Strategy Improved Pelican Optimization Algorithm" Biomimetics 9, no. 10: 647. https://doi.org/10.3390/biomimetics9100647

APA Style

Qiu, S., Dai, J., & Zhao, D. (2024). Path Planning of an Unmanned Aerial Vehicle Based on a Multi-Strategy Improved Pelican Optimization Algorithm. Biomimetics, 9(10), 647. https://doi.org/10.3390/biomimetics9100647

Article Metrics

Back to TopTop