This article presents the design, control, and implementation of a small quad-rotor system under the practical limitation of being cost effective for private use, such as in the cases of control education or hobbies involving radio-controlled systems. Several practical problems associated with implementing a small quad-rotor system had to be taken into account to satisfy this cost constraint. First, the size was reduced to attain better maneuverability. Second, the main control hardware was limited to an 8-bit processor such as an AVR to reduce cost. Third, the algorithms related to the control and sensing tasks were optimized to be within the computational capabilities of the available processor within one sampling time. A small quad-rotor system was ultimately implemented after satisfying all of the above practical limitations. Experimental studies were conducted to confirm the control performance and the operational abilities of the system.
1. Introduction
There has been increasing research into the development of unmanned vehicle systems (UVS) that will help save human labor or even human lives in dangerous environments. A successful UVS must feature several technologies, including localization, path planning, and control, if it is to be autonomous
[1
-
4]
.
Typically, in unmanned aerial vehicle (UAV) systems, autonomous navigation plays an important role in gathering information from the ground
[5]
. Particularly for military operations in dangerous zones, UAVs undertake a variety of valuable missions such as surveillance, monitoring, and even defense. Most military UAVs adopt a conventional take-off and landing design that requires a long range and a wide and long runway to take off and land.
However, surveillance in complex environments such as urban areas requires a different take-off and landing approach. UAVs need to be capable of vertical take-off and landing in a limited space
[6
,
7]
.
Recently, the use of fan-type power has attracted the attention of researchers developing small UAVs for taking off and landing in confined areas. Instead of using a single propeller, four equal-sized fans are utilized. Since such a “quad-rotor” system has four equal-sized fans, it can generate a greater amount of thrust and thus realize more stable hovering control.
Although quad-rotor systems are affected by wind and suffer from limited battery capacity when operating in an outdoor environment, these systems have attracted researcher’s attention owing to their apparent suitability for performing certain tasks. Such tasks include traffic monitoring on highways and the surveillance of accidents on the road.
Considerable research has been undertaken into the development of quad-rotor systems. Quad-rotor systems have already been applied to surveillance tasks
[8
-
18]
, and aggressive maneuvering control has also been implemented
[19]
. Excellent maneuvering control has been demonstrated for small quadrotors developed at the University of Pennsylvania. While most quad-rotor systems focus on flying, Flymobile focuses on both flying and driving, and we have performed successful flying and driving tests
[20
,
21]
. Recent research into quad-rotor systems has focused more on localization based on sensors
[22
-
24]
.
In this study, a novel design was developed for small quadrotor systems meant for private use such as control education or hobbies involving radio-controlled systems, with the goal of producing a smaller, cost-effective unit. Another reason for downsizing the system was to improve the maneuverability of the quad-rotor system. Its small size allows high speed and rapid changes in direction to increase its mobility.
Since the quad-rotor system is small, there are several practical limitations affecting the implementation of the system at a price point that is affordable for public use. However, the reduction of cost involves several technical constraints:
-
1) The structural size is reduced to attain better maneuverability. The mass is less than 1 kg, and the length is 0.5 m.
-
2) The control hardware is limited to an 8-bit processor such as an AVR, rather than a digital signal processor (DSP) chip. Some mathematical functions such as square root and arctangent must be approximated since they are beyond the capabilities of 8-bit processors.
-
3) Algorithms related to the control and sensing processes must be shortened in order to minimize the calculation time in line with the sampling time for practical control.
-
4) Integer-based operations are required for numerical calculations.
After compensating for the aforementioned problems, we actually implemented a small quad-rotor system. Experimental studies of several flying tests in both indoor and outdoor environments were conducted to demonstrate the operational abilities of the system.
Motion attained by controlling rotor speed
2. Quad-Rotor System
- 2.1 Kinematics
The quad-rotor system has four rotors and propellers, as shown in
Figure 1
. A pair of propellers rotates in the clockwise direction (
FR, FL
) and another pair (
FF, FB
) rotates in the counterclockwise direction to prevent spinning of the body. Combining the force
Fi
generated by each of the propellers determines the motion of the system.
Table 1
shows the motion based on the induced thrust forces where
FF, FB, FR, FL
are the forces produced by the front, back, right, and left rotors, respectively.
The coordinates of the quad-rotor system (
OV XV YV ZV
) are defined in the global coordinate(
OWXWYWZW
).
Changing the speed of each rotor generates translational movement
P
= [
x, y, z
]
T
and rotational movement Ω = [
Φ, θ, Ψ]T
. Note that the linear velocity and the angular velocity in the global frame are defined as
where
Φ, θ, Ψ
are the roll, pitch, and yaw angles, respectively.
The linear velocity
V
is related to the linear velocity of the vehicle frame
VV
through a rotational transformation as
where
R(Φ, θ, Ψ)
=
R(ZWΨ)R(YWθ)R(XWΦ)
is the resultant
Model of a quad-rotor system.
rotational matrix for the roll, pitch, and yaw rotation about global coordinates
XW, YW, ZW
, respectively. It is found as
where
cΦ
= cos
(Φ), sΦ
= sin
(Φ), cθ
= cos
(θ), sθ
= sin
(θ)
and
cΨ
= cos
(Ψ), sΨ
= sin
(Ψ)
.
Therefore, the linear velocity in the vehicle coordinate is found to be
where
R-1
=
RT
and
u, v, w
are the linear velocity about the
XV, YV, ZV
axis, respectively.
The angular velocity is given by
where
ωV
is the angular velocity of the vehicle frame, and
T
is the Euler kinematic equation and defined by
Conversely, the angular velocity of the vehicle frame can be obtained from Eq. (5) as
where
- 2.2 Dynamics
The translational motion equation under the influence of gravity force is defined as
where
ƒ
= [
ƒxƒyƒz
]
T
is the translation force,
m
is the mass of the system, and
G
is the gravity force. Substituting Eqs. (4) and (7) into Eq. (9) yields
where
g
is the gravitational acceleration.
Solving Eq. (10) for
yields
Note that
ƒx
=
ƒy
= 0 and
ƒz
=
ƒT
where
ƒT
is the total thrust force since we have four rotors to control the elevation, roll, pitch, and yaw angles.
In the same way, the moment equation can be described as
where
is the moment force and
I
is the moment of the system, given as
where
IXX, IYY , IZZ
are the moment of inertia about the
X, Y, Z
axes, respectively.
Substituting Eqs. (7) and (13) into Eq. (12) yields
Rearranging Eq. (14) with respect to
yields
It is convenient to represent dynamic Eqs. (11) and (15), specified for the vehicle frame, into a global frame through relationship Eq. (2). The dynamic equation in the global frame, assuming that the Coriolis terms and gyroscopic effects can be neglected, yields
During hovering, the thrust force is assumed to be proportional to the square of propeller’s rotational speed, that is,
where
αthrust
is the constant and
ωi
is propeller
i
’s rotational speed. The drag force is assumed to be proportional to the square of the rotational speed of the propeller, that is,
where
αdrag
is the constant.
Although we have six variables to represent the system, we have only four inputs, making the quad-rotor an underactuated system. We regard the elevation
z
, roll, pitch, and yaw angles (
Φ, θ, Ψ
) as the control variables. Therefore, each force has the following relationship with the force produced by each rotor.
where
ƒT
is the total thrust force;
TΦ, Tθ, TΨ
are the torque of the roll, pitch, and yaw angles, respectively;
L
is the distance from the center of mass of the system to the center of each rotor; and
C
is a constant factor.
3. Control Schemes
- 3.1 Linear Control
The angle of the quad-rotor system is regulated by controlling the velocity of each rotor. The direction of movement of the system is determined by combining the magnitudes of each rotor velocity. Although there are six variables for describing a quad-rotor system, there are only four actuators, which means that control of all six variables is difficult.
The linearized dynamics for the attitude control can be given from Eq. (16) as
Thus, basic movements such as reaching a certain altitude and hovering while adopting a specific attitude can be considered. The hovering motion is related to the control of the roll and pitch angles, and the attainment of altitude is related to the control of the thrust force. Since a quad-rotor system is a symmetrical structure, yaw angle control is not considered seriously in this case.
From the roll and pitch control inputs, the force input to each rotor can be determined. Each rotor force is described as
where
Control block diagram.
and
In this case,
uth, uΦ, uθ, uΨ
are the control inputs for the thrust, and the roll, pitch, and yaw angles, respectively.
- 3.2 Simulation Studies
Based on the control block diagram shown in
Figure 2
, we performed a simulation study. We control the altitude and three angles.
The desired trajectories for the attitude control are given differently with respect to the time range.
Table 2
lists the controller gains. The attitude control performances are shown in
Figure 3
. We see that the quad-rotor system follows the desired trajectory well.
Controller gains
Specification of small quad rotor system
Specification of small quad rotor system
4. Design of Small Quad-Rotor System
Figure 4
shows the actual small quad-rotor system. The body frame is casted. As the control hardware, AVR is used rather than DSP to reduce the cost.
The sampling time is 4 ms. All of the hardware and sensors are located in the center of the unit. For angle detection, a gyro and an accelerometer are used.
Table 3
lists the specifications of the small quad rotor system. The total mass is 0.95 kg and the maximum thrust is 2 kg.
Figure 5
is an overall block diagram of the control hardware. The 8-bit microprocessor performs all of the calculations: control signals, sensor signals, and communication.
5. Practical Limitations
- 5.1 Computing Algorithms for Angles
To obtain the roll and pitch angles, a 3-axis gyro and 3-axis accelerometer are used. The following equations are used to obtain the roll and pitch angles from the accelerometer measurements.
where
αx, αy, αz
are the measured acceleration values for each axis as determined from the accelerometer.
Attitude control.
Thus, computing Eq. (22) is a burden for an 8-bit processor, since tan
-1
and
operations require the math library and they are calculated based on the floating point data format. This leads to the computational limitation of the processor since the inherent processor cannot handle those computations within an acceptable sampling time. Therefore, the approximation of those mathematical operations is required to approximate the necessary mathematical functions.
- 5.1.1 Square Root Operation
The square operation can be approximated and obtained by applying Newton’s method through several iterations. Eq. (23) defines the relationship of the square operation. Given value a,
Small quad-rotor system.
Overall block diagram of system.
value b can be calculated as follows.
Newton’s method is given as
Reformulating Eq. (23) into Eq. (24) yields the update equation.
where
n
is the sequence.
Finally, the value of b can be obtained iteratively.
Approximation of atan2 function.
- 5.1.2 tan-1Operation
For the tan
-1
operation, a table lookup method is used to match the real values of tan
-1
with several linear functions within the range of useful angles.
Although there are mismatch errors resulting from the approximation process, these errors are small and can be neglected for real applications.
Figure 6
shows the approximation of the
atan
2 function within the range of 0° ~ 90° by four linear functions.
- 5.1.3 Integer Operation
Another consideration is the use of the integer operation rather than the floating point format for numerical calculations. For example, a typical IIR filter calculation can be performed as Eq. (26) for the floating point format that is not permitted by processors with low computational power. Therefore, the integer-based operations in Eq. (27) should be performed by accepting lower computing accuracy.
Within the useful range of angles, namely, from 0° to ±90°, the approximated integer operation is compared with the floating point operation shown in
Figure 7
. The two operations are similar except around ±90° where there is a slight mismatch between the two operations.
Test of approximation of atan2 function.
Two-stage filtering process.
- 5.2 Complementary Filtering Method
We measured the roll and pitch angles using an accelerometer and a gyro sensor. Since the accuracy of the sensors is poor due to the noisy environment, we applied two-stage filtering. The first-stage filtering involves the use of a complementary filter to maximize the filter characteristics. Then, the second stage filtering technique uses a Kalman filter after the complementary filter to suppress the effects of noise, as shown in
Figure 8
.
We designed filters that combined the two low-cost sensors: a gyro sensor and an accelerometer. We combine the two sensors as a complementary filter to obtain more accurate angle measurements. The complementary filter consists of a low-pass filter for the accelerometer and a high-pass filter for the gyro sensor. The filtered outputs are added together to estimate the value, as shown in
Figure 9
.
When the sensor transfer functions are given for the accelerometer as
Ha
(
s
), and for the gyro sensor as
Hg
(
s
), the complementary filter satisfies the following relationship:
where
Fa
(
s
) and
Fg
(
s
) are the transfer functions for the filters. If the sensor characteristics are unknown, we suggest the
Complementary filter.
application of
Ha
(
s
) = 1 and
Hg
(
s
) = 1 for simplicity.
Then, each filter of
Fa
(
s
),
Fg
(
s
) can be simply designed as a first-order filter.
where
Fa
(
s
) is a low-pass filter,
Fg
(
s
) is a high-pass filter, and
λ
is the time constant. The appropriate cutoff frequency for the low-pass and high-pass filters can be found by an empirical process. In our case,
λ
= 0:77 is obtained from the empirical studies.
- 5.3 Simplified Kalman Filter
The Kalman filter equation for the angle measurement is given by
[21
,
22]
where
dT
is the sampling time (4 ms),
and
ωk
and
υk
are the process noise and measurement noise, respectively.
The conventional Kalman filter requires several repetitive steps to estimate states Eq. (31) to Eq. (35).
Time update:
Measurement update:
where
Q
and
R
are the covariance matrices of the process and measurement noises, respectively.
However, the computation of the Kalman filter is a considerable burden for an 8-bit microprocessor. Although the Kalman filtering method normally requires an iterative procedure to update the state correctly, a simplified version can be used. Instead of using all the steps of the Kalman filtering algorithm, a simplified process can be employed whereby the Kalman gain is fixed. In this case, the updates of Eqs. (32, 33, 35) are not required. Therefore, the form of the simplified Kalman filter algorithm will be as follows:
Time update :
Measurement update :
where the Kalman gain K is a fixed Kalman gain and
H
= [1; 0].
- 5.4 Filtering Test
We conducted a filtering test based on the aforementioned simplified algorithms. The result of one typical filtering test is shown in
Figure 10
. The results of the single-stage and twostage filter design technique are compared. The filtered signal, after being passed through the complementary filter, is compared with the signals output from the Kalman filter after the complementary filter. We can clearly see that the signals output from the two-stage filtering method, after being passed through the complementary and Kalman filters, are more stable.
- 5.5 Overall Hardware Structure
The signals obtained from the filtering algorithms were used in the control algorithms.
Figure 11
shows the connection between the control and the filtering block diagram. The roll and pitch angles are measured by a gyro and an accelerometer, and those signals are fused with the complementary filter, for which the cutoff frequency is set to 1.3 Hz. Then, the signals are passed
Filtered signals.
Control and filtering process.
through the Kalman filter.
The filtered signals are used for PD controllers and the PD gains are set to 1.2 and 0.18 for the proportional and derivative gain, respectively. Then, the control torque applied to each rotor is calculated by Eq. (19).
6. Experiments
- 6.1 Indoor Flying Task
After implementing the hardware and software under the aforementioned constraints, flying tests were conducted for real operations. Firstly, a flying test for the small quad-rotor system
Indoor flying demonstration.
was performed inside a building to minimize disturbances such as that presented by wind.
Figure 12
shows a flying demonstration controlled by a joystick through a remote controller.
Another indoor flying test was conducted in a small space.
Figure 13
illustrates an actual indoor flying task where the quadrotor elevates from the floor and then lands on the floor. All of the trajectory commands are issued by the remote controller. The corresponding roll and pitch angle plots are shown in Figure 14. We can clearly see that the roll and pitch angles are well balanced. The oscillation errors are within about ±5°.
- 6.2 Outdoor Flying Task
After adjusting the control parameters for stable flying in the indoor environment, the quad-rotor system was tested in an outdoor environment (on the roof of a building).
Figure 15
illustrates the actual flying movement. The quad-rotor system was controlled by an operator.
7. Conclusion
We have presented the implementation of a small quad-rotor system under several practical constraints of minimizing the total cost. Changing the main control hardware from a DSP to an AVR limits the computational ability of the filtering and control algorithms. To satisfy the desired sampling time, the required mathematical functions are simplified and approximated. In addition, a simplified version of the Kalman filtering algorithm is presented and used for actual system control. Actual flying demonstrations in both indoor and outdoor environments conwww
Flying control of small quad-rotor indoors.
Roll and pitch angles forFigure 13.
firmed the functionality of the small quad-rotor system using approximated calculations for the algorithms.
- Conflict of Interest
No potential conflict of interest relevant to this article was reported.
Flying control of small quad-rotor outdoors.
Acknowledgements
This research has been supported by Korea Research Foundation (KRF) through the general research program (2010-0024904) in Korea and the center for autonomous intelligent manipulation (AIM) for service robots of the Ministry of Knowledge Economy (MKE), Korea, under the Human Resources Development Program for Convergence Robot Specialists support program supervised by the National IT Industry Promotion Agency (NIPA) (NIPA-2013-H1502-13-1001).
Tusseyeva I.
,
Kim S. G.
,
Kim Y. G.
2013
“3D global dynamic window approach for navigation of autonomous underwater vehicles,”
International Journal of Fuzzy Logic and Intelligent Systems
13
(2)
91 -
99
DOI : 10.5391/IJFIS.2013.13.2.91
Im D. Y.
,
Ryoo Y. J.
2009
“Development of steering actuator for unmanned vehicle based on magnetic marker,”
Journal of Korean Institute of Intelligent Systems
19
(3)
375 -
378
DOI : 10.5391/JKIIS.2009.19.3.375
Jeon S. W.
,
Jung S.
2009
“Localization and control of an outdoor mobile robot based on an estimator with sensor fusion,”
Journal of Institute of Embedded Engineering of Korea
4
(2)
69 -
78
Kim D. W.
,
Igor Y.
,
Kang E. S.
,
Jung S.
2013
“Design and control of an omni-directional cleaning robot based on landmarks,”
Journal of Korean Institute of Intelligent Systems
23
(2)
100 -
106
DOI : 10.5391/JKIIS.2013.23.2.100
Yun D. Y.
,
Kim S. H.
2007
“A design of fire monitoring system based on unmaned helicopter and sensor network,”
Journal of Korean Institute of Intelligent Systems
17
(2)
173 -
178
Eom I. Y.
,
Jung S.
2011
“Intelligent force control application of an autonomous helicopter system,”
Journal of Institute of Embedded Engineering of Korea
6
(5)
303 -
309
Kim M. H.
,
Park J. B.
,
Lee H. J.
,
Cha D. B.
,
Joo Y. H.
2002
“A decentralized control technique for experimental nonlinear helicopter systems,”
Journal of Korean Institute of Intelligent Systems
12
(1)
80 -
84
Amaral T. G.
,
Cris´ostomo M. M.
,
Pires V. F.
2002
“Helicopter motion control using adaptive neuro-fuzzy inference controller,”
in Proceedings of the 28th Annual Conference of the IEEE Industrial Electronics Society
Sevilla, Spain
November 5-8
2090 -
2095
Altu˘g E.
,
Ostrowski J. P.
,
Mahony R.
2002
“Control of a quadrotor helicopter using visual feedback,”
in Proceedings of the IEEE International Conference on Robotics and Automation Washington, DC
May 11-15
72 -
77
Castillo P.
,
Dzul A.
,
Lozano R.
2004
“Real-time stabilization and tracking of a four-rotor mini rotorcraft,”
IEEE Transactions on Control Systems Technology
12
(4)
510 -
516
DOI : 10.1109/TCST.2004.825052
Xu R.
,
O¨zgner U¨.
2006
“Sliding mode control of a quadrotor helicopter,”
in Proceedings of the 45th IEEE Conference on Decision and Control
San Diego, CA
December 13-15
4957 -
4962
Erginer E.
,
Altu˘g E.
2007
“Modeling and PD control of a quadrotor VTOL vehicle,”
in Proceedings of the IEEE Intelligent Vehicles Symposium
Istanbul, Turkey
June 13-15
Bouktir Y.
,
Haddad M.
,
Chettbi T.
2008
“Trajectory planning for a quadrotor helicopter,”
in Proceedings of the Mediterranean Conference on Control and Automation
Ajaccio-Corsica, France
June 25-27
1258 -
1263
Das A.
,
Subbarao K.
,
Lewis F.
2009
“Dynamic inversion with zero-dynamics stabilisation for quadrotor control,”
IET Control Theory and Applications
3
(3)
303 -
314
DOI : 10.1049/iet-cta:20080002
Dierks T.
,
Jagannathan S.
2010
“Output feedback control of a quadrotor UAV using neural networks,”
IEEE Transactions on Neural Networks
21
(1)
50 -
66
DOI : 10.1109/TNN.2009.2034145
Tayebi A.
,
McGilvray S.
2006
“Attitude stabilization of a VTOL quadrotor aircraft,”
IEEE Transactions on Control Systems Technology
14
(3)
562 -
571
DOI : 10.1109/TCST.2006.872519
Bouabdallah S.
,
Siegwart R.
2007
“Full control of a quadrotor,”
in IEEE/RSJ International Conference on Intelligent Robots and Systems
San Diego, CA
October 29-November 2
Zhang R.
,
Wang X.
,
Cai K. Y.
2009
“Quadrotor aircraft control without velocity measurements,”
in Proceedings of the 48th IEEE Conference on Decision and Control held jointly with 2009 28th Chinese Control Conference
Shanghai, China
December 15-18
5213 -
5218
Huang H.
,
Hoffmann G. M.
,
Waslander S. L.
,
Tomlin C. J.
2009
“Aerodynamics and control of autonomous quadrotor helicopters in aggressive maneuvering,”
in Proceedings of the IEEE International Conference on Robotics and Automation
Kobe, Japan
May 12-17
3277 -
3282
Jeong S. H.
,
Lee M. K.
,
Jung S.
2010
“Calibration and control of rotor actuation of flymobile by force measurements,”
in Proceedings of the 7th International Conference on Ubiquitous Robots and Ambient Intelligence
Busan, Korea
November 24-27
395 -
398
Jeong S. H.
,
Jung S.
2011
“Implementation of low cost small quadrotor system,”
in Korea Robotics Society Annual Conference
Jeonju, Korea
July
15 -
18
Achtelik M.
,
Tianguang Z.
,
Kuhnlenz K.
,
Buss M.
2009
“Visual tracking and control of a quadcopter using a stereo camera system and inertial sensors,”
in International Conference on Mechatronics and Automation
Changchun, China
August 9-12
2863 -
2869
Schwager M.
,
Julian B. J.
,
Angermann M.
,
Rus D.
2011
“Eyes in the sky: decentralized control for the deployment of robotic camera networks,”
Proceedings of the IEEE
99
(9)
1541 -
1561
DOI : 10.1109/JPROC.2011.2158377