SlideShare a Scribd company logo
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol.1,No.4,November 2013

OPTIMAL AND PID CONTROLLER FOR
CONTROLLING CAMERA’S POSITION IN
UNMANNED AERIAL VEHICLES
MOHAMMAD ABDULRAHMAN AL-MASHHADANI
Department of Information System and Technology, Belarusian National Technical
University,Minsk ,Belarus

ABSTRACT
This paper describes two controllers designed specifically for adjusting camera’s position in a small
unmanned aerial vehicle (UAV). The optimal controller was designed and first simulated by using
MATLAB technique and the results displayed graphically, also PID controller was designedand
simulatedby using MATLAB technique .The goal of this paper is to connect the tow controllers in cascade
mode to obtain the desired performance and correction in camera’s position in both roll and pitch.

KEYWORDS
Unmanned Aerial Vehicles, System Control, Servo Motor, PID Controller, Optimal Control

1. INTRODUCTION
Unmanned aerial vehicle is remotely piloted or self piloted (without pilot) aircraftwhich can carry
many different types of accessories such as cameras. In many types of UAV’s servo motors are
using for adjusting movements, sensors and communications equipment [1].Control of the
movements and flying systems in the UAV is customarily done by using the microcontrollers
optimal controllers or conventional PID control techniques.The main objective of the work
reported in this paper is to evaluate the performance of each of optimal and PID controllers
separately and will show the characteristics of the each of PID and optimal controllers, and which
controller is better for obtaining the desired response.

2. SERVO MOTORS
Using the servomotor is helpful to correct the performance of a mechanism because it uses error
sensing feedback. The servo motors usually used in the systems where the feedback or error
correction signals help control mechanical position or other parameters[3]. Some servos also have
rotation limit of 360°, but servos do not rotate continually. The Servos are used for precision
positioning. They are used in many fields like toys, cars and UAVs. Servos are commonly
electrical or partially electronic in nature, using an electric motor as the primary means of
creating mechanical force. Other types of servos use hydraulics, pneumatics, or magnetic
DOI : 10.5121/ijitmc.2013.1403

25
principles [3]. Usually, servos operate on the principle of negative feedback, where the control
input is compared to the actual position of the mechanical system as measured by some sort of
transducer at the output.

2.1. Modeling a Simple Servo motor
DC servo motorhas an output shaft with an inertial load(J) on it.Theamount of frictions in the
bearings of the motor and load represented in our paper by the constant (b).The input voltage u(t)
is transformed by the motor into a torque T(t) in the motor output shaft. If we assume that (h) is
the angular position of the servo output shaft, then the torque balance can be written as:
J*ḣ+b*ḧ=T(t)

(1)

Where:
(ḣ)- Is the shaft velocity, (ḧ)-is the shaft torque
The control objective is to control the shaft position (h) or the shaft velocity (h) to be some desire
value. The input voltage u(t) is related to the torque T(t) by a gain (K) and the inertia load divided
by the friction coefficient is referred to as the system time constant (τ) where:
τ =J/b

(2)

So the system model becomes:
τ* ḣ+ ḧ=K.u(t)

(3)

The linear part of the servo system model can be put in the transfer function form:

y (s )  s (K 1) u (s )
s

(4)

Where y(s) is the output shaft position and u(s) is the motor input. K is the system gain and τ.
Where :(tau) is the time constant.
Let’s go now to the UAV and will show and explain the scheme for controlling the rotational
position of the camera for roll and pitch movements of an unmanned air vehicle (UAV).Roll error
and pitch error signals obtained from gyro systems in the UAV are subtractive combined with roll
and pitch position signals, to generated control signals to be applied to rotate the camera in a way
that compensates for the roll and pitch movements of the UAV, and effectively isolates the
camera from roll and pitch movements of the UAV and the camera will provide a good photo or
video without loss in information (Fig. 1).

26
Figure1. Control system scheme for the camera in UAV

2.2. The Flight Controllers in UAV
The better method for controlling of a small UAV is to use the flight controller as consisting of
two cascaded controllers as shown in Fig.2.The firstcontroller, is designed to control the attitude
which takes desired attitude angles as inputs and generates the actuator commands that will result
in the desired attitude. The secondcontroller, which controls the slower translational rate
variables, takes desired velocity or position as input and generates desired angels to the inner
loop.

Figure 2.Overall control scheme

