Skip to main content
  • Original Paper
  • Open access
  • Published:

Feasible path planning for fixed-wing UAVs using seventh order Bézier curves

Abstract

This study presents a novel methodology for generating smooth feasible paths for autonomous aerial vehicles in the three-dimensional space based on a variation of the Spatial Quintic Pythagorean Hodographs curves. Generated paths must satisfy three main constraints: (i) maximum curvature, (ii) maximum torsion and (iii) maximum climb (or dive) angle. A given path is considered to be feasible if the main kinematic constraints of the vehicle are not violated, which is accomplished in our approach by connecting different waypoints with seventh order Bézier curves. This also indirectly insures the smoothness of the vehicle’s acceleration profile between two consecutive points of the curve and of the entire path by controlling the curvature values at the extreme points of each composing Bézier curve segment. The computation of the Pythagorean Hodograph is cast as an optimization problem, for which we provide an algorithm with fast convergence to the final result. The proposed methodology is applicable to vehicles in three-dimensional environments, which can be modeled presuming the imposed constraints. Our methodology is validated in simulation with real parameters and simulated flight data of a small autonomous aerial vehicle.

1 Introduction

Path planning is a fundamental task for any kind of autonomous mobile robot. Even though it might be possible for such robots to traverse their environments solely in a reactive way, the competence of planning and computing paths is an important feature for a large number of vehicles and a great variety of tasks.

In spite of its relevance, there are not that many works dealing with vehicles that move in three-dimensional space. Furthermore, and less obvious, the increased freedom provided by a less restrictive environment poses many new challenges. Current problems, such as path planning for multiple Unmanned Aerial Vehicles (UAVs) and Autonomous Underwater Vehicles (AUVs), still call for better solutions.

The interest and research in UAVs have been increasingly growing, specially due to the decrease in cost, weight, size and performance of actuators, sensors and processors. As far as the capacity of covering a broad set of relevant applications is concerned, UAVs clearly have their niche of applications, which cannot be fulfilled by other types of mobile robots. One of their main advantages is in several types of monitoring and surveillance tasks, where they are able to navigate over large areas obviously faster than land vehicles, with a privileged view from above.

As their availability increases, so does the possibility of having multiple of such vehicles traversing a given volume of the air space. Therefore, there is a growing need to study and develop techniques for the generation of safe and feasible paths considering specific constraints of the different types of aerial robots. Robotics literature describes several such algorithms. However, one fundamental feature of a path planning algorithm is to insure that the vehicle will be able to execute the generated path, which means that limitations on vehicle movements must be obeyed (i.e., nonholonomic constraints). For example, curvature radius is one such restriction imposed on paths generated for typical Ackerman steering vehicles, since the sliding constraint of wheels dictates that the component of the wheel’s motion orthogonal to the wheel plane must be zero.

1.1 Unmanned Aerial Vehicles

UAVs can be divided into at least three categories: rotary-wing aircrafts (e.g., helicopters and quadrotors), aerostatic aircrafts (such as airships and hot air balloons) and fixed-wing aircrafts (airplanes). The technique described in this text will have its focus mostly in a fixed-wing UAV, however, without the loss of generality, it can be applied to other types of vehicles (even ground and underwater robots).

Mobile robots frequently present some types of motion constraints that must be solved by path planning algorithms. Fixed-wing aerial vehicles, for example, present dynamic behaviors where position and orientation variables are completely interdependent, which in turn imposes several nonholonomic constraints to the system. These constraints are embedded, for example, in the maximum values of lateral acceleration that can be imposed by those vehicles, which can be translated by the smallest curvature radius that the vehicle can perform in space. Fixed-wing aircrafts present also other limitations on their mobility such as maximum climb or dive angles and minimum speed.

One of the fundamental motion constraints of a vehicle moving in three-dimensional space is the climb (or dive) angle. This basically refers to the rate of change in altitude, which may be severely restricted for some types of aerial vehicles. There are aircrafts, for example, that have a very small angle of attackFootnote 1 which is often limited by the control action of the guidance system. Other examples are underwater vehicles for which the climb angle is confined to short boundaries subtended by the configuration of their actuators and control surfaces.

In this study, a novel path planning methodology based on a variation of the Spatial Quintic Pythagorean Hodograph curves is proposed. The method takes into account three major motion constraints of a fixed-wing UAV in the three-dimensional space: maximum curvature, maximum torsion and maximum climb angle, but with special emphasis on the cases of limited climb (or dive) rates.

For the special case of fixed-wing aircrafts, the main goal is to guarantee stall-free maneuvers. The general idea behind the method is to model the path as a seventh order spatial Bézier curve which is iteratively computed. This path satisfies all the required constraints and, at the same time, with a satisfactory length. It also guarantees smoothness of the acceleration profile of the entire path by controlling the curvature values of the curves that composes it. An algorithm with fast convergence to the final result is also described and evaluated, since the Pythagorean Hodograph computation is cast as an optimization problem.

Section 2 constitutes an overview of the related work in the literature, where the theoretical foundations of this work is discussed. Then, Sect. 3 presents the methodology, where the problem is formally posed along with the improvements, and the proposed optimization algorithm to calculate the paths. Results obtained for a virtual UAV and for a simulated model of an actual UAV called AqVS developed at Universidade Federal de Minas Gerais are presented are discussed in Sect. 4. Finally, Sect. 5 concludes the article and points to future research directions.

2 Related work

One of the most important factors for path planning is to produce paths that are feasible of being executed by the targeted vehicle. This means that during path generation, the movement restrictions of the vehicle must be considered (e.g., nonholonomic constraints). This problem has been thoroughly studied, and the literature available in the area abounds specially for manipulators and two-dimensional mobile robots [18].

Some approaches of single vehicle path planning in less restrictive environments can be found in the literature [17, 23]. Voronoi diagrams [5, 7] and Vector Field [13, 19] are widely used techniques to generate paths for aerial robots with such constraints. However, very few works deal with the three-dimensional case.

