Applsci 11 03417 v2
Applsci 11 03417 v2
sciences
Article
Distributed 3-D Path Planning for Multi-UAVs with Full Area
Surveillance Based on Particle Swarm Optimization
Nafis Ahmed, Chaitali J. Pawase and KyungHi Chang *
Department of Electrical and Computer Engineering, Inha University, Incheon 22212, Korea;
nafisahmed5753@gmail.com (N.A.); chaitalipawase17@gmail.com (C.J.P.)
* Correspondence: khchang@inha.ac.kr
Abstract: Collision-free distributed path planning for the swarm of unmanned aerial vehicles (UAVs)
in a stochastic and dynamic environment is an emerging and challenging subject for research in
the field of a communication system. Monitoring the methods and approaches for multi-UAVs
with full area surveillance is needed in both military and civilian applications, in order to protect
human beings and infrastructure, as well as their social security. To perform the path planning
for multiple unmanned aerial vehicles, we propose a trajectory planner based on Particle Swarm
Optimization (PSO) algorithm to derive a distributed full coverage optimal path planning, and a
trajectory planner is developed using a dynamic fitness function. In this paper, to obtain dynamic
fitness, we implemented the PSO algorithm independently in each UAV, by maximizing the fitness
function and minimizing the cost function. Simulation results show that the proposed distributed
path planning algorithm generates feasible optimal trajectories and update maps for the swarm of
UAVs to surveil the entire area of interest.
Keywords: 3D trajectory planning; unmanned aerial vehicle; distributed path planning; PSO; area
Citation: Ahmed, N.; Pawase, C.J.; surveillance; dynamic fitness function
Chang, K. Distributed 3-D Path
Planning for Multi-UAVs with Full
Area Surveillance Based on Particle
Swarm Optimization. Appl. Sci. 2021,
1. Introduction
11, 3417. https://doi.org/10.3390/
app11083417 Unmanned Aerial Vehicles (UAVs), known as drones, gained much popularity in
the area of surveillance due to their capability in vertical take-off and landing, and high
Academic Editor: Álvaro Gutiérrez maneuverability, which provides various benefits in various platforms or environments.
UAVs can be also used for surveilling [1] providing security to the larger government or
Received: 26 February 2021 private area known as estates [2], and also can be used for sensing and data collection [3,4].
Accepted: 5 April 2021 However, when defining a mission, path planning plays a basic and crucial role in the
Published: 10 April 2021 whole system. Generally speaking, when designing a path for UAV, it should reflect various
factors, including dynamic target point, obstacles avoidance both statically and dynamically,
Publisher’s Note: MDPI stays neutral the shortest pathfinding, as well as mission planning while surveilling. Nowadays, UAVs
with regard to jurisdictional claims in are widely used for various purposes, especially for surveilling because of the small size and
published maps and institutional affil- lightweight, easy operational procedure, and tremendous benefits of easy access from one
iations. place to another place. UAVs are gaining more popularity in surveillance. For this reason,
path planning for UAVs is more crucial, and it plays a fundamental role in the autonomous
flight system for unmanned aerial vehicles (UAVs). It refers to the optimal path planning
problem of an unmanned aircraft, which can be formulated as an optimization problem
Copyright: © 2021 by the authors. of finding the most compatible path from source to destination. The feasible trajectory is
Licensee MDPI, Basel, Switzerland. usually correlated with the path minimizing certain optimization indexes, for example,
This article is an open access article energy consumption, flight risk, path length, etc. of certain path planning missions.
distributed under the terms and
conditions of the Creative Commons 1.1. Related Work
Attribution (CC BY) license (https:// While thinking about generating path planning for UAVs, we have to consider the
creativecommons.org/licenses/by/
scenario, whether it is a two-dimensional (2-D) environment or a three-dimensional (3-D)
4.0/).
environment. There are various path planning strategies regarding both 2-D and 3-D
environments. As we are working with UAVs, which are related to the 3-D environment,
we have focused mainly on path planning in the 3-D environment. There are so many
path planning algorithms regarding the 3-D environment, which can be categorized into
five categories [5]. These include, (i) Sampling-Based Algorithms, like, visibility graph,
corridor map [6], Rapidly-exploring Random Tree (RRT) [7], 3-D Voronoi [8] (ii) Node
Based Optimal Algorithms, such as, Dijkstra’s Algorithm [9], A* algorithm [10], D* al-
gorithm [11], (iii) Mathematics Model-Based Algorithms, like, Linear Programming and
Optimal Control [12], Binary Linear Programming [13], Nonlinear Programming [14,15],
(iv) Bio-inspired Algorithms, which can be divided into two types, Evolutionary Algo-
rithm [16], and Neural Network [17], and (v) Multi-fusion Based Algorithms [18]. There
are various types of Evolutionary Algorithm, such as, Genetic Algorithm [19], Memetic
Algorithm [20], Particle Swarm Optimization (PSO) [21], and Ant Colony Optimization
(ACO) [22], which are notable for the path planning of UAVs in the 3-D environment. Evo-
lutionary Algorithms are the algorithms that update the results in iteration-by-iterations.
In our proposed 3-D path planning methodology, we used Particle Swarm Optimization
(PSO), due to its benefits like the advantages of easy implementation, simple parameter
settings, fast convergence speed, and for which the PSO algorithm has been widely used
in various fields, such as, functions optimization, neural networks training, and fuzzy
logic system control are notable. However, it has some limitations too, like premature
convergence, route self-crossing. The authors in [23] suggest that this problem can be
solved by using the following techniques, (1) adjust important parameters iteratively;
(2) random grouping inversion strategy for avoiding premature convergence. In terms
of area coverage, various techniques have been suggested by various authors, such as
the authors in [24] decomposed the concave region into a convex sub-region, then the
flight direction was determined based on the width of the convex polygon. Some adjacent
sub-areas were merged to avoid unnecessary repetitive movement. In [25], the authors
proposed a new approach relative to UAVs’ capabilities assessment by using hierarchical
fuzzy inference and established a cost model for UAVs’ mission execution. The authors
in [26], believed that a rectangle can be circumscribed by any polygon. The idea of poly-
gon region segmentation was adopted by the authors in [27]. The sweeping technique
was used for area decomposition by the authors in [28], to minimize the number of UAV,
turns inside the subareas by generating the optimal number of lanes. In [29], for moving
targets, the formation coverage search method was proposed. The authors in [30–33]
discussed distributed path planning using the PSO algorithm and the designing of the
quadrotor control.
10
0.1
Fk ( x ) = ∑ 10
− ηab )2 + γa
(1)
a = 1 ∑ b =1 ( x b
where parameters η and γ are used to vary the shape of the terrain. We adopted this
terrain because there is a shortage of widely-accepted benchmarks in the field of trajectory
planning for UAVs. Therefore, the local maxima of the landscape can be considered
mountains [34].
Tr = T1 , T2 , T3 , . . . , TNw (2)
where Nw is known as the number of waypoints in a feasible trajectory, r and w are positive
integer numbers, and the number of trajectories is proportional to the number of waypoints.
where Fobj is the objective function, focusing to gain maximum values in terms of other
parameters, Fconst is the physical and environmental limitations, should be accomplished
before trajectory planning.
Objective Function
Surveillance Area
Name Energy Consumption Flight Risk Estimation
Importance
Abbreviation EC FRE SAI
Equation (5)–(10) (11)–(14) (15)–(17)
Value/Range [0, 1] [0, 1] [0, 1]
Constraint Function
Restricted Turning Operational Coverage
Aerial Collision
Name Area Angle Area Range
Constraint Avoidance
Constraint Constraint Constraint Constraint
Abbreviation AC RAC TAC OAC CRC CA
Equation (19) (20) (21) (22) (23) (24)
Value/Range 0 0 0 0 0 0
Appl. Sci. 2021, 11, 3417 5 of 20
where FEC , FFRE , and FSAI are defined to be in the range of [0, 1] and wi (i = 1, 2, 3) were used
for expressing the weight of the objective component. Our main focus was on generating
the optimum path with less energy consumption, environmental flight risk, but higher
surveillance. Therefore, we designate surveillance area importance as the positive and the
rest areas negative values.
dmax
maxEC = ( Nw − 1) ∗ Pw ∗ (9)
v
where, p
dmax = X 2 + Y 2 + Z2 (10)
where X, Y, and Z are the boundary condition of operation space in the 3-D environment.
ri,har
i + 1 = η ∗ ( z i +1 − z i ) (11)
Nw
AC = 0, AC = ∑ ACi (19)
i =1
where,
P, i f z j < Area( xi , yi )
ACi =
0, otherwise
Nw
RAC = 0, RAC = ∑ RACi (20)
i =1
where,
P, i f waypoint in range x j , y j
RACi =
0, otherwise
where,
range( x j , y j ) = lx ≤ x j ≤ ux ∩ ly ≤ y j ≤ uy
where Nw is the number of waypoints, lx , ly are the lower bounds of x and y, u x , uy is the
upper bounds of x and y.
Nw −1
TAC = 0, TAC = ∑ TACi (21)
i =2
where,
P, i f θ > θmax
TACi =
0, otherwise
where θ defines the turning angle of the UAV in 3-D directions (xi , yi , zi ), and θmax is the
maximum tolerable turning angle.
Nw
OAC = 0, OAC = ∑ OACi (22)
i =1
Appl. Sci. 2021, 11, 3417 8 of 20
where,
0, i f waypoint in map x j , y j
OACi =
P, otherwise
where,
range( x j , y j ) = lx ≤ x j ≤ ux ∩ ly ≤ y j ≤ uy
where Nw is the number of waypoints, lx , ly are the lower bounds of x and y, u x , uy is the
upper bounds of x, and y, respectively.
Nw
CRC = 0, CRC = ∑ CRCi (23)
i =1
where,
P, i f waypoint i in Range x j, y j
CRCi =
0, otherwise
where,
range x j , y j = lx ≤ x j ≤ u x ∩ ly ≤ y j ≤ uy
where Nw is the number of waypoints, lx , ly are the lower bounds of x and y, u x , uy is the
upper bounds of x and y.
where, (
P, i f dijmn < dmin
CAi =
0, otherwise
where dmin is the minimum safe distance to avoid the collision, dijuv is the Cartesian distance
between the ith waypoint of pth UAV trajectory and the jth waypoint of qth UAV trajectory.
In Equation (27), r1 and r2 denoting the random values between 0 and 1, w is the
inertia coefficient which reflects the influence of the velocity in the previous iteration on the
current iteration. n1 and n2 are self-cognitive and social cognitive values, which indicate the
inheriting abilities from the particle itself and the whole swarm. Pseudocode for dynamic
fitness function using PSO can be shown in Algorithm 1.
Algorithm 1: Pseudocode for Dynamic Fitness Function using PSO.
iii. For each value of xi along the line, check the following condition, if pi < 0, the next
point needs to be selected as (xi+1 , yi ) and:
Repeat the steps until the set destination i.e., (xend , yend ) is reached
The pseudocode of the Bresenham algorithm is given in Algorithm 2:
Appl. Sci. 2021, 11, 3417 11 of 20
For PSO algorithm parameter setting, the authors in [41] suggested the value of
important parameters, like inertia, is 0.7298 and both the cognitive value as 1.4960. The
authors in [42] suggested that inertia value can be selected within the value range from
0.4 to 0.9 and optimal value can be achieved by trial and error methodology, where the
cognitive value can be selected as 2.0. We conducted a simulation by using both values
and found that the second parameter value set has the better result, in terms of our
simulation parameters. Therefore, the resulting values of the parameter have been used
in this paper. We demonstrate the comparison between conventional PSO and PSO with
modified parameters (mPSO) in Figure 3a. The result shows that the fitness value of the
proposed modified-PSO (mPSO) algorithm converges faster to a stable value as the number
of iterations increases. In the simulation, mPSO achieved higher Fitness values in a much
shorter period of time than the conventional PSO, which led UAVs to surveille full areas in
a short period of time. As the fitness value is the major factor for our proposed trajectory
planner, we compared PSO and mPSO for their fitness value, in terms of the convergence
over the number of iterations. This is the reason why we followed mPSO for further
experimentation. These parameter values of PSO and mPSO are given in Table 3.
Figure 3. Fitness value, (a) comparison between Conventional PSO versus modified PSO, and (b)
effect of the number of particles on dynamic fitness value.
In the objective function designing, we had to consider the impact of energy consump-
tion, flight risk estimation, and SAI value on each other, where all the values had been
normalized. It was supposed to have the optimal flight path, which consists of less energy
consumption and flight risk, and a higher SAI value. For this reason, we designed the
function by considering energy consumption and flight risk with a minimum value, where
the SAI value has to be the maximum value. Figure 4 represents the objective function
value curve and total fitness values under EC, FRE, SAI, respectively, where the number of
iterations is 100 and the number of particles is 150. It shows the trajectory optimization
performance of the flight time, in terms of energy consumption, fight risk, and surveillance
area importance. As the number of iterations increased, the energy consumption and flight
risk minimized and maintained a stable value, while their surveillance area importance
values maximized. From the simulation results shown in Figure 4, it is observed that the
simulation begins with the last value achieved from the dynamic fitness function. As the
number of iterations increased the energy consumption, flight risk, and SAI value con-
verged quickly and gradually improved the performance of the dynamic fitness function.
This ensured that at each iteration, the particles tried to minimize energy consumption
and flight risk, while maximizing the SAI value, which proves the effectiveness of our
proposed algorithm. The optimization performance of the path planner, in terms of energy
consumption and flight risk estimation, can be expressed as a fitness function that indicates
the effectiveness of path planning. Fitness function itself consists of two parts, (i) objective
value, (ii) constraints value. An optimal path should not have any kind of constraints in its
path planning, thus, all constraints should be zero. Figure 5a, demonstrates the effective-
ness of our paths where all the constraints are zero. Figure 5b,c show the objective value,
and total fitness value, respectively for the different part of fitness values in each waypoint.
Figure 4. Optimal objective values, (a) energy consumption, (b) flight risk, and (c) SAI value.
The SAI weight value has an impact on the total fitness value. Therefore, to find the
necessary optimal weight value for SAI we conducted various simulations, as shown in
Figure 6. As the weight value of SAI was expected to be positive, we selected a wide range
of positive values for our simulation. For a large value of the weight, the impact on EC,
FRE, and SAI was less. Therefore, we selected the weight value from a minimal positive
value. The weight values and corresponding impact on EC, FRE, and SAI, along with
objective values, are shown in Table 4.
Appl. Sci. 2021, 11, 3417 15 of 20
Figure 5. Different parts of fitness value in each waypoint, (a) constraints value, (b) objective value,
and (c) constraints value and objective value.
Figure 6. Impact of the weighted parameter value, (a) as SAI parameter weight value increases, SAI
value increases proportionally; (b) selection of the optimal weight value for SAI.
In our implementation, a full area coverage was based on distributed path planning.
We considered two scenarios of full coverage, with overlapping, and without overlapping,
respectively. In overlapping conditions, to cover the whole surveillance area, UAVs take so
many steps that are known as waypoints. Sometimes, it takes very high computational time
to complete the task. On the other hand, the second scenario is a non-overlapping condition,
which requires less computational time and converges faster. To make the environment less
complicated and faster and more convenient to converge, we only considered the second
scenario, in this study, which involves path planning with the non-overlapping condition.
Figure 7a, shows the optimal paths, followed by UAV1, UAV2, UAV3, and UAV4
started from the GBS set as the starting point and denoted by a green rectangular box.
After surveilling of the whole area, it again came back to the endpoint, marked as a yellow
rectangular box. In Figure 7a, the red rectangle box represents the restricted areas where
UAVs are not allowed to fly. With the edge cells having higher SAI value, UAVs need
to surveille those edge areas first having level-3 importance, then the inner areas having
Appl. Sci. 2021, 11, 3417 16 of 20
level-2 priority, and the center having least priority as level-1. We gave the cell edge area
more importance by considering that, generally when we design anything, we give more
importance to the center as our valuable infrastructure is situated in the center. In that
sense, edge areas received less importance, which may pose a great threat. Whenever
any threats begin, they commence from the outside region first not from the inside area.
Moreover, if we can prevent it earlier, before entering the sensitive area, we will be able to
lessen the threat much. That is the reason why we gave cell edge more importance. We
observed that the trajectories, generated for each flight time, avoid all the restricted areas
and reach the destination safely after full coverage of the surveillance area.
Figure 7. Distributed Path Planning for Multi-UAVs (a) 2-D environment, (b) 3-D environment.
Our operational area is based on a 3-D environment, while covering the distance
from one waypoint to another waypoint, UAV made changes in the X, Y, and Z-axis.
Altitude changes for all the UAVs during flight time are shown in Table 5 and the cor-
responding flight times for the UAVs can be seen in Table 6. Figure 7b also shows that
the ability of UAVs to decide to change in altitude and turning angle when hills or un-
structured environment appear in path planning shows that our system has dynamic
environment adaptability.
Altitude (Meter)
No. of Waypoints
UAV1 UAV2 UAV3 UAV4
1 0.4827 0.4792 0.3403 0.5184
2 1.3508 0.3393 1.3211 0.8365
3 1.1563 0.9815 1.2727 0.4283
4 1.3724 0.2747 1.1685 0.9781
5 0.8549 0.8525 1.3761 0.0475
6 0.8316 0.1218 0.8848 0.1951
7 0.8528 0.0602 1.0310 0.5889
8 0.5366 0.5191 0.4815 0.5165
Appl. Sci. 2021, 11, 3417 17 of 20
The proposed trajectory planner also ensures that the multiple UAVs do not collide
with each other while surveilling. The respective Fitness values of all four UAVs for full
coverage are shown in Figure 8.
Figure 8. The fitness value of all four UAVs in terms of the number of the waypoints, (a) UAV1, (b)
UAV2, (c) UAV3, and (d) UAV4.
In our simulation, the operating area was assumed to be 1 km × 1 km, with a per
cell value of 50 m. During the surveillance, UAVs took off from the starting point and
returned to the ending point. Table 6 shows the total distances covered by the UAVs
and the necessary flight time for both 2-D and 3-D cases and it is observed that in a 3-D
environment, UAVs cover more distance than in a 2-D environment. In our implementation,
we assume that a UAV can cover up to four cells from a single location. As a result of this
assumption, we can see that all of the UAVs have covered the entire operational region,
except the restricted area, which is not allowed to be surveilled.
Distributed Path Planning for Multi-UAVs in the 2-D and 3-D environment for the
larger-sized area is shown in Figure 9. To consider a larger size for our simulation we
have selected a 30 × 30 grid size having the area of 3 km × 3 km (per cell 100 m). In
our simulation where grid size was 20 × 20, each of the four UAV needs 8 waypoints to
Appl. Sci. 2021, 11, 3417 18 of 20
surveille the whole area. However, as the operational area size increased, the number of
the required waypoints also increased; that is, 11 waypoints for each of the UAV.
Figure 9. Distributed Path Planning for Multi-UAVs for larger size in (a) 2-D environment, (b) 3-D environment.
6. Conclusions
In this paper, we proposed a distributed 3-D path planning for multiple UAVs, based
on Particle Swarm Optimization with Bresenham Algorithm, to make an optimal trajectory
for multiple UAVs. We introduced a multi-dynamic fitness function that has optimization
indexes, such as energy consumption, flying risk, surveillance area importance (SAI), and
UAV maneuverability. Moreover, we also obtained the optimal weight of SAI for an objec-
tive value to obtain dynamic fitness to generate a collision-free trajectory for multiple UAVs.
To analyze the performance of the proposed optimal trajectory planner, we designed a
dynamic fitness function mechanism with a cost function. The numerical results of experi-
ments carried out in this research work show that the PSO, with Bresenham Algorithm, can
be applied for multi-UAVs to surveille the whole area of interest by generating an optimal
path. Currently, we carry out experiments for the swarm of four UAVs, and we evaluate
feasibility, robustness, and dynamic environment adaptability for our three dimensions
distributed trajectory planner to analyze the performance and effectiveness of the system.
The simulation results prove that our proposals can perform a collision-free distributed
trajectory planning for multiple UAVs to surveille the whole area of interest by flight time
and flight distance optimized manner. For future work, we will consider an unstructured
dynamic environment to perform three dimensions of distributed trajectory planning.
We may apply our developed distributed trajectory planner to interface with the drone
model for security purposes, to make a real-time application of multiple UAVs for full area
surveillance under a dynamic environment.
Author Contributions: Supervision and investigation K.C.; N.A. and C.J.P. are contributed equally
in this paper for methodology and writing original draft preparation; writing-review and editing
K.C., N.A. and C.J.P. All authors have read and agreed to the published version of the manuscript.
Funding: This work was supported by the National Research Foundation of Korea (NRF) grant
funded by the Korean government (MSIT) (No. NRF-2019R1F1A1061696).
Institutional Review Board Statement: Not Applicable.
Informed Consent Statement: Not Applicable.
Data Availability Statement: No new data were created or analyzed in this study. Data sharing does
not apply to this article.
Appl. Sci. 2021, 11, 3417 19 of 20
Abbreviations
The following abbreviations are used in the manuscript:
References
1. Teng, H.; Ahmad, I.; Msm, A.; Chang, K. 3D Optimal Surveillance Trajectory Planning for Multiple UAVs by Using Particle
Swarm Optimization With Surveillance Area Priority. IEEE Access 2020, 8, 86316–86327. [CrossRef]
2. Sheng, G.; Min, M.; Xiao, L.; Liu, S. Reinforcement Learning-Based Control for Unmanned Aerial Vehicles. J. Commun. Inf. Netw.
2018, 3, 39–48. [CrossRef]
3. Yang, Q.; Yoo, S.-J. Optimal UAV Path Planning: Sensing Data Acquisition Over IoT Sensor Networks Using Multi-Objective
Bio-Inspired Algorithms. IEEE Access 2018, 6, 13671–13684. [CrossRef]
4. Zhan, C.; Zeng, Y.; Zhang, R. Energy-efficient data collection in UAV enabled wireless sensor network. IEEE Wirel. Commun. Lett.
2018, 7, 328–331. [CrossRef]
5. Yang, L.; Qi, J.; Xiao, J.; Yong, X. A literature review of UAV 3D path planning. In Proceedings of the 11th World Congress on
Intelligent Control and Automation, Shenyang, China, 29 June–4 July 2014; pp. 2376–2381. [CrossRef]
6. Geraerts, R. Planning short paths with clearance using explicit corridors. In Proceedings of the IEEE International Conference on
Robotics and Automation, Anchorage, Alaska, 3 May 2010; pp. 1997–2004.
7. Yang, K.; Sukkarieh, S. Real-time continuous curvature path planning of UAVs in cluttered environments. In Proceedings of the
5th International Symposium on Mechatronics and Its Applications, ISMA 2008, Amman, Jordan, 27–29 May 2008; pp. 1–6.
8. Cho, Y.; Kim, D.; Kim, D.S.K. Topology representation for the Voronoi diagram of 3D spheres. Int. J. CAD/CAM 2005, 5, 59–68.
9. Musliman, I.A.; Rahman, A.A.; Coors, V. Implementing 3D network analysis in 3D-GIS. Int. Arch. ISPRS 2008, 37, 913–918.
10. De Filippis, L.; Guglieri, G.; Quagliotti, F. Path Planning strategies for UAVs in 3D environments. J. Intell. Robot. Syst. 2012, 65,
247–264. [CrossRef]
11. Carsten, J.; Ferguson, D.; Stentz, A. 3d field d: Improved path planning and replanning in three dimensions. In Proceedings of
the 2006 IEEE/RSJ International Conference on Intelligent Robots and Systems, Beijing, China, 9–15 October 2006; pp. 3381–3386.
12. Miller, B.; Stepanyan, K.; Miller, A. 3D path planning in a threat environment. In Proceedings of the 2011 50th IEEE Conference
on Decision and Control and European Control Conference (CDC-ECC), Orlando, FL, USA, 12–15 December 2011; pp. 6864–6869.
13. Masehian, E.; Habibi, G. Robot path planning in 3D space using binary integer programming. Proc. World Acad. Sci. Eng. Technol.
2007, 23, 26–31.
14. Chamseddine, A.; Zhang, Y.; Rabbath, C.A. Flatness-based trajectory planning/replanning for a quadrotor unmanned aerial
vehicle. Aerosp. Electron. Syst. IEEE Trans. 2012, 48, 2832–2848. [CrossRef]
15. Borrelli, F.; Subramanian, D.; Raghunathan, A.U. MILP and NLP techniques for centralized trajectory planning of multiple
unmanned air vehicles. In Proceedings of the American Control Conference, Minneapolis, MN, USA, 14–16 June 2006; p. 6.
16. Hasircioglu, I.; Topcuoglu, H.R.; Ermis, M. 3-D path planning for the navigation of unmanned aerial vehicles by using evolutionary
algorithms. In Proceedings of the 10th Annual Conference on Genetic and Evolutionary Computation, Atlanta, GA, USA, 12–16
July 2008; pp. 1499–1506.
17. Kroumov, V.; Yu, J.; Shibayama, K. 3D path planning for mobile robots using simulated annealing neural network. Int. J. Innov.
Comput. Inf. Control 2010, 6, 2885–2899.
18. Scholer, F.; la Cour-Harbo, A. Generating approximative minimum length paths in 3D for UAVs. In Proceedings of the IEEE
Intelligent Vehicles Symposium, Madrid, Spain, 3–7 June 2012; pp. 229–233.
19. Pehlivanoglu, Y.V.; Baysal, O.; Hacioglu, A. Path planning for autonomous UAV via vibrational genetic algorithm. Aircr. Eng.
Aerosp. Technol. Int. J. 2007, 79, 352–359. [CrossRef]
Appl. Sci. 2021, 11, 3417 20 of 20
20. Shahidi, N.; Esmaeilzadeh, H.; Abdollahi, M. Memetic Algorithm Based Path Planning for a Mobile Robot. In Proceedings of the
International Conference on Computational Intelligence, Istanbul, Turkey, 17–19 December 2004; pp. 56–59.
21. Foo, J.L.; Knutzon, J.; Kalivarapu, V. Path planning of unmanned aerial vehicles using B-splines and particle swarm optimization.
J. Aerosp. Comput. Inf. Commun. 2009, 6, 271–290. [CrossRef]
22. Cheng, C.T.; Fallahi, K.; Leung, H. Cooperative path planner for UAVs using ACO algorithm with Gaussian distribution
functions. In Proceedings of the IEEE International Symposium on Circuits and Systems, ISCAS, Taipei, Taiwan, 24–27 May 2009;
pp. 173–176.
23. Xi, J.; Li, S.; Sheng, J.; Zhang, Y.; Cui, Y. Application of Improved Particle Swarm Optimization for Navigation of Unmanned
Surface Vehicles. Sensors 2019, 19, 3096.
24. Li, Y.; Chen, H.; Meng, J.E. Coverage path planning for UAVs based on enhanced exact cellular decomposition method.
Mechatronics 2011, 21, 876–885. [CrossRef]
25. Peng, H.; Shen, L.C.; Huo, X.H. Research on Multiple UAV Cooperative Area Coverage Searching. J. Syst. Simul. 2007, 19,
2472–2476. (In Chinese)
26. Wu, Q.P.; Zhou, S.L.; Yin, G.Y. Improvement of Multi-UAV Cooperative Coverage Searching Method. Electron. Opt. Control 2016,
23, 80–84.
27. Guo, Y.; Qu, Z. Coverage control for a mobile robot patrolling a dynamic and uncertain environment. In Proceedings of the
Fifth World Congress on Intelligent Control and Automation, WCICA 2004, Hangzhou, China, 15–19 June 2004; Volume 6,
pp. 4899–4903.
28. Araujo, J.F.; Sujit, P.B.; Sousa, J.B. Multiple UAV area decomposition and coverage. In Proceedings of the Computational
Intelligence for Security and Defense Applications (CISDA), Singapore, 16–19 April 2013; pp. 30–37.
29. Xuan, Y.B.; Huang, C.Q.; Wu, W.C. Coverage search strategies for moving targets using multiple unmanned aerial vehicle teams.
Syst. Eng. Electron. 2013, 35, 539–544.
30. Belkadi, A.; Ciarletta, L.; Theilliol, D. UAVs team flight training based on a virtual leader: Application to a fleet of Quadrotors. In
Proceedings of the 2015 International Conference on Unmanned Aircraft Systems (ICUAS), Denver, CO, USA, 9–12 June 2015;
pp. 1364–1369.
31. Belkadi, A.; Ciarletta, L.; Theilliol, D. UAVs fleet control design using distributed particle swarm optimization: A leaderless
approach. In Proceedings of the 2016 International Conference on Unmanned Aircraft Systems (ICUAS), Arlington, VA, USA,
7–10 June 2016; pp. 364–371.
32. Belkadi, A.; Abaunza, H.; Ciarletta, L.; Castillo, P.; Theilliol, D. Distributed Path Planning for Controlling a Fleet of UAVs:
Application to a Team of Quadrotors * *Research supported by the Conseil Regional de Lorraine, the Ministére de L’Education
Nationale, de l’Enseignement Supérieur et de La Recherche, and the National Network of Robotics Platforms (ROBOTEX), from
France. IFAC-Pap. OnLine 2017, 50, 15983–15989. [CrossRef]
33. Belkadi, A.; Abaunza, H.; Ciarletta, L.; Castillo, P.; Theilliol, D. Design and Implementation of Distributed Path Planning
Algorithm for a Fleet of UAVs. IEEE Trans. Aerosp. Electron. Syst. 2019, 55, 2647–2657. [CrossRef]
34. Golzari, S.; Zardehsavar, M.N.; Mousavi, A.; Saybani, M.R.; Khalili, A.; Shamshirband, S. KGSA: A Gravitational Search Algorithm
for Multimodal Optimization based on K-Means Niching Technique and a Novel Elitism Strategy. Open Math. 2018, 16, 1582–1606.
[CrossRef]
35. Zheng, C.; Li, L.; Xu, F.; Sun, F.; Ding, M. Evolutionary route planner for unmanned air vehicles. IEEE Trans. Robot. 2005, 21,
609–620. [CrossRef]
36. Cabreira, T.; Brisolara, L.; Ferreira, P., Jr. Survey on coverage path planning with unmanned aerial vehicles. Drones 2019, 3, 4.
[CrossRef]
37. Noonan, A.; Schinstock, D.; Lewis, C.; Spletzer, B. Optimal Turning Path Generation for Unmanned Aerial Vehicles (No. SAND2007-
3152C); Sandia National Lab. (SNL-NM): Albuquerque, NM, USA, 2007.
38. Bresenham, J.E. Algorithm for computer control of a digital plotter. IBM Syst. J. 1965, 4, 25–30. [CrossRef]
39. Koopman, P., Jr. Bresenham Line-Drawing Algorithm; Fourth Dimension: North Kingstown, RI, USA, 1987; pp. 12–16.
40. Rashid, A.T.; Ali, A.A.; Frasca, M.; Fortuna, L. Path planning with obstacle avoidance based on visibility binary tree algorithm.
Robot. Auton. Syst. 2013, 61, 1440–1449. [CrossRef]
41. Roberge, V.; Tarbouchi, M.; Labonte, G. Comparison of parallel genetic algorithm and particle swarm optimization for real-time
UAV path planning. IEEE Trans. Ind. Inf. 2013, 9, 132–141. [CrossRef]
42. Jordehi, A.R.; Jasni, J. Parameter selection in particle swarm optimization: A survey. J. Exp. Theor. Artif. Intell. 2012, 25, 527–542.
[CrossRef]