Next Article in Journal
Study of Annealing Temperature Effect on the Photovoltaic Performance of BiOI-Based Materials
Next Article in Special Issue
Detection and Tracking of Moving Pedestrians with a Small Unmanned Aerial Vehicle
Previous Article in Journal
Evaluating Litter Yield and Decomposition for Re-Vegetated Mangroves in a Subtropical Mudflat
Previous Article in Special Issue
Intelligent Human–UAV Interaction System with Joint Cross-Validation over Action–Gesture Recognition and Scene Understanding
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Development of Path Planning Tool for Unmanned System Considering Energy Consumption

Department of Electric Vehicle Engineering, Dongshin University, Jeollanam-do 58245, Korea
Appl. Sci. 2019, 9(16), 3341; https://doi.org/10.3390/app9163341
Submission received: 29 January 2019 / Revised: 5 August 2019 / Accepted: 13 August 2019 / Published: 14 August 2019
(This article belongs to the Special Issue Unmanned Aerial Vehicles (UAVs))

Abstract

:
Increasing the flight endurance of unmanned aerial vehicles (UAVs) has received attention recently. To solve this problem, two research topics have generally appeared: Shortest-path planning (SPP) and remaining-flying-range estimation. In this work, energy-efficient path planning by considering the distance between waypoint nodes, the minimum and maximum speed of the UAV, the weight of the UAV, and the angle between two intersecting edges is proposed. The performances of energy-efficient path planning (EEPP) and generic shortest-path planning are compared using extended-Kalman-filter-based state-of-charge and state-of-power estimation. Using this path-planning tool and considering energy consumption during flight operation, two different path plans can be obtained and compared in advance so that the operator can decide which path to choose by consulting a comparison chart. According to the experimental results, the EEPP algorithm results in 0.96% of improved SOC leftover and 11.03 ( W ) of lowered SOP compared to the SPP algorithm.
Keywords:
EEPP; EKF; path planning; SOC; SOP

1. Introduction

As unmanned aerial vehicle (UAV) technology matures, the longtime flight endurance capability of UAVs is gaining attention [1,2]. Because the energy density ( W / kg ) of the battery pack (in particular, Li-ion) is closely correlated with the overall flight time of the UAV, it is recommended to choose cells possessing as high an energy density as possible [3,4]. However, in contrast to electric vehicles (EVs), the operation times of electric aircraft, including the UAV, drastically decrease as the system weights increase. Hence, technology development for increasing UAV flight time has been delayed for a long time.
Lately, the EV industry has been growing quickly, and automotive industry researchers have focused their attention on accurately predicting the energy leftover so that the driving range can be extended. Accurate energy leftover monitoring (state of charge (SOC) estimation in the EV industry), aims to extend the driving range, and it is related to shortest-path planning (SPP), which is essential to saving energy. Both accurate SOC estimation and SPP should ultimately enhance the fuel economy of EVs, and the same philosophy applies to UAVs.
There have been numerous studies regarding path planning. Chang et al. proposed a method to achieve an effective delivery route for trucks carrying delivery drones with moving shift-weights-based K-means clustering and traveling-salesman-problem modeling [5]. Rubio et al. presented adaptive path planning for multiple UAVs using evolutionary computation combined with market-based cooperation strategies [6].
Further, there has been research regarding the accurate estimation of the remaining driving or flying range. Oliva et al. suggested a model-based approach by combining unscented filtering and Markov chains to predict the remaining driving range (RDR) [7]. Ondruska et al. proposed the efficient computation of RDR confidence level using a feature-based linear regression framework with a varying probabilistic attainability map in real-time [8]. Ferreira et al. presented an interaction method between a driver and EV to estimate EV range using a regression-model-based data mining approach [9].
Unlike the previously listed works, this study contributes to the energy-efficient path planning (EEPP) of the UAV to ultimately increase the flight endurance compared with the general SPP. To verify the improved fuel efficiency, the concept of the extended Kalman filter (EKF)-based SOC estimation method is adopted. To mimic cell behavior, a physics-based equivalent circuit model (ECM) is used [10,11,12,13].
The overall mission hierarchy to achieve an energy-efficient path proposed in this paper is as follows.
First, with the given satellite map, the EEPP algorithm generates the most energy-efficient path with step-by-step processes; (1) obstacle detection, (2) extract obstacle, (3) obstacle separation, (4) add buffer zone, (5) Voronoi, (6) filter out useless candidates, (7) 1D optimal control, and (8) SPP or EEPP selection. Here, the format of the output path has both Euclidean and GPS coordinates. In contrast to the SPP algorithm, which uses Dijkstra algorithm, the EEPP algorithm uses three step-by-step processes; (1) find all trajectory candidates, (2) calculate total unit energy consumption (UEC) of all trajectory candidates, and (3) find a trajectory having the minimum UEC.
Second, either flight simulation with equivalent circuit model (ECM) of the Li-Ion battery pack or the flight experiment with a real Li-Ion battery pack is performed using the previously obtained energy-efficient path and gives out the voltage and current profiles of each cell.
Third, a battery state estimator uses the voltage and current profiles of cells to calculate the SOC. In particular, the battery state estimator uses the EKF to calculate the SOC.
The flow of this paper is as follows: In Section 2, the overall mission hierarchy, including four subparts (path planning, flight simulation, flight experiment, and battery state estimation), is described. In Section 3, the path planning, including the SPP and EEPP algorithms, is explained. Section 4 covers the mathematical formulation of the UAV and battery pack. Section 5 presents the simulation and experimental setups, while Section 6 shows the simulation and experiment results. Section 7 contains the conclusion of this paper and describes future works.