Rapidly-exploring Random Trees (RRTs) are also widely used, especially for solving the path problem for nonholonomic vehicles in broader scenarios. In [6], the authors present trajectory planning for both an automobile and a spacecraft. In the latter example, even though an obstacle-free environment is considered, the focus remains on the motion constraints that need to be satisfied for a safe entry of the spacecraft in Earth’s atmosphere. Other works like [14] use this technique to generate nominal paths for miniature aerial vehicles. The authors present an algorithm for terrain avoidance for the air platform BYU/MAV, which, among other things, enables the vehicle to fly through canyons and urban environments. And although these studies consider some restrictions inherent to aerial robots, none of them take into account important constraints such as climbing rate and spatial torsion on fixed-wing vehicles.

There are also some works that only deal with the generation of safe paths for vehicles assuming an obstacle-free environment. Among those is the work of [22], which presents one of the first methods based on the Pythagorean Hodograph (a special type of Bézier curve) for the path planning for UAVs. The author discusses numerous advantages of using such a curve in the modeling of paths for vehicles with nonholonomic constraints.

In this study, we use a special technique to compute feasible paths, called PH Interpolation. The PH provides several properties that can be considered advantageous in the path planning problem such as uniformity in the parametric distribution, continuous parametric speed and capability to admit real-time interpolation. More details about these features will be detailed later.

The PH curves were presented for the first time for the two-dimensional case by Farouki and Sakkalis [12]. Initially, only fifth order curves were considered since they are much simpler. A Hermite Interpolation algorithm was proposed in [11], where the authors demonstrated that there are four possible solutions for the curve in \(\mathbb{R }^2\) space. The chosen solution is the one that minimizes the cost function (bending energy function), based on the integral of the modulus of the curvature function (torsion in their case is assumed to be null).

The three-dimensional case was initially presented by Farouki et al. [10]. In [9], the quaternion representation was used to deal with Hermite Interpolation issues, and the authors claim that the infinite cardinality of the set of solutions for the problem is due to an underdetermined system of equations that are needed to compute the final curve.

In order to significantly reduce the solution space, the authors suggest assigning a small set of values to the unknown variables, reducing the number of possible solutions. The best solution is obtained from the minimization of the cost function defined in [10], that is based on the integral of the sum of the curvature and torsion functions modulus of each curve.

Two of the first works involving the use of PH curve for robot path planning are Shanmugavel et al. [22] for the two-dimensional case and in [21] for the three-dimensional case. In order to guarantee that the PH did not violate the kinematic constraints of the vehicle, the authors proposed a modification where the PH curve was computed iteratively. For every step of the algorithm, gain values were increased until \({\vec{r}}(t)\) becomes realizable. However, only the curvature and torsion constraints were considered. As it will be shown later, for vehicles with bounded climb (or dive) angle values, it is not possible to minimize the problem for the spatial cost functions.

In [2], the authors present an improved cost function based on [10] that considers all three constraints: curvature, torsion and climb angle. This study represents an improvement with respect to [21] since it considers the limitation in the climb angle of fixed-wing UAVs. A new cost function, computationally less expensive, was presented in [1], where only the climb angle constraint is used in the minimization function.

Other works, such as [4, 22], present the application of PH curves in the path planning and trajectory planning problem for multiple vehicles. Both, however, deal only with the two-dimensional case, without taking into account torsion and climb angle constraints.

The adaptation of the fifth order PH curve was firstly proposed by Alves Neto et al. [3]. The main objective was to create Bézier curves with continuous curvature profiles among several waypoints in \(\mathbb{R }^2\). That work presents a methodology based on a variation of the RRTs that generate feasible trajectories for autonomous vehicles with nonholonomic constraints in environments with obstacles.

In this study, we expand to \(\mathbb{R }^3\) the methodology described in [3], keeping the continuity in the curvature profile and taking into account all three constraints, namely curvature, torsion and climb (or dive) angle. Our method also allows the connection of two different curves without violating the constraints of the whole path. We propose a new cost function that will include just the climb angle constraint, indirectly ensuring the others constraints, that effectively reduce the computational cost of the method. We also present an optimization function based on the bending energy function in order to minimize the total path length.

3 Methodology

In this section, we initially present the theoretical formalization of our problem. We describe mathematically the robot’s constraints and the Pythagorean Hodograph formulation. We then provide the foundations for calculating the PH curves for which the union of several paths keeps the continuous curvature profile in the final plan. Finally, we show an optimization problem formulation that will allow us to generate short paths that are feasible by the robot.

3.1 Problem formalization

We assumed an obstacle-free environment, where the only restrictions for navigation are imposed by its own kinematic constraints. A pair of waypoints, \({\langle {p_{i}},{p_{f}} \rangle }\), mark the initial and final poses, respectively, which define the position and (partially) the orientation of the robot at the extreme points of a single path. This path may be defined mathematically as a parametric curve \({\vec{r}}(t)\) in \(\mathbb{R }^3\), where \(t\) is a parameter that continuously varies in \(\mathbb{R }\). In this manner, planning a path between two waypoints can be formally posed as:

$$\begin{aligned} \begin{aligned}&{p_{i}}(x_{i},y_{i},z_{i},\psi _{i},\theta _{i})={\vec{r}}(t_{i}), \\&{p_{f}}(x_{f},y_{f},z_{f},\psi _{f},\theta _{f})={\vec{r}}(t_{f}), \end{aligned} \end{aligned}$$
(1)

where \(t_{i}\) and \(t_{f}\) are the initial and final values, respectively, for the curve parameter \(t\).

Each waypoint \({p_{}}\) is described by three-position (x, y, z) and two-orientation (\(\psi ,\theta \)) variables. The variable \(\psi \) is an angle that describes the waypoint orientation parallel to the XY plane in relation to the \(\mathbf X \) axis. We define \(\theta \) as the waypoint orientation measured in relation to the \(\mathbf X \) axis and parallel to XZ plane. Here, we must say that the roll angle (\(\phi \) in conventional aeronautical notation) is not considered, since it has no physical sense regarding the curve in the 3D space. In other words, the curve represents a trajectory to be followed, not the actual trajectory being executed by the robot.

Now, given a sequence of \({P}\) waypoints, \(\mathcal{P }={\langle {p_{1}},\ldots ,{p_{{P}}} \rangle }\), that must be reached by the robot, a total feasible path \({\mathcal{R }}\) will be the union of each \({\vec{r}}(t)\) calculated between each sequence pair in \(\mathcal{P }\). This is formalized in Eq. (2):