3. SYSTEM CONTROL REPRESENTATION
The transfer function of the servo motor used in our experiment as shown below:
firstwe will view the open-loop step response for the system, Then create a new m-file in Matlab
and add in the following code:
27
num=1050; den=[1 30 0]; step(num,den)
The DC gain of the plant used the above transfer function is () , so 10.5 x 10^5 is the final value
of the output related to a unit step input. This corresponds to the steady-state error of 1.5x10^5,
quite large indeed. Furthermore, the rise time is equal to the settling time.The goal of this
problem is to obtain a controller to give the following parameters:
•
•
•

Fast rise time
Minimum overshoot
No steady-state error

Modeling the optimal controller
The optimal controller equation in the Z-domain is given in the equation below:

1 b 1

z

b 2

1

z

2

W ( z) K
0 (1 

)(1 a1

1

z

1

z

)

Where: K, b1, b2, a1 are coefficients defined as below:
ab

K 0

;

 (1 A )(1 B)
b1( A  B);

b2 AB;

bBaA( a  b ) AB
a1
( aB )(1 A )(1 B)
Ae

ah

;Be

bh

; h 0.001sec

The modeling of the controller using MATLAB Simulink is as shown in the Fig.3

28
Figure 3.Optimal controller design simulink

After running this model we can see the output signal as shown in Fig.4:

Figure 4.Output signal of the optimal controller

3.2. The PID Controller modeling
The transfer function of the PID controller is:

G(S )  K p 

Ki
 K d .s
s

Where:
Kp = Proportional gain ,Ki= Integral gain ,Kd = Derivative gain
The proportional gain (Kp) will reduce the rise time and will reduce (but never eliminate) the
steady-state error. The integral gain (Ki) will eliminate the steady-state error, but it may make the
29
transient response worse. The derivative gain (Kd) will increase the stability of the system, reduce
the overshoot, and improve the transient response.Performance criteria were specified as:
Rise time tr0.1
Settling time
ts0.5
Maximum overshoot Mr0.5%
Steady state error (e) 0.5%
Running the program and we will get the needed parameters. From the parameters tuning we
can get:
Kd = 0.008672, Ki =0.008672, Kp = 0.114
Fig.5 shows the PID controller designed by using MATLAB Simulink where all of controller
coefficients were adjusted.

Figure 5.PID control system designed in MATLAB Simulink

30
After running this simulink, we can see the signal shown in Fig.6

Figure 6.Output signal in the case of PID

By comparing the signal output in case of optimal controller (Fig.4) and PID controller (Fig.6) we
obtain the signals shown in Fig.7.

Figure 7.output signals compared between the 2-controllers

We can summarize the performance of the optimal and PID controllers obtained by our
experiment as in the table.1 shown:

31
Table 1. OPTIMAL AND PID OUTPUT SIGNAL CHARACTERISTICS

controller
optimal
PID

RISE OVERSHOOT SETTLING
S-S
TIME
TIME
ERROR
0.2
0.2

none
none

0.4
0.57

0.4%
0.53%

Let’s now campaign the 2-controller as we explain above in cascade mode to get the desired
output signal and the desired output voltage from the servo motor to give the right signal to the
camera position (Fig.8).

Figure 8.output signal for combining optimal and PID controllers

As we see in fig.8 the desired performance well obtained and this refer that the combined of the
optimal and PID controllers in cascade mode give the performance better than if they worked
separately.

4. Conclusions
• Flight control of UAV is done by using tow controllers instead of one and the tow controllers is
designed by using MATLAB technic .
• Optimal controller satisfies the performance requirements. But, PID controller was unable to
give fast rise time and it failed to satisfy the performance requirements.
• Combining the optimal and PID controllers as we suggested in this paper in cascade mode will
give the desired performance and this will make no loss in information in the cameras movements
in both roll and pitch.

32
ACKNOWLEDGMENTS
I would like to acknowledge my professor Alexander A.Lobaty and Mr.A.G.Streshnov for their
big assistants.

REFERENCES
[1]