2. Mission Hierarchy

Figure 1 depicts the overall mission hierarchy to achieve the most energy-efficient path and corresponding estimated SOC value.
First, using a Google Earth satellite photograph, and the takeoff and landing locations, the most energy-efficient path is determined by the path-planning part. Here, the path is saved in both the Cartesian system unit, T r a j e c t o r y x y z , and the geographic coordinate system unit, T r a j e c t o r y G P S .
Second, the achieved path is utilized for the indoor flight simulation and outdoor flight experiment to calculate the cell open-circuit voltage (OCV), v o c v , and load current, i o , data.
Third, the achieved cell voltage and current data are utilized for the battery state estimation to calculate the SOC. Both SOC S i m and SOC E x p are calculated to compare results.
With the achieved SOC value, one can finally determine whether the EEPP algorithm results in an energy-efficient path.

3. Path Planning

Figure 2 displays a magnified version of the path-planning part of Figure 1. This part results in either the shortest path or energy-efficient path. The detailed description of each subpart is given elsewhere [14].

3.1. SPP

The Dijkstra algorithm is used for the SPP algorithm, which utilizes the weights of each edge between nodes to calculate the minimum sum of the total distance from the start node to the goal node [15].
The overall flowchart of the SPP algorithm is shown in Figure 3.

3.2. EEPP

In contrast to the general SPP algorithm, which only accounts for the distance between nodes, the EEPP algorithm calculates the energy-efficient path by considering factors including the distance between nodes, the minimum and maximum speed of the UAV, and the weight of the UAV as shown in Figure 4.
The overall amount of battery consumption of the UAV, B o , would be
B o = B t + B h + B a + B n + B d + B c + B l ,
where B t is the battery consumption during takeoff ( W ), B h is the battery consumption during hovering ( W ), B a is the battery consumption during acceleration ( W ), B n is the battery consumption during normal flight ( W ), B d is the battery consumption during deceleration ( W ), B c is the battery consumption during the circular flight ( W ), and B l is the battery consumption during landing ( W ).
Because the takeoff and landing occur in a short period and the amount of battery consumption is insignificant compared with the total consumption, B t and B l are assumed to be zero, and Equation (1) becomes
B o B h + B a + B n + B d + B c .
If there are n e number of edges in the given path,
B o i = 1 n e ( B h + B a + B n + B d + B c ) .
From the equation of a single rotor helicopter in hover [16,17], the required hovering power of the UAV can be derived as
B h = m 3 2 g 3 2 ρ ζ n r ,
where m is the mass of the UAV ( kg ), g is the gravitational acceleration ( m / s 2 ), ρ is the fluid density of air ( kg / m 3 ), ζ is the total area of the spinning rotor disk ( m 2 ), and n r is the number of rotors (no unit).
The required power for the acceleration can be derived as
B a = 1 2 t a ( 0 t a a max d t ) 2 = 1 2 m a max 2 t a ,
where a m a x is the maximum acceleration ( m / s 2 ), and t a is the time taken for the acceleration ( s ).
The required power for the deceleration can be derived as
B d = 1 2 t d ( 0 t d a min d t ) 2 ,
where a m i n is the minimum acceleration ( m / s 2 ), and t d is the time taken for the deceleration ( s ). Here, with assumptions that t a = t d and a m a x = a m i n , one can conclude B a = B d .
The required power for the normal (constant speed) flight can be derived as
B n = 1 2 t n m v max 2 .
Here, v m a x is the maximum velocity ( m / s 2 ), and t n is the time taken for the normal flight ( s ).
The required power for the circular flight can be derived as
B c = 1 2 t c m v min 2
where v m i n is the minimum velocity ( m / s 2 ), and t c is the time taken for the circular flight ( s ).
The unknown value, t a , in Equation (5) can be calculated as
t a = t d = v max v min a max .
The unknown value, t n , in Equation (7) can be calculated as
1 2 t c = 1 v min { v min 2 a max tan ( π 2 α 2 ) } ,
therefore,
t c = 2 v min a max tan ( π 2 α 2 ) ,
where α is the intersection angle of two edges, which satisfies 0 α π .
Because
b 1 = t a v min + 1 2 t a ( v max v min ) , b 2 = v min 2 a max tan ( π 2 α 2 ) ,
the unknown value, t c , in Equation (8) can be calculated as
t n = 1 v max { W i 1 , W i 2 ( b 1 + b 2 ) } ,
where W i is the waypoint (no unit), b 1 is the distance in which the UAV accelerates or decelerates ( m ), and b 2 is the distance at which the UAV flies in a circular motion ( m ).
If Equations (4)–(13) are combined into Equation (3), then
B 0 = i = 1 n e [ m 3 2 g 3 2 ρ ζ n r + m a max ( v max v min ) + m v max 3 2 { W i 1 , W i 2 ( b 1 + b 2 ) } + m v min a max 4 tan ( π 2 α 2 ) ] .
To calculate the total unit energy consumption (UEC) ( Wh ), U b , Equation (14) is converted as
B 0 = t t 3600 i = 1 n e [ m 3 2 g 3 2 ρ ζ n r + m a max ( v max v min ) + m v max 3 2 { W i 1 , W i 2 ( b 1 + b 2 ) } + m v min a max 4 tan ( π 2 α 2 ) ]
where t t = t a + t n + t d + t c .
The overall flowchart of the EEPP algorithm is shown in Figure 5.

