SlideShare una empresa de Scribd logo
1 de 4
Descargar para leer sin conexión
N. Ives Roque Pacheco et al. Int. Journal of Engineering Research and Application www.ijera.com
ISSN : 2248-9622, Vol. 5, Issue 5, ( Part -4) May 2015, pp.07-10
www.ijera.com 7 | P a g e
Stability Control of an Autonomous Quadcopter through PID
Control Law
Nicolas Ives Roque Pacheco*, Daniel de Castro Ribeiro Resende **, Pedro
Américo Almeida Magalhães***
*( Graduate of Mechatronic Engineering, Pontificia Universidade Católica de Minas Gerais, Brazil)
** (Graduate of Mechatronic Engineering, Pontificia Universidade Católica de Minas Gerais, Brazil)
***(Department of Mechanical Engineering, Pontificia Universidade Católica de Minas Gerais, Brazil)
ABSTRACT
In the recent years the world has seen a astonishing ascendance of non tripulated vehicles, and among these is
the quadrotors aircrafts or quadcopters. These types of aircraft have been of particular interest due to its easy
maneuverability in closed and open spaces and somewhat simplified dynamics. In these paper is presented an
first attempt in the built model, to control the 4 DOF(Degrees of freedom) of an soon to be autonomous
quadcopter through PID law in an controlled environment.
Keywords – Quadcopter, PID law, Autonomous flight
I. Introduction
The first quadcopter model to be developed was
called the Breguet-Richet aircraft dated from1907.
This mechanism was a simple cross structure (fig.1)
with a motor-propeller in the end of each bar, for lift,
and additional propellers to make it translate in the
space [1]. After many years of development Mark
Adam Kaplan developed the enhanced the Breguet-
Richet machinery, birthing the actual model known
as quadcopter [2] which used the roll-pitch yaw
angles of the vehicle to make translations on the
space. Although Kaplan model was capable of
successful flight, it was obsolete when it came to
speed, load and obtained height, when compared to
the others aircraft models from the period.
Fig. 1- Quadcopter Body-frame.
In the 90’s with the advent of robotics and
microcontrollers, enthusiasts of air-modeling and
robotics resurrected the quadcopter model that
presented for flying robots the advantage of
maneuverability, simple rotor dynamics, reduced
gyroscopic effects and capability of load increase [3].
The quadcopter is a 6 degree of freedom (DOF)
platform capable of rotations and translations in the
space. Although the quadcopter can perform all of
these actions, it’s inputs are limited to four, being
these the lift produced by each rotor, making the
quadrotor a sub-actuated system. Beyond this
complication, such system has a non-linear dynamic
that contributes to the challenge of the
implementation of control that will allow it to
perform stable flight.
As said before the quadcopter is a system with
four inputs with six outputs, but due to its simple
structure it’s almost easy to pick the four observable
variables that will make the feedback of the system
[4]. These being:
 Height: this output is controlled through the
increase or decrease of the rotors lift by the same
amount making it translate in the Z-axis of the
earth frame.
 Roll: X body-frame rotation by θ. This
movement is caused by making the rotors lift in
the Y-axis in the body frame differ by an finite
amount in finite time interval.
 Pitch: Y body-frame axis rotation by Φ. This
action is performed exactly as the roll, but
instead the rotors in the Y-axis is the ones in the
X-axis that have a different lift.
 Yaw: as show in fig.1 the rotors have different
spin directions, being the pair in the X-axis
direction counter-clockwise and in the ones in
the Y-axis direction clockwise. By making the
rotation of the propeller between these pairs
different a Z-axis rotation is induced.
For each one of these DOF was elaborated a PID
controller. This type of controller is thoroughly used
in the control of robotics system due to its
characteristics of [5]:
 Having a simple structure.
FRONT
RIGHT
RESEARCH ARTICLE OPEN ACCESS
N. Ives Roque Pacheco et al. Int. Journal of Engineering Research and Application www.ijera.com
ISSN : 2248-9622, Vol. 5, Issue 5, ( Part -4) May 2015, pp.07-10
www.ijera.com 8 | P a g e
 Having a good performance in many processes.
 Having the possibility of tuning the parameters
without an exact modeling of the system.
In this article is presented the elaboration of
linear PID control, and the simulation results for a
indoors controlled flight of the system.
II. Quadcopter modeling.
For the modeling of the quadcopter was assumed
the following to be true:
 The quadcopter structure is rigid and symmetric.
 The geometric, mass center and body-frame of