SeferKurnaz , Omer Cetin and OkyayKaynak , Adaptive neuro-fuzzy inference system based
autonomous flight controlof unmanned air vehicles, Expert Systems with Applications 37 ,2010,P
1229–1234
[2] Rahul Malhotra, Narinder Singh, Yaduvir Singh, SOFT COMPUTING TECHNIQUES FOR
PROCESSCONTROL APPLICATIONS, International Journal on Soft Computing ( IJSC ), Vol.2,
No.3, August 2011
[3] SHAMSUL NIZAM BIN MOHD YUSOF AHAMID, DEVELOPING LQR TO CONTROL SPEED
MOTOR USING MATLAB GUI, Faculty of Electrical and Electronics Engineering , University
Malaysia Pahang, NOVEMBER 2008
[4] Jyotsna’sBlog,SERVOMECHANISMS AND ITS APPLICATIONS,July 2009
[5] http://www.engineersgarage.com/articles/servo-motor
[6] Servo control systems: DC servomechanisms. Control-systems principles.co.UK.
[7] Downs, Stuart G., unmanned air vehicle servoing dipole, Northrop Grumman Corporation Los
Angeles, CA,2004
[8] PID control-National Instrument , http://www.ni.com/white-paper/6440/en
[9] Tsai-JiunRenand Tien-ChiChen, Motion control for a two-wheeled vehicle using a self-tuning PID
controller, Control Engineering Practice Volume 16, Issue 3, March 2008, P 365–375
[10] Wallén, A. (2000): “Tools for Autonomous Process Control”. PhD, Department of automatic Control,
Lund Institute of Technology, Lund, Sweden.
[11] Panagopoulos, H. (2000): “PID Control; Design, Extension, Application”. PhD thesis, Department of
automatic Control, Lund Institute of Technology, Lund,Sweden.
[12] ieniazek, J. Software-based Camera Stabilization on Unmanned Aircraft, Aircraft Engineering and
Aerospace Technology: An International Journal, Vol. 75, No. 6, 2003.

33

More Related Content

PDF
Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...
PPSX
Backstepping control of cart pole system
PDF
Raymond.Brunkow-Project-EEL-3657-Sp15
PDF
Modeling, simulation and control of a robotic arm
PDF
Simulation and experimental study on PID control of a quadrotor MAV with pert...
PDF
Real-time PID control of an inverted pendulum
PDF
Implementation Of Flight Control System Based ON KF AND PID CONTROL
PDF
Iaetsd modelling and controller design of cart inverted pendulum system using...
Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...
Backstepping control of cart pole system
Raymond.Brunkow-Project-EEL-3657-Sp15
Modeling, simulation and control of a robotic arm
Simulation and experimental study on PID control of a quadrotor MAV with pert...
Real-time PID control of an inverted pendulum
Implementation Of Flight Control System Based ON KF AND PID CONTROL
Iaetsd modelling and controller design of cart inverted pendulum system using...

What's hot (19)

PDF
MODELLING AND SIMULATION OF INVERTED PENDULUM USING INTERNAL MODEL CONTROL
PDF
Intelligent Control of a Robot Manipulator
PDF
Inverted Pendulum Control: A Brief Overview
PPT
1 mrac for inverted pendulum
PDF
Paper id 24201493
PDF
Automatic control and mixed sensitivity Hinf control
PDF
Controller design of inverted pendulum using pole placement and lqr
PPT
12EE62R11_Final Presentation
PPTX
Attitude Control of Satellite Test Setup Using Reaction Wheels
PDF
Iaetsd modelling of one link flexible arm manipulator using
PDF
Design and Implementation of an Electrical Lift Controlled using PLC
PPTX
Quadcopter final report anand
PDF
control system lab 02 - PID tuning
PDF
Image Based Visual Servoing for Omnidirectional Wheeled Mobile Robots in Volt...
PDF
Comparisons of fuzzy mras and pid controllers for ems maglev train
PDF
Rotor Resistance Adaptation Scheme Using Neural Learning Algorithm for a Fuzz...
PDF
Article 1
PDF
Discrete Time Optimal Tracking Control of BLDC Motor
PPTX
Modelling and Control of Ground Test Set-up of Attitude of Satellite
MODELLING AND SIMULATION OF INVERTED PENDULUM USING INTERNAL MODEL CONTROL
Intelligent Control of a Robot Manipulator
Inverted Pendulum Control: A Brief Overview
1 mrac for inverted pendulum
Paper id 24201493
Automatic control and mixed sensitivity Hinf control
Controller design of inverted pendulum using pole placement and lqr
12EE62R11_Final Presentation
Attitude Control of Satellite Test Setup Using Reaction Wheels
Iaetsd modelling of one link flexible arm manipulator using
Design and Implementation of an Electrical Lift Controlled using PLC
Quadcopter final report anand
control system lab 02 - PID tuning
Image Based Visual Servoing for Omnidirectional Wheeled Mobile Robots in Volt...
Comparisons of fuzzy mras and pid controllers for ems maglev train
Rotor Resistance Adaptation Scheme Using Neural Learning Algorithm for a Fuzz...
Article 1
Discrete Time Optimal Tracking Control of BLDC Motor
Modelling and Control of Ground Test Set-up of Attitude of Satellite
Ad