4. Mathematical Modeling of the UAV and Battery Pack

4.1. UAV

The configuration and governing control inputs of the quadrotor are described in Figure 6, where X E , Y E , and Z E represent earth coordinates, x q , y q , and z q represent quadrotor coordinates, and F i represents a thrust force generated by the i-th rotor in the indicated direction.
To extract current and voltage profiles along the predetermined path obtained from the previous section, an enhanced quadrotor dynamic model can be represented as
w 1 2 = b ( T + τ x + τ y + τ z ) 1 w 2 2 = l b ( τ x + τ z ) w 3 2 = l b ( T + τ y ) w 4 2 = d ( T + τ x τ y + τ z )
where T is the total upward thrust of the UAV ( N ), b is the thrust factor, and w i is the i-th rotor speed ( rad / s ), l is the lever length from the center of gravity (CG) to rotors ( m ), d is the drag factor, and τ x , τ y , and τ z are torques applied on the UAV’s body along x-, y-, and z-axes ( N · m ) [21,22].
Here, T , τ x , τ y , and τ z can be calculated using proportional–integral–derivative (PID) controllers as
T = k p T ( z * z ) + k i T t 1 t 2 ( z * z ) d t + k d T ( z ˙ * z ˙ ) + W / 4 b , τ x = k p x ( ϕ * ϕ ) + k i x t 1 t 2 ( ϕ * ϕ ) d t + k d x ( ϕ ˙ * ϕ ˙ ) , τ y = k p y ( θ * θ ) + k i y t 1 t 2 ( θ * θ ) d t + k d y ( θ ˙ * θ ˙ ) , τ z = k p z ( ψ * ψ ) + k i z t 1 t 2 ( ψ * ψ ) d t + k d z ( ψ ˙ * ψ ˙ ) ,
where k p , k i , and k d are PID controller gains, ϕ , θ , and ψ are roll, pitch, and yaw angles ( rad ), uppercase letter * represents reference data, and W is the UAV weight ( kg ).
The full quadrotor UAV dynamic model can be written as
x ¨ = ( cos ϕ sin θ cos ψ + sin ϕ sin ψ ) 1 m b ( w 1 2 + w 2 2 + w 3 2 + w 4 2 ) , y ¨ = ( cos ϕ sin θ sin ψ sin ϕ cos ψ ) 1 m b ( w 1 2 + w 2 2 + w 3 2 + w 4 2 ) , z ¨ = ( cos ϕ cos θ ) 1 m b ( w 1 2 + w 2 2 + w 3 2 + w 4 2 ) g , ϕ ¨ = θ ˙ ψ ˙ ( I y I z I x ) J r I x θ ˙ ( w 1 + w 3 w 2 w 4 ) + l I x b ( w 4 2 w 2 2 ) , θ ¨ = ϕ ˙ ψ ˙ ( I z I x I y ) J r I y ϕ ˙ ( w 1 + w 3 w 2 w 4 ) + l I y b ( w 3 2 w 1 2 ) , ψ ¨ = ϕ ˙ θ ˙ ( I x I y I z ) + 1 I z d ( w 2 2 + w 4 2 w 1 2 w 3 2 ) .
Here, J r is the rotor inertia ( kg · m 2 ).
Using the fact that power can be calculated by multiplying the thrust and velocity, one can calculate the required propulsive thrust power from the total upward thrust T in Equation (15) as
P = T v 0 .
Then, the load current can be calculated using
P v t = i 0
where v t is the terminal voltage ( V ), and i 0 is the load current ( A ).
The above equations are used for the operation of flight simulation, as shown in Figure 7.

4.2. Battery Pack

4.2.1. ECM