the quadcopter are coincident.
Through equations (1) and (2) we relate the
concatenated vector that contains the linear and
angular velocities of the body-frame (subscript B)
and earth-frame (subscript E).
(1)
(2)
Where (3) is the rotation operator, (4) is
the transfer operator for the system rotations
and is a 3 by 3 null matrix.
(3)
(4)
The system dynamics in the body frame were
equated through the Newton-Euler (6) formalism
where in the left-hand-side of the equation is the
resultant force summed with the Coriolis and
centripetal force . In the right-hand-side are
the gravitational force , the gyroscopic effects
and the forces and torques
originated from the propellers.
(5)
Rewriting the equation above in an system of
equations, we can isolate the body-frame
accelerations on the left-hand-side, allowing us to
describe therefore the aircraft dynamics through (6)
(6)
III. QUADCOPTER DATA
The constructed quadcopter (Fig.2) consists of a
two perpendicular aluminum axis fixed in a nylon
board, with 4 brushless E-Max CF2822 motors, each
connected in a (Electronic Speed Controller) Mistery
Simonk 30A and propellers GWS Slow-flyer 8’x4.3’.
Fig. 2 Modeled quadcopter
A reproduction of the model in the CAD
(Computer Aided Design) Solidworks allowed an
estimation of the mass properties of the system,
giving as output an mass of 695g and and the inertia
tensor given by (7).
(7)
For the set consisting of propeller, motor and
ESC’s were used an dynamometer that gave the
output lift of the rotating propeller in gram-force for a
given PWM (Pulse Wave Modulation). The resulting
curves can be seen in figures 3 to 6.
Fig. 3 – Back Rotor
N. Ives Roque Pacheco et al. Int. Journal of Engineering Research and Application www.ijera.com
ISSN : 2248-9622, Vol. 5, Issue 5, ( Part -4) May 2015, pp.07-10
www.ijera.com 9 | P a g e
Fig. 4 Right Rotor
Fig. 5 Left Rotor
Fig. 6 Front Rotor
For the used range of PWM a line seemed a good
approximation yielding the following equations for
the front (8), right (9), left (10) and back(11) motor.
y= 5.426x – 97.84 (8)
y = 5.276x – 109.3 (9)
y = 5.426x – 97.84 (10)
y = 5.487x – 106.7 (11)
Where y is the force and x is the PWM. The
linear correlation coefficient for the equations 8 to 11
were 0.999, 0.999, 0.998 e 0.999 respectively,
showing that the fitted curve gives a reasonable
approximation for the motor dynamics.
The thrust and drag coefficient of the propeller
were obtained from an available database [6],
allowing then a full elaboration of the quadcopter
main dynamics.
IV. SIMULATION
With the given data for the quadcopter system,
an implementation of the model in block diagram,
fig. 7 was made in the MATLAB toolbox system
simulation, Simulink.
Fig. 7 Simulink block diagram.
The simulation reproduced a take-off flight and
hovering flight in sequence for the modeled
quadcopter. Since the microcontroller allows only
integer values for the PWM a quantization block was
inserted between the controllers output and the motor
block, giving a quantized response as show in fig.8
The controllers were tuned using the Ziegler
Nichols method, yielding the following results for the
height in meters and roll pitch and yaw in radians
shown in fig.9.
Fig. 8 Propellers response.
Fig. 9 Simulation results.
N. Ives Roque Pacheco et al. Int. Journal of Engineering Research and Application www.ijera.com
ISSN : 2248-9622, Vol. 5, Issue 5, ( Part -4) May 2015, pp.07-10
www.ijera.com 10 | P a g e
V. CONCLUSIONS
The results from the simulation showed that
flight for the quadcopter controlled through PID is
possible, but the achieved results were somewhat
poor. Even though the yaw can be easily stabilized
with the PID controller, for the roll and pitch curve is
easily seem that the quadcopter passes more time
above the desired angle of 0 than below it, causing a
undesirable translation on the Y and X axis of the
earth-frame., showing that the tuned PID controller is
incapable to account for the motor thrust differences
given by the as can be seen in equations 8 to 11.
For this problem a Kalman filter implementation
seems to be capable of estimating the X and Y
translation and feeding it to the controllers allowing
the removal of this issue, or yet a visual system
capable of giving the translations for feedback
control system for the X and Y coordinates of the
body frame.
REFERENCES
This heading is not assigned a number.
[1] BOUAHBDALLAH, Samir; NOTH, André;
SEIGWART, Roland. . PID vs LQ Control
Techniques Applied Indoor Micro
Quadrirotor. In: Proceedings of 2004
IEEE/RSJ International Conference On
Intelligent Robots and Systems. P. 2451-
2456, 2004.
[2] BASTA, Peter O. Quad Copter Flight.
California State University, Northridge.
Thesis Electric Engineering, 2012, p. 60.
[3] JIANG, Jun et al. Control Platform Design
and Experiment of a Quadrirotor.
Proceedings of the 32nd Chinese Control
Conference. 2013. p. 2974-2979.
[4] BRESCIANI, Tommaso. Modelling,
Identification and Control of a
Quadrirotor Helicopter. Universidaty of
Lund, Thesis Automation Engineering,
2008, p. 184.
[5] LEONG, Bernard Tat Meng; LOW, Sew
Ming; OOI, Melanie Po-Leen. Low-Cost
Microcontroller-based Hover Control
Design of a Quadcopter. Procedia
Engineering. V. 41, p. 458-464, 2012.
[6] BRANDT, John B.; SELIG, Michael S.
Propeller Performance Data at Low
Reynolds Numbers. 49th AIAA Aerospace
Sciences Meeting, Orlando, FL, 2011.

Más contenido relacionado

La actualidad más candente

Quadcopter Design for Payload Delivery
Quadcopter Design for Payload Delivery Quadcopter Design for Payload Delivery
Quadcopter Design for Payload Delivery Onyebuchi nosiri
 
Neural Network Control Based on Adaptive Observer for Quadrotor Helicopter
Neural Network Control Based on Adaptive Observer for Quadrotor HelicopterNeural Network Control Based on Adaptive Observer for Quadrotor Helicopter
Neural Network Control Based on Adaptive Observer for Quadrotor HelicopterIJITCA Journal
 
Analysis & Control of Inverted Pendulum System Using PID Controller
Analysis & Control of Inverted Pendulum System Using PID ControllerAnalysis & Control of Inverted Pendulum System Using PID Controller
Analysis & Control of Inverted Pendulum System Using PID ControllerIJERA Editor
 
Construction of Quadcopter
Construction of QuadcopterConstruction of Quadcopter
Construction of QuadcopterMichael Bseliss
 
Final Year Project report on quadcopter
Final Year Project report on quadcopter Final Year Project report on quadcopter
Final Year Project report on quadcopter Er. Ashutosh Mishra
 
Development of a Customized Autopilot for Unmanned Helicopter Model Using Gen...
Development of a Customized Autopilot for Unmanned Helicopter Model Using Gen...Development of a Customized Autopilot for Unmanned Helicopter Model Using Gen...
Development of a Customized Autopilot for Unmanned Helicopter Model Using Gen...Ahmed Momtaz Hosny, PhD
 
Design and Simulation of Different Controllers for Stabilizing Inverted Pendu...
Design and Simulation of Different Controllers for Stabilizing Inverted Pendu...Design and Simulation of Different Controllers for Stabilizing Inverted Pendu...
Design and Simulation of Different Controllers for Stabilizing Inverted Pendu...IJERA Editor
 
Quadcopter final report anand
Quadcopter final report anandQuadcopter final report anand
Quadcopter final report anandAnand kumar
 
Report of quadcopter
Report of quadcopterReport of quadcopter
Report of quadcopterAshish Patel
 
Manual - Full Quadcopters review (watermarked)
Manual - Full Quadcopters review (watermarked)Manual - Full Quadcopters review (watermarked)
Manual - Full Quadcopters review (watermarked)Quads For Fun
 