$$\begin{aligned} {\mathcal{R }}=\left\{ \bigcup _{k=1}^{{P}-1}{\vec{r}}_k \in \mathbb{R }: {\vec{r}}_k \;\mathrm{is\; a\; single\; feasible\; path}\right\} . \end{aligned}$$
(2)

3.1.1 Constraints

In order to be considered a feasible path for a given robot, the curve \({\vec{r}}(t)\) must respect the kinematic constraints of the vehicle. The three motion constraints mentioned before are the maximum curvature (\({\kappa _{\mathrm{max}}}\)), the maximum torsion (\({\tau _{\mathrm{max}}}\)) and the maximum climb (or dive) angle (\({\theta _{\mathrm{max}}}\)) that are realizable by the robot in the three-dimensional space. It is possible to completely define a curve in \(\mathbb{R }^3\) as a function of curvature and torsion only [16].

As far as the underlying physics of the system is concerned, the curvature may be defined as a quantity that is directly proportional to the lateral acceleration of the robot in the space. The value of \({\kappa _{\mathrm{max}}}\) is inversely proportional to the minimum curvature radius (\({\rho _{\mathrm{min}}}\)) of the curve that the vehicle is capable of executing, which is also proportional to the maximum lateral acceleration of the vehicle.

The curvature function of a curve in the \(n\)-dimensional space is given by Eq. (3):

$$\begin{aligned} \kappa (t)=\frac{|\dot{{\vec{r}}}(t)\times \ddot{{\vec{r}}}(t)|}{|\dot{{\vec{r}}}(t)|^3} . \end{aligned}$$
(3)

The torsion of the curve is directly proportional to the angular moment (roll moment) of the robot, which is also physically limited. Thus, the value of \({\tau _{\mathrm{max}}}\) is given as a function of the minimum torsion radius (\({\sigma _{\mathrm{min}}}\)) that the robot can describe in the space. The torsion of a curve can be computed by Eq. (4):

$$\begin{aligned} \tau (t)=\frac{[\dot{{\vec{r}}}(t)\times \ddot{{\vec{r}}}(t)]\cdot \dddot{{\vec{r}}}(t)}{|\dot{{\vec{r}}}(t)\times \ddot{{\vec{r}}}(t)|^2} . \end{aligned}$$
(4)

Finally, the climb (or dive) angle is proportional to the ascent (or descent) rate of the robot in the three-dimensional space. In other words, it captures the variation of the altitude (z) throughout the path. For vehicles with limited values of inclination angle, such as fixed-wing aircrafts, this is a key variable. The value of \({\theta _{\mathrm{max}}}\) may depend on many factors, as the translation speed and the spatial orientation of the robot. The climb angle function of a three-dimensional parametric curve is given by Eq. (5):

$$\begin{aligned} \theta (t)=\text{ tan}^{-1} \left(\frac{\dot{z}(t)}{\sqrt{\dot{x}(t)^2+\dot{y}(t)^2}}\right) . \end{aligned}$$
(5)

It is possible to show that this function is mathematically limited to the interval \([-\tfrac{\pi }{2},\tfrac{\pi }{2}]\). The same is true for the value of \({\theta _{\mathrm{max}}}\).

Finally, the path \({\vec{r}}(t)\) is valid for a vehicle if the modulus of the curvature, torsion and climb angle functions are smaller than the vehicle’s absolute maximum values, as stated in Eq. (6):

$$\begin{aligned} {\vec{r}}(t)&\!\!=\{{\vec{r}}\in \mathbb{R }: |\kappa (t)|\!<\!{\kappa _{\mathrm{max}}},|\tau (t)|\!<\!{\tau _{\mathrm{max}}},|\theta (t)| \!<\!{\theta _{\mathrm{max}}}\}. \nonumber \\ \end{aligned}$$
(6)

It is important to note that the above maximum values result from the dynamic constraints of the vehicle. Therefore, since our kinematic approach guarantees continuity of the curvature, torsion, and climb angle functions, by respecting the maximum variable values, indirectly the vehicle dynamics are accounted for. Discontinuities in the curvature function, for example, may induce infinite variations of lateral acceleration, which of course, are not realizable. The same is true for torsional values. In the case of the climb angle function, the lack of continuity implies in the tangential discontinuity of the curve itself.

In the next section, we detailed the necessary steps to realize the union in Eq. (2) in order to guarantee curvature and climb angle continuity for \({\mathcal{R }}\). As expressed by Eq. 3, the curve produced by the path planning algorithm must be continuously derivable, and it must also be second order differentiable (\(C^2\)).

3.1.2 Spatial Pythagorean Hodograph curves

Spatial Pythagorean Hodograph curves are a special kind of parametric polynomial curves defined in \(\mathbb{R }^3\). They are represented in general as:

$$\begin{aligned} {\vec{r}}(t)=[x(t),y(t),z(t)], \end{aligned}$$

and their derivatives (Hodograph components) satisfy the Pythagorean condition presented in Eq. (7):

$$\begin{aligned} \dot{x}(t)^2+\dot{y}(t)^2+\dot{z}(t)^2=h(t)^2, \end{aligned}$$
(7)

for some polynomial \(h(t)\). This means that the parametric “speed”, \(\dot{s}(t)\), of the curve can be described by a polynomial, making it possible to compute the length of the path, \(s\), as shown in Eq. (8):

$$\begin{aligned} s=\int \limits _{t_{i}}^{t_{f}}\sqrt{\dot{x}(t)^2+\dot{y}(t)^2+\dot{z}(t)^2}\,\mathrm{d}t=\int \limits _0 ^1 |h(t)|\,\mathrm{d}t. \end{aligned}$$
(8)

Spatial PH curves are further shaped as \(n\)-th order Bézier curves presented in Eq. (9):

$$\begin{aligned} \vec{r}(t)=\sum _{k=0}^{n}{\mathbf{p }_{k}}\genfrac(){0.0pt}{}{n}{k}(1-t)^{n-k}t^k;\quad t \in [0, 1] \end{aligned}$$
(9)

where \({\mathbf{p }_{k}}=[x_k,y_k,z_k]\) is the \(k\)-th control point of the Bézier function. \(N\)-th order Bézier curves always have \(n\) + 1 control points that define the curve shape according to their spatial position [16].

