1. Introduction
Recent progress in communication, sensing and battery technology have made Unmanned Aerial Vehicles (UAVs) draw much attention in both military and civilian fields. With the continuous evolution of UAV technologies, mini-UAVs have become indispensable tools across a broad spectrum of tasks such as reconnaissance, remote sensing, surveillance, and search operations. Their high maneuverability and deployment flexibility make them particularly well-suited for mission-critical scenarios—for example, assisting firefighting units in delineating wildfire perimeters, enabling media teams to capture real-time event coverage, supporting law enforcement in crowd surveillance, and aiding rescue personnel in locating missing individuals in challenging environments. In these contexts, UAVs leverage onboard sensors to gather mission-relevant environmental data and provide operational support.
This study investigates the deployment of mini-UAVs for supporting monitoring operations in complex environments, as shown in
Figure 1. Perception results from UAVs are advantageous to scene analysis, and enable workers to devise solutions in real time. Due to their advantages of flexibility, low cost and high sensor resolution, UAVs have been widely used in geological hazard (including rockfall, landslide, and mudslide) monitoring. Using these UAVs, high quality images as well as exact geographic positions of surveillance sites can be acquired in real time. All this information provides statistical analysis to workers so as to ensure the effectiveness of strategic decisions.
Since perceptual information accumulates along a piecewise path, many coverage path planning strategies have been proposed to optimize coverage in either gathered messages or flight cost. A review of the most successful methods is provided in [
1]. These methods were proposed to handle specific environments, meeting criteria such as minimization of coverage time [
2], and several goals were set for coverage assessment.
One of the first goals considered for coverage planning is MCI (Maximization of Coverage Information) [
3], where an information theoretic approach is used to select desired headings for maximization of the information gain. Various evolutionary operators were proposed to drive the motion of a single UAV to maximize the collected information by Ergezer H et al. [
4]. In this algorithm, the initial population of seed paths is generated by employing a pattern search strategy in conjunction with the solution to the Traveling Salesman Problem (TSP).
MCT (Minimization of Coverage Time) is commonly used to design a motion plan that minimizes the duration while simultaneously providing complete coverage [
2,
5,
6,
7,
8,
9,
10,
11]. A lower bound on time to achieve complete coverage was established by Cheng P et al. [
5], based on which an analytical coverage plan can be derived. This approach is applicable for 3-D urban structure inspection, since the sensor model is tightly cooperated with dynamic motion of a UAV. The MCT problem is tackled as a generalized traveling salesman problem in [
2]. It studies results concerning the construction of a spanning tree and consequently designs a polynomial-time tree construction algorithm.
MCA (Maximization of Coverage Area) deals with the problem of complete coverage with limited resources, either in number of agents or sensor ability [
12,
13,
14]. Complete coverage is guaranteed by using cost functions to obtain a path that can cover the environment by visiting each point at least once [
12]. Constrained Delaunay Triangulation is used to represent the environment and a spanning tour algorithm is employed to build cycles to be assigned to an individual robot with a limited visibility range [
13]. The method is guaranteed to be complete and robust, provided that at least one robot operates correctly. Completeness of coverage can be achieved by using a quasi-minimal number set of observers [
14], and an evolutionary algorithm is proposed to generate hierarchy paths.
MRC (Minimization of Repeated Coverage) intends to minimize coverage overlapping and thus improve coverage efficiency [
15,
16,
17]. The bathymetric map under consideration is segmented based on depth similarity, enabling the coverage path planning task to be decomposed and solved for each region individually [
15]. Overlaps between adjacent coverage paths often arise on sloped terrain due to non-uniform inter-path distances introduced when projecting a 2D coverage plan onto a 3D topographic surface [
17]. To address this issue, a side-to-side strategy is introduced, wherein a cylindrical volume is constructed around a selected seed curve in three-dimensional space. Neighboring paths are then derived by computing the intersection curves between this cylinder and the terrain surface, ensuring adaptive spacing and improved surface conformity.
MPL (Minimization of Path Length) aims at finding paths with the shortest length [
18,
19,
20,
21]. This target is particularly suitable for cases where a series of discrete task points need to be visited. Methods such as Dubins curve [
18,
19] and SOM (Self-Organization Map) [
20] are applied to plan the shortest path. In those approaches, travelling distance is generally supposed be equal to the consumed energy.
Another alternative is MCE (Minimization of Coverage Energy) [
22,
23,
24,
25,
26,
27,
28,
29]. In these approaches, an energy model is built to estimate the energy consumption for a piecewise path [
22,
23,
26,
27,
28]. An energy-efficient coverage path planning technique utilizing the Glasius bio-inspired neural network for autonomous ship hull inspection is presented in [
22]. However, the energy model is simply built on changes in direction, distance, and vertical position and is only suitable for ground vehicles. The energy-aware algorithm presented in [
27] seeks to optimize energy usage, but it fails to account for motion variability and payload effects, thereby limiting the reliability of its energy assessment. A route-based optimization framework employing column generation is proposed in [
28], enabling precise tracking of energy consumption during distinct mission phases. To evaluate the energy cost for a different path, the power required to hover and in forward flight is calculated. To address the path planning problem under energy constraints, a voronoi-based path generation algorithm is described in [
29]. In this approach, the energy consumption is assumed to be in direct proportion to path length.
An energy-efficient coverage path planning algorithm that enhances UAV autonomy enables extended flight distances, even in cluttered and complex environments. Nevertheless, due to inherent limitations in battery life and payload capacity, mini-UAVs exhibit constrained endurance during mission execution. Moreover, as throttle control must be dynamically adjusted according to varying flight behaviors, the resulting energy consumption becomes path-dependent. Consequently, integrating accurate energy consumption estimation into the path planning process is of practical importance, particularly for ensuring mission feasibility and maximizing operational efficiency in energy-limited scenarios.
In this paper, an energy-optimal coverage path planning method on 3D terrain for quad-rotor aircraft is proposed. The coverage problem is addressed by generating an energy consumption map, which is constructed using a quadrotor power estimation model in conjunction with a Digital Surface Model (DSM) of the terrain.
The specific contributions of this paper are given below.
- (1)
An energy-optimal coverage path planning algorithm tailored for quadrotor UAVs is proposed, aiming to maximize the coverage area within the constraints of limited battery capacity. The method guarantees consistent observation resolution and can further support estimation of the required number of UAVs for full-area coverage. To this end, an analytical terrain model is developed to digitize topographic surfaces, thereby mitigating the influence of terrain geometry on coverage uniformity.
- (2)
A specific power estimator model is built and optimal flight control information is derived. A high level of estimation accuracy is achieved as the power model integrates the combined effects of flight dynamics, sensor instrumentation, control systems, and environmental aerodynamic disturbances.
- (3)
A Genetic Algorithm (GA) is employed to traverse the energy map, effectively mitigating the risk of entrapment in local optima. The proposed framework is implemented within a semi-physical simulation environment, and its performance is empirically validated.
The remainder of this paper is structured as follows.
Section 2 outlines the problem formulation. In
Section 3, the proposed energy consumption model is described in detail, along with the energy-aware control strategy applied to piecewise flight paths.
Section 4 introduces a three-stage coverage path planning algorithm specifically designed for quadrotor UAVs.
Section 5 presents simulation and experimental results that demonstrate the effectiveness of the proposed approach. Finally,
Section 6 concludes the paper with a summary of findings and future research directions.
2. Problem Definition
We consider a quad-rotor equipped with a camera mounted on a stabilizer in this paper. The UAV flies over the whole area and the mounted camera takes snaps at different locations with an expected viewpoint and angle. The coverage path planning problem aims to find a solution that minimizes total energy under the image quality constraint.
2.1. Topographic Surface Modeling Using Scattered Elevation Points
Terrain modeling constitutes the foundational step in three-dimensional coverage path planning. Digital Elevation Models (DEMs), which employ elevation values for discrete spatial points, are commonly used to represent the underlying terrain surface. To obtain a continuous surface representation, interpolation techniques—such as Kriging—are applied to estimate the elevations at unsampled locations based on the available DEM data. However, such methods provide elevation data only at discrete sampling points. To achieve a more continuous and analytically tractable representation of topographic surfaces in three-dimensional space, analytical models can be derived from DEMs. These models facilitate terrain characterization, which is critical for accurately estimating the cost associated with various coverage patterns. Polynomial functions are often employed for curve and surface fitting due to their capability to smoothly approximate known data points. Nonetheless, when the approximation domain spans a large interval, high-degree polynomials are required, which may lead to numerical instability and increased computational complexity. By contrast, the degrees of splines are decided only by the number of control points, while they contains favorable recurrence characters for situations at higher degrees. In particular, Bezier splines (surface, as shown in
Figure 2) pass through the starting and ending points while approximating the remaining control vertexes, and thus Bezier surfaces were employed to build the digital surface model in this work.
The parametrization of a Bezier surface is defined as follows:
where
.
2.2. Sensor Observation Model
The sensor’s field of view (FOV) is modeled following the formulation established in our previous work, as illustrated in
Figure 3, and the same definition is adopted herein. The sensing footprint is approximated as a square region with side length defined by
, where
denotes the sensor range and
represents the FOV angle. This approximation determines the mesh resolution of the projection plane, upon which a discrete set of sampling nodes is selected across the surface.
To evaluate the observation quality, the effective resolution is defined in [
7]:
where
is the points set within the FOV.
These definitions are also used in this paper. It has been proven that the image quality of video sensors tightly depends on the viewing distance, the angle of incidence relative to the terrain surface, and the viewing direction. Inspired by this, we should figure out the UAV position consuming the least energy while ensuring image quality.
2.3. Energy Model of a Quad-Rotor Aircraft
Quad-rotor control and dynamics have been enormously investigated in the literature [
8,
9]. A quad-rotor dynamic model can be described by the following equations [
9]:
, and represent the UAV’s roll, pitch, and yaw angles, respectively. x, y, z The variables x, y, and z denote the UAV’s position. , and denote the UAV’s moments of inertia about the x, y, and z-axes, respectively. represents the rotor’s moment of inertia, and is the mass of the UAV. Ui = (i = 1, 2, 3, 4) are intermediate control variables, defined as shown in Equation (4).
The first component in the orientation subsystem accounts for the gyroscopic effect induced by the rigid body’s spatial rotation, while the second term arises from the rotational dynamics of the propulsion assembly.
In Equation (4), denotes the rotational speed of the i-th motor; represents the thrust coefficient, and is the drag coefficient, both determined by the structural characteristics of the UAV.
However, UAVs will unavoidably be affected by wind disturbance in a real environment, which can cause them to experience extra force. As shown in
Figure 4, this wind force not only increases the drag on the UAV’s body, but also alters the induced airflow velocity underneath the rotor blades. Consequently, the lift would also differ. Considering that the UAV’s body has a relatively small cross-sectional area, only the effects of wind force on the rotor blades will be taken into account.
The application scenario of this work is as follows: a quad-rotor UAV is used to survey a known region (mainly DEMs) in a 3D environment. Our goal is to use the on-board camera to carry out coverage perception of the whole region with minimal energy consumption while satisfying the observation resolution requirement. Given the above prior conditions, the specific problems to be solved can be formulated as:
where
N represents the number of UAVs to be deployed,
K is the path number of each UAV, and L denotes the energy cost of a piecewise path (energy consumed by sensors is also included). Since UAVs have six degrees of freedom in translation and rotation, this gives rise to a flexible and varying path even for a fixed starting and ending pose state. As a result, path parameters such as flight time and energy consumption vary significantly under different flight paths. Therefore, it is indispensable to optimize the input control variables in order to minimize the cost function L.
In
Figure 5, the problem to evaluate the extrema of
L with the given starting and ending points, as well as the corresponding initial and final states, is equivalently expressed in the framework of optimal control. Based on the established control model, a feasible control law is selected to meet predetermined requirements and achieve optimal performance:
where
contains boundary conditions and
provides the end term.
4. Energy-Optimal Path Planning
A triple-phase coverage path planning algorithm is introduced as a solution to the previously identified problems. Our method consists of three phases: terrain modeling, optimal flight control on piecewise path, and cost map traversal. In the terrain modeling stage, a Bezier surface is used to characterize the 3D terrain, and the sampling positions of the UAV within the grid area are determined by the predefined observation resolution. Subsequently, the UAV’s dynamic model is employed to derive optimal control parameters that minimize energy consumption along each piecewise segment of the path. Finally, an energy consumption map of the whole area is constructed based on the above results, and an optimized coverage path is figured out. The usual flowchart of this algorithm is described in
Figure 7.
Phase 1: Digital surface modeling. To image a terrain surface with a sensor containing uniform resolution, a UAV adapts its position according to the terrain elevation. The nodes at which the UAV captures snapshots are treated as control points of a Bezier surface, from which the analytical parameters of the surface are subsequently derived.
Figure 8 shows a closed surface to be observed. Global Mapper software (V14.0) comes with a terrain gridding tool that imports the terrain DEM data and allows grid elements with the longitude, latitude, and altitude information of each grid point to be exported. To determine the UAV’s flight altitude and sampling positions, the normal vectors of each grid area must be calculated, and then a point along the normal vector with a fixed height offset from the grid center is used as the UAV’s observation point.
Phase 2: Optimal power estimation and energy consumption map construction. Combined with the UAV’s dynamic model, the Automatic Control and Dynamic Optimization (ACADO) numerical optimization method is used to optimize energy consumption along the piecewise path as well as the energy consumption map established on this basis. As all sampling points are determined in phase 1, the corresponding starting and ending points, along with the associated UAV flight state information, are used as boundary conditions for the ACADO inputs.
Consequently, the optimal control strategy and the corresponding energy cost for each path segment are computed. To clarify the optimization process implemented in this phase, we present a schematic flowchart in
Figure 9, which outlines the core steps of the ACADO-based energy minimization procedure. This includes system modeling, cost function specification, constraint setting, and solver execution, all aligned with the UAV’s dynamic characteristics.
Furthermore, a weighted directed graph G is built to store this consumed energy. It should be noted that the adjacency matrix of this energy consumption map is a non-symmetric matrix, mainly due to factors such as terrain features (such as different relative slope values between two points in space).
Phase 3: Energy-optimal path generation. Given the energy map, the problem of figuring out an energy-optimized coverage path is transformed into a graph traversal problem with minimum cost. For convenience, a weighted directed graph GE = (V, E) is utilized for terrain representation. Specifically, each edge is associated with the energy cost of the corresponding path segment and is a vertex set annotated with corresponding elevation values.
Discrete grids can be regarded as destination cities in the TSP model, and the energy cost between paths can be treated as distance between cities. Therefore, the TSP model can be used to solve the traversal problem. Provided the TSP is NP-hard, a GA can be employed for map traversal.
5. Experiments and Performance Evaluation
For performance evaluation, simulation experiments were conducted in the MATLAB@R2022b environment on an Intel(R) Core(TM) i7-9850H CPU with 12 GB memory. Some typical experimental results are shown in
Figure 10,
Figure 11,
Figure 12 and
Figure 13, with structural and state parameters used to generate them given in
Table 1 and
Table 2.
5.1. UAV Static Power
The static power mainly consists of consumption from the flight control board and sensing devices such as the camera and ultrasonic radar. For accurate measurement, we designed a SCM (Single Chip Microcomputer) system (STM8L151C8) equipped with a current sampling module. Therefore, the static power was acquired by setting the UAV to a standby state. Our hardware acquisition system was as follows.
The blue curve denotes the operational current recorded by the designed system, while the red line represents the measurement results after Kalman filtering. During the first few seconds, the UAV ran in an unloaded condition. For observation convenience, the motor power was freely modulated to increase the current measurements. From the above measurement, we can see that the data within the elliptical box retained nearly 0.2 A, which is the static working current of the UAV.
5.2. Coverage Path Planning Results
Accounting for validity, a DJI M100 UAV with a battery capacity of 80.84 Wh was employed for the experiment. The structural parameters were acquired from the operation manual, as follows:
The moment of inertia was obtained based on the CAD model officially provided, and the mechanical parameters of the fuselage as well as the motor-related parameters were acquired through measurements.
Due to feasibility concerns, some variables were constrained during the optimization process based on the theoretical restrictions. Specifically, the angular speed was bounded within 10000 rpm and linear velocity was limited to .
In order to verify the effectiveness of our algorithm, simulations were conducted on terrains of three typical scenarios in this section.
Table 3 lists the geographic information for the selected three terrains, including longitude and latitude ranges, and their corresponding areas.
To evaluate the performance of our proposed energy-optimized coverage path planning algorithm, we conducted a comparative study against the classical lawnmower-style approach under identical terrain scenarios [
30]. The terrain scenarios used in our simulations were uniformly modeled with a grid resolution of approximately 2.861 km
2/400, ensuring consistent spatial granularity across all experiments. Each UAV observation footprint was aligned with the normal vector of the corresponding terrain grid, allowing the onboard sensor to maintain perpendicularity to the surface for optimal image resolution. The sampling rate was set to 1/3, meaning that one image was captured for every three grid points, which balanced observation density and energy efficiency in our proposed planning framework.
Table 4 summarizes the Bezier grid resolution and GA settings used in each simulation scenario, including population size, generation count, and crossover/mutation probabilities. The comparisons include path length and total energy consumption.
Table 5 lists the results for the different coverage path planning methods (including both horizontal and vertical lawnmower paths) for three different terrains. In
Table 4, #1 represents a lawnmower path starting from the vertical direction, and #2 represents a lawnmower path starting from the horizontal direction. It can be seen that the proposed coverage path planning algorithm had significant differences in both path length and energy consumption compared to the two classic coverage path planning algorithms. This is because the UAV needed to constantly adjust the flight altitude, which increases energy consumption in the classic coverage path planning algorithms. Even for classic coverage paths with less height adjustment, they still had more energy consumption compared to the proposed algorithm, while the latter could ensure a path length equal to the former. This is because in the classic algorithm: (1) the additional energy consumption caused by the difference in path height was not completely eliminated, and the classic path still followed a zigzag-shaped regular route; (2) the classic path planning method did not quantitatively consider the impact of path length on UAV energy consumption. However, in our method, energy consumption was tightly derived from the immediate dynamics.
Figure 12 and
Figure 13 are similar to the scenario depicted in
Figure 11, except that the terrain was changed to be rougher. It should be noted that three unmanned aerial vehicles were used to cover the complete area in Scenario 3 considering the battery capacity of a single UAV. To demonstrate the universality and scalability of the algorithm, the takeoff positions of the three unmanned aerial vehicles were randomly assigned. As shown in
Table 4, the algorithm designed in this paper also showed superiority in energy consumption and path length compared to classic algorithms.
5.3. Real-World Deployment and Environmental Considerations
The selected terrain scenarios used in this study were representative regions randomly sampled from publicly available DEM datasets. All evaluations were conducted using simulations, incorporating realistic UAV dynamic parameters and authentic elevation data. While physical flight experiments were not performed at this stage, the proposed algorithm was designed with practical deployment in mind. In future work, we plan to transfer the computed coverage paths to real UAV platforms for field trials, validating their performance under operational conditions.
To ensure computational feasibility, the framework adopts a modular, three-stage structure. The most computationally demanding components—such as energy consumption modeling and global path optimization using genetic algorithms—are performed offline. Once the energy-optimal path is generated, it can be uploaded to an onboard flight controller, which executes the trajectory in real time with only light adjustments. This separation allows the system to operate on conventional UAV hardware with limited onboard computing capacity.
Currently, the energy estimation module includes a simplified aerodynamic disturbance model that accounts for a static effect of wind on rotor lift. However, dynamic variations in wind speed and direction are not yet explicitly integrated into the planning framework. In real-world scenarios, such environmental factors may cause fluctuations in energy consumption and impact flight stability. To improve robustness and applicability, future versions of the model will incorporate dynamic wind fields or real-time wind measurement into both the energy model and the control optimization process.