Project seminar quadcopter
Project seminar quadcopterProject seminar quadcopter
Project seminar quadcopterShazaan Sayeed
 
Unmanned Aerial Vehicle for Surveillance
Unmanned Aerial Vehicle for Surveillance Unmanned Aerial Vehicle for Surveillance
Unmanned Aerial Vehicle for Surveillance Vedant Srivastava
 
Modeling and simulation of vehicle windshield wiper system using h infinity l...
Modeling and simulation of vehicle windshield wiper system using h infinity l...Modeling and simulation of vehicle windshield wiper system using h infinity l...
Modeling and simulation of vehicle windshield wiper system using h infinity l...Mustefa Jibril
 

La actualidad más candente (20)

Quadcopter Design for Payload Delivery
Quadcopter Design for Payload Delivery Quadcopter Design for Payload Delivery
Quadcopter Design for Payload Delivery
 
Neural Network Control Based on Adaptive Observer for Quadrotor Helicopter
Neural Network Control Based on Adaptive Observer for Quadrotor HelicopterNeural Network Control Based on Adaptive Observer for Quadrotor Helicopter
Neural Network Control Based on Adaptive Observer for Quadrotor Helicopter
 
A Suitable Structure to Control the System of Quad-rotor Miniature Aerial Veh...
A Suitable Structure to Control the System of Quad-rotor Miniature Aerial Veh...A Suitable Structure to Control the System of Quad-rotor Miniature Aerial Veh...
A Suitable Structure to Control the System of Quad-rotor Miniature Aerial Veh...
 
Analysis & Control of Inverted Pendulum System Using PID Controller
Analysis & Control of Inverted Pendulum System Using PID ControllerAnalysis & Control of Inverted Pendulum System Using PID Controller
Analysis & Control of Inverted Pendulum System Using PID Controller
 
B045012015
B045012015B045012015
B045012015
 
Construction of Quadcopter
Construction of QuadcopterConstruction of Quadcopter
Construction of Quadcopter
 
Quadcopter ppt
Quadcopter pptQuadcopter ppt
Quadcopter ppt
 
D045021025
D045021025D045021025
D045021025
 
Final Year Project report on quadcopter
Final Year Project report on quadcopter Final Year Project report on quadcopter
Final Year Project report on quadcopter
 
Development of a Customized Autopilot for Unmanned Helicopter Model Using Gen...
Development of a Customized Autopilot for Unmanned Helicopter Model Using Gen...Development of a Customized Autopilot for Unmanned Helicopter Model Using Gen...
Development of a Customized Autopilot for Unmanned Helicopter Model Using Gen...
 
Qaudcopters
QaudcoptersQaudcopters
Qaudcopters
 
Design and Simulation of Different Controllers for Stabilizing Inverted Pendu...
Design and Simulation of Different Controllers for Stabilizing Inverted Pendu...Design and Simulation of Different Controllers for Stabilizing Inverted Pendu...
Design and Simulation of Different Controllers for Stabilizing Inverted Pendu...
 
Quadcopter final report anand
Quadcopter final report anandQuadcopter final report anand
Quadcopter final report anand
 
Report of quadcopter
Report of quadcopterReport of quadcopter
Report of quadcopter
 
Discrete Time Optimal Tracking Control of BLDC Motor
Discrete Time Optimal Tracking Control of BLDC MotorDiscrete Time Optimal Tracking Control of BLDC Motor
Discrete Time Optimal Tracking Control of BLDC Motor
 
Manual - Full Quadcopters review (watermarked)
Manual - Full Quadcopters review (watermarked)Manual - Full Quadcopters review (watermarked)
Manual - Full Quadcopters review (watermarked)
 
Project seminar quadcopter
Project seminar quadcopterProject seminar quadcopter
Project seminar quadcopter
 
The Control Structure for DC Motor based on the Flatness Control
The Control Structure for DC Motor based on the Flatness ControlThe Control Structure for DC Motor based on the Flatness Control
The Control Structure for DC Motor based on the Flatness Control
 
Unmanned Aerial Vehicle for Surveillance
Unmanned Aerial Vehicle for Surveillance Unmanned Aerial Vehicle for Surveillance
Unmanned Aerial Vehicle for Surveillance
 
Modeling and simulation of vehicle windshield wiper system using h infinity l...
Modeling and simulation of vehicle windshield wiper system using h infinity l...Modeling and simulation of vehicle windshield wiper system using h infinity l...
Modeling and simulation of vehicle windshield wiper system using h infinity l...
 

Destacado

Trẻ Bị đau đầu Gối
Trẻ Bị đau đầu GốiTrẻ Bị đau đầu Gối
Trẻ Bị đau đầu Gốizandra643
 
5 pertambangan
5 pertambangan5 pertambangan
5 pertambanganbodarianna
 
1 вступительное слово 20 мая закордонец татьяна
1 вступительное слово 20 мая закордонец татьяна1 вступительное слово 20 мая закордонец татьяна
1 вступительное слово 20 мая закордонец татьянаPartnerSB
 
διεύρυνση της μάθησης
διεύρυνση της μάθησηςδιεύρυνση της μάθησης
διεύρυνση της μάθησηςHIOTELIS IOANNIS
 
gallerirundan2_031211
gallerirundan2_031211gallerirundan2_031211
gallerirundan2_031211Johan Vestin
 
2015 Broken Hill Resources Investment Symposium - South Australian Departmen...
2015 Broken Hill Resources Investment Symposium -  South Australian Departmen...2015 Broken Hill Resources Investment Symposium -  South Australian Departmen...
2015 Broken Hill Resources Investment Symposium - South Australian Departmen...Symposium
 
2015 Broken Hill Resources Investment Symposium - Impact Minerals (ASX:IPT) -...
2015 Broken Hill Resources Investment Symposium - Impact Minerals (ASX:IPT) -...2015 Broken Hill Resources Investment Symposium - Impact Minerals (ASX:IPT) -...
2015 Broken Hill Resources Investment Symposium - Impact Minerals (ASX:IPT) -...Symposium
 
Перелік обладнання та матеріалів
Перелік обладнання та матеріалівПерелік обладнання та матеріалів
Перелік обладнання та матеріалівVictoria Best
 