By using the two-ladder battery ECM and impedance voltage response, as shown in Figure 8, the v t can be determined as
v t = v o c v i 0 R 0 v c 1 v c 2 = v o c v i 0 R 0 i 0 R 1 ( 1 e Δ t / τ 1 ) i 0 R 2 ( 1 e Δ t / τ 2 )
where v o c v is the OCV voltage ( V ), R 0 is the resistor ( Ω ), v c i is the voltage across the i-th RC-network ( V ), τ i is the time constant ( s ), which is calculated as τ i = R i C i in which R i is the resistor ( Ω ) and C i is the capacitor ( F ) of the i-th ladder, and t is the time ( s ).

4.2.2. TBLI Parameter Identification

The ECM parameters, including R 0 , R 1 , C 1 , R 2 , and C 2 , are extracted at SOC 10% intervals using the high-performance pulse characterization current pattern, as shown in Appendix A [12]. Here, the table-based linear interpolation (TBLI) method is used to determine ECM parameters corresponding to varying SOC values. Although R 0 , R 1 , C 1 , R 2 , and C 2 are the functions of the SOC, C-rate, and temperature, only the SOC variance effect is considered in this research.

4.2.3. SOC and SOP State Estimation

The SOC estimation is performed using the EKF for each cell. For the EKF algorithm application, Equation (21) and SOC calculation based on current integration method are fused and converted into the discrete-time state space model as
[ v c 1 v c 2 z ] k + 1 = [ e Δ t / τ 1 0 0 0 e Δ t / τ 2 0 0 0 1 ] [ v c 1 v c 2 z ] k + [ R 1 ( 1 e Δ t / τ 1 ) R 2 ( 1 e Δ t / τ 2 ) η Δ t / ( 3600 Q n o r m ) ] k i 0 , k + [ n w 1 n w 2 n w 3 ] k , [ v c 1 v c 2 z ] k = [ 1 0 0 0 1 0 0 0 1 ] [ v c 1 v c 2 z ] k + [ 0 0 0 ] k i 0 , k + [ n v 1 n v 2 n v 3 ] k ,
where z is the SOC ( % / 100 ), Δ t is 0.1 s, and n w i and n v i are system and measurement noises ( V ), respectively. Here, the term z can be calculated as z ( t ) = Q init + η i 0 ( t ) / Q norm ( t ) where Q init is the initial battery capacity ( Ah ), η is the battery efficiency (assumed as 1), and Q norm is the current battery capacity ( Ah ).
With an initial estimation vector, x ^ 0 , and covariance vector, P 0 , the estimation vector and covariance vector can be propagated using
x ^ k + 1 = f ( x ^ k ) , P k + 1 = A k + 1 P k A k + 1 T + Q k .
The Kalman gain, K k , can be calculated as
K k + 1 = P k + 1 H k + 1 T ( H k + 1 P k + 1 H k + 1 T + R k + 1 ) 1 .
With the updated Kalman gain, K k + 1 , and updated measurement, z k + 1 , the updated estimation vector, x ^ k + 1 , can be calculated as
x ^ k + 1 = x ^ k + 1 + K k + 1 ( z k + 1 h k + 1 ( x ^ k + 1 ) ) ,
and the updated covariance vector, P k + 1 , can be calculated as
P k + 1 = P k + 1 K k + 1 H k + 1 P k + 1 .
The final SOC value of the battery pack is conservatively chosen as the minimum value of each cell as
S O C p a c k , k = min ( z k 1 , , z k n ) × 100 ,
where S O C p a c k , k is the SOC (%) of a battery pack at the k-th time step.
Regarding the state of power (SOP) estimation, the maximum discharging current, i m a x d i s , can be calculated as
i max d i s = C r a t e Q n o r m
where C r a t e is the C-rate of the cell (no unit).
The maximum discharging current considering the SOC, i m a x , k d i s , S O C ( i ) , can be calculated as
i max , k d i s , S O C ( i ) = { ( z k ( i ) 3 σ z , k ( i ) ) z min } C r a t e Q n o r m
where σ is the standard deviation of the cell SOCs ( % / 100 ), z m i n is the minimum SOC ( % / 100 ), η is the battery efficiency (assumed as one), and T k T o is the time flown from the beginning ( s ). Here, 3 σ was used for the 99.7% confidence interval of the cell SOC estimation values.
The maximum discharging current considering the cell voltage, i m a x , k d i s , v o l t ( i ) , can be calculated as
i max , k d i s , v o l t ( i ) = | i 0 , k | { v o c v ( z k ( i ) ) v min ( i ) } { 1 | v o c v ( z k ( i ) v min ( i ) ) | + 1 v max ( i ) { v o c v ( z k ( i ) ) v min ( i ) } } ,
where v o c v is the open-circuit voltage (OCV) (V), and v m i n is the minimum cell voltage (V). Here, v m i n ( 1 ) = 3.679   V , v m i n ( 2 ) = 3.660   V , v m i n ( 3 ) = 3.663   V , v m i n ( 4 ) = 3.626   V , v m a x ( 1 ) = 4.171   V , v m a x ( 2 ) = 4.176   V , v m a x ( 3 ) = 4.174   V , v m a x ( 4 ) = 4.174   V , z m i n = 0 , C r a t e = 18   C , N p = 1 , N s = 4 , and Q n o r m = 3.3   Ah .
With the previously found i m a x d i s , i m a x , k d i s , S O C ( i ) , and i m a x , k d i s , v o l t ( i ) , one can calculate i m a x , k d i s as
i max , k d i s = min ( i max d i s , i max , k d i s , S O C ( i ) , i max , k d i s , v o l t ( i ) )
and can calculate P m a x , k d i s ( i ) as
P max , k d i s ( i ) = i max , k d i s { v o c v ( z k ( i ) ) i max , k d i s | v o c v ( z k ( i ) ) v min i 0 , k | } .
Then, the maximum power that each cell could perform, P m a x d i s ( i ) , is calculated as
P max d i s ( i ) = v max ( i ) i max d i s
and compared with the maximum power that each cell performs during the discharging process, P m a x , k d i s ( i ) , as
P max , k d i s ( i ) = N p min ( N s P max d i s ( i ) , i = 1 N s i max , k d i s ( v o c v ( z k ( i ) ) i max , k d i s R d i s ( i ) ) )
where the total initial resistance of each cell, R d i s ( i ) , can be calculated as
R d i s ( i ) = v o c v ( z k ( i ) ) v min i 0 , k .
Figure 9 presents the flowchart of the battery state estimation [23].