Viewers also liked (17)

PPTX
перші розділи. герої роману.
PDF
Antykwa toruńska light
PPTX
Oxford II Chester and Wells hondenbanken
PDF
Pediatric truma 60 (2)
PDF
Oxigen Beamer
PDF
Ping! LaTeX
PPTX
Holy Trinity_Prelims_Answers
PDF
Latin modern
PDF
Towards a better life by sabry shaheen - summary
PDF
Analysis big data by use php with storm
PPTX
001 poesia matemática millôr
PDF
INFLUENCE OF OVERLAYERS ON DEPTH OF IMPLANTED-HETEROJUNCTION RECTIFIERS
PPTX
Buoyancy in air2
PDF
Thunder box home
PPTX
Module 4 | CEST-richtlijnen voor beheerders van digitale collecties | Bewaren
PDF
Joyjoy
PPT
Red star group staffing solutions pvt 2
перші розділи. герої роману.
Antykwa toruńska light
Oxford II Chester and Wells hondenbanken
Pediatric truma 60 (2)
Oxigen Beamer
Ping! LaTeX
Holy Trinity_Prelims_Answers
Latin modern
Towards a better life by sabry shaheen - summary
Analysis big data by use php with storm
001 poesia matemática millôr
INFLUENCE OF OVERLAYERS ON DEPTH OF IMPLANTED-HETEROJUNCTION RECTIFIERS
Buoyancy in air2
Thunder box home
Module 4 | CEST-richtlijnen voor beheerders van digitale collecties | Bewaren
Joyjoy
Red star group staffing solutions pvt 2
Ad

Similar to Optimal and pid controller for controlling camera’s position in unmanned aerial vehicles (20)

PDF
Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...
PDF
CE150--Hongyi Huang
DOCX
Pi controller ieee format
PDF
Design and control of ems magnetic levitation train using fuzzy mras and pid ...
PDF
Modified Chattering Free Sliding Mode Control of DC Motor
PDF
MODELING AND DESIGN OF CRUISE CONTROL SYSTEM WITH FEEDFORWARD FOR ALL TERRIAN...
PDF
Identification and Real Time Control of a DC Motor
PDF
IRJET- Speed Control of Induction Motor using Hybrid PID Fuzzy Controller
PDF
D0255033039
PDF
Thrust vector controlled (tcv) rocket modelling using lqr controller
PDF
Jw3417821791
PDF
Speed control of a dc motor a matlab approach
PDF
D011121524
PDF
PID controller for microsatellite yaw-axis attitude control system using ITAE...
PDF
Mathematical model analysis and control algorithms design based on state feed...
PDF
IRJET- A Performance of Hybrid Control in Nonlinear Dynamic Multirotor UAV
PDF
Development of a Customized Autopilot for Unmanned Helicopter Model Using Gen...
PDF
6. performance analysis of pd, pid controllers for speed control of dc motor
PDF
MODELING AND DESIGN OF CRUISE CONTROL SYSTEM WITH FEEDFORWARD FOR ALL TERRIAN...
PDF
Design and implementation of antenna control servo system for satellite grou
Optimal and Pid Controller for Controlling Camera's Position InUnmanned Aeria...
CE150--Hongyi Huang
Pi controller ieee format
Design and control of ems magnetic levitation train using fuzzy mras and pid ...
Modified Chattering Free Sliding Mode Control of DC Motor
MODELING AND DESIGN OF CRUISE CONTROL SYSTEM WITH FEEDFORWARD FOR ALL TERRIAN...
Identification and Real Time Control of a DC Motor
IRJET- Speed Control of Induction Motor using Hybrid PID Fuzzy Controller
D0255033039
Thrust vector controlled (tcv) rocket modelling using lqr controller
Jw3417821791
Speed control of a dc motor a matlab approach
D011121524
PID controller for microsatellite yaw-axis attitude control system using ITAE...
Mathematical model analysis and control algorithms design based on state feed...
IRJET- A Performance of Hybrid Control in Nonlinear Dynamic Multirotor UAV
Development of a Customized Autopilot for Unmanned Helicopter Model Using Gen...
6. performance analysis of pd, pid controllers for speed control of dc motor
MODELING AND DESIGN OF CRUISE CONTROL SYSTEM WITH FEEDFORWARD FOR ALL TERRIAN...
Design and implementation of antenna control servo system for satellite grou