Kelas ii sd matematika_amin mustoha
Kelas ii sd matematika_amin mustohaKelas ii sd matematika_amin mustoha
Kelas ii sd matematika_amin mustohaisty-alkhawarizmi
 
Indigestion? food intolerance?
Indigestion? food intolerance?Indigestion? food intolerance?
Indigestion? food intolerance?Alex Nedvetsky
 
On thi thpt toan 2014 2015
On thi thpt toan 2014 2015On thi thpt toan 2014 2015
On thi thpt toan 2014 2015baoanh79
 
Pembentangan kajian tindakan
Pembentangan kajian tindakanPembentangan kajian tindakan
Pembentangan kajian tindakanLinda Salleh
 
Leo, 品毅 -作品集
Leo, 品毅 -作品集Leo, 品毅 -作品集
Leo, 品毅 -作品集品毅 劉
 
4. Τα δικαιωματα των ηλικιωμενων
4. Τα δικαιωματα των ηλικιωμενων4. Τα δικαιωματα των ηλικιωμενων
4. Τα δικαιωματα των ηλικιωμενωνdimkom
 

Destacado (20)

Trẻ Bị đau đầu Gối
Trẻ Bị đau đầu GốiTrẻ Bị đau đầu Gối
Trẻ Bị đau đầu Gối
 
5 pertambangan
5 pertambangan5 pertambangan
5 pertambangan
 
1 вступительное слово 20 мая закордонец татьяна
1 вступительное слово 20 мая закордонец татьяна1 вступительное слово 20 мая закордонец татьяна
1 вступительное слово 20 мая закордонец татьяна
 
คำสั่งควบคุมการทำงาน
คำสั่งควบคุมการทำงานคำสั่งควบคุมการทำงาน
คำสั่งควบคุมการทำงาน
 
διεύρυνση της μάθησης
διεύρυνση της μάθησηςδιεύρυνση της μάθησης
διεύρυνση της μάθησης
 
Jadwal
JadwalJadwal
Jadwal
 
gallerirundan2_031211
gallerirundan2_031211gallerirundan2_031211
gallerirundan2_031211
 
2015 Broken Hill Resources Investment Symposium - South Australian Departmen...
2015 Broken Hill Resources Investment Symposium -  South Australian Departmen...2015 Broken Hill Resources Investment Symposium -  South Australian Departmen...
2015 Broken Hill Resources Investment Symposium - South Australian Departmen...
 
2015 Broken Hill Resources Investment Symposium - Impact Minerals (ASX:IPT) -...
2015 Broken Hill Resources Investment Symposium - Impact Minerals (ASX:IPT) -...2015 Broken Hill Resources Investment Symposium - Impact Minerals (ASX:IPT) -...
2015 Broken Hill Resources Investment Symposium - Impact Minerals (ASX:IPT) -...
 
Перелік обладнання та матеріалів
Перелік обладнання та матеріалівПерелік обладнання та матеріалів
Перелік обладнання та матеріалів
 
Kelas ii sd matematika_amin mustoha
Kelas ii sd matematika_amin mustohaKelas ii sd matematika_amin mustoha
Kelas ii sd matematika_amin mustoha
 
Indigestion? food intolerance?
Indigestion? food intolerance?Indigestion? food intolerance?
Indigestion? food intolerance?
 
On thi thpt toan 2014 2015
On thi thpt toan 2014 2015On thi thpt toan 2014 2015
On thi thpt toan 2014 2015
 
Pembentangan kajian tindakan
Pembentangan kajian tindakanPembentangan kajian tindakan
Pembentangan kajian tindakan
 
Leo, 品毅 -作品集
Leo, 品毅 -作品集Leo, 品毅 -作品集
Leo, 品毅 -作品集
 
shaktivel chemical engineer get
shaktivel chemical engineer getshaktivel chemical engineer get
shaktivel chemical engineer get
 
Npb 106 95
Npb 106 95Npb 106 95
Npb 106 95
 
Production Diary
Production DiaryProduction Diary
Production Diary
 
Triết 2
Triết 2Triết 2
Triết 2
 
4. Τα δικαιωματα των ηλικιωμενων
4. Τα δικαιωματα των ηλικιωμενων4. Τα δικαιωματα των ηλικιωμενων
4. Τα δικαιωματα των ηλικιωμενων
 

Similar a Stability Control of an Autonomous Quadcopter through PID Control Law

DEVELOPMENT AND IMPLEMENTATION OF A ADAPTIVE FUZZY CONTROL SYSTEM FOR A VTOL ...
DEVELOPMENT AND IMPLEMENTATION OF A ADAPTIVE FUZZY CONTROL SYSTEM FOR A VTOL ...DEVELOPMENT AND IMPLEMENTATION OF A ADAPTIVE FUZZY CONTROL SYSTEM FOR A VTOL ...
DEVELOPMENT AND IMPLEMENTATION OF A ADAPTIVE FUZZY CONTROL SYSTEM FOR A VTOL ...ijctcm
 
DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...
DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...
DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...ijistjournal
 
DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...
DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...
DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...ijistjournal
 
PID vs LQR controller for tilt rotor airplane
PID vs LQR controller for tilt rotor airplane PID vs LQR controller for tilt rotor airplane
PID vs LQR controller for tilt rotor airplane IJECEIAES
 
A Comparison of Closed-Loop Performance of MULTIROTOR Configurations using No...
A Comparison of Closed-Loop Performance of MULTIROTOR Configurations using No...A Comparison of Closed-Loop Performance of MULTIROTOR Configurations using No...
A Comparison of Closed-Loop Performance of MULTIROTOR Configurations using No...IRJET Journal
 
PID Control of A Quadrotor UAV
PID Control of A Quadrotor UAVPID Control of A Quadrotor UAV
PID Control of A Quadrotor UAVIRJET Journal
 
Modeling and Fuzzy Logic Control of a Quadrotor UAV
Modeling and Fuzzy Logic Control of a Quadrotor UAVModeling and Fuzzy Logic Control of a Quadrotor UAV
Modeling and Fuzzy Logic Control of a Quadrotor UAVIRJET Journal
 
Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...
Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...
Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...Zac Darcy
 