The path planning problem is then reduced to find a solution to an Hermite Interpolation problem. One important advantage of using this model is that the resulting curve is infinitely continuous, so that the curvature, torsion and inclination functions are always smooth.

To guarantee that the PH does not violate the kinematic constraints of the vehicle, Shanmugavel et al. [21] propose a modification to iteratively compute the PH. It uses gain factors to modify the position of some of the control points in every step of an iterative algorithm, until \({\vec{r}}(t)\) becomes realizable. We will discuss these characteristics later in this article. However, Shanmugavel’s method only consider the curvature and torsion constraints. As it will be shown later, for vehicles with bounded values of climb (or dive) angle, it is not possible to minimize the problem for that spatial cost function. Therefore, we propose a new cost function that incorporates all three variables along with limitations on their maximum values. The \({\theta _{\mathrm{max}}}\) constraint will be included in the PH computation, which will then generate feasible paths for robots in three-dimensional space, under all the aforementioned constraints.

3.2 Smooth path calculation

In this section, we present a method to calculate Bézier curves that fulfills the three constraint conditions mentioned before. We begin by mentioning an interesting characteristic of Bézier curves. They are infinitely differentiable functions, which mean that one curve has continuous curvature profiles. However, if we connect two or more curves to compose a path \({\mathcal{R }}\) among several waypoints, it is possible that discontinuity in accelerations will show up at the connecting points, violating the \(C^2\) condition. Then, in order to keep the continuity, we must calculate Bézier curves whose curvature values at extreme points are identical.

According to [20], the initial curvature of a Bézier function can be mathematically determined by Eq. (10):

$$\begin{aligned} \kappa (t)|_{t=0}=\dfrac{(n-1)}{n}\dfrac{|{\mathbf{p }_{2}}-{\mathbf{p }_{1}}|}{|{\mathbf{p }_{1}}-{\mathbf{p }_{0}}|} \sin \sigma _i, \end{aligned}$$
(10)

where \(n\) is the Bézier order and \(\sigma _i\) represents the angle between the vectors \(\overrightarrow{{\mathbf{p }_{0}}{\mathbf{p }_{1}}}\) and \(\overrightarrow{{\mathbf{p }_{1}}{\mathbf{p }_{2}}}\).

It is possible to guarantee a null curvature value at the initial point by forcing collinearity of these vectors. The same idea can be extended to the final curvature value, as shown in Eq. (11):

$$\begin{aligned} \kappa (t)|_{t=1}=\dfrac{(n-1)}{n}\dfrac{|{\mathbf{p }_{7}}-{\mathbf{p }_{6}}|}{|{\mathbf{p }_{6}}-{\mathbf{p }_{5}}|} \sin \sigma _f, \end{aligned}$$
(11)

where \(\sigma _f\) is the angle between the vectors \(\overrightarrow{{\mathbf{p }_{5}}{\mathbf{p }_{6}}}\) and \(\overrightarrow{{\mathbf{p }_{6}}{\mathbf{p }_{7}}}\).

Then, we will always have zero curvature value at the extreme points of each Bézier, making its composition with others curves (\({\mathcal{R }}\)) a \(C^2\) function, as required. The main reason which led us to choose a seventh order function is now clear. We must keep the three initial and three final control points of the Bézier aligned. So we need at least other two points to create a function with at least one point of inflexion, in order to make a more flexible path.

With this in mind, we use an adaptation of the Pythagorean Hodograph formalism to compute these eight control points. Therefore, we may use the set of Eq. 12, which depends only on the initial and final configuration points, and represent an Hermite Interpolation system.

$$\begin{aligned} {\mathbf{p }_{0}}&= [x_{i},y_{i},z_{i}] ,\end{aligned}$$
(12)
$$\begin{aligned} {\mathbf{p }_{1}}&= {\mathbf{p }_{0}}+{c_0}\,{\mathcal{A }_{0}}\mathbf{i }{\mathcal{A }_{0}^*},\end{aligned}$$
(13)
$$\begin{aligned} {\mathbf{p }_{2}}&= {\mathbf{p }_{1}}+{c_0}\,{\mathcal{A }_{0}}\mathbf{i }{\mathcal{A }_{0}^*},\end{aligned}$$
(14)
$$\begin{aligned} {\mathbf{p }_{3}}&= {\mathbf{p }_{2}}+\dfrac{{c_0}}{2}({\mathcal{A }_{0}}\mathbf{i }{\mathcal{A }_{1}^*}+{\mathcal{A }_{1}}\mathbf{i }{\mathcal{A }_{0}^*}),\end{aligned}$$
(15)
$$\begin{aligned} {\mathbf{p }_{4}}&= {\mathbf{p }_{3}}-\dfrac{{c_7}}{2}({\mathcal{A }_{2}}\mathbf{i }{\mathcal{A }_{1}^*}+{\mathcal{A }_{1}}\mathbf{i }{\mathcal{A }_{2}^*}),\end{aligned}$$
(16)
$$\begin{aligned} {\mathbf{p }_{5}}&= {\mathbf{p }_{6}}-{c_7}\,{\mathcal{A }_{2}}\mathbf{i }{\mathcal{A }_{2}^*},\end{aligned}$$
(17)
$$\begin{aligned} {\mathbf{p }_{6}}&= {\mathbf{p }_{7}}-{c_7}\,{\mathcal{A }_{2}}\mathbf{i }{\mathcal{A }_{2}^*},\end{aligned}$$
(18)
$$\begin{aligned} {\mathbf{p }_{7}}&= [x_{f},y_{f},z_{f}]. \end{aligned}$$
(19)

where \({c_0}\) and \({c_7}\) are gain factors that determine the magnitude of the vectors and have unit values for PH with no constraints. The above set of equations was derived from [9], and according to the authors, it represents an underdetermined system. In other words, there are infinitely many spatial PH curves that interpolate the initial and final waypoints.

The PH provides several properties that can be considered advantageous in the path planning problem, of which, the most relevant for this study are: (i) the uniform distribution of points along the curve, which contributes to the smoothness of the path; (ii) the parametric speed (first order derivative) that provides a continuous velocity profile; and finally (iii) the capability to admit real-time interpolator algorithms for computer numerical control.