5. Simulation and Experimental Setups

5.1. Simulation Setup

All simulations were performed with a quadrotor vehicle with initial system properties P o = [ 0 , 0 , 0 ]   m , θ o = [ 0 , 0 , 0 ]   rad , w o = [ 0 ,   0 ,   0 ]   rad / s , v o = [ 0 ,   0 ,   0 ]   m / s , a o = [ 0 ,   0 ,   0 ]   m / s 2 , v m i n 2 = 0   m / s , v m a x 2 = 5   m / s , a m a x 2 = 0.5   m / s 2 , A l t m i n = 3   m , and A l t n = 30   m , where P o , θ o , w o , v o , a o , A l t m i n , and A l t n are initial position, attitude, angular velocity, velocity, acceleration, minimum flight altitude, and normal flight altitude, respectively. Also, the time step used in MATLAB/Simulink is 0.01 s, installed in a desktop with the following system specifications; Intel Core i5-4590 CPU 3.40- GHz processor, 64-bit operating system, and 4.00- GB RAM. Every simulation flight was performed with a fully charged 4s 3300- mAh battery pack.

5.2. Experiment Setup

All experiments were performed with the parts shown in Figure 1—a PX4 Pro powered F450 quadrotor, shown in Figure 10a; Pixhawk 2.1 flight controller, as in Figure 10b; QGroundControl (QGC), shown in Figure 10c; Pixhawk 2.1 Here + RTK, as in Figure 10d; eLogger V4 voltage and current data logging system, as shown in Figure 10e; and a 4s 3300- mAh battery pack, shown in Figure 10f—for the outdoor autopilot experiment with a previously achieved energy-efficient path. In particular, the Pixhawk 2.1 Here + RTK is used for the centimeter-level autopilot path following accuracy.
The overall experiment setup is presented in Figure 11. On the day of the experiment, the wind speed was approximately 2 m / s .
For the experiment, the SPP and EEPP trajectories represented as the Cartesian system unit, T r a j e c t o r y x y z , obtained from the path-planning algorithm shown in Figure 2 are converted into the geographic coordinate system unit, T r a j e c t o r y G P S . The detailed description can be found in previous work [24].
In particular, the waypoint list of T r a j e c t o r y G P S is saved as a text file following the Pixhawk waypoint file format, as depicted in Table 1 [25]. For the waypoints lists of SPP and EEPP trajectories, see Appendix B.

6. Simulation and Experimental Results

6.1. Simulation Result

From the flight simulation, the obtained current and voltage profiles are shown in Figure 12. Here, negative current represents discharging.
Energy consumption comparison results of the SPP and EEPP algorithms are listed in Table 2 and Figure 13.
The percentage difference between the actual values of SPP and EEPP is shown in Table 3 and Figure 14. According to the result, the SOC leftover is larger and the SOP peak is lower when using SPP.

6.2. Experimental Result

From the flight experiment, the obtained current and voltage profiles are shown in Figure 15.
Energy consumption comparison results of the SPP and EEPP algorithms are shown in Table 4 and Figure 16.
The percentage difference between the actual values of SPP and EEPP is shown in Table 5 and Figure 17. According to the result, the SOC leftover is larger and the SOP peak is lower when using EEPP.
The overall reference, simulation, and experiment flight trajectories of the SPP and EEPP algorithms are drawn on Google Earth, as shown in Figure 18. Here, yellow polygons represent imaginary obstacles that the UAV should avoid. The blue line represents the reference trajectory that the UAV should follow. The red line represents the simulation flight trajectory. The green line represents the experiment flight trajectory.

7. Conclusions