IRJET- Quadrotor Modeling and Control using PID Technique
IRJET- Quadrotor Modeling and Control using PID TechniqueIRJET- Quadrotor Modeling and Control using PID Technique
IRJET- Quadrotor Modeling and Control using PID TechniqueIRJET Journal
 
Hexacopter using MATLAB Simulink and MPU Sensing
Hexacopter using MATLAB Simulink and MPU SensingHexacopter using MATLAB Simulink and MPU Sensing
Hexacopter using MATLAB Simulink and MPU SensingIRJET Journal
 
Modelling and control of a quad rotor robot
Modelling and control of a quad rotor robotModelling and control of a quad rotor robot
Modelling and control of a quad rotor robotPrasanna Ramamurthy
 
Optimal backstepping control of quadrotor UAV using gravitational search opti...
Optimal backstepping control of quadrotor UAV using gravitational search opti...Optimal backstepping control of quadrotor UAV using gravitational search opti...
Optimal backstepping control of quadrotor UAV using gravitational search opti...journalBEEI
 
The research of 6-DOF flight simulator washout filter Control Method
The research of 6-DOF flight simulator washout filter Control MethodThe research of 6-DOF flight simulator washout filter Control Method
The research of 6-DOF flight simulator washout filter Control MethodIJRES Journal
 
minor project on vertical take off.pptx
minor project on vertical take off.pptxminor project on vertical take off.pptx
minor project on vertical take off.pptxrajmohonsarkar
 
Elevation, pitch and travel axis stabilization of 3DOF helicopter with hybrid...
Elevation, pitch and travel axis stabilization of 3DOF helicopter with hybrid...Elevation, pitch and travel axis stabilization of 3DOF helicopter with hybrid...
Elevation, pitch and travel axis stabilization of 3DOF helicopter with hybrid...IJECEIAES
 
Neural Network Control Based on Adaptive Observer for Quadrotor Helicopter
Neural Network Control Based on Adaptive Observer for Quadrotor HelicopterNeural Network Control Based on Adaptive Observer for Quadrotor Helicopter
Neural Network Control Based on Adaptive Observer for Quadrotor HelicopterIJITCA Journal
 
An Unmanned Rotorcraft System with Embedded Design
An Unmanned Rotorcraft System with Embedded DesignAn Unmanned Rotorcraft System with Embedded Design
An Unmanned Rotorcraft System with Embedded DesignIOSR Journals
 

Similar a Stability Control of an Autonomous Quadcopter through PID Control Law (20)

DEVELOPMENT AND IMPLEMENTATION OF A ADAPTIVE FUZZY CONTROL SYSTEM FOR A VTOL ...
DEVELOPMENT AND IMPLEMENTATION OF A ADAPTIVE FUZZY CONTROL SYSTEM FOR A VTOL ...DEVELOPMENT AND IMPLEMENTATION OF A ADAPTIVE FUZZY CONTROL SYSTEM FOR A VTOL ...
DEVELOPMENT AND IMPLEMENTATION OF A ADAPTIVE FUZZY CONTROL SYSTEM FOR A VTOL ...
 
DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...
DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...
DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...
 
DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...
DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...
DUAL NEURAL NETWORK FOR ADAPTIVE SLIDING MODE CONTROL OF QUADROTOR HELICOPTER...
 
Final
FinalFinal
Final
 
Modelling and Parameters Identification of a Quadrotor Using a Custom Test Rig
Modelling and Parameters Identification of a Quadrotor Using a Custom Test RigModelling and Parameters Identification of a Quadrotor Using a Custom Test Rig
Modelling and Parameters Identification of a Quadrotor Using a Custom Test Rig
 
PID vs LQR controller for tilt rotor airplane
PID vs LQR controller for tilt rotor airplane PID vs LQR controller for tilt rotor airplane
PID vs LQR controller for tilt rotor airplane
 
A Comparison of Closed-Loop Performance of MULTIROTOR Configurations using No...
A Comparison of Closed-Loop Performance of MULTIROTOR Configurations using No...A Comparison of Closed-Loop Performance of MULTIROTOR Configurations using No...
A Comparison of Closed-Loop Performance of MULTIROTOR Configurations using No...
 
PID Control of A Quadrotor UAV
PID Control of A Quadrotor UAVPID Control of A Quadrotor UAV
PID Control of A Quadrotor UAV
 
Modeling and Fuzzy Logic Control of a Quadrotor UAV
Modeling and Fuzzy Logic Control of a Quadrotor UAVModeling and Fuzzy Logic Control of a Quadrotor UAV
Modeling and Fuzzy Logic Control of a Quadrotor UAV
 
Making of Drone
Making of  DroneMaking of  Drone
Making of Drone
 
Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...
Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...
Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...
 
IRJET- Quadrotor Modeling and Control using PID Technique
IRJET- Quadrotor Modeling and Control using PID TechniqueIRJET- Quadrotor Modeling and Control using PID Technique
IRJET- Quadrotor Modeling and Control using PID Technique
 
Hexacopter using MATLAB Simulink and MPU Sensing
Hexacopter using MATLAB Simulink and MPU SensingHexacopter using MATLAB Simulink and MPU Sensing
Hexacopter using MATLAB Simulink and MPU Sensing
 
Modelling and control of a quad rotor robot
Modelling and control of a quad rotor robotModelling and control of a quad rotor robot
Modelling and control of a quad rotor robot
 
Optimal backstepping control of quadrotor UAV using gravitational search opti...
Optimal backstepping control of quadrotor UAV using gravitational search opti...Optimal backstepping control of quadrotor UAV using gravitational search opti...
Optimal backstepping control of quadrotor UAV using gravitational search opti...
 
The research of 6-DOF flight simulator washout filter Control Method
The research of 6-DOF flight simulator washout filter Control MethodThe research of 6-DOF flight simulator washout filter Control Method
The research of 6-DOF flight simulator washout filter Control Method
 
minor project on vertical take off.pptx
minor project on vertical take off.pptxminor project on vertical take off.pptx
minor project on vertical take off.pptx
 