Once the Bézier points are computed, we must guarantee that the generated curve does note violate the kinematic constraints of the vehicle, according to the constraints conditions of Eq. (6). Hence, we must determine the values of \({c_0}\) and \({c_7}\) in Eq. (12). As there is no closed form solution, these values will be estimated, in the next section, as the solution to an optimization problem .

The problem is initially approached by assuming that the extreme points of the curve (\({\mathbf{p }_{0}}\) and \({\mathbf{p }_{7}}\)) are directly determined by the initial and final poses \({p_{i}}\) and \({p_{f}}\), respectively. All the remaining points will depend on these pose vectors and on the \({c_0}\) and \({c_7}\) gains.

In our development, we use the quaternion formulation, which allows for a more compact and elegant representation of the system, as well as providing a clearer geometric view of the solution. The parameters \({\mathcal{A }_{k}}\), with \(k=\{1,2,3\}\), are quaternions described by Eq. (20),

$$\begin{aligned} {\mathcal{A }_{k}}=a+a_x\mathbf i +a_y\mathbf j +a_z\mathbf k =\left[ \begin{array}{c} a \\ a_x \\ a_y \\ a_z \end{array} \right] , \end{aligned}$$
(20)

where \(a\) corresponds to the scalar part and \([a_x,a_y,a_z]\) to the vector elements of the quaternion. The conjugate of \({\mathcal{A }_{k}}\) is denoted as \({\mathcal{A }_{k}^*}\). A set of equations of this type presents a solution \({\mathbf{c }}\) which also is a pure vector quaternion, as shown by Eq. (21):

$$\begin{aligned} {\mathcal{A }_{}}\mathbf{i }{\mathcal{A }_{}^*}={\mathbf{c }}, \end{aligned}$$
(21)

where \(\mathbf{i }\) is a pure vector quaternion since its scalar part is null and \(\mathbf{i }^2=-1\).

Hence, a system which is composed of three equations and four unknown variables can be formed, leaving one degree of freedom yet to be determined. With this, the solution for every \({\mathcal{A }_{k}}\) is parameterized by an angular variable \(\phi _k\) (for a detailed explanation, the reader is referred to [10]). Deriving Eq. (21) with respect to \({\mathcal{A }_{0}}\), one obtains:

$$\begin{aligned} {\mathcal{A }_{0}}(\phi _0)=\sqrt{\frac{|{{\mathbf{d}}_{i}}|}{2}(1+\lambda _i)}\left[ \begin{array}{c} -\sin (\phi _0) \\ \cos (\phi _0) \\ \dfrac{\mu _i\cos (\phi _0)+\nu _i\sin (\phi _0)}{1+\lambda _i} \\ \dfrac{\nu _i\cos (\phi _0)-\mu _i\sin (\phi _0)}{1+\lambda _i} \end{array} \right], \nonumber \\ \end{aligned}$$
(22)

where \({{\mathbf{d}}_{i}}\) is the vector direction of the pose \({p_{i}}\), computed as

$$\begin{aligned} {{\mathbf{d}}_{i}}={c_0}[\cos (\psi _i)\cos (\theta _i),\sin (\psi _i)\cos (\theta _i),\sin (\theta _i)] \end{aligned}$$

and

$$\begin{aligned}{}[\lambda _i,\mu _i,\nu _i]=\dfrac{{{\mathbf{d}}_{i}}}{|{{\mathbf{d}}_{i}}|}. \end{aligned}$$

Equivalently, \({\mathcal{A }_{2}}\) can be expressed as:

$$\begin{aligned} {\mathcal{A }_{2}}(\phi _2)\!=\!\sqrt{\frac{|\mathbf{d}_{f}|}{2}(1+\lambda _f)}\left[ \begin{array}{c} -\sin (\phi _2) \\ \cos (\phi _2) \\ \dfrac{\mu _f\cos (\phi _2)+\nu _f\sin (\phi _2)}{1+\lambda _f} \\ \dfrac{\nu _f\cos (\phi _2)-\mu _f\sin (\phi _2)}{1+\lambda _f} \end{array} \right], \nonumber \\ \end{aligned}$$
(23)

where \(\mathbf{d}_{f}\) is the vector direction of the pose \({p_{f}}\), given by:

$$\begin{aligned} \mathbf{d}_{f}={c_7}[\cos (\psi _f)\cos (\theta _f),\sin (\psi _f)\cos (\theta _f),\sin (\theta _f)] \end{aligned}$$

and

$$\begin{aligned}{}[\lambda _f,\mu _f,\nu _f]=\dfrac{\mathbf{d}_{f}}{|\mathbf{d}_{f}|}. \end{aligned}$$

Once the values of \({\mathcal{A }_{0}}\) and \({\mathcal{A }_{2}}\) are determined by setting the values of \(\phi _0\) and \(\phi _2\), \({\mathcal{A }_{1}}\) can be defined as a function of a third angle variable \(\phi _1\):

$$\begin{aligned} {\mathcal{A }_{1}}(\phi _1)=-\dfrac{3}{4}({\mathcal{A }_{0}}+{\mathcal{A }_{2}})+\dfrac{\sqrt{\dfrac{|{\mathbf{c }}|}{2}(1+\lambda )}}{4} {\mathcal{A }_{c}}(\phi _1) , \end{aligned}$$
(24)

where

$$\begin{aligned} {\mathcal{A }_{c}}(\phi _1)=\left[ \begin{array}{c} -\sin (\phi _1) \\ \cos (\phi _1) \\ \dfrac{\mu \cos (\phi _1)+\nu \sin (\phi _1)}{1+\lambda } \\ \dfrac{\nu \cos (\phi _1)-\mu \sin (\phi _1)}{1+\lambda } \end{array} \right] , \end{aligned}$$

\({\mathbf{c }}\) is a pure vector quaternion given by

$$\begin{aligned} {\mathbf{c }}=120({\mathbf{p }_{f}}-{\mathbf{p }_{i}})-15({{\mathbf{d}}_{i}}+\mathbf{d}_{f})+5({\mathcal{A }_{0}}\mathbf{i }{\mathcal{A }_{2}^*}+{\mathcal{A }_{2}}\mathbf{i }{\mathcal{A }_{0}^*}) \nonumber \\ \end{aligned}$$
(25)

and

$$\begin{aligned}{}[\lambda ,\mu ,\nu ]=\dfrac{{\mathbf{c }}}{|{\mathbf{c }}|} . \end{aligned}$$