In this work, the EEPP algorithm is proposed and its performance is compared to the generic SPP algorithm using EKF-filter-based SOC estimation. Using the proposed path planning tool, two different path plans can be obtained and compared in advance. According to the experimental results, the EEPP algorithm results in an energy-efficient path.
Regarding the SOC, 0.96% is saved when using the EEPP algorithm, and this implies that the fuel economy is improved. Regarding the SOP, 11.03 ( W ) is lowered, and this implies that the internal shock of the battery pack is reduced. Although the rate of improved fuel economy and internal shock of the battery pack is not as good in this study, these two key factors can be enhanced in mission planning with longer trajectories. Here, the difference between simulation and experiment results appears to be caused by factors such as environmental effects and a less mature quadrotor simulation model.
In the future, instead of 2D path planning, 3D path planning with an enhanced EEPP algorithm are planned to greatly improve the fuel economy of the UAV. Also, rather than the offline method presented here, the development of online real-time energy-efficient path planning based on the probabilistic method is planned.

Acknowledgments

This work was supported by the JeonNam TechnoPark (JNTP) through the project (B0080802000131).

Conflicts of Interest

The author declares no conflict of interest.

Appendix A

Figure A1. ECM parameter values: (a) R0; (b) R1; (c) C1; (d) R2; (e) C2.
Figure A1. ECM parameter values: (a) R0; (b) R1; (c) C1; (d) R2; (e) C2.
Applsci 09 03341 g0a1

Appendix B

Figure A2. Waypoint list of SPP and EEPP trajectories: (a) SPP; (b) EEPP.
Figure A2. Waypoint list of SPP and EEPP trajectories: (a) SPP; (b) EEPP.
Applsci 09 03341 g0a2

References

  1. Kim, K.; Kim, T.; Lee, K.; Kwon, S. Fuel Cell System with Sodium Borohydride as Hydrogen Source for Unmanned Aerial Vehicles. J. Power Sources 2011, 196, 9069–9075. [Google Scholar] [CrossRef]
  2. Gao, X.; Hou, Z.; Guo, Z.; Fan, R.; Chen, X. The Equivalence of Gravitational Potential and Rechargeable Battery for High-Altitude Long-Endurance Solar-Powered Aircraft on Energy Storage. Energy Convers. Manag. 2013, 76, 986–995. [Google Scholar] [CrossRef]
  3. Khaligh, A.; Li, Z. Battery, Ultracapacitor, Fuel Cell, and Hybrid Energy Storage Systems for Electric, Hybrid Electric, Fuel Cell, and Plug-In Hybrid Electric Vehicles: State of the Art. IEEE Trans. Veh. Technol. 2010, 59, 2806–2814. [Google Scholar] [CrossRef]
  4. Noorden, R.A. Better Battery—Chemists are Reinventing Rechargeable Cells to Drive Down Costs and Boost Capacity. Nature 2014, 507, 26–28. [Google Scholar] [PubMed]
  5. Chang, Y.S.; Lee, H.J. Optimal Delivery Routing with Wider Drone-Delivery Areas Along a Shorter Truck-Route. Expert Syst. Appl. 2018, 104, 307–317. [Google Scholar] [CrossRef]
  6. Rubio, J.C.; Vagners, J.; Rysdyk, R. Adaptive Path Planning for Autonomous UAV Oceanic Search Missions. In Proceedings of the AIAA 1st Intelligent Systems Technical Conference, Chicago, IL, USA, 20–22 September 2004. [Google Scholar]
  7. Oliva, J.A.; Weihrauch, C.; Bertram, T. A Model-Based Approach for Predicting the Remaining Driving Range in Electric Vehicles. In Proceedings of the Annual Conference of the Prognostics and Health Management Society, New Orleans, LA, USA, 14–17 October 2013. [Google Scholar]
  8. Ondruska, P.; Posner, I. Probabilistic Attainability Maps: Efficiently Predicting Driver-Specific Electric Vehicle Range. In Proceedings of the IEEE Intelligent Vehicles Symposium Proceedings, Dearborn, MI, USA, 8–11 June 2014. [Google Scholar]
  9. Ferreira, J.C.; Monteiro, V.; Afonso, J.L. Dynamic Range Prediction for an Electric Vehicle. In Proceedings of the EVS27 International Battery, Hybrid and Fuel Cell Electric Vehicle Symposium, Barcelona, Spain, 17–20 November 2013. [Google Scholar]
  10. Plett, G.L. Battery Management Systems, II: Equivalent-Circuit Methods, 2nd ed.; Artech House Publishers: Norwood, MA, USA, 2014. [Google Scholar]
  11. Sharma, O.P. Analysis and Parameter Estimation of Li-Ion Batteries Simulations for Electric Vehicles. In Proceedings of the American Control Conference, San Francisco, CA, USA, 29 June–21 July 2011. [Google Scholar]
  12. Thanagasundram, S.; Arunachala, R.; Makinejad, K.; Teutsch, T.; Jossen, A. A Cell Level Model for Battery Simulation. In Proceedings of the European Electric Vehicle Congress, Brussels, Belgium, 20–22 November 2012. [Google Scholar]
  13. Plett, G.L. Extended Kalman Filtering for Battery Management Systems of LiPB-based HEV Battery Packs–Part 3. State and Parameter Estimation. J. Power Sources 2004, 134, 277–292. [Google Scholar] [CrossRef]
  14. Jung, S.; Ariyur, K.B. Robustness for Scalable Autonomous UAV Operations. Int. J. Aeronaut. Space Sci. 2017, 18, 767–779. [Google Scholar] [CrossRef]
  15. Jung, S.; Ariyur, K.B. Scalable Autonomy for UAVs. In Proceedings of the AIAA Infotech@Aerospace, St. Louis, MO, USA, 29–31 March 2011. [Google Scholar]
  16. Leishman, J.G. Principles of Helicopter Aerodynamics, 2nd ed.; Cambridge University Press: Cambridge, UK, 2002. [Google Scholar]
  17. Dorling, K.; Heinrichs, J.; Messier, G.G.; Magierowski, S. Vehicle Routing Problems for Drone Delivery. IEEE Trans. Syst. Man Cybern. Syst. 2017, 47, 70–85. [Google Scholar] [CrossRef]
  18. Dubins, L.E. On Curves of Minimal Length with a Constraint on Average Curvature and with Prescribed Initial and Terminal Positions and Tangent. Am. J. Math. 1957, 79, 497–516. [Google Scholar] [CrossRef]
  19. Tsourdos, A.; White, B.; Shanmugavel, M. Cooperative Path Planning of Unmanned Aerial Vehicles, 1st ed.; John Wiley & Sons: Chichester, UK, 2011. [Google Scholar]
  20. Jung, S.; Ariyur, K.B. Enabling Operational Autonomy for UAVs with Scalability. AIAA J. Aerosp. Inf. Syst. 2013, 10, 516–529. [Google Scholar]
  21. Robotics, P.C. Vision and Control: Fundamental Algorithms in MATLAB; Springer: Berlin/Heidelberg, Germany, 2011. [Google Scholar]
  22. Jung, S.; Ariyur, K.B. Strategic Cattle Roundup using Multiple Quadrotor UAVs. Int. J. Aeronaut. Space Sci. 2017, 18, 315–326. [Google Scholar] [CrossRef]
  23. Jung, S.; Jeong, H. Extended Kalman Filter-Based State of Charge and State of Power Estimation Algorithm for Unmanned Aerial Vehicle Li-Po Battery Pack. Energies 2017, 10, 1237. [Google Scholar] [CrossRef]
  24. Steven, B.L.; Lewis, F.L. Aircraft Control and Simulation; John Wiley & Sons: New York, NY, USA, 2003. [Google Scholar]
  25. QGroundControl—Waypoint Protocol. Available online: https://goo.gl/SqVVzd (accessed on 28 June 2018).