Elevation, pitch and travel axis stabilization of 3DOF helicopter with hybrid...
Elevation, pitch and travel axis stabilization of 3DOF helicopter with hybrid...Elevation, pitch and travel axis stabilization of 3DOF helicopter with hybrid...
Elevation, pitch and travel axis stabilization of 3DOF helicopter with hybrid...
 
Neural Network Control Based on Adaptive Observer for Quadrotor Helicopter
Neural Network Control Based on Adaptive Observer for Quadrotor HelicopterNeural Network Control Based on Adaptive Observer for Quadrotor Helicopter
Neural Network Control Based on Adaptive Observer for Quadrotor Helicopter
 
An Unmanned Rotorcraft System with Embedded Design
An Unmanned Rotorcraft System with Embedded DesignAn Unmanned Rotorcraft System with Embedded Design
An Unmanned Rotorcraft System with Embedded Design
 

Último

Introduction to IEEE STANDARDS and its different types.pptx
Introduction to IEEE STANDARDS and its different types.pptxIntroduction to IEEE STANDARDS and its different types.pptx
Introduction to IEEE STANDARDS and its different types.pptxupamatechverse
 
College Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service NashikCollege Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service NashikCall Girls in Nagpur High Profile
 
(SHREYA) Chakan Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Esc...
(SHREYA) Chakan Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Esc...(SHREYA) Chakan Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Esc...
(SHREYA) Chakan Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Esc...ranjana rawat
 
result management system report for college project
result management system report for college projectresult management system report for college project
result management system report for college projectTonystark477637
 
University management System project report..pdf
University management System project report..pdfUniversity management System project report..pdf
University management System project report..pdfKamal Acharya
 
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...ranjana rawat
 
CCS335 _ Neural Networks and Deep Learning Laboratory_Lab Complete Record
CCS335 _ Neural Networks and Deep Learning Laboratory_Lab Complete RecordCCS335 _ Neural Networks and Deep Learning Laboratory_Lab Complete Record
CCS335 _ Neural Networks and Deep Learning Laboratory_Lab Complete RecordAsst.prof M.Gokilavani
 
Processing & Properties of Floor and Wall Tiles.pptx
Processing & Properties of Floor and Wall Tiles.pptxProcessing & Properties of Floor and Wall Tiles.pptx
Processing & Properties of Floor and Wall Tiles.pptxpranjaldaimarysona
 
The Most Attractive Pune Call Girls Manchar 8250192130 Will You Miss This Cha...
The Most Attractive Pune Call Girls Manchar 8250192130 Will You Miss This Cha...The Most Attractive Pune Call Girls Manchar 8250192130 Will You Miss This Cha...
The Most Attractive Pune Call Girls Manchar 8250192130 Will You Miss This Cha...ranjana rawat
 
Call Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur Escorts
Call Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur EscortsCall Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur Escorts
Call Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur EscortsCall Girls in Nagpur High Profile
 
MANUFACTURING PROCESS-II UNIT-5 NC MACHINE TOOLS
MANUFACTURING PROCESS-II UNIT-5 NC MACHINE TOOLSMANUFACTURING PROCESS-II UNIT-5 NC MACHINE TOOLS
MANUFACTURING PROCESS-II UNIT-5 NC MACHINE TOOLSSIVASHANKAR N
 
KubeKraft presentation @CloudNativeHooghly
KubeKraft presentation @CloudNativeHooghlyKubeKraft presentation @CloudNativeHooghly
KubeKraft presentation @CloudNativeHooghlysanyuktamishra911
 
Coefficient of Thermal Expansion and their Importance.pptx
Coefficient of Thermal Expansion and their Importance.pptxCoefficient of Thermal Expansion and their Importance.pptx
Coefficient of Thermal Expansion and their Importance.pptxAsutosh Ranjan
 
ONLINE FOOD ORDER SYSTEM PROJECT REPORT.pdf
ONLINE FOOD ORDER SYSTEM PROJECT REPORT.pdfONLINE FOOD ORDER SYSTEM PROJECT REPORT.pdf
ONLINE FOOD ORDER SYSTEM PROJECT REPORT.pdfKamal Acharya
 
Java Programming :Event Handling(Types of Events)
Java Programming :Event Handling(Types of Events)Java Programming :Event Handling(Types of Events)
Java Programming :Event Handling(Types of Events)simmis5
 
UNIT-II FMM-Flow Through Circular Conduits
UNIT-II FMM-Flow Through Circular ConduitsUNIT-II FMM-Flow Through Circular Conduits
UNIT-II FMM-Flow Through Circular Conduitsrknatarajan
 
Extrusion Processes and Their Limitations
Extrusion Processes and Their LimitationsExtrusion Processes and Their Limitations
Extrusion Processes and Their Limitations120cr0395
 

Último (20)

Introduction to IEEE STANDARDS and its different types.pptx
Introduction to IEEE STANDARDS and its different types.pptxIntroduction to IEEE STANDARDS and its different types.pptx
Introduction to IEEE STANDARDS and its different types.pptx
 
College Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service NashikCollege Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
 
Roadmap to Membership of RICS - Pathways and Routes
Roadmap to Membership of RICS - Pathways and RoutesRoadmap to Membership of RICS - Pathways and Routes
Roadmap to Membership of RICS - Pathways and Routes
 
(SHREYA) Chakan Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Esc...
(SHREYA) Chakan Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Esc...(SHREYA) Chakan Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Esc...
(SHREYA) Chakan Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Esc...
 
result management system report for college project
result management system report for college projectresult management system report for college project
result management system report for college project
 
University management System project report..pdf
University management System project report..pdfUniversity management System project report..pdf
University management System project report..pdf
 
(INDIRA) Call Girl Aurangabad Call Now 8617697112 Aurangabad Escorts 24x7
(INDIRA) Call Girl Aurangabad Call Now 8617697112 Aurangabad Escorts 24x7(INDIRA) Call Girl Aurangabad Call Now 8617697112 Aurangabad Escorts 24x7
(INDIRA) Call Girl Aurangabad Call Now 8617697112 Aurangabad Escorts 24x7
 
Water Industry Process Automation & Control Monthly - April 2024
Water Industry Process Automation & Control Monthly - April 2024Water Industry Process Automation & Control Monthly - April 2024
Water Industry Process Automation & Control Monthly - April 2024
 
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
 