Recently uploaded (20)

PPT
“AI and Expert System Decision Support & Business Intelligence Systems”
PDF
Dropbox Q2 2025 Financial Results & Investor Presentation
PPTX
Effective Security Operations Center (SOC) A Modern, Strategic, and Threat-In...
PDF
Building Integrated photovoltaic BIPV_UPV.pdf
PDF
Machine learning based COVID-19 study performance prediction
PPTX
Cloud computing and distributed systems.
PDF
Reach Out and Touch Someone: Haptics and Empathic Computing
PPTX
PA Analog/Digital System: The Backbone of Modern Surveillance and Communication
PDF
cuic standard and advanced reporting.pdf
PDF
Build a system with the filesystem maintained by OSTree @ COSCUP 2025
PPTX
Big Data Technologies - Introduction.pptx
PDF
Unlocking AI with Model Context Protocol (MCP)
PDF
Encapsulation_ Review paper, used for researhc scholars
PPT
Teaching material agriculture food technology
PDF
Shreyas Phanse Resume: Experienced Backend Engineer | Java • Spring Boot • Ka...
PDF
Advanced methodologies resolving dimensionality complications for autism neur...
PDF
Chapter 3 Spatial Domain Image Processing.pdf
PDF
The Rise and Fall of 3GPP – Time for a Sabbatical?
PDF
Approach and Philosophy of On baking technology
PDF
KodekX | Application Modernization Development
“AI and Expert System Decision Support & Business Intelligence Systems”
Dropbox Q2 2025 Financial Results & Investor Presentation
Effective Security Operations Center (SOC) A Modern, Strategic, and Threat-In...
Building Integrated photovoltaic BIPV_UPV.pdf
Machine learning based COVID-19 study performance prediction
Cloud computing and distributed systems.
Reach Out and Touch Someone: Haptics and Empathic Computing
PA Analog/Digital System: The Backbone of Modern Surveillance and Communication
cuic standard and advanced reporting.pdf
Build a system with the filesystem maintained by OSTree @ COSCUP 2025
Big Data Technologies - Introduction.pptx
Unlocking AI with Model Context Protocol (MCP)
Encapsulation_ Review paper, used for researhc scholars
Teaching material agriculture food technology
Shreyas Phanse Resume: Experienced Backend Engineer | Java • Spring Boot • Ka...
Advanced methodologies resolving dimensionality complications for autism neur...
Chapter 3 Spatial Domain Image Processing.pdf
The Rise and Fall of 3GPP – Time for a Sabbatical?
Approach and Philosophy of On baking technology
KodekX | Application Modernization Development