Figure 1. Mission hierarchy.
Figure 1. Mission hierarchy.
Applsci 09 03341 g001
Figure 2. Flowchart of path planning.
Figure 2. Flowchart of path planning.
Applsci 09 03341 g002
Figure 3. Flowchart of shortest-path planning (SPP) algorithm.
Figure 3. Flowchart of shortest-path planning (SPP) algorithm.
Applsci 09 03341 g003
Figure 4. Analysis of flight path using the Dubins path method [18,19,20].
Figure 4. Analysis of flight path using the Dubins path method [18,19,20].
Applsci 09 03341 g004
Figure 5. Flowchart of the energy-efficient path planning (EEPP) algorithm.
Figure 5. Flowchart of the energy-efficient path planning (EEPP) algorithm.
Applsci 09 03341 g005
Figure 6. Quadrotor configuration.
Figure 6. Quadrotor configuration.
Applsci 09 03341 g006
Figure 7. Flowchart of the EEPP algorithm.
Figure 7. Flowchart of the EEPP algorithm.
Applsci 09 03341 g007
Figure 8. Battery modeling; (a) two-ladder battery equivalent circuit model (ECM); (b) impedance voltage response.
Figure 8. Battery modeling; (a) two-ladder battery equivalent circuit model (ECM); (b) impedance voltage response.
Applsci 09 03341 g008
Figure 9. Flowchart of battery state estimation.
Figure 9. Flowchart of battery state estimation.
Applsci 09 03341 g009
Figure 10. Flight experiment parts: (a) F450 quadrotor, (b) Pixhawk 2.1, (c) QGroundControl (QGC), (d) Pixhawk 2.1 Here+ RTK, (e) eLogger V4, and (f) 4s 3300- mAh battery pack.
Figure 10. Flight experiment parts: (a) F450 quadrotor, (b) Pixhawk 2.1, (c) QGroundControl (QGC), (d) Pixhawk 2.1 Here+ RTK, (e) eLogger V4, and (f) 4s 3300- mAh battery pack.
Applsci 09 03341 g010
Figure 11. Flight experiment setup.
Figure 11. Flight experiment setup.
Applsci 09 03341 g011
Figure 12. Current and voltage profiles (simulation): (a) Current profile and (b) voltage profile.
Figure 12. Current and voltage profiles (simulation): (a) Current profile and (b) voltage profile.
Applsci 09 03341 g012
Figure 13. State of charge (SOC) and state of power (SOP) comparison (simulation): (a) SOC and (b) SOP.
Figure 13. State of charge (SOC) and state of power (SOP) comparison (simulation): (a) SOC and (b) SOP.
Applsci 09 03341 g013
Figure 14. The comparison results in percentage (simulation).
Figure 14. The comparison results in percentage (simulation).
Applsci 09 03341 g014
Figure 15. Current and voltage profiles (experiment): (a) Current profile and (b) voltage profile.
Figure 15. Current and voltage profiles (experiment): (a) Current profile and (b) voltage profile.
Applsci 09 03341 g015
Figure 16. SOC and SOP comparison (experiment): (a) SOC and (b) SOP.
Figure 16. SOC and SOP comparison (experiment): (a) SOC and (b) SOP.
Applsci 09 03341 g016
Figure 17. The comparison results in percentage (experiment).
Figure 17. The comparison results in percentage (experiment).
Applsci 09 03341 g017
Figure 18. Reference, simulation, and experiment flight trajectories of: (a) SPP algorithm (2D), (b) EEPP algorithm (2D), (c) SPP algorithm (3D), and (d) EEPP algorithm (3D).
Figure 18. Reference, simulation, and experiment flight trajectories of: (a) SPP algorithm (2D), (b) EEPP algorithm (2D), (c) SPP algorithm (3D), and (d) EEPP algorithm (3D).
Applsci 09 03341 g018
Table 1. Waypoint file format.
Table 1. Waypoint file format.
QGC WPL < VERSION>
<INDEX><CURRENT WP><COORD FRAME><COMMAND><PARAM1><PARAM2>
<PARAM3><PARAM4><PARAM5/X/< PARAM6/Y/< PARAM5/Z/<AUTOCONTINUE>
LONGITUDE>LATITUDE >ALTITUDE >
Table 2. Comparison result (simulation).
Table 2. Comparison result (simulation).
SPPEEPP
Prediction ValueActual ValuePrediction ValueActual Value
Total Trajectory Distance ( m )204.63193.30208.76201.08
Min Speed of UAV ( m / s )0000
Max Speed of UAV ( m / s )50.3450.33
Weight of UAV ( kg )1.411.411.411.41
Total UEC ( Wh )4.4711.545.7111.99
Algorithm Run Time ( s )11.5120.34
SOC Leftover ( % )72.0070.80
SOP Peak ( W )566.20543.47
Table 3. Comparison results in percentage (simulation).
Table 3. Comparison results in percentage (simulation).
S P P E E P P S P P × 100   ( % )
Total Trajectory Distance ( m )−4.02
Min. Speed of UAV ( m / s )0
Max. Speed of UAV ( m / s )2.94
Weight of UAV ( kg )0
Total UEC ( Wh )−3.90
Algorithm Run Time ( s )−76.72
SOC Leftover ( % )1.67
SOP Peak ( W )4.01
Table 4. Energy consumption comparison (experiment).
Table 4. Energy consumption comparison (experiment).
SPPEEPP
Prediction ValueActual ValuePrediction ValueActual Value
Total Trajectory Distance ( m )205.75174.11212.17183.64
Min. Speed of UAV ( m / s )0000
Max. Speed of UAV ( m / s )54.2054.61
Weight of UAV ( kg )1.411.411.411.41
Total UEC ( Wh )4.477.945.717.41
Algorithm Run Time ( s )11.5120.34
SOC Leftover ( % )83.7384.53
SOP Peak ( W )448.85498.37
Table 5. Comparison result in percentage (experiment).
Table 5. Comparison result in percentage (experiment).
S P P E E P P S P P × 100   ( % )
Total Trajectory Distance ( m )−5.47
Min. Speed of UAV ( m / s )0
Max. Speed of UAV ( m / s )−9.76
Weight of UAV ( kg )0
Total UEC ( Wh )6.68
Algorithm Run Time ( s )−76.72
SOC Leftover ( % )−0.96
SOP Peak ( W )−11.03

Share and Cite

MDPI and ACS Style

Jung, S. Development of Path Planning Tool for Unmanned System Considering Energy Consumption. Appl. Sci. 2019, 9, 3341. https://doi.org/10.3390/app9163341

AMA Style

Jung S. Development of Path Planning Tool for Unmanned System Considering Energy Consumption. Applied Sciences. 2019; 9(16):3341. https://doi.org/10.3390/app9163341

Chicago/Turabian Style

Jung, Sunghun. 2019. "Development of Path Planning Tool for Unmanned System Considering Energy Consumption" Applied Sciences 9, no. 16: 3341. https://doi.org/10.3390/app9163341

Note that from the first issue of 2016, this journal uses article numbers instead of page numbers. See further details here.

Article Metrics

Back to TopTop