CCS335 _ Neural Networks and Deep Learning Laboratory_Lab Complete Record
CCS335 _ Neural Networks and Deep Learning Laboratory_Lab Complete RecordCCS335 _ Neural Networks and Deep Learning Laboratory_Lab Complete Record
CCS335 _ Neural Networks and Deep Learning Laboratory_Lab Complete Record
 
Processing & Properties of Floor and Wall Tiles.pptx
Processing & Properties of Floor and Wall Tiles.pptxProcessing & Properties of Floor and Wall Tiles.pptx
Processing & Properties of Floor and Wall Tiles.pptx
 
The Most Attractive Pune Call Girls Manchar 8250192130 Will You Miss This Cha...
The Most Attractive Pune Call Girls Manchar 8250192130 Will You Miss This Cha...The Most Attractive Pune Call Girls Manchar 8250192130 Will You Miss This Cha...
The Most Attractive Pune Call Girls Manchar 8250192130 Will You Miss This Cha...
 
Call Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur Escorts
Call Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur EscortsCall Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur Escorts
Call Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur Escorts
 
MANUFACTURING PROCESS-II UNIT-5 NC MACHINE TOOLS
MANUFACTURING PROCESS-II UNIT-5 NC MACHINE TOOLSMANUFACTURING PROCESS-II UNIT-5 NC MACHINE TOOLS
MANUFACTURING PROCESS-II UNIT-5 NC MACHINE TOOLS
 
KubeKraft presentation @CloudNativeHooghly
KubeKraft presentation @CloudNativeHooghlyKubeKraft presentation @CloudNativeHooghly
KubeKraft presentation @CloudNativeHooghly
 
Coefficient of Thermal Expansion and their Importance.pptx
Coefficient of Thermal Expansion and their Importance.pptxCoefficient of Thermal Expansion and their Importance.pptx
Coefficient of Thermal Expansion and their Importance.pptx
 
ONLINE FOOD ORDER SYSTEM PROJECT REPORT.pdf
ONLINE FOOD ORDER SYSTEM PROJECT REPORT.pdfONLINE FOOD ORDER SYSTEM PROJECT REPORT.pdf
ONLINE FOOD ORDER SYSTEM PROJECT REPORT.pdf
 
Java Programming :Event Handling(Types of Events)
Java Programming :Event Handling(Types of Events)Java Programming :Event Handling(Types of Events)
Java Programming :Event Handling(Types of Events)
 
UNIT-II FMM-Flow Through Circular Conduits
UNIT-II FMM-Flow Through Circular ConduitsUNIT-II FMM-Flow Through Circular Conduits
UNIT-II FMM-Flow Through Circular Conduits
 
Extrusion Processes and Their Limitations
Extrusion Processes and Their LimitationsExtrusion Processes and Their Limitations
Extrusion Processes and Their Limitations
 