3.3 Iterative algorithm

To compute the spatial PH, it is necessary to determine the values of the angles \(\phi _0\), \(\phi _1\), \(\phi _2\) and the gains \({c_0}\) and \({c_7}\). The angular variables are defined for the range \([-\tfrac{\pi }{2},\tfrac{\pi }{2}]\). In [10], authors claim (empirically) that it is possible to represent the solution space in extensive form enough, by the quantization of the values of each of these angles according to:

$$\begin{aligned} \phi _k=\left[-\tfrac{\pi }{2},-\tfrac{\pi }{4},0,\tfrac{\pi }{4},\tfrac{\pi }{2}\frac{}{}\right]. \end{aligned}$$

The combinatorial arrangement of these five values for each \(\phi _k\) leads to a total of 125 solutions for the PH curve. The authors also argue that for most cases, \(\phi _1\) may be equal to \(-\tfrac{\pi }{2}\), without the loss of generality, reducing the number of solutions to 25. This value, generally, makes the final result to minimize the variation under the \(\mathbf Z \) axis, what also reduces the climb angle function.

Each of these solutions has different curvature, torsion and climb angle functions. The best solution is the one that minimizes the cost function of the path, or the elastic bending energy function [8]:

$$\begin{aligned} \mathcal{E }=\int \limits _0 ^1\omega (t)^2 \,|\dot{\vec{r}}(t)|\,\mathrm{d}t, \end{aligned}$$
(26)

where \(\omega (t)\) is the total curvature of the spatial PH, which is given by:

$$\begin{aligned} \omega (t)=\sqrt{\kappa (t)^2+\tau (t)^2}. \end{aligned}$$
(27)

This solution, however, is not satisfactory for the problem considered here, since it does not take into account the climb angle function in the energy computation. As it will be shown later, the PH curves that minimize the cost function, may present climb (or dive) angles unattainable for a given robot.

To tackle this issue, the following elastic bending energy function is proposed in [2]:

$$\begin{aligned} \omega (t)=\sqrt{\left(\frac{\kappa (t)}{{\kappa _{\mathrm{max}}}}\right)^2+\left( \frac{\tau (t)}{{\tau _{\mathrm{max}}}}\right)^2+\left(\frac{\theta (t)}{{\theta _{\mathrm{max}}}} \right)^2}. \end{aligned}$$
(28)

Besides minimizing the rate of growth of the vehicle’s climbing action in three-dimensional space, this function still takes into account the three aforementioned constraints and their maximum values in a normalized form. The problem with this is the increase in the computational complexity in relation to the previous equation.

We show in [1] that a more satisfactory result can be obtained using the following cost function:

$$\begin{aligned} \omega (t)=|\theta (t)|. \end{aligned}$$
(29)

Instead of considering the curvature and torsion profiles, this new function takes into account only the aforementioned climb constraint of the vehicle, which minimizes the cost of algorithm and contributes to the smoothing of the climb rate of the curve. It is possible to demonstrate that, by minimizing \(\theta (t)\), which means to reduce the \(\dot{z}(t)\) over the \(XY\) plane, the curvature and, mainly, the torsion function also decrease.

We verified experimentally that, in most cases, the smallest values of \(\mathcal{E }\) were obtained when \(\phi _1=-\tfrac{\pi }{2}\) (as seen in the previous case), and when the difference between \(\phi _0\) and \(\phi _2\) was the largest possible. Therefore, taking \(\phi _0\) in the \(\phi _k\) interval and \(\phi _2=-\phi _0\), makes it possible to reduce the number of solutions to only five.