Optimal and pid controller for controlling camera’s position in unmanned aerial vehicles

  • 1. International Journal of Information Technology, Modeling and Computing (IJITMC) Vol.1,No.4,November 2013 OPTIMAL AND PID CONTROLLER FOR CONTROLLING CAMERA’S POSITION IN UNMANNED AERIAL VEHICLES MOHAMMAD ABDULRAHMAN AL-MASHHADANI Department of Information System and Technology, Belarusian National Technical University,Minsk ,Belarus ABSTRACT This paper describes two controllers designed specifically for adjusting camera’s position in a small unmanned aerial vehicle (UAV). The optimal controller was designed and first simulated by using MATLAB technique and the results displayed graphically, also PID controller was designedand simulatedby using MATLAB technique .The goal of this paper is to connect the tow controllers in cascade mode to obtain the desired performance and correction in camera’s position in both roll and pitch. KEYWORDS Unmanned Aerial Vehicles, System Control, Servo Motor, PID Controller, Optimal Control 1. INTRODUCTION Unmanned aerial vehicle is remotely piloted or self piloted (without pilot) aircraftwhich can carry many different types of accessories such as cameras. In many types of UAV’s servo motors are using for adjusting movements, sensors and communications equipment [1].Control of the movements and flying systems in the UAV is customarily done by using the microcontrollers optimal controllers or conventional PID control techniques.The main objective of the work reported in this paper is to evaluate the performance of each of optimal and PID controllers separately and will show the characteristics of the each of PID and optimal controllers, and which controller is better for obtaining the desired response. 2. SERVO MOTORS Using the servomotor is helpful to correct the performance of a mechanism because it uses error sensing feedback. The servo motors usually used in the systems where the feedback or error correction signals help control mechanical position or other parameters[3]. Some servos also have rotation limit of 360°, but servos do not rotate continually. The Servos are used for precision positioning. They are used in many fields like toys, cars and UAVs. Servos are commonly electrical or partially electronic in nature, using an electric motor as the primary means of creating mechanical force. Other types of servos use hydraulics, pneumatics, or magnetic DOI : 10.5121/ijitmc.2013.1403 25
  • 2. principles [3]. Usually, servos operate on the principle of negative feedback, where the control input is compared to the actual position of the mechanical system as measured by some sort of transducer at the output. 2.1. Modeling a Simple Servo motor DC servo motorhas an output shaft with an inertial load(J) on it.Theamount of frictions in the bearings of the motor and load represented in our paper by the constant (b).The input voltage u(t) is transformed by the motor into a torque T(t) in the motor output shaft. If we assume that (h) is the angular position of the servo output shaft, then the torque balance can be written as: J*ḣ+b*ḧ=T(t) (1) Where: (ḣ)- Is the shaft velocity, (ḧ)-is the shaft torque The control objective is to control the shaft position (h) or the shaft velocity (h) to be some desire value. The input voltage u(t) is related to the torque T(t) by a gain (K) and the inertia load divided by the friction coefficient is referred to as the system time constant (τ) where: τ =J/b (2) So the system model becomes: τ* ḣ+ ḧ=K.u(t) (3) The linear part of the servo system model can be put in the transfer function form: y (s )  s (K 1) u (s ) s (4) Where y(s) is the output shaft position and u(s) is the motor input. K is the system gain and τ. Where :(tau) is the time constant. Let’s go now to the UAV and will show and explain the scheme for controlling the rotational position of the camera for roll and pitch movements of an unmanned air vehicle (UAV).Roll error and pitch error signals obtained from gyro systems in the UAV are subtractive combined with roll and pitch position signals, to generated control signals to be applied to rotate the camera in a way that compensates for the roll and pitch movements of the UAV, and effectively isolates the camera from roll and pitch movements of the UAV and the camera will provide a good photo or video without loss in information (Fig. 1). 26
  • 3. Figure1. Control system scheme for the camera in UAV 2.2. The Flight Controllers in UAV The better method for controlling of a small UAV is to use the flight controller as consisting of two cascaded controllers as shown in Fig.2.The firstcontroller, is designed to control the attitude which takes desired attitude angles as inputs and generates the actuator commands that will result in the desired attitude. The secondcontroller, which controls the slower translational rate variables, takes desired velocity or position as input and generates desired angels to the inner loop. Figure 2.Overall control scheme 3. SYSTEM CONTROL REPRESENTATION The transfer function of the servo motor used in our experiment as shown below: firstwe will view the open-loop step response for the system, Then create a new m-file in Matlab and add in the following code: 27
  • 4. num=1050; den=[1 30 0]; step(num,den) The DC gain of the plant used the above transfer function is () , so 10.5 x 10^5 is the final value of the output related to a unit step input. This corresponds to the steady-state error of 1.5x10^5, quite large indeed. Furthermore, the rise time is equal to the settling time.The goal of this problem is to obtain a controller to give the following parameters: • • • Fast rise time Minimum overshoot No steady-state error Modeling the optimal controller The optimal controller equation in the Z-domain is given in the equation below: 1 b 1 z b 2 1 z 2 W ( z) K 0 (1  )(1 a1 1 z 1 z ) Where: K, b1, b2, a1 are coefficients defined as below: ab K 0 ;  (1 A )(1 B) b1( A  B); b2 AB; bBaA( a  b ) AB a1 ( aB )(1 A )(1 B) Ae ah ;Be bh ; h 0.001sec The modeling of the controller using MATLAB Simulink is as shown in the Fig.3 28
  • 5. Figure 3.Optimal controller design simulink After running this model we can see the output signal as shown in Fig.4: Figure 4.Output signal of the optimal controller 3.2. The PID Controller modeling The transfer function of the PID controller is: G(S )  K p  Ki  K d .s s Where: Kp = Proportional gain ,Ki= Integral gain ,Kd = Derivative gain The proportional gain (Kp) will reduce the rise time and will reduce (but never eliminate) the steady-state error. The integral gain (Ki) will eliminate the steady-state error, but it may make the 29
  • 6. transient response worse. The derivative gain (Kd) will increase the stability of the system, reduce the overshoot, and improve the transient response.Performance criteria were specified as: Rise time tr0.1 Settling time ts0.5 Maximum overshoot Mr0.5% Steady state error (e) 0.5% Running the program and we will get the needed parameters. From the parameters tuning we can get: Kd = 0.008672, Ki =0.008672, Kp = 0.114 Fig.5 shows the PID controller designed by using MATLAB Simulink where all of controller coefficients were adjusted. Figure 5.PID control system designed in MATLAB Simulink 30
  • 7. After running this simulink, we can see the signal shown in Fig.6 Figure 6.Output signal in the case of PID By comparing the signal output in case of optimal controller (Fig.4) and PID controller (Fig.6) we obtain the signals shown in Fig.7. Figure 7.output signals compared between the 2-controllers We can summarize the performance of the optimal and PID controllers obtained by our experiment as in the table.1 shown: 31
  • 8. Table 1. OPTIMAL AND PID OUTPUT SIGNAL CHARACTERISTICS controller optimal PID RISE OVERSHOOT SETTLING S-S TIME TIME ERROR 0.2 0.2 none none 0.4 0.57 0.4% 0.53% Let’s now campaign the 2-controller as we explain above in cascade mode to get the desired output signal and the desired output voltage from the servo motor to give the right signal to the camera position (Fig.8). Figure 8.output signal for combining optimal and PID controllers As we see in fig.8 the desired performance well obtained and this refer that the combined of the optimal and PID controllers in cascade mode give the performance better than if they worked separately. 4. Conclusions • Flight control of UAV is done by using tow controllers instead of one and the tow controllers is designed by using MATLAB technic . • Optimal controller satisfies the performance requirements. But, PID controller was unable to give fast rise time and it failed to satisfy the performance requirements. • Combining the optimal and PID controllers as we suggested in this paper in cascade mode will give the desired performance and this will make no loss in information in the cameras movements in both roll and pitch. 32
  • 9. ACKNOWLEDGMENTS I would like to acknowledge my professor Alexander A.Lobaty and Mr.A.G.Streshnov for their big assistants. REFERENCES [1] SeferKurnaz , Omer Cetin and OkyayKaynak , Adaptive neuro-fuzzy inference system based autonomous flight controlof unmanned air vehicles, Expert Systems with Applications 37 ,2010,P 1229–1234 [2] Rahul Malhotra, Narinder Singh, Yaduvir Singh, SOFT COMPUTING TECHNIQUES FOR PROCESSCONTROL APPLICATIONS, International Journal on Soft Computing ( IJSC ), Vol.2, No.3, August 2011 [3] SHAMSUL NIZAM BIN MOHD YUSOF AHAMID, DEVELOPING LQR TO CONTROL SPEED MOTOR USING MATLAB GUI, Faculty of Electrical and Electronics Engineering , University Malaysia Pahang, NOVEMBER 2008 [4] Jyotsna’sBlog,SERVOMECHANISMS AND ITS APPLICATIONS,July 2009 [5] http://www.engineersgarage.com/articles/servo-motor [6] Servo control systems: DC servomechanisms. Control-systems principles.co.UK. [7] Downs, Stuart G., unmanned air vehicle servoing dipole, Northrop Grumman Corporation Los Angeles, CA,2004 [8] PID control-National Instrument , http://www.ni.com/white-paper/6440/en [9] Tsai-JiunRenand Tien-ChiChen, Motion control for a two-wheeled vehicle using a self-tuning PID controller, Control Engineering Practice Volume 16, Issue 3, March 2008, P 365–375 [10] Wallén, A. (2000): “Tools for Autonomous Process Control”. PhD, Department of automatic Control, Lund Institute of Technology, Lund, Sweden. [11] Panagopoulos, H. (2000): “PID Control; Design, Extension, Application”. PhD thesis, Department of automatic Control, Lund Institute of Technology, Lund,Sweden. [12] ieniazek, J. Software-based Camera Stabilization on Unmanned Aircraft, Aircraft Engineering and Aerospace Technology: An International Journal, Vol. 75, No. 6, 2003. 33