Stability Control of an Autonomous Quadcopter through PID Control Law

  • 1. N. Ives Roque Pacheco et al. Int. Journal of Engineering Research and Application www.ijera.com ISSN : 2248-9622, Vol. 5, Issue 5, ( Part -4) May 2015, pp.07-10 www.ijera.com 7 | P a g e Stability Control of an Autonomous Quadcopter through PID Control Law Nicolas Ives Roque Pacheco*, Daniel de Castro Ribeiro Resende **, Pedro Américo Almeida Magalhães*** *( Graduate of Mechatronic Engineering, Pontificia Universidade Católica de Minas Gerais, Brazil) ** (Graduate of Mechatronic Engineering, Pontificia Universidade Católica de Minas Gerais, Brazil) ***(Department of Mechanical Engineering, Pontificia Universidade Católica de Minas Gerais, Brazil) ABSTRACT In the recent years the world has seen a astonishing ascendance of non tripulated vehicles, and among these is the quadrotors aircrafts or quadcopters. These types of aircraft have been of particular interest due to its easy maneuverability in closed and open spaces and somewhat simplified dynamics. In these paper is presented an first attempt in the built model, to control the 4 DOF(Degrees of freedom) of an soon to be autonomous quadcopter through PID law in an controlled environment. Keywords – Quadcopter, PID law, Autonomous flight I. Introduction The first quadcopter model to be developed was called the Breguet-Richet aircraft dated from1907. This mechanism was a simple cross structure (fig.1) with a motor-propeller in the end of each bar, for lift, and additional propellers to make it translate in the space [1]. After many years of development Mark Adam Kaplan developed the enhanced the Breguet- Richet machinery, birthing the actual model known as quadcopter [2] which used the roll-pitch yaw angles of the vehicle to make translations on the space. Although Kaplan model was capable of successful flight, it was obsolete when it came to speed, load and obtained height, when compared to the others aircraft models from the period. Fig. 1- Quadcopter Body-frame. In the 90’s with the advent of robotics and microcontrollers, enthusiasts of air-modeling and robotics resurrected the quadcopter model that presented for flying robots the advantage of maneuverability, simple rotor dynamics, reduced gyroscopic effects and capability of load increase [3]. The quadcopter is a 6 degree of freedom (DOF) platform capable of rotations and translations in the space. Although the quadcopter can perform all of these actions, it’s inputs are limited to four, being these the lift produced by each rotor, making the quadrotor a sub-actuated system. Beyond this complication, such system has a non-linear dynamic that contributes to the challenge of the implementation of control that will allow it to perform stable flight. As said before the quadcopter is a system with four inputs with six outputs, but due to its simple structure it’s almost easy to pick the four observable variables that will make the feedback of the system [4]. These being:  Height: this output is controlled through the increase or decrease of the rotors lift by the same amount making it translate in the Z-axis of the earth frame.  Roll: X body-frame rotation by θ. This movement is caused by making the rotors lift in the Y-axis in the body frame differ by an finite amount in finite time interval.  Pitch: Y body-frame axis rotation by Φ. This action is performed exactly as the roll, but instead the rotors in the Y-axis is the ones in the X-axis that have a different lift.  Yaw: as show in fig.1 the rotors have different spin directions, being the pair in the X-axis direction counter-clockwise and in the ones in the Y-axis direction clockwise. By making the rotation of the propeller between these pairs different a Z-axis rotation is induced. For each one of these DOF was elaborated a PID controller. This type of controller is thoroughly used in the control of robotics system due to its characteristics of [5]:  Having a simple structure. FRONT RIGHT RESEARCH ARTICLE OPEN ACCESS
  • 2. N. Ives Roque Pacheco et al. Int. Journal of Engineering Research and Application www.ijera.com ISSN : 2248-9622, Vol. 5, Issue 5, ( Part -4) May 2015, pp.07-10 www.ijera.com 8 | P a g e  Having a good performance in many processes.  Having the possibility of tuning the parameters without an exact modeling of the system. In this article is presented the elaboration of linear PID control, and the simulation results for a indoors controlled flight of the system. II. Quadcopter modeling. For the modeling of the quadcopter was assumed the following to be true:  The quadcopter structure is rigid and symmetric.  The geometric, mass center and body-frame of the quadcopter are coincident. Through equations (1) and (2) we relate the concatenated vector that contains the linear and angular velocities of the body-frame (subscript B) and earth-frame (subscript E). (1) (2) Where (3) is the rotation operator, (4) is the transfer operator for the system rotations and is a 3 by 3 null matrix. (3) (4) The system dynamics in the body frame were equated through the Newton-Euler (6) formalism where in the left-hand-side of the equation is the resultant force summed with the Coriolis and centripetal force . In the right-hand-side are the gravitational force , the gyroscopic effects and the forces and torques originated from the propellers. (5) Rewriting the equation above in an system of equations, we can isolate the body-frame accelerations on the left-hand-side, allowing us to describe therefore the aircraft dynamics through (6) (6) III. QUADCOPTER DATA The constructed quadcopter (Fig.2) consists of a two perpendicular aluminum axis fixed in a nylon board, with 4 brushless E-Max CF2822 motors, each connected in a (Electronic Speed Controller) Mistery Simonk 30A and propellers GWS Slow-flyer 8’x4.3’. Fig. 2 Modeled quadcopter A reproduction of the model in the CAD (Computer Aided Design) Solidworks allowed an estimation of the mass properties of the system, giving as output an mass of 695g and and the inertia tensor given by (7). (7) For the set consisting of propeller, motor and ESC’s were used an dynamometer that gave the output lift of the rotating propeller in gram-force for a given PWM (Pulse Wave Modulation). The resulting curves can be seen in figures 3 to 6. Fig. 3 – Back Rotor
  • 3. N. Ives Roque Pacheco et al. Int. Journal of Engineering Research and Application www.ijera.com ISSN : 2248-9622, Vol. 5, Issue 5, ( Part -4) May 2015, pp.07-10 www.ijera.com 9 | P a g e Fig. 4 Right Rotor Fig. 5 Left Rotor Fig. 6 Front Rotor For the used range of PWM a line seemed a good approximation yielding the following equations for the front (8), right (9), left (10) and back(11) motor. y= 5.426x – 97.84 (8) y = 5.276x – 109.3 (9) y = 5.426x – 97.84 (10) y = 5.487x – 106.7 (11) Where y is the force and x is the PWM. The linear correlation coefficient for the equations 8 to 11 were 0.999, 0.999, 0.998 e 0.999 respectively, showing that the fitted curve gives a reasonable approximation for the motor dynamics. The thrust and drag coefficient of the propeller were obtained from an available database [6], allowing then a full elaboration of the quadcopter main dynamics. IV. SIMULATION With the given data for the quadcopter system, an implementation of the model in block diagram, fig. 7 was made in the MATLAB toolbox system simulation, Simulink. Fig. 7 Simulink block diagram. The simulation reproduced a take-off flight and hovering flight in sequence for the modeled quadcopter. Since the microcontroller allows only integer values for the PWM a quantization block was inserted between the controllers output and the motor block, giving a quantized response as show in fig.8 The controllers were tuned using the Ziegler Nichols method, yielding the following results for the height in meters and roll pitch and yaw in radians shown in fig.9. Fig. 8 Propellers response. Fig. 9 Simulation results.
  • 4. N. Ives Roque Pacheco et al. Int. Journal of Engineering Research and Application www.ijera.com ISSN : 2248-9622, Vol. 5, Issue 5, ( Part -4) May 2015, pp.07-10 www.ijera.com 10 | P a g e V. CONCLUSIONS The results from the simulation showed that flight for the quadcopter controlled through PID is possible, but the achieved results were somewhat poor. Even though the yaw can be easily stabilized with the PID controller, for the roll and pitch curve is easily seem that the quadcopter passes more time above the desired angle of 0 than below it, causing a undesirable translation on the Y and X axis of the earth-frame., showing that the tuned PID controller is incapable to account for the motor thrust differences given by the as can be seen in equations 8 to 11. For this problem a Kalman filter implementation seems to be capable of estimating the X and Y translation and feeding it to the controllers allowing the removal of this issue, or yet a visual system capable of giving the translations for feedback control system for the X and Y coordinates of the body frame. REFERENCES This heading is not assigned a number. [1] BOUAHBDALLAH, Samir; NOTH, André; SEIGWART, Roland. . PID vs LQ Control Techniques Applied Indoor Micro Quadrirotor. In: Proceedings of 2004 IEEE/RSJ International Conference On Intelligent Robots and Systems. P. 2451- 2456, 2004. [2] BASTA, Peter O. Quad Copter Flight. California State University, Northridge. Thesis Electric Engineering, 2012, p. 60. [3] JIANG, Jun et al. Control Platform Design and Experiment of a Quadrirotor. Proceedings of the 32nd Chinese Control Conference. 2013. p. 2974-2979. [4] BRESCIANI, Tommaso. Modelling, Identification and Control of a Quadrirotor Helicopter. Universidaty of Lund, Thesis Automation Engineering, 2008, p. 184. [5] LEONG, Bernard Tat Meng; LOW, Sew Ming; OOI, Melanie Po-Leen. Low-Cost Microcontroller-based Hover Control Design of a Quadcopter. Procedia Engineering. V. 41, p. 458-464, 2012. [6] BRANDT, John B.; SELIG, Michael S. Propeller Performance Data at Low Reynolds Numbers. 49th AIAA Aerospace Sciences Meeting, Orlando, FL, 2011.