Finally, the values of \({c_0}\) and \({c_7}\) (the gains for which the spatial PH fulfills the requirements described in Eq. (6) still remains to be determined. This naturally leads to an optimization approach, since there is no closed solution for this problem. Increasing these gains tends to minimize the function \(\omega (t)\) as a whole, which is indirectly linked to the inverse of the parametric “speed” of the curve. However, that produces, as a consequence, an increase in path length. Thus, the ideal values of \({c_0}\) and \({c_7}\) are those which produce a feasible curve for a given robot, but also minimizes the length of \(s\).

In the first step of the algorithm, the values of these gain factors are set to one. In each iteration of the algorithm, the conditions of Eq. (6) are observed, and gains are increased by

$$\begin{aligned} {c_0}&= {c_0}+\frac{\mathcal{E }_0}{\mathcal{E }}({\rho _{\mathrm{min}}}+{\sigma _{\mathrm{min}}}) ,\end{aligned}$$
(30)
$$\begin{aligned} {c_7}&= {c_7}+\frac{\mathcal{E }_7}{\mathcal{E }}({\rho _{\mathrm{min}}}+{\sigma _{\mathrm{min}}}), \end{aligned}$$
(31)

where

$$\begin{aligned} \mathcal{E }_0=\int \limits _0 ^{0.5}\omega (t)^2 \,|\dot{\vec{r}}(t)|\,\mathrm{d}t \end{aligned}$$

and

$$\begin{aligned} \mathcal{E }_7=\int \limits _{0.5}^1\omega (t)^2 \,|\dot{\vec{r}}(t)|\,\mathrm{d}t . \end{aligned}$$

This method promotes a convergence to the result with a very small number of iterations, producing a curve of reasonable length.

4 Experiments and results

In this section, we present and discuss the results of our experimental validation. Firstly, we describe the experiments for a simulated airplane, modeled only by the three kinematic constraints, namely curvature, torsion and climb angle. Then, we apply the proposed method to a simulated model based on a real UAV developed at the Universidade Federal de Minas Gerais/Brazil. All experiments were performed using the® software (Version R2008b) running on a computer with Ubuntu/Linux 10.04 operating system.

4.1 Virtual airplane

Firstly, we use a single simulated UAV. This step was designed to show the applicability of seventh order Bézier curves to paths of aircraft with relatively small values of maximum climb angle and with torsion radius much smaller than curvature radius. This is a key feature of our approach, since it would be otherwise very complex to be handled by other methods.

Our vehicle presents the following constraints:

  • \({\rho _{\mathrm{min}}}=10\) m,

  • \({\sigma _{\mathrm{min}}}=100\) m,

  • \({\theta _{\mathrm{max}}}=\tfrac{\pi }{6}\) rad.

These values were arbitrarily chosen, so that the vehicle would present a relatively small climb angle of about \(30^{\circ }\), and a minimum torsion radius ten times larger than the minimum radius of curvature.

At first, we have also established two spatial configurations representing the initial and final waypoints of a single path to be planned, where position variables units are in meters and the orientation ones in radians (Table 1).

Table 1 Initial and final waypoints for the virtual UAV

A very important point is to insure that the values of the climb angles \(\theta _i\) and \(\theta _f\) at these waypoints are smaller in magnitude than the maximum climb angle. Otherwise, it becomes impossible to find values of \({c_0}\) and \({c_7}\) that guarantee the condition 6 for \({\vec{r}}(t)\). Figure 1 shows the result of our methodology for a single path.

Fig. 1
figure 1

Single path curve between \({p_{i}}=[0,0,0,-\frac{\pi }{2},\frac{\pi }{6}]\) and \({p_{f}}=[50,20,50,-\frac{\pi }{2},0]\) for a virtual UAV with \({\rho _{\mathrm{min}}}=10\) m, \({\sigma _{\mathrm{min}}}=100\) m and \({\theta _{\mathrm{max}}}=\frac{\pi }{6}\) rad

Besides the generated path, it is also possible to see the configuration of the control points computed for the curve. Those points were obtained using the values \(\phi _0=\frac{\pi }{2}\), \(\phi _1=-\frac{\pi }{2}\) and \(\phi _2=-\frac{\pi }{2}\) for our seventh order Bézier curve.

Figure 2 shows the constraint functions of the single path. Curvature (Fig. 2a), torsion (Fig. 2b) and climb angle ( Fig. 2c) functions are continuous and bounded by the maximum \({\kappa _{\mathrm{max}}}\), \({\tau _{\mathrm{max}}}\) and \({\theta _{\mathrm{max}}}\) values, respectively.

Fig. 2
figure 2

Constraint functions of a curvature, b torsion and c climb angle of the single path

Also, it is important to notice that the extreme points in the curvature profile of Fig. 2a are both null, as we explained before. This means that, when we use this method to generate a path among several waypoints, all curvature values between single paths will be zero, and the total curvature profile of \({\mathcal{R }}\) will be continuous.

We next apply our technique to generate feasible paths for a sequence of eight waypoints \({\langle {p_{a}},{p_{h}} \rangle }\). Again, position variables units are in meters and orientation ones in radians. The configurations used are presented at (Table 2).

Table 2 Waypoint set \({\langle {p_{a}}, {p_{h}} \rangle }\) for the virtual UAV

Figures 3 and 4 present the results obtained for the final path \({\mathcal{R }}\) and its curvature profile. The mean time and the standard deviation of the method in the generation of all these single paths were about 0.2 and 0.07 s, respectively. It can be easily seen that it produced a continuous and smooth curvature function.

Fig. 3
figure 3

\({\mathcal{R }}\) path among waypoints \({\langle {p_{a}},{p_{h}} \rangle }\) for the single UAV

Fig. 4
figure 4

Curvature profile of \({\mathcal{R }}\) from Fig. 3

4.2 AqVS UAV

The technique was also used to plan paths for a small unmanned fixed-wing aircraft called AqVS (Fig. 5), developed at Universidade Federal de Minas Gerais. This is a small hand launched hybrid electric motor sail plane, equipped with a GPS receptor, barometric altimeter, infrared inclinometer, airspeed sensor and a CCD camera. It is controlled by a set of PID stabilizators for autonomous navigation (see [15] for further information). In this part of the work, we use the AqVS simulation environment, implemented using the® graphical language. It was based on the assumption that the vehicle can be correctly represented as a rigid body with six degrees of freedom. Table 3 presents the main characteristics of the AqVS autonomous airplane.

Fig. 5
figure 5

AqVS, a UAV from the Universidade Federal de Minas Gerais, Brazil [15]

Table 3 AqVS main characteristics [15]

The above values were determined using real data from actual flights of the SUAV, considering a speed of approximately 50 km/h. This vehicle has shown to be a good choice for testing our methodology because of its small climb angle (about \(6^{\circ }\)). This represents a very challenging issue in the context of the problem of generating paths for this vehicle. We used a simulated model of the AqVS to test our methodology. Figure 6 shows the result of the AqVS/SUAV flight over a set of five points, randomly chosen as presented in Table 4.

Fig. 6
figure 6

AqVS trajectory over the planned paths using Spatial seventh order Bézier curves

Table 4 Waypoint set \({\langle {p_{a}},{p_{e}} \rangle }\) for the AqVS/UAV

The blue line in the graph represents the actual trajectory executed by the SUAV when tracking the planned paths. The experiment was realized with wind perturbations of about 10 km/h at the North direction. The flight path was smooth and with the specified constraints. In spite of the noise, which is mainly due to the altitude and GPS sensors and the actions of the control system, the vehicle is able to tightly track the path. Figure 7 presents the absolute error between the real position of the simulated SUAV through time and the planned path, which shows a mean error of approximate 20 m. This error is a result of the wind speed disturbance and the biased sensors uncertainties.

Fig. 7
figure 7

Absolute error between the position of the simulated SUAV through time and the planned path

5 Conclusion and future work

We presented a methodology for path planning in three-dimensional environments for autonomous vehicles that consider at least three motion constraints: maximum curvature, maximum torsion and maximum climb angles. The methodology is an extension of the Spatial Pythagorean Hodographs where such constraints are explicitly taken into account.

The use of analytical curves, such as Bézier curves, allowed for greater flexibility of this model with a low computational cost. The design of these curves takes into account very simple kinematics and dynamics constraints, which imply the simplification of the model of the vehicle at few points of operation.

The proposed methodology uses an elastic bending energy function for the resolution of the Spatial Pythagorean Hodograph that minimizes the climb angle function of the curve \({\vec{r}}(t)\), generating a solution that is adequate for vehicles with limited climb (or dive) angle capability. The methodology was also used to generate paths with satisfactory results for a simulated model of a real SUAV. As part of our ongoing research, we plan on incorporating other constraints to the cost function, such as maximum translation speed.

As further investigation, we will also consider environments with static and dynamic objects, which may demand path replanning in real time, which is of major relevance to the case of multiple and cooperating vehicles moving in three-dimensional space.

Notes

  1. Defined as the angle that the chord of the wing, viewed laterally, makes with respect to the wind. This is also another way to define the climb angle.

References

  1. Alves Neto A, Campos MFM (2009) A path planning algorithm for UAVs with limited climb angle. In: The 2009 IEEE/RSJ international xonference on intelligent robots and systems (IROS’09), St. Louis, USA

  2. Alves Neto A, Campos MFM (2009) On the generation of feasible paths for aerial robots with limited climb angle. In: Proceedings of the IEEE international conference on robotics and automation (ICRA’09). Kobe, Japan

  3. Alves Neto A, Macharet DG, Campos MFM (2010) Feasible RRT-based path planning using seventh order bézier curves. In: The 2010 IEEE/RSJ international conference on intelligent robots and systems (IROS’10). Taipei, Taiwan

  4. Alves Neto A, Macharet DG, Campos MFM (2010) On the generation of trajectories for multiple UAVs in environments with obstacles. J Intell Robotic Syst 57(4):123–141

    Article  MATH  Google Scholar 

  5. Bortoff S (2000) Path planning for UAVs. In: Proceedings of the American control conference, vol 1, Chicago, Illinois, USA, pp 364–368. doi:10.1109/ACC.2000.878915

  6. Cheng P, Shen Z, Lavalle SM (2001) RRT-based trajectory design for autonomous automobiles and spacecraft. Arch Control Sci 11(3–4):167–194

    MATH  MathSciNet  Google Scholar 

  7. Dogan A (2003) Probabilistic path planning for UAVs. In: Proceedings of 2nd AIAA unmanned unlimited systems, technologies, and operations—aerospace, land, and sea conference and workshop exhibition. San Diego, CA, USA

  8. Farouki RT (1996) The elastic bending energy of Pythagorean hodograph curves. Comput Aided Geom Des 13:227–241

    Article  MATH  MathSciNet  Google Scholar 

  9. Farouki RT, Han CY (2006) Algorithms for spatial Pythagorean-hodograph curves. In: Klette R, Kozera R, Noakes L, Weickert J (eds) Geometric properties for incomplete data, Springer pp 43–58

  10. Farouki RT, al Kandari M, Sakkalis T (2002) Hermite interpolation by rotation-invariant spatial Pythagorean-hodograph curves. Adv Comput Math 17:369–383

    Article  MATH  MathSciNet  Google Scholar 

  11. Farouki RT, Neff CA (1995) Hermite interpolation by Pythagorean hodograph quintics. Math Comput 64:1589–1609

    Article  MATH  MathSciNet  Google Scholar 

  12. Farouki RT, Sakkalis T (1990) Pythagorean hodographs. IBM J Res Dev 34(5):736–752

    Article  MathSciNet  Google Scholar 

  13. Gonçalves VM, Pimenta LCA, Maia CA, Dutra BCO, Pereira GAS (2010) Vector fields for robot navigation along time-varying curves in n-dimensions. Trans Robotics 26:647–659. doi:10.1109/TRO.2010.2053077

    Article  Google Scholar 

  14. Griffiths S, Saunders J, Curtis A, Barber B, McLain T, Beard R (2006) Maximizing miniature aerial vehicles. IEEE Robotics Autom Mag 13(3):34–43. doi:10.1109/MRA.2006.1678137

    Google Scholar 

  15. Iscold P, Pereira G, Torres L (2010) Development of a hand-launched small UAV for ground reconnaissance. IEEE Trans Aerospace Electron Syst 6(1):335–348. doi:10.1109/TAES.2010.5417166

    Article  Google Scholar 

  16. Kreyszig E (1991) Differential Geometry, vol 1. Dover Publications, New York

    Google Scholar 

  17. Kuwata Y, Richards A, Schouwenaars T, How JP (2005) Robust constrained receding horizon control for trajectory planning. In: Proceedings of the AIAA guidance, navigation and control conference

  18. LaValle SM (2006) Planning algorithms. Cambridge University Press, Urbana

    Book  MATH  Google Scholar 

  19. Nelson DR, Blake D, Timothy B, Mclain W, Beard RW (2006) Vector field path following for small unmanned air vehicles. IEEE Trans Control Syst Technol 48: 5788–5794

    Google Scholar 

  20. Sederberg TW (2007) Computer aided geometric design, chap. 2. Brigham Young University, Provo, Utah

  21. Shanmugavel M, Tsourdos A, Zbikowski R, White BA (2007) 3D path planning for multiple UAVs using Pythagorean hodograph curves. In: Proceedings of the AIAA guidance, navigation and control conference and exhibit (AIAA-GNC). Hilton Head, South Carolina

  22. Shanmugavel M, Tsourdos A, Zbikowski R, White BA, Rabbath CA, Lechevin N (2006) A solution to simultaneous arrival of multiple UAVs using Pythagorean hodograph curves. In: Proceedings of the IEEE American control conference (ACC), pp 2813–2818, Minneapolis, Minnesota, USA

  23. Wzorek M, Doherty P (2006) Reconfigurable path planning for an autonomous unmanned aerial vehicle. In: International conference on hybrid information technology (ICHIT ’06), vol 2, pp 242–249

Download references

Acknowledgments

The authors gratefully thank Prof. Paulo Iscold from the Center for Aeronautics Studies (CEA) of UFMG for the flight data of the AqVS/UAV. This work was developed with the support of CNPq, CAPES and FAPEMIG.

Author information

Authors and Affiliations

Authors

Corresponding author

Correspondence to Armando Alves Neto.

Rights and permissions

Open Access This article is distributed under the terms of the Creative Commons Attribution 2.0 International License ( https://creativecommons.org/licenses/by/2.0 ), which permits unrestricted use, distribution, and reproduction in any medium, provided the original work is properly cited.

Reprints and permissions

About this article

Cite this article

Neto, A.A., Macharet, D.G. & Campos, M.F.M. Feasible path planning for fixed-wing UAVs using seventh order Bézier curves. J Braz Comput Soc 19, 193–203 (2013). https://doi.org/10.1007/s13173-012-0093-3

Download citation

  • Received:

  • Accepted:

  • Published:

  • Issue Date:

  • DOI: https://doi.org/10.1007/s13173-012-0093-3

Keywords