SlideShare a Scribd company logo
1 of 11
Download to read offline
Sundarapandian et al. (Eds) : ICAITA, SAI, SEAS, CDKP, CMCA-2013
pp. 339–349, 2013. © CS & IT-CSCP 2013 DOI : 10.5121/csit.2013.3828
MODELING AND DESIGN OF CRUISE
CONTROL SYSTEM WITH FEEDFORWARD
FOR ALL TERRIAN VEHICLES
Khaled Sailan and Klaus.Dieter Kuhnert
Siegen university .electrical engineering department
Real time system institute
Siegen, Germany
khaled.sailan@student.uni-siegen.de
kuhnert@fb12.uni-siegen.de
ABSTRACT
This paper presents PID controller with feed-forward control. The cruise control system is one
of the most enduringly popular and important models for control system engineering. The
system is widely used because it is very simple to understand and yet the control techniques
cover many important classical and modern design methods. In this paper, the mathematical
modeling for PID with feed-forward controller is proposed for nonlinear model with
disturbance effect. Feed-forward controller is proposed in this study in order to eliminate the
gravitational and wind disturbance effect. Simulation will be carried out . Finally, a C++
program written and feed to the microcontroller type AMR on our robot
KEYWORDS
PID controller, feed-forward controller, robot ,modeling and simulation
1. INTRODUCTION
Autonomous operation of mobile robots requires effective speed control over a range of speeds.
In this paper, we present an adaptive speed control design and implementation for a throttle-
regulated internal combustion engine on an All Terrain Vehicle (ATV), one of the platforms used
within the AMOR project figure 1. This is a difficult problem due to significant nonlinearities in
the engine dynamics and throttle control.
Although some of the reviewed automatic speed controllers in the literature have been
implemented on production vehicles, the control techniques are not directly applicable to the
ATV throttle control problem. First, the ATV’s engine is mechanically controlled via a
carburetor, unlike most production vehicles, which have microprocessor-based engine
management systems which guarantee maximum engine efficiency and horsepower.
Second, the ATV carburetor clearances make it difficult to incorporate a sensor to measure the
throttle plate angle, which is required in virtually all the automotive speed controllers in the
Computer Science & Information Technology (CS & IT) 340
literature. Third, and importantly, the automatic speed control (cruise control) of modern
automobiles is generally recommended for use at speeds greater than 13m/s. At speeds below 13
m/s most internal combustion engines exhibit considerable torque fluctuations, a highly nonlinear
phenomenon which results in considerable variation in engine speed and crankshaft angular
speed. This makes it extremely challenging to design an effective controller for speeds below
13m/s. the ATV throttle is actuated via R/C servo instead of a pneumatic actuator, the preferred
actuator in most production vehicles. Although the R/C servo setup has the potential to provide
faster and more accurate throttle plate control, it provides no explicit feedback of the servo’s
angular position.
The disturbance due to road conditions ,engine temperature ,gearbox and steering specially at 0
m/sec speed the most important disturbance effect is the road conditions and steering effect which
will be take in consideration in this papers.
Figure 1 AMOR autonomous mobile robot
The two main challenges in designing an effective speed controller for the ATV are 1) the lack of
a complete mathematical model for the engine, and 2) the highly nonlinear nature of the engine
dynamics, especially for the targeted low speed range of 1-13m/s. Both of these reasons make the
use of classical control strategies, such as PID Controller not easy.
One of the main reasons for these challenges is the ATV’s carburetor. Carburetors are general
calibrated for a fixed range of altitudes and ambient temperatures. Since maximum engine
efficiency and horsepower are directly related to proper carburetor setting, any significant
changes in altitude and ambient temperatures require recalibration of the carburetor, a tedious
task. In contrast, modern engine control systems employ microprocessor-based systems to control
fuel injection and ignition point. Engine control strategies depend strongly on the current
operating point, and there are no complete mathematical models of the engine parameters. As a
result, most engine controllers use look-up tables to represent the control strategy. These tables
are generated from extensive field experiments and engineering expertise. Therefore, it is very
difficult to employ conventional control techniques that require a precise mathematical model to
synthesize a speed control algorithm component for a PID controller). The operating point of the
ATV’s engine moves with respect to changing load conditions, slippage in the PVT and the
carburetor nonlinear characteristics. Nevertheless, a PI controller can be used for higher speeds
where the carburetor operation is fairly linear, i.e., throttle openings above one-half and speeds
above 15MPH, covering the upper portion of our target speed range. This result indicates that a
341 Computer Science & Information Technology (CS & IT)
possible approach is to use more than one control strategy via lookup tables, depending on the
speed range.
Another approach to the control problem is to apply adaptive control techniques. However, a
complete mathematical model of the engine parameters is not available, and developing this
model requires information about the engine which we were unable to obtain from the
manufacturer. This approach will discuss in this paper.
2. MODELING OF CRUISE CONTROL
The purpose of the cruise control system is regulating the vehicle speed so that it follows the
driver’s command and maintains the speed at the commanded level as shown in figure 2 [3].
Figure 2 block diagram of cruise control system
Based on the command signal ‫ݒ‬ோ from the driver and the feedback signal from the speed sensor,
the cruise controller regulates vehicle speed ‫ݒ‬ by adjusting the engine throttle angle u to increase
or decrease the engine drive force Fd. The longitudinal dynamics of the vehicle as governed by
Newton’s low (or d’Alembert’s principle) is.
‫ܨ‬ௗ = ‫ܯ‬
ௗ
ௗ௧
‫ݒ‬ + ‫ܨ‬௔ + ‫ܨ‬௚ (1)
Figure 3 AMOR robot longitudinal by dynamic model
Computer Science & Information Technology (CS & IT) 342
Where M
ୢ
ୢ୲
v is the inertia force, Fa is the aerodynamic drag And F୥ is the climbing resistance or
downgrade force. The forces Fd, Fa, and Fg are produced as shown in the model of Fig. 3 [1],
where ‫ݒ‬௪is the wind gust speed, M is the mass of the vehicle and passenger(s), θ is the road
grade, and Ca is the aerodynamic drag coefficient. The throttle actuator and vehicle propulsion
system are modeled as a time delay in cascade with a first order lag and a force saturation
characteristic
‫ܨ‬௚ = ‫݃ܯ‬ sinߠ
‫ܨ‬௔ = ‫ܥ‬௔(‫ݒ‬ − ‫ݒ‬௪)ଶ
The actuator and the vehicle propulsion system are modelled as cascade temporary lag of first
order
‫ܥ‬ଵ ்݁௦
1 + ܶ‫ݏ‬
And a saturation force feature due to the engine physic limitations (Fd is limited between Fd min
and Fd max).
The controller design for this system begins by simplifying the model. Consider to set all the
initial conditions to zero.
The same applies to the disturbance parameters. Hence, it is assumed is no wind gust and no
grading exists during the movement of the car. Applying this zero initial condition to the block
diagram, the model is left with the forward path and the unity feedback loop of the output speed.
Since the state variables have been chosen to be the output speed and the drive force, the
corresponding state and output equations are found to be :
ߥሶ =
ଵ
௠
(‫ܨ‬ௗ − ‫ܥ‬௔ߥଶ
) (2)
‫݀ܨ‬ሶ =
ଵ
்
(‫ܥ‬ଵ‫ݐ(ݑ‬ − ܶ) − ‫ܨ‬ௗ ) (3)
‫ݕ‬ = ‫ݒ‬ (4)
However, a problem of non linearity arises. There is a squared term in the equation (2). One way
to overcome this problem is to linearize all of the state-equations by differentiating both left and
right hand sides of the equations with M, Ca, C1, T and v remain constant. After differentiating,
the state-equations become
ௗ
ௗ௧
ߥሶ =
ଵ
ெ
(−2‫ܥ‬௔‫ݒ‬ ߜ‫ݒ‬ − ߜ‫ܨ‬ௗ) (5)
݀
݀‫ݐ‬
Fdሶ =
1
ܶ
(‫ܥ‬ଵߜ‫ݐ(ݑ‬ − ܶ) − ߜ‫ܨ‬ௗ ) (6)
and the output equation becomes
‫ݕ‬ = ߜ‫ݒ‬
343 Computer Science & Information Technology (CS & IT)
In the equation, δv means that the output is discrete and δFd also means that drive force is
discrete. The symbol v means the desired and δu(t-τ) is the time delay of the engine. Up to this
point, both the state and output equations are written in time domain. The linearized model
provides a transfer function can be obtained by solving the state-equations for the ratio of ∆V (s)
/ ∆U(s) .
∆ܸ(‫)ݏ‬
∆ܷ(‫)ݏ‬
=
ܽ݁ିఛ௦
(‫ݏ‬ + ܾ) (‫ݏ‬ + ݀)
(7)
ܽ =
‫1ܥ‬
‫ܶܯ‬
ܾ =
2‫ݒܽܥ‬
‫ܯ‬
݀ =
1
ܶ
Where
It is obvious that the system described by this transfer function is second order system with time
delay. Because the complexity of the system and the poor of the engine parameter system
identification tool used to define the system transfer function .From system identification
‫)ݏ(ܩ‬ =
∆ܸ(‫)ݏ‬
∆ܷ(‫)ݏ‬
=
0,0144݁ି଴.଴଴ଵ௦
‫ݏ‬ଶ + 0.018‫ݏ‬ + 0.006
3. CONTROLLER DESIGNE
The problem of cruise control system is to maintain the output speed v of the system as set by
input signal base on the command signal vR from the driver. Cruise controller design is applied
assuming a single-loop system configuration with a linear model and nonlinear model, as shown
in Fig. 4. The controller function Gc(s) is designed to augment or modify the open-loop function
in a manner that produces the desired closed-loop performance characteristics. The plant
functions Gp(s) represent the actuators and the controller part of the system, and the plant
parameters are determined primarily by functional aspects of the control task.
Before make any decision of controller design, a few of design specification have been set. In this
design, we take two considerations to be met which are settling time Ts less than 1s and
percentage of overshot %OS is less than 20%.because the system is nonlinear system
proportional-integral derivatives (PID) with feed-forward designed used for this proposed .
Figure 4 cruise control system configuration
Computer Science & Information Technology (CS & IT) 344
Nonlinear model using PID controller is design of the controller has been based on use of the
linearized model. Although a simple and quick check of the design, a more accurate simulation
should be done by applying the controller to the original nonlinear model as shown in Fig. 3.
The PID controller that take in consideration figure 4 describe as ߜ‫)ݐ(ݑ‬ = ‫ܣ‬ = ݇௣݁(‫)ݐ‬ +
݇௜ ‫׬‬ ݁(߬) ݀(߬) + ݇ௗ
ௗ௘(௧)
ௗ௧
(8)
Figure 5 PID controller applied to the nonlinear plant
The basic concept of feed-forward (FF) control is to measure important disturbance variables and
take corrective action before they upset the process to improve the performance result. the main
disturbance acting on our system is the road incline and the steering effect specially in when the
robot start from zero speed this disturbance will take in consideration. A feed-forward control
system is shown in Fig.6, where disturbances are measured and compensating control actions are
taken through the feed-forward controller. Deviations in the controlled variables can be calculated
as:
∆‫ݒ‬ = ‫ܦ߂݂݂ܩ݌ܩ‬ + ‫ܦ߂݀ܩ‬ (9)
In order to make ∆v zero, a feed-forward controller of the following form is designed. Supposed
that,
‫݀ܩ‬ =
‫݀ܭ‬
(߬ௗ‫ݏ‬ + 1)
(10)
‫݌ܩ‬ =
‫݌ܭ‬ ݁ିఛ௦
൫߬௣ଵ‫ݏ‬ + 1൯൫߬௣ଶ‫ݏ‬ + 1൯
(11)
Then from equation (16-17), the ideal feed-forward controller,
‫݂݂ܩ‬ = −‫݌ܩ‬ିଵ
‫݀ܩ‬ = ‫݂݂ܭ‬
൫߬௣ଵ‫ݏ‬ + 1൯൫߬௣ଶ‫ݏ‬ + 1൯ ݁ିఛ௦
(߬ௗ‫ݏ‬ + 1)
(12)
Where feed-forward controller gain is ‫݂݂ܭ‬ =
ି௄ௗ
௞௣
. In process plant applications, ‫݂݂ܩ‬ is typically
chosen to be of static form, and it is this approach that will be adopted in this project.
345 Computer Science & Information Technology (CS & IT)
Figure 6 a feed-forward control system
4. EXPEREMENTS AND RESULTS
The system is modeled using Matlab/Simulink as shown in figure.7 to investigate and to find the
parameters of PID controller (Kp,Kd,Ki) and the feed forward controller gain due to the road
incline which changes with changing the operating point and for each operating point there is new
feed-forward gain as it shown in look-up table.1. For the disturbance from the steering system
there is also effect on the system so a new gain should apply to the system for each operating
point and table 2 shows the gain with the steering angle .
Figure 7 block diagram of simulate cruise control with FF
Computer Science & Information Technology (CS & IT) 346
For implement the PID controller on AMOR Robot with feed-forward control a program written in
C++ by taking the sensors value and compare it with the reference value and calculate the error,
for feed-forward a function written to take the value from look up table when the disturbance from
road and from the steering occur and measured before it effects the system,
Angle Gain(ࡷࢌࢌ)
4.0 5.7
5.0 7.0
6.0 8.0
7.0 9.0
8.0 10.0
9.0 11.0
10.0 12.0
12.0 14.0
14.0 16.0
15.0 17.0
Table 1 Road incline disturbance lookup table
Angle Gain(ࡷࢌࢌ)
0.0 6.5
10 6.0
40 7.0
80 2.0
96 0.0
127 0.0
140 0.5
150 0.5
160 0.5
170 1.5
Table 2 steering disturbance lookup table
many experiments has done to get the best result for the cruise control of AMOR robot and as
shown in figure 7 the simulated cruise control system by using PID controller with feed-forward to
cancel the effect of the disturbance from the road incline and from the steering and figure 8 shows
how is the system signal if we used the PID controller and if we did not use the PID controller it
show that the signal is speed up over the reference speed but with PID controller it still in near the
reference speed with small error .Figure 9(b) illustrates the real system signal during the driving on
the flat and up and down hill with using PID controller without feed-forward and figure 9 (a)
shows the PID controller with feed-forward controller with 2.5m/sec reference speed. Table 3
shows the controller parameters and specifications that meet our design specifications .
347 Computer Science & Information Technology (CS & IT)
parameters value
P 6
I 0.45
D 0.00
‫ܭ‬௙௙ 5.7
Rising time 0.120 millisecond
Overshoot 8.92%
Steady state error 0.00
Table 3 controller Parameters and specifications
Figure 7 simulated PID controller
Figure 8 the real system with and without controller
Computer Science & Information Technology (CS & IT) 348
Figure 9 (a) PID controller with Feed-forward
Figure 9 (b) PID controller without Feed-forward
6. CONCLUSIONS
The mathematical model for cruise control system has been derived successfully .simulated cruise
control system for our plant (AMOR robot) and the effect of disturbance from the incline road
and from the steering is also simulated and the parameters for the PID controller and for the Feed-
forward controller that meet the system specification estimated . This result from the simulated
model feed to the real system by written a program in C++ language and upload the C++ code to
the AMR Robot microcontroller and the best results that meets our system specification and
overcome the effect of disturbance is achieved .
REFERENCES
[1] Khairuddin Osman, Mohd. Fuaad Rahmat, Mohd Ashraf Ahmad Modelling and Controller Design for
a Cruise Control System, 2009 5th International Colloquium on Signal Processing & Its Applications
(CSPA).
349 Computer Science & Information Technology (CS & IT)
[2] Lewis Paul H. and Yang Chang. 1997. Basic Control System Engineering. Prentice-Hall, Inc. New
Jersey, USA.
[3] ME 132, Spring 2005, UC Berkeley, A. Packard.
[4] Karl.john Aström, control system design 2002.
[5] Andres Escobar D.addaptive fuzzy control applied toa speed control The Online Journal on
Electronics and Electrical Engineering (OJEEE)
[6] Thanah hung tran modeling and contol of unmanned Ground Vehicle .Phd thesis september 2007.
[7] Ashitey Trebi-Ollennu, John M. Dolan, and Pradeep Khosla , Adaptive Fuzzy Throttle Control for an
All Terrain Vehicle.
[8] T. Tekorius, D. Levisauskas. Comperative investigation of feed forward control algorithms electronic
and electrical engineering ISSN1392-1215 2011. No. 9(115).
[9] Kumeresan A. Danapalasingam, Anders la Cour-Harbo and Morten Bisgaard.Desturbance Effects in
Nonlenear Control Systems and Fee-forward Control Strategy. 2009 IEEE International Conference
on Control and Automation Christchurch, New Zealand, December 9-11, 2009.
[10] Eduardo J. Adam * and Jacinto L. Marchetti. Feed-forward Controller Design Based on H∞
Analysis.E.J. Adam, J.L. Marchetti / Proceedings of ENPROMER 2001 Volume I (2001) 271-
276Dynamics, Operability and Process Control

More Related Content

What's hot

Observer-based controller design and simulation for an active suspension system
Observer-based controller design and simulation for an active suspension systemObserver-based controller design and simulation for an active suspension system
Observer-based controller design and simulation for an active suspension systemTom Hemans
 
SIMULATION OF THE DYNAMIC MODEL OF A VEHICLE AND FEM ANALYSIS ABOUT ITS DRIVE...
SIMULATION OF THE DYNAMIC MODEL OF A VEHICLE AND FEM ANALYSIS ABOUT ITS DRIVE...SIMULATION OF THE DYNAMIC MODEL OF A VEHICLE AND FEM ANALYSIS ABOUT ITS DRIVE...
SIMULATION OF THE DYNAMIC MODEL OF A VEHICLE AND FEM ANALYSIS ABOUT ITS DRIVE...Giacomo Risitano
 
Simulation of an Active Suspension Using PID Control
Simulation of an Active Suspension Using PID ControlSimulation of an Active Suspension Using PID Control
Simulation of an Active Suspension Using PID ControlSuzana Avila
 
Advanced deep flux weakening operation control strategies for IPMSM
Advanced deep flux weakening operation control strategies for IPMSM Advanced deep flux weakening operation control strategies for IPMSM
Advanced deep flux weakening operation control strategies for IPMSM IJECEIAES
 
Performance evolution of a PMSG based WECS using maximum power point tracking...
Performance evolution of a PMSG based WECS using maximum power point tracking...Performance evolution of a PMSG based WECS using maximum power point tracking...
Performance evolution of a PMSG based WECS using maximum power point tracking...theijes
 
1 s2.0-s0957415814001354-main
1 s2.0-s0957415814001354-main1 s2.0-s0957415814001354-main
1 s2.0-s0957415814001354-mainrabeenanchal
 
Modeling of Electro Mechanical Actuator with Inner Loop controller
Modeling of Electro Mechanical Actuator with Inner Loop controllerModeling of Electro Mechanical Actuator with Inner Loop controller
Modeling of Electro Mechanical Actuator with Inner Loop controllerIRJET Journal
 
Control of Wind Energy Conversion System and Power Quality Improvement in the...
Control of Wind Energy Conversion System and Power Quality Improvement in the...Control of Wind Energy Conversion System and Power Quality Improvement in the...
Control of Wind Energy Conversion System and Power Quality Improvement in the...ijeei-iaes
 
Design and implementation of antenna control servo system for satellite grou
Design and implementation of antenna control servo system for satellite grouDesign and implementation of antenna control servo system for satellite grou
Design and implementation of antenna control servo system for satellite grouIAEME Publication
 
Design and control of ems magnetic levitation train using fuzzy mras and pid ...
Design and control of ems magnetic levitation train using fuzzy mras and pid ...Design and control of ems magnetic levitation train using fuzzy mras and pid ...
Design and control of ems magnetic levitation train using fuzzy mras and pid ...Mustefa Jibril
 
Fuzzy Adaptive Control for Direct Torque in Electric Vehicle
Fuzzy Adaptive Control for Direct Torque in Electric VehicleFuzzy Adaptive Control for Direct Torque in Electric Vehicle
Fuzzy Adaptive Control for Direct Torque in Electric VehicleIAES-IJPEDS
 
Torque estimator using MPPT method for wind turbines
Torque estimator using MPPT method for wind turbines Torque estimator using MPPT method for wind turbines
Torque estimator using MPPT method for wind turbines IJECEIAES
 
Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...
Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...
Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...IJECEIAES
 
Control systems project report (180501008)(180501016)(180501018)(180501020)
Control systems project report (180501008)(180501016)(180501018)(180501020)Control systems project report (180501008)(180501016)(180501018)(180501020)
Control systems project report (180501008)(180501016)(180501018)(180501020)khang31
 
Novelty Method of Speed Control Analysis of Permanent Magnet Brushless DC Motor
Novelty Method of Speed Control Analysis of Permanent Magnet Brushless DC MotorNovelty Method of Speed Control Analysis of Permanent Magnet Brushless DC Motor
Novelty Method of Speed Control Analysis of Permanent Magnet Brushless DC MotorIRJET Journal
 

What's hot (20)

Observer-based controller design and simulation for an active suspension system
Observer-based controller design and simulation for an active suspension systemObserver-based controller design and simulation for an active suspension system
Observer-based controller design and simulation for an active suspension system
 
SIMULATION OF THE DYNAMIC MODEL OF A VEHICLE AND FEM ANALYSIS ABOUT ITS DRIVE...
SIMULATION OF THE DYNAMIC MODEL OF A VEHICLE AND FEM ANALYSIS ABOUT ITS DRIVE...SIMULATION OF THE DYNAMIC MODEL OF A VEHICLE AND FEM ANALYSIS ABOUT ITS DRIVE...
SIMULATION OF THE DYNAMIC MODEL OF A VEHICLE AND FEM ANALYSIS ABOUT ITS DRIVE...
 
dSPACE DS1104 Based Real Time Implementation of Sliding Mode Control of Induc...
dSPACE DS1104 Based Real Time Implementation of Sliding Mode Control of Induc...dSPACE DS1104 Based Real Time Implementation of Sliding Mode Control of Induc...
dSPACE DS1104 Based Real Time Implementation of Sliding Mode Control of Induc...
 
Simulation of an Active Suspension Using PID Control
Simulation of an Active Suspension Using PID ControlSimulation of an Active Suspension Using PID Control
Simulation of an Active Suspension Using PID Control
 
Advanced deep flux weakening operation control strategies for IPMSM
Advanced deep flux weakening operation control strategies for IPMSM Advanced deep flux weakening operation control strategies for IPMSM
Advanced deep flux weakening operation control strategies for IPMSM
 
Performance evolution of a PMSG based WECS using maximum power point tracking...
Performance evolution of a PMSG based WECS using maximum power point tracking...Performance evolution of a PMSG based WECS using maximum power point tracking...
Performance evolution of a PMSG based WECS using maximum power point tracking...
 
1 s2.0-s0957415814001354-main
1 s2.0-s0957415814001354-main1 s2.0-s0957415814001354-main
1 s2.0-s0957415814001354-main
 
Modeling of Electro Mechanical Actuator with Inner Loop controller
Modeling of Electro Mechanical Actuator with Inner Loop controllerModeling of Electro Mechanical Actuator with Inner Loop controller
Modeling of Electro Mechanical Actuator with Inner Loop controller
 
Control of Wind Energy Conversion System and Power Quality Improvement in the...
Control of Wind Energy Conversion System and Power Quality Improvement in the...Control of Wind Energy Conversion System and Power Quality Improvement in the...
Control of Wind Energy Conversion System and Power Quality Improvement in the...
 
Adaptive fuzzy sliding mode controller design for PMLSM position control
Adaptive fuzzy sliding mode controller design for PMLSM position controlAdaptive fuzzy sliding mode controller design for PMLSM position control
Adaptive fuzzy sliding mode controller design for PMLSM position control
 
Design and implementation of antenna control servo system for satellite grou
Design and implementation of antenna control servo system for satellite grouDesign and implementation of antenna control servo system for satellite grou
Design and implementation of antenna control servo system for satellite grou
 
124
124124
124
 
Self-tuning Position Control for the Linear Long-stroke, Compound Switched Re...
Self-tuning Position Control for the Linear Long-stroke, Compound Switched Re...Self-tuning Position Control for the Linear Long-stroke, Compound Switched Re...
Self-tuning Position Control for the Linear Long-stroke, Compound Switched Re...
 
Design and control of ems magnetic levitation train using fuzzy mras and pid ...
Design and control of ems magnetic levitation train using fuzzy mras and pid ...Design and control of ems magnetic levitation train using fuzzy mras and pid ...
Design and control of ems magnetic levitation train using fuzzy mras and pid ...
 
Fuzzy Adaptive Control for Direct Torque in Electric Vehicle
Fuzzy Adaptive Control for Direct Torque in Electric VehicleFuzzy Adaptive Control for Direct Torque in Electric Vehicle
Fuzzy Adaptive Control for Direct Torque in Electric Vehicle
 
Torque estimator using MPPT method for wind turbines
Torque estimator using MPPT method for wind turbines Torque estimator using MPPT method for wind turbines
Torque estimator using MPPT method for wind turbines
 
Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...
Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...
Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...
 
Control systems project report (180501008)(180501016)(180501018)(180501020)
Control systems project report (180501008)(180501016)(180501018)(180501020)Control systems project report (180501008)(180501016)(180501018)(180501020)
Control systems project report (180501008)(180501016)(180501018)(180501020)
 
B04450517
B04450517B04450517
B04450517
 
Novelty Method of Speed Control Analysis of Permanent Magnet Brushless DC Motor
Novelty Method of Speed Control Analysis of Permanent Magnet Brushless DC MotorNovelty Method of Speed Control Analysis of Permanent Magnet Brushless DC Motor
Novelty Method of Speed Control Analysis of Permanent Magnet Brushless DC Motor
 

Similar to MODELING AND DESIGN OF CRUISE CONTROL SYSTEM WITH FEEDFORWARD FOR ALL TERRIAN VEHICLES

Nonlinear integral control for dc motor speed control with unknown and variab...
Nonlinear integral control for dc motor speed control with unknown and variab...Nonlinear integral control for dc motor speed control with unknown and variab...
Nonlinear integral control for dc motor speed control with unknown and variab...Saif al-din ali
 
Nonlinear integral control for dc motor speed control
Nonlinear integral control for dc motor speed controlNonlinear integral control for dc motor speed control
Nonlinear integral control for dc motor speed controlSaif al-din ali
 
Model Validation and Control of an In-Wheel DC Motor Prototype for Hybrid El...
Model Validation and Control of an In-Wheel DC Motor  Prototype for Hybrid El...Model Validation and Control of an In-Wheel DC Motor  Prototype for Hybrid El...
Model Validation and Control of an In-Wheel DC Motor Prototype for Hybrid El...Scientific Review SR
 
Fuzzy logic Technique Based Speed Control of a Permanent Magnet Brushless DC...
Fuzzy logic Technique Based Speed Control of a Permanent  Magnet Brushless DC...Fuzzy logic Technique Based Speed Control of a Permanent  Magnet Brushless DC...
Fuzzy logic Technique Based Speed Control of a Permanent Magnet Brushless DC...IJMER
 
Comparison of cascade P-PI controller tuning methods for PMDC motor based on ...
Comparison of cascade P-PI controller tuning methods for PMDC motor based on ...Comparison of cascade P-PI controller tuning methods for PMDC motor based on ...
Comparison of cascade P-PI controller tuning methods for PMDC motor based on ...IJECEIAES
 
IRJET- Review: Different Techniques of Speed Control of DC Motor
IRJET-  	  Review: Different Techniques of Speed Control of DC MotorIRJET-  	  Review: Different Techniques of Speed Control of DC Motor
IRJET- Review: Different Techniques of Speed Control of DC MotorIRJET Journal
 
Modified Chattering Free Sliding Mode Control of DC Motor
Modified Chattering Free Sliding Mode Control of DC MotorModified Chattering Free Sliding Mode Control of DC Motor
Modified Chattering Free Sliding Mode Control of DC MotorIJMER
 
Speed and Torque Control of Mechanically Coupled Permanent Magnet Direct Curr...
Speed and Torque Control of Mechanically Coupled Permanent Magnet Direct Curr...Speed and Torque Control of Mechanically Coupled Permanent Magnet Direct Curr...
Speed and Torque Control of Mechanically Coupled Permanent Magnet Direct Curr...IDES Editor
 
Rotor Resistance Adaptation Scheme Using Neural Learning Algorithm for a Fuzz...
Rotor Resistance Adaptation Scheme Using Neural Learning Algorithm for a Fuzz...Rotor Resistance Adaptation Scheme Using Neural Learning Algorithm for a Fuzz...
Rotor Resistance Adaptation Scheme Using Neural Learning Algorithm for a Fuzz...IOSR Journals
 
IRJET- Speed Control of Induction Motor using Hybrid PID Fuzzy Controller
IRJET- Speed Control of Induction Motor using Hybrid PID Fuzzy ControllerIRJET- Speed Control of Induction Motor using Hybrid PID Fuzzy Controller
IRJET- Speed Control of Induction Motor using Hybrid PID Fuzzy ControllerIRJET Journal
 
STATOR FLUX OPTIMIZATION ON DIRECT TORQUE CONTROL WITH FUZZY LOGIC
STATOR FLUX OPTIMIZATION ON DIRECT TORQUE CONTROL WITH FUZZY LOGIC STATOR FLUX OPTIMIZATION ON DIRECT TORQUE CONTROL WITH FUZZY LOGIC
STATOR FLUX OPTIMIZATION ON DIRECT TORQUE CONTROL WITH FUZZY LOGIC cscpconf
 
CONTROL OF AN INDUCTION MOTOR WITH DOUBLE ANN MODEL BASED DTC
CONTROL OF AN INDUCTION MOTOR WITH DOUBLE ANN MODEL BASED DTCCONTROL OF AN INDUCTION MOTOR WITH DOUBLE ANN MODEL BASED DTC
CONTROL OF AN INDUCTION MOTOR WITH DOUBLE ANN MODEL BASED DTCcsandit
 
D0255033039
D0255033039D0255033039
D0255033039theijes
 
African vulture optimizer algorithm based vector control induction motor driv...
African vulture optimizer algorithm based vector control induction motor driv...African vulture optimizer algorithm based vector control induction motor driv...
African vulture optimizer algorithm based vector control induction motor driv...IJECEIAES
 
Speed Control of Dc Motor using Adaptive PID with SMC Scheme
Speed Control of Dc Motor using Adaptive PID with SMC SchemeSpeed Control of Dc Motor using Adaptive PID with SMC Scheme
Speed Control of Dc Motor using Adaptive PID with SMC SchemeIRJET Journal
 
An investigation on switching
An investigation on switchingAn investigation on switching
An investigation on switchingcsandit
 

Similar to MODELING AND DESIGN OF CRUISE CONTROL SYSTEM WITH FEEDFORWARD FOR ALL TERRIAN VEHICLES (20)

Nonlinear integral control for dc motor speed control with unknown and variab...
Nonlinear integral control for dc motor speed control with unknown and variab...Nonlinear integral control for dc motor speed control with unknown and variab...
Nonlinear integral control for dc motor speed control with unknown and variab...
 
Nonlinear integral control for dc motor speed control
Nonlinear integral control for dc motor speed controlNonlinear integral control for dc motor speed control
Nonlinear integral control for dc motor speed control
 
Model Validation and Control of an In-Wheel DC Motor Prototype for Hybrid El...
Model Validation and Control of an In-Wheel DC Motor  Prototype for Hybrid El...Model Validation and Control of an In-Wheel DC Motor  Prototype for Hybrid El...
Model Validation and Control of an In-Wheel DC Motor Prototype for Hybrid El...
 
Fuzzy logic Technique Based Speed Control of a Permanent Magnet Brushless DC...
Fuzzy logic Technique Based Speed Control of a Permanent  Magnet Brushless DC...Fuzzy logic Technique Based Speed Control of a Permanent  Magnet Brushless DC...
Fuzzy logic Technique Based Speed Control of a Permanent Magnet Brushless DC...
 
C010411722
C010411722C010411722
C010411722
 
Design of H_∞ for induction motor
Design of H_∞ for induction motorDesign of H_∞ for induction motor
Design of H_∞ for induction motor
 
Comparison of cascade P-PI controller tuning methods for PMDC motor based on ...
Comparison of cascade P-PI controller tuning methods for PMDC motor based on ...Comparison of cascade P-PI controller tuning methods for PMDC motor based on ...
Comparison of cascade P-PI controller tuning methods for PMDC motor based on ...
 
IRJET- Review: Different Techniques of Speed Control of DC Motor
IRJET-  	  Review: Different Techniques of Speed Control of DC MotorIRJET-  	  Review: Different Techniques of Speed Control of DC Motor
IRJET- Review: Different Techniques of Speed Control of DC Motor
 
Modified Chattering Free Sliding Mode Control of DC Motor
Modified Chattering Free Sliding Mode Control of DC MotorModified Chattering Free Sliding Mode Control of DC Motor
Modified Chattering Free Sliding Mode Control of DC Motor
 
Speed and Torque Control of Mechanically Coupled Permanent Magnet Direct Curr...
Speed and Torque Control of Mechanically Coupled Permanent Magnet Direct Curr...Speed and Torque Control of Mechanically Coupled Permanent Magnet Direct Curr...
Speed and Torque Control of Mechanically Coupled Permanent Magnet Direct Curr...
 
Rotor Resistance Adaptation Scheme Using Neural Learning Algorithm for a Fuzz...
Rotor Resistance Adaptation Scheme Using Neural Learning Algorithm for a Fuzz...Rotor Resistance Adaptation Scheme Using Neural Learning Algorithm for a Fuzz...
Rotor Resistance Adaptation Scheme Using Neural Learning Algorithm for a Fuzz...
 
Design and implementation speed control system of DC Motor based on PID contr...
Design and implementation speed control system of DC Motor based on PID contr...Design and implementation speed control system of DC Motor based on PID contr...
Design and implementation speed control system of DC Motor based on PID contr...
 
IRJET- Speed Control of Induction Motor using Hybrid PID Fuzzy Controller
IRJET- Speed Control of Induction Motor using Hybrid PID Fuzzy ControllerIRJET- Speed Control of Induction Motor using Hybrid PID Fuzzy Controller
IRJET- Speed Control of Induction Motor using Hybrid PID Fuzzy Controller
 
STATOR FLUX OPTIMIZATION ON DIRECT TORQUE CONTROL WITH FUZZY LOGIC
STATOR FLUX OPTIMIZATION ON DIRECT TORQUE CONTROL WITH FUZZY LOGIC STATOR FLUX OPTIMIZATION ON DIRECT TORQUE CONTROL WITH FUZZY LOGIC
STATOR FLUX OPTIMIZATION ON DIRECT TORQUE CONTROL WITH FUZZY LOGIC
 
CONTROL OF AN INDUCTION MOTOR WITH DOUBLE ANN MODEL BASED DTC
CONTROL OF AN INDUCTION MOTOR WITH DOUBLE ANN MODEL BASED DTCCONTROL OF AN INDUCTION MOTOR WITH DOUBLE ANN MODEL BASED DTC
CONTROL OF AN INDUCTION MOTOR WITH DOUBLE ANN MODEL BASED DTC
 
D0255033039
D0255033039D0255033039
D0255033039
 
[000007]
[000007][000007]
[000007]
 
African vulture optimizer algorithm based vector control induction motor driv...
African vulture optimizer algorithm based vector control induction motor driv...African vulture optimizer algorithm based vector control induction motor driv...
African vulture optimizer algorithm based vector control induction motor driv...
 
Speed Control of Dc Motor using Adaptive PID with SMC Scheme
Speed Control of Dc Motor using Adaptive PID with SMC SchemeSpeed Control of Dc Motor using Adaptive PID with SMC Scheme
Speed Control of Dc Motor using Adaptive PID with SMC Scheme
 
An investigation on switching
An investigation on switchingAn investigation on switching
An investigation on switching
 

More from cscpconf

ANALYSIS OF LAND SURFACE DEFORMATION GRADIENT BY DINSAR
ANALYSIS OF LAND SURFACE DEFORMATION GRADIENT BY DINSAR ANALYSIS OF LAND SURFACE DEFORMATION GRADIENT BY DINSAR
ANALYSIS OF LAND SURFACE DEFORMATION GRADIENT BY DINSAR cscpconf
 
4D AUTOMATIC LIP-READING FOR SPEAKER'S FACE IDENTIFCATION
4D AUTOMATIC LIP-READING FOR SPEAKER'S FACE IDENTIFCATION4D AUTOMATIC LIP-READING FOR SPEAKER'S FACE IDENTIFCATION
4D AUTOMATIC LIP-READING FOR SPEAKER'S FACE IDENTIFCATIONcscpconf
 
MOVING FROM WATERFALL TO AGILE PROCESS IN SOFTWARE ENGINEERING CAPSTONE PROJE...
MOVING FROM WATERFALL TO AGILE PROCESS IN SOFTWARE ENGINEERING CAPSTONE PROJE...MOVING FROM WATERFALL TO AGILE PROCESS IN SOFTWARE ENGINEERING CAPSTONE PROJE...
MOVING FROM WATERFALL TO AGILE PROCESS IN SOFTWARE ENGINEERING CAPSTONE PROJE...cscpconf
 
PROMOTING STUDENT ENGAGEMENT USING SOCIAL MEDIA TECHNOLOGIES
PROMOTING STUDENT ENGAGEMENT USING SOCIAL MEDIA TECHNOLOGIESPROMOTING STUDENT ENGAGEMENT USING SOCIAL MEDIA TECHNOLOGIES
PROMOTING STUDENT ENGAGEMENT USING SOCIAL MEDIA TECHNOLOGIEScscpconf
 
A SURVEY ON QUESTION ANSWERING SYSTEMS: THE ADVANCES OF FUZZY LOGIC
A SURVEY ON QUESTION ANSWERING SYSTEMS: THE ADVANCES OF FUZZY LOGICA SURVEY ON QUESTION ANSWERING SYSTEMS: THE ADVANCES OF FUZZY LOGIC
A SURVEY ON QUESTION ANSWERING SYSTEMS: THE ADVANCES OF FUZZY LOGICcscpconf
 
DYNAMIC PHONE WARPING – A METHOD TO MEASURE THE DISTANCE BETWEEN PRONUNCIATIONS
DYNAMIC PHONE WARPING – A METHOD TO MEASURE THE DISTANCE BETWEEN PRONUNCIATIONS DYNAMIC PHONE WARPING – A METHOD TO MEASURE THE DISTANCE BETWEEN PRONUNCIATIONS
DYNAMIC PHONE WARPING – A METHOD TO MEASURE THE DISTANCE BETWEEN PRONUNCIATIONS cscpconf
 
INTELLIGENT ELECTRONIC ASSESSMENT FOR SUBJECTIVE EXAMS
INTELLIGENT ELECTRONIC ASSESSMENT FOR SUBJECTIVE EXAMS INTELLIGENT ELECTRONIC ASSESSMENT FOR SUBJECTIVE EXAMS
INTELLIGENT ELECTRONIC ASSESSMENT FOR SUBJECTIVE EXAMS cscpconf
 
TWO DISCRETE BINARY VERSIONS OF AFRICAN BUFFALO OPTIMIZATION METAHEURISTIC
TWO DISCRETE BINARY VERSIONS OF AFRICAN BUFFALO OPTIMIZATION METAHEURISTICTWO DISCRETE BINARY VERSIONS OF AFRICAN BUFFALO OPTIMIZATION METAHEURISTIC
TWO DISCRETE BINARY VERSIONS OF AFRICAN BUFFALO OPTIMIZATION METAHEURISTICcscpconf
 
DETECTION OF ALGORITHMICALLY GENERATED MALICIOUS DOMAIN
DETECTION OF ALGORITHMICALLY GENERATED MALICIOUS DOMAINDETECTION OF ALGORITHMICALLY GENERATED MALICIOUS DOMAIN
DETECTION OF ALGORITHMICALLY GENERATED MALICIOUS DOMAINcscpconf
 
GLOBAL MUSIC ASSET ASSURANCE DIGITAL CURRENCY: A DRM SOLUTION FOR STREAMING C...
GLOBAL MUSIC ASSET ASSURANCE DIGITAL CURRENCY: A DRM SOLUTION FOR STREAMING C...GLOBAL MUSIC ASSET ASSURANCE DIGITAL CURRENCY: A DRM SOLUTION FOR STREAMING C...
GLOBAL MUSIC ASSET ASSURANCE DIGITAL CURRENCY: A DRM SOLUTION FOR STREAMING C...cscpconf
 
IMPORTANCE OF VERB SUFFIX MAPPING IN DISCOURSE TRANSLATION SYSTEM
IMPORTANCE OF VERB SUFFIX MAPPING IN DISCOURSE TRANSLATION SYSTEMIMPORTANCE OF VERB SUFFIX MAPPING IN DISCOURSE TRANSLATION SYSTEM
IMPORTANCE OF VERB SUFFIX MAPPING IN DISCOURSE TRANSLATION SYSTEMcscpconf
 
EXACT SOLUTIONS OF A FAMILY OF HIGHER-DIMENSIONAL SPACE-TIME FRACTIONAL KDV-T...
EXACT SOLUTIONS OF A FAMILY OF HIGHER-DIMENSIONAL SPACE-TIME FRACTIONAL KDV-T...EXACT SOLUTIONS OF A FAMILY OF HIGHER-DIMENSIONAL SPACE-TIME FRACTIONAL KDV-T...
EXACT SOLUTIONS OF A FAMILY OF HIGHER-DIMENSIONAL SPACE-TIME FRACTIONAL KDV-T...cscpconf
 
AUTOMATED PENETRATION TESTING: AN OVERVIEW
AUTOMATED PENETRATION TESTING: AN OVERVIEWAUTOMATED PENETRATION TESTING: AN OVERVIEW
AUTOMATED PENETRATION TESTING: AN OVERVIEWcscpconf
 
CLASSIFICATION OF ALZHEIMER USING fMRI DATA AND BRAIN NETWORK
CLASSIFICATION OF ALZHEIMER USING fMRI DATA AND BRAIN NETWORKCLASSIFICATION OF ALZHEIMER USING fMRI DATA AND BRAIN NETWORK
CLASSIFICATION OF ALZHEIMER USING fMRI DATA AND BRAIN NETWORKcscpconf
 
VALIDATION METHOD OF FUZZY ASSOCIATION RULES BASED ON FUZZY FORMAL CONCEPT AN...
VALIDATION METHOD OF FUZZY ASSOCIATION RULES BASED ON FUZZY FORMAL CONCEPT AN...VALIDATION METHOD OF FUZZY ASSOCIATION RULES BASED ON FUZZY FORMAL CONCEPT AN...
VALIDATION METHOD OF FUZZY ASSOCIATION RULES BASED ON FUZZY FORMAL CONCEPT AN...cscpconf
 
PROBABILITY BASED CLUSTER EXPANSION OVERSAMPLING TECHNIQUE FOR IMBALANCED DATA
PROBABILITY BASED CLUSTER EXPANSION OVERSAMPLING TECHNIQUE FOR IMBALANCED DATAPROBABILITY BASED CLUSTER EXPANSION OVERSAMPLING TECHNIQUE FOR IMBALANCED DATA
PROBABILITY BASED CLUSTER EXPANSION OVERSAMPLING TECHNIQUE FOR IMBALANCED DATAcscpconf
 
CHARACTER AND IMAGE RECOGNITION FOR DATA CATALOGING IN ECOLOGICAL RESEARCH
CHARACTER AND IMAGE RECOGNITION FOR DATA CATALOGING IN ECOLOGICAL RESEARCHCHARACTER AND IMAGE RECOGNITION FOR DATA CATALOGING IN ECOLOGICAL RESEARCH
CHARACTER AND IMAGE RECOGNITION FOR DATA CATALOGING IN ECOLOGICAL RESEARCHcscpconf
 
SOCIAL MEDIA ANALYTICS FOR SENTIMENT ANALYSIS AND EVENT DETECTION IN SMART CI...
SOCIAL MEDIA ANALYTICS FOR SENTIMENT ANALYSIS AND EVENT DETECTION IN SMART CI...SOCIAL MEDIA ANALYTICS FOR SENTIMENT ANALYSIS AND EVENT DETECTION IN SMART CI...
SOCIAL MEDIA ANALYTICS FOR SENTIMENT ANALYSIS AND EVENT DETECTION IN SMART CI...cscpconf
 
SOCIAL NETWORK HATE SPEECH DETECTION FOR AMHARIC LANGUAGE
SOCIAL NETWORK HATE SPEECH DETECTION FOR AMHARIC LANGUAGESOCIAL NETWORK HATE SPEECH DETECTION FOR AMHARIC LANGUAGE
SOCIAL NETWORK HATE SPEECH DETECTION FOR AMHARIC LANGUAGEcscpconf
 
GENERAL REGRESSION NEURAL NETWORK BASED POS TAGGING FOR NEPALI TEXT
GENERAL REGRESSION NEURAL NETWORK BASED POS TAGGING FOR NEPALI TEXTGENERAL REGRESSION NEURAL NETWORK BASED POS TAGGING FOR NEPALI TEXT
GENERAL REGRESSION NEURAL NETWORK BASED POS TAGGING FOR NEPALI TEXTcscpconf
 

More from cscpconf (20)

ANALYSIS OF LAND SURFACE DEFORMATION GRADIENT BY DINSAR
ANALYSIS OF LAND SURFACE DEFORMATION GRADIENT BY DINSAR ANALYSIS OF LAND SURFACE DEFORMATION GRADIENT BY DINSAR
ANALYSIS OF LAND SURFACE DEFORMATION GRADIENT BY DINSAR
 
4D AUTOMATIC LIP-READING FOR SPEAKER'S FACE IDENTIFCATION
4D AUTOMATIC LIP-READING FOR SPEAKER'S FACE IDENTIFCATION4D AUTOMATIC LIP-READING FOR SPEAKER'S FACE IDENTIFCATION
4D AUTOMATIC LIP-READING FOR SPEAKER'S FACE IDENTIFCATION
 
MOVING FROM WATERFALL TO AGILE PROCESS IN SOFTWARE ENGINEERING CAPSTONE PROJE...
MOVING FROM WATERFALL TO AGILE PROCESS IN SOFTWARE ENGINEERING CAPSTONE PROJE...MOVING FROM WATERFALL TO AGILE PROCESS IN SOFTWARE ENGINEERING CAPSTONE PROJE...
MOVING FROM WATERFALL TO AGILE PROCESS IN SOFTWARE ENGINEERING CAPSTONE PROJE...
 
PROMOTING STUDENT ENGAGEMENT USING SOCIAL MEDIA TECHNOLOGIES
PROMOTING STUDENT ENGAGEMENT USING SOCIAL MEDIA TECHNOLOGIESPROMOTING STUDENT ENGAGEMENT USING SOCIAL MEDIA TECHNOLOGIES
PROMOTING STUDENT ENGAGEMENT USING SOCIAL MEDIA TECHNOLOGIES
 
A SURVEY ON QUESTION ANSWERING SYSTEMS: THE ADVANCES OF FUZZY LOGIC
A SURVEY ON QUESTION ANSWERING SYSTEMS: THE ADVANCES OF FUZZY LOGICA SURVEY ON QUESTION ANSWERING SYSTEMS: THE ADVANCES OF FUZZY LOGIC
A SURVEY ON QUESTION ANSWERING SYSTEMS: THE ADVANCES OF FUZZY LOGIC
 
DYNAMIC PHONE WARPING – A METHOD TO MEASURE THE DISTANCE BETWEEN PRONUNCIATIONS
DYNAMIC PHONE WARPING – A METHOD TO MEASURE THE DISTANCE BETWEEN PRONUNCIATIONS DYNAMIC PHONE WARPING – A METHOD TO MEASURE THE DISTANCE BETWEEN PRONUNCIATIONS
DYNAMIC PHONE WARPING – A METHOD TO MEASURE THE DISTANCE BETWEEN PRONUNCIATIONS
 
INTELLIGENT ELECTRONIC ASSESSMENT FOR SUBJECTIVE EXAMS
INTELLIGENT ELECTRONIC ASSESSMENT FOR SUBJECTIVE EXAMS INTELLIGENT ELECTRONIC ASSESSMENT FOR SUBJECTIVE EXAMS
INTELLIGENT ELECTRONIC ASSESSMENT FOR SUBJECTIVE EXAMS
 
TWO DISCRETE BINARY VERSIONS OF AFRICAN BUFFALO OPTIMIZATION METAHEURISTIC
TWO DISCRETE BINARY VERSIONS OF AFRICAN BUFFALO OPTIMIZATION METAHEURISTICTWO DISCRETE BINARY VERSIONS OF AFRICAN BUFFALO OPTIMIZATION METAHEURISTIC
TWO DISCRETE BINARY VERSIONS OF AFRICAN BUFFALO OPTIMIZATION METAHEURISTIC
 
DETECTION OF ALGORITHMICALLY GENERATED MALICIOUS DOMAIN
DETECTION OF ALGORITHMICALLY GENERATED MALICIOUS DOMAINDETECTION OF ALGORITHMICALLY GENERATED MALICIOUS DOMAIN
DETECTION OF ALGORITHMICALLY GENERATED MALICIOUS DOMAIN
 
GLOBAL MUSIC ASSET ASSURANCE DIGITAL CURRENCY: A DRM SOLUTION FOR STREAMING C...
GLOBAL MUSIC ASSET ASSURANCE DIGITAL CURRENCY: A DRM SOLUTION FOR STREAMING C...GLOBAL MUSIC ASSET ASSURANCE DIGITAL CURRENCY: A DRM SOLUTION FOR STREAMING C...
GLOBAL MUSIC ASSET ASSURANCE DIGITAL CURRENCY: A DRM SOLUTION FOR STREAMING C...
 
IMPORTANCE OF VERB SUFFIX MAPPING IN DISCOURSE TRANSLATION SYSTEM
IMPORTANCE OF VERB SUFFIX MAPPING IN DISCOURSE TRANSLATION SYSTEMIMPORTANCE OF VERB SUFFIX MAPPING IN DISCOURSE TRANSLATION SYSTEM
IMPORTANCE OF VERB SUFFIX MAPPING IN DISCOURSE TRANSLATION SYSTEM
 
EXACT SOLUTIONS OF A FAMILY OF HIGHER-DIMENSIONAL SPACE-TIME FRACTIONAL KDV-T...
EXACT SOLUTIONS OF A FAMILY OF HIGHER-DIMENSIONAL SPACE-TIME FRACTIONAL KDV-T...EXACT SOLUTIONS OF A FAMILY OF HIGHER-DIMENSIONAL SPACE-TIME FRACTIONAL KDV-T...
EXACT SOLUTIONS OF A FAMILY OF HIGHER-DIMENSIONAL SPACE-TIME FRACTIONAL KDV-T...
 
AUTOMATED PENETRATION TESTING: AN OVERVIEW
AUTOMATED PENETRATION TESTING: AN OVERVIEWAUTOMATED PENETRATION TESTING: AN OVERVIEW
AUTOMATED PENETRATION TESTING: AN OVERVIEW
 
CLASSIFICATION OF ALZHEIMER USING fMRI DATA AND BRAIN NETWORK
CLASSIFICATION OF ALZHEIMER USING fMRI DATA AND BRAIN NETWORKCLASSIFICATION OF ALZHEIMER USING fMRI DATA AND BRAIN NETWORK
CLASSIFICATION OF ALZHEIMER USING fMRI DATA AND BRAIN NETWORK
 
VALIDATION METHOD OF FUZZY ASSOCIATION RULES BASED ON FUZZY FORMAL CONCEPT AN...
VALIDATION METHOD OF FUZZY ASSOCIATION RULES BASED ON FUZZY FORMAL CONCEPT AN...VALIDATION METHOD OF FUZZY ASSOCIATION RULES BASED ON FUZZY FORMAL CONCEPT AN...
VALIDATION METHOD OF FUZZY ASSOCIATION RULES BASED ON FUZZY FORMAL CONCEPT AN...
 
PROBABILITY BASED CLUSTER EXPANSION OVERSAMPLING TECHNIQUE FOR IMBALANCED DATA
PROBABILITY BASED CLUSTER EXPANSION OVERSAMPLING TECHNIQUE FOR IMBALANCED DATAPROBABILITY BASED CLUSTER EXPANSION OVERSAMPLING TECHNIQUE FOR IMBALANCED DATA
PROBABILITY BASED CLUSTER EXPANSION OVERSAMPLING TECHNIQUE FOR IMBALANCED DATA
 
CHARACTER AND IMAGE RECOGNITION FOR DATA CATALOGING IN ECOLOGICAL RESEARCH
CHARACTER AND IMAGE RECOGNITION FOR DATA CATALOGING IN ECOLOGICAL RESEARCHCHARACTER AND IMAGE RECOGNITION FOR DATA CATALOGING IN ECOLOGICAL RESEARCH
CHARACTER AND IMAGE RECOGNITION FOR DATA CATALOGING IN ECOLOGICAL RESEARCH
 
SOCIAL MEDIA ANALYTICS FOR SENTIMENT ANALYSIS AND EVENT DETECTION IN SMART CI...
SOCIAL MEDIA ANALYTICS FOR SENTIMENT ANALYSIS AND EVENT DETECTION IN SMART CI...SOCIAL MEDIA ANALYTICS FOR SENTIMENT ANALYSIS AND EVENT DETECTION IN SMART CI...
SOCIAL MEDIA ANALYTICS FOR SENTIMENT ANALYSIS AND EVENT DETECTION IN SMART CI...
 
SOCIAL NETWORK HATE SPEECH DETECTION FOR AMHARIC LANGUAGE
SOCIAL NETWORK HATE SPEECH DETECTION FOR AMHARIC LANGUAGESOCIAL NETWORK HATE SPEECH DETECTION FOR AMHARIC LANGUAGE
SOCIAL NETWORK HATE SPEECH DETECTION FOR AMHARIC LANGUAGE
 
GENERAL REGRESSION NEURAL NETWORK BASED POS TAGGING FOR NEPALI TEXT
GENERAL REGRESSION NEURAL NETWORK BASED POS TAGGING FOR NEPALI TEXTGENERAL REGRESSION NEURAL NETWORK BASED POS TAGGING FOR NEPALI TEXT
GENERAL REGRESSION NEURAL NETWORK BASED POS TAGGING FOR NEPALI TEXT
 

Recently uploaded

The Most Excellent Way | 1 Corinthians 13
The Most Excellent Way | 1 Corinthians 13The Most Excellent Way | 1 Corinthians 13
The Most Excellent Way | 1 Corinthians 13Steve Thomason
 
Software Engineering Methodologies (overview)
Software Engineering Methodologies (overview)Software Engineering Methodologies (overview)
Software Engineering Methodologies (overview)eniolaolutunde
 
Presiding Officer Training module 2024 lok sabha elections
Presiding Officer Training module 2024 lok sabha electionsPresiding Officer Training module 2024 lok sabha elections
Presiding Officer Training module 2024 lok sabha electionsanshu789521
 
KSHARA STURA .pptx---KSHARA KARMA THERAPY (CAUSTIC THERAPY)————IMP.OF KSHARA ...
KSHARA STURA .pptx---KSHARA KARMA THERAPY (CAUSTIC THERAPY)————IMP.OF KSHARA ...KSHARA STURA .pptx---KSHARA KARMA THERAPY (CAUSTIC THERAPY)————IMP.OF KSHARA ...
KSHARA STURA .pptx---KSHARA KARMA THERAPY (CAUSTIC THERAPY)————IMP.OF KSHARA ...M56BOOKSTORE PRODUCT/SERVICE
 
18-04-UA_REPORT_MEDIALITERAСY_INDEX-DM_23-1-final-eng.pdf
18-04-UA_REPORT_MEDIALITERAСY_INDEX-DM_23-1-final-eng.pdf18-04-UA_REPORT_MEDIALITERAСY_INDEX-DM_23-1-final-eng.pdf
18-04-UA_REPORT_MEDIALITERAСY_INDEX-DM_23-1-final-eng.pdfssuser54595a
 
Concept of Vouching. B.Com(Hons) /B.Compdf
Concept of Vouching. B.Com(Hons) /B.CompdfConcept of Vouching. B.Com(Hons) /B.Compdf
Concept of Vouching. B.Com(Hons) /B.CompdfUmakantAnnand
 
Class 11 Legal Studies Ch-1 Concept of State .pdf
Class 11 Legal Studies Ch-1 Concept of State .pdfClass 11 Legal Studies Ch-1 Concept of State .pdf
Class 11 Legal Studies Ch-1 Concept of State .pdfakmcokerachita
 
Enzyme, Pharmaceutical Aids, Miscellaneous Last Part of Chapter no 5th.pdf
Enzyme, Pharmaceutical Aids, Miscellaneous Last Part of Chapter no 5th.pdfEnzyme, Pharmaceutical Aids, Miscellaneous Last Part of Chapter no 5th.pdf
Enzyme, Pharmaceutical Aids, Miscellaneous Last Part of Chapter no 5th.pdfSumit Tiwari
 
Solving Puzzles Benefits Everyone (English).pptx
Solving Puzzles Benefits Everyone (English).pptxSolving Puzzles Benefits Everyone (English).pptx
Solving Puzzles Benefits Everyone (English).pptxOH TEIK BIN
 
microwave assisted reaction. General introduction
microwave assisted reaction. General introductionmicrowave assisted reaction. General introduction
microwave assisted reaction. General introductionMaksud Ahmed
 
BASLIQ CURRENT LOOKBOOK LOOKBOOK(1) (1).pdf
BASLIQ CURRENT LOOKBOOK  LOOKBOOK(1) (1).pdfBASLIQ CURRENT LOOKBOOK  LOOKBOOK(1) (1).pdf
BASLIQ CURRENT LOOKBOOK LOOKBOOK(1) (1).pdfSoniaTolstoy
 
_Math 4-Q4 Week 5.pptx Steps in Collecting Data
_Math 4-Q4 Week 5.pptx Steps in Collecting Data_Math 4-Q4 Week 5.pptx Steps in Collecting Data
_Math 4-Q4 Week 5.pptx Steps in Collecting DataJhengPantaleon
 
URLs and Routing in the Odoo 17 Website App
URLs and Routing in the Odoo 17 Website AppURLs and Routing in the Odoo 17 Website App
URLs and Routing in the Odoo 17 Website AppCeline George
 
Sanyam Choudhary Chemistry practical.pdf
Sanyam Choudhary Chemistry practical.pdfSanyam Choudhary Chemistry practical.pdf
Sanyam Choudhary Chemistry practical.pdfsanyamsingh5019
 
A Critique of the Proposed National Education Policy Reform
A Critique of the Proposed National Education Policy ReformA Critique of the Proposed National Education Policy Reform
A Critique of the Proposed National Education Policy ReformChameera Dedduwage
 
POINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptx
POINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptxPOINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptx
POINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptxSayali Powar
 
The basics of sentences session 2pptx copy.pptx
The basics of sentences session 2pptx copy.pptxThe basics of sentences session 2pptx copy.pptx
The basics of sentences session 2pptx copy.pptxheathfieldcps1
 
Separation of Lanthanides/ Lanthanides and Actinides
Separation of Lanthanides/ Lanthanides and ActinidesSeparation of Lanthanides/ Lanthanides and Actinides
Separation of Lanthanides/ Lanthanides and ActinidesFatimaKhan178732
 

Recently uploaded (20)

The Most Excellent Way | 1 Corinthians 13
The Most Excellent Way | 1 Corinthians 13The Most Excellent Way | 1 Corinthians 13
The Most Excellent Way | 1 Corinthians 13
 
Software Engineering Methodologies (overview)
Software Engineering Methodologies (overview)Software Engineering Methodologies (overview)
Software Engineering Methodologies (overview)
 
Presiding Officer Training module 2024 lok sabha elections
Presiding Officer Training module 2024 lok sabha electionsPresiding Officer Training module 2024 lok sabha elections
Presiding Officer Training module 2024 lok sabha elections
 
KSHARA STURA .pptx---KSHARA KARMA THERAPY (CAUSTIC THERAPY)————IMP.OF KSHARA ...
KSHARA STURA .pptx---KSHARA KARMA THERAPY (CAUSTIC THERAPY)————IMP.OF KSHARA ...KSHARA STURA .pptx---KSHARA KARMA THERAPY (CAUSTIC THERAPY)————IMP.OF KSHARA ...
KSHARA STURA .pptx---KSHARA KARMA THERAPY (CAUSTIC THERAPY)————IMP.OF KSHARA ...
 
18-04-UA_REPORT_MEDIALITERAСY_INDEX-DM_23-1-final-eng.pdf
18-04-UA_REPORT_MEDIALITERAСY_INDEX-DM_23-1-final-eng.pdf18-04-UA_REPORT_MEDIALITERAСY_INDEX-DM_23-1-final-eng.pdf
18-04-UA_REPORT_MEDIALITERAСY_INDEX-DM_23-1-final-eng.pdf
 
Concept of Vouching. B.Com(Hons) /B.Compdf
Concept of Vouching. B.Com(Hons) /B.CompdfConcept of Vouching. B.Com(Hons) /B.Compdf
Concept of Vouching. B.Com(Hons) /B.Compdf
 
Class 11 Legal Studies Ch-1 Concept of State .pdf
Class 11 Legal Studies Ch-1 Concept of State .pdfClass 11 Legal Studies Ch-1 Concept of State .pdf
Class 11 Legal Studies Ch-1 Concept of State .pdf
 
Enzyme, Pharmaceutical Aids, Miscellaneous Last Part of Chapter no 5th.pdf
Enzyme, Pharmaceutical Aids, Miscellaneous Last Part of Chapter no 5th.pdfEnzyme, Pharmaceutical Aids, Miscellaneous Last Part of Chapter no 5th.pdf
Enzyme, Pharmaceutical Aids, Miscellaneous Last Part of Chapter no 5th.pdf
 
Solving Puzzles Benefits Everyone (English).pptx
Solving Puzzles Benefits Everyone (English).pptxSolving Puzzles Benefits Everyone (English).pptx
Solving Puzzles Benefits Everyone (English).pptx
 
microwave assisted reaction. General introduction
microwave assisted reaction. General introductionmicrowave assisted reaction. General introduction
microwave assisted reaction. General introduction
 
BASLIQ CURRENT LOOKBOOK LOOKBOOK(1) (1).pdf
BASLIQ CURRENT LOOKBOOK  LOOKBOOK(1) (1).pdfBASLIQ CURRENT LOOKBOOK  LOOKBOOK(1) (1).pdf
BASLIQ CURRENT LOOKBOOK LOOKBOOK(1) (1).pdf
 
_Math 4-Q4 Week 5.pptx Steps in Collecting Data
_Math 4-Q4 Week 5.pptx Steps in Collecting Data_Math 4-Q4 Week 5.pptx Steps in Collecting Data
_Math 4-Q4 Week 5.pptx Steps in Collecting Data
 
URLs and Routing in the Odoo 17 Website App
URLs and Routing in the Odoo 17 Website AppURLs and Routing in the Odoo 17 Website App
URLs and Routing in the Odoo 17 Website App
 
Sanyam Choudhary Chemistry practical.pdf
Sanyam Choudhary Chemistry practical.pdfSanyam Choudhary Chemistry practical.pdf
Sanyam Choudhary Chemistry practical.pdf
 
9953330565 Low Rate Call Girls In Rohini Delhi NCR
9953330565 Low Rate Call Girls In Rohini  Delhi NCR9953330565 Low Rate Call Girls In Rohini  Delhi NCR
9953330565 Low Rate Call Girls In Rohini Delhi NCR
 
A Critique of the Proposed National Education Policy Reform
A Critique of the Proposed National Education Policy ReformA Critique of the Proposed National Education Policy Reform
A Critique of the Proposed National Education Policy Reform
 
POINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptx
POINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptxPOINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptx
POINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptx
 
The basics of sentences session 2pptx copy.pptx
The basics of sentences session 2pptx copy.pptxThe basics of sentences session 2pptx copy.pptx
The basics of sentences session 2pptx copy.pptx
 
TataKelola dan KamSiber Kecerdasan Buatan v022.pdf
TataKelola dan KamSiber Kecerdasan Buatan v022.pdfTataKelola dan KamSiber Kecerdasan Buatan v022.pdf
TataKelola dan KamSiber Kecerdasan Buatan v022.pdf
 
Separation of Lanthanides/ Lanthanides and Actinides
Separation of Lanthanides/ Lanthanides and ActinidesSeparation of Lanthanides/ Lanthanides and Actinides
Separation of Lanthanides/ Lanthanides and Actinides
 

MODELING AND DESIGN OF CRUISE CONTROL SYSTEM WITH FEEDFORWARD FOR ALL TERRIAN VEHICLES

  • 1. Sundarapandian et al. (Eds) : ICAITA, SAI, SEAS, CDKP, CMCA-2013 pp. 339–349, 2013. © CS & IT-CSCP 2013 DOI : 10.5121/csit.2013.3828 MODELING AND DESIGN OF CRUISE CONTROL SYSTEM WITH FEEDFORWARD FOR ALL TERRIAN VEHICLES Khaled Sailan and Klaus.Dieter Kuhnert Siegen university .electrical engineering department Real time system institute Siegen, Germany khaled.sailan@student.uni-siegen.de kuhnert@fb12.uni-siegen.de ABSTRACT This paper presents PID controller with feed-forward control. The cruise control system is one of the most enduringly popular and important models for control system engineering. The system is widely used because it is very simple to understand and yet the control techniques cover many important classical and modern design methods. In this paper, the mathematical modeling for PID with feed-forward controller is proposed for nonlinear model with disturbance effect. Feed-forward controller is proposed in this study in order to eliminate the gravitational and wind disturbance effect. Simulation will be carried out . Finally, a C++ program written and feed to the microcontroller type AMR on our robot KEYWORDS PID controller, feed-forward controller, robot ,modeling and simulation 1. INTRODUCTION Autonomous operation of mobile robots requires effective speed control over a range of speeds. In this paper, we present an adaptive speed control design and implementation for a throttle- regulated internal combustion engine on an All Terrain Vehicle (ATV), one of the platforms used within the AMOR project figure 1. This is a difficult problem due to significant nonlinearities in the engine dynamics and throttle control. Although some of the reviewed automatic speed controllers in the literature have been implemented on production vehicles, the control techniques are not directly applicable to the ATV throttle control problem. First, the ATV’s engine is mechanically controlled via a carburetor, unlike most production vehicles, which have microprocessor-based engine management systems which guarantee maximum engine efficiency and horsepower. Second, the ATV carburetor clearances make it difficult to incorporate a sensor to measure the throttle plate angle, which is required in virtually all the automotive speed controllers in the
  • 2. Computer Science & Information Technology (CS & IT) 340 literature. Third, and importantly, the automatic speed control (cruise control) of modern automobiles is generally recommended for use at speeds greater than 13m/s. At speeds below 13 m/s most internal combustion engines exhibit considerable torque fluctuations, a highly nonlinear phenomenon which results in considerable variation in engine speed and crankshaft angular speed. This makes it extremely challenging to design an effective controller for speeds below 13m/s. the ATV throttle is actuated via R/C servo instead of a pneumatic actuator, the preferred actuator in most production vehicles. Although the R/C servo setup has the potential to provide faster and more accurate throttle plate control, it provides no explicit feedback of the servo’s angular position. The disturbance due to road conditions ,engine temperature ,gearbox and steering specially at 0 m/sec speed the most important disturbance effect is the road conditions and steering effect which will be take in consideration in this papers. Figure 1 AMOR autonomous mobile robot The two main challenges in designing an effective speed controller for the ATV are 1) the lack of a complete mathematical model for the engine, and 2) the highly nonlinear nature of the engine dynamics, especially for the targeted low speed range of 1-13m/s. Both of these reasons make the use of classical control strategies, such as PID Controller not easy. One of the main reasons for these challenges is the ATV’s carburetor. Carburetors are general calibrated for a fixed range of altitudes and ambient temperatures. Since maximum engine efficiency and horsepower are directly related to proper carburetor setting, any significant changes in altitude and ambient temperatures require recalibration of the carburetor, a tedious task. In contrast, modern engine control systems employ microprocessor-based systems to control fuel injection and ignition point. Engine control strategies depend strongly on the current operating point, and there are no complete mathematical models of the engine parameters. As a result, most engine controllers use look-up tables to represent the control strategy. These tables are generated from extensive field experiments and engineering expertise. Therefore, it is very difficult to employ conventional control techniques that require a precise mathematical model to synthesize a speed control algorithm component for a PID controller). The operating point of the ATV’s engine moves with respect to changing load conditions, slippage in the PVT and the carburetor nonlinear characteristics. Nevertheless, a PI controller can be used for higher speeds where the carburetor operation is fairly linear, i.e., throttle openings above one-half and speeds above 15MPH, covering the upper portion of our target speed range. This result indicates that a
  • 3. 341 Computer Science & Information Technology (CS & IT) possible approach is to use more than one control strategy via lookup tables, depending on the speed range. Another approach to the control problem is to apply adaptive control techniques. However, a complete mathematical model of the engine parameters is not available, and developing this model requires information about the engine which we were unable to obtain from the manufacturer. This approach will discuss in this paper. 2. MODELING OF CRUISE CONTROL The purpose of the cruise control system is regulating the vehicle speed so that it follows the driver’s command and maintains the speed at the commanded level as shown in figure 2 [3]. Figure 2 block diagram of cruise control system Based on the command signal ‫ݒ‬ோ from the driver and the feedback signal from the speed sensor, the cruise controller regulates vehicle speed ‫ݒ‬ by adjusting the engine throttle angle u to increase or decrease the engine drive force Fd. The longitudinal dynamics of the vehicle as governed by Newton’s low (or d’Alembert’s principle) is. ‫ܨ‬ௗ = ‫ܯ‬ ௗ ௗ௧ ‫ݒ‬ + ‫ܨ‬௔ + ‫ܨ‬௚ (1) Figure 3 AMOR robot longitudinal by dynamic model
  • 4. Computer Science & Information Technology (CS & IT) 342 Where M ୢ ୢ୲ v is the inertia force, Fa is the aerodynamic drag And F୥ is the climbing resistance or downgrade force. The forces Fd, Fa, and Fg are produced as shown in the model of Fig. 3 [1], where ‫ݒ‬௪is the wind gust speed, M is the mass of the vehicle and passenger(s), θ is the road grade, and Ca is the aerodynamic drag coefficient. The throttle actuator and vehicle propulsion system are modeled as a time delay in cascade with a first order lag and a force saturation characteristic ‫ܨ‬௚ = ‫݃ܯ‬ sinߠ ‫ܨ‬௔ = ‫ܥ‬௔(‫ݒ‬ − ‫ݒ‬௪)ଶ The actuator and the vehicle propulsion system are modelled as cascade temporary lag of first order ‫ܥ‬ଵ ்݁௦ 1 + ܶ‫ݏ‬ And a saturation force feature due to the engine physic limitations (Fd is limited between Fd min and Fd max). The controller design for this system begins by simplifying the model. Consider to set all the initial conditions to zero. The same applies to the disturbance parameters. Hence, it is assumed is no wind gust and no grading exists during the movement of the car. Applying this zero initial condition to the block diagram, the model is left with the forward path and the unity feedback loop of the output speed. Since the state variables have been chosen to be the output speed and the drive force, the corresponding state and output equations are found to be : ߥሶ = ଵ ௠ (‫ܨ‬ௗ − ‫ܥ‬௔ߥଶ ) (2) ‫݀ܨ‬ሶ = ଵ ் (‫ܥ‬ଵ‫ݐ(ݑ‬ − ܶ) − ‫ܨ‬ௗ ) (3) ‫ݕ‬ = ‫ݒ‬ (4) However, a problem of non linearity arises. There is a squared term in the equation (2). One way to overcome this problem is to linearize all of the state-equations by differentiating both left and right hand sides of the equations with M, Ca, C1, T and v remain constant. After differentiating, the state-equations become ௗ ௗ௧ ߥሶ = ଵ ெ (−2‫ܥ‬௔‫ݒ‬ ߜ‫ݒ‬ − ߜ‫ܨ‬ௗ) (5) ݀ ݀‫ݐ‬ Fdሶ = 1 ܶ (‫ܥ‬ଵߜ‫ݐ(ݑ‬ − ܶ) − ߜ‫ܨ‬ௗ ) (6) and the output equation becomes ‫ݕ‬ = ߜ‫ݒ‬
  • 5. 343 Computer Science & Information Technology (CS & IT) In the equation, δv means that the output is discrete and δFd also means that drive force is discrete. The symbol v means the desired and δu(t-τ) is the time delay of the engine. Up to this point, both the state and output equations are written in time domain. The linearized model provides a transfer function can be obtained by solving the state-equations for the ratio of ∆V (s) / ∆U(s) . ∆ܸ(‫)ݏ‬ ∆ܷ(‫)ݏ‬ = ܽ݁ିఛ௦ (‫ݏ‬ + ܾ) (‫ݏ‬ + ݀) (7) ܽ = ‫1ܥ‬ ‫ܶܯ‬ ܾ = 2‫ݒܽܥ‬ ‫ܯ‬ ݀ = 1 ܶ Where It is obvious that the system described by this transfer function is second order system with time delay. Because the complexity of the system and the poor of the engine parameter system identification tool used to define the system transfer function .From system identification ‫)ݏ(ܩ‬ = ∆ܸ(‫)ݏ‬ ∆ܷ(‫)ݏ‬ = 0,0144݁ି଴.଴଴ଵ௦ ‫ݏ‬ଶ + 0.018‫ݏ‬ + 0.006 3. CONTROLLER DESIGNE The problem of cruise control system is to maintain the output speed v of the system as set by input signal base on the command signal vR from the driver. Cruise controller design is applied assuming a single-loop system configuration with a linear model and nonlinear model, as shown in Fig. 4. The controller function Gc(s) is designed to augment or modify the open-loop function in a manner that produces the desired closed-loop performance characteristics. The plant functions Gp(s) represent the actuators and the controller part of the system, and the plant parameters are determined primarily by functional aspects of the control task. Before make any decision of controller design, a few of design specification have been set. In this design, we take two considerations to be met which are settling time Ts less than 1s and percentage of overshot %OS is less than 20%.because the system is nonlinear system proportional-integral derivatives (PID) with feed-forward designed used for this proposed . Figure 4 cruise control system configuration
  • 6. Computer Science & Information Technology (CS & IT) 344 Nonlinear model using PID controller is design of the controller has been based on use of the linearized model. Although a simple and quick check of the design, a more accurate simulation should be done by applying the controller to the original nonlinear model as shown in Fig. 3. The PID controller that take in consideration figure 4 describe as ߜ‫)ݐ(ݑ‬ = ‫ܣ‬ = ݇௣݁(‫)ݐ‬ + ݇௜ ‫׬‬ ݁(߬) ݀(߬) + ݇ௗ ௗ௘(௧) ௗ௧ (8) Figure 5 PID controller applied to the nonlinear plant The basic concept of feed-forward (FF) control is to measure important disturbance variables and take corrective action before they upset the process to improve the performance result. the main disturbance acting on our system is the road incline and the steering effect specially in when the robot start from zero speed this disturbance will take in consideration. A feed-forward control system is shown in Fig.6, where disturbances are measured and compensating control actions are taken through the feed-forward controller. Deviations in the controlled variables can be calculated as: ∆‫ݒ‬ = ‫ܦ߂݂݂ܩ݌ܩ‬ + ‫ܦ߂݀ܩ‬ (9) In order to make ∆v zero, a feed-forward controller of the following form is designed. Supposed that, ‫݀ܩ‬ = ‫݀ܭ‬ (߬ௗ‫ݏ‬ + 1) (10) ‫݌ܩ‬ = ‫݌ܭ‬ ݁ିఛ௦ ൫߬௣ଵ‫ݏ‬ + 1൯൫߬௣ଶ‫ݏ‬ + 1൯ (11) Then from equation (16-17), the ideal feed-forward controller, ‫݂݂ܩ‬ = −‫݌ܩ‬ିଵ ‫݀ܩ‬ = ‫݂݂ܭ‬ ൫߬௣ଵ‫ݏ‬ + 1൯൫߬௣ଶ‫ݏ‬ + 1൯ ݁ିఛ௦ (߬ௗ‫ݏ‬ + 1) (12) Where feed-forward controller gain is ‫݂݂ܭ‬ = ି௄ௗ ௞௣ . In process plant applications, ‫݂݂ܩ‬ is typically chosen to be of static form, and it is this approach that will be adopted in this project.
  • 7. 345 Computer Science & Information Technology (CS & IT) Figure 6 a feed-forward control system 4. EXPEREMENTS AND RESULTS The system is modeled using Matlab/Simulink as shown in figure.7 to investigate and to find the parameters of PID controller (Kp,Kd,Ki) and the feed forward controller gain due to the road incline which changes with changing the operating point and for each operating point there is new feed-forward gain as it shown in look-up table.1. For the disturbance from the steering system there is also effect on the system so a new gain should apply to the system for each operating point and table 2 shows the gain with the steering angle . Figure 7 block diagram of simulate cruise control with FF
  • 8. Computer Science & Information Technology (CS & IT) 346 For implement the PID controller on AMOR Robot with feed-forward control a program written in C++ by taking the sensors value and compare it with the reference value and calculate the error, for feed-forward a function written to take the value from look up table when the disturbance from road and from the steering occur and measured before it effects the system, Angle Gain(ࡷࢌࢌ) 4.0 5.7 5.0 7.0 6.0 8.0 7.0 9.0 8.0 10.0 9.0 11.0 10.0 12.0 12.0 14.0 14.0 16.0 15.0 17.0 Table 1 Road incline disturbance lookup table Angle Gain(ࡷࢌࢌ) 0.0 6.5 10 6.0 40 7.0 80 2.0 96 0.0 127 0.0 140 0.5 150 0.5 160 0.5 170 1.5 Table 2 steering disturbance lookup table many experiments has done to get the best result for the cruise control of AMOR robot and as shown in figure 7 the simulated cruise control system by using PID controller with feed-forward to cancel the effect of the disturbance from the road incline and from the steering and figure 8 shows how is the system signal if we used the PID controller and if we did not use the PID controller it show that the signal is speed up over the reference speed but with PID controller it still in near the reference speed with small error .Figure 9(b) illustrates the real system signal during the driving on the flat and up and down hill with using PID controller without feed-forward and figure 9 (a) shows the PID controller with feed-forward controller with 2.5m/sec reference speed. Table 3 shows the controller parameters and specifications that meet our design specifications .
  • 9. 347 Computer Science & Information Technology (CS & IT) parameters value P 6 I 0.45 D 0.00 ‫ܭ‬௙௙ 5.7 Rising time 0.120 millisecond Overshoot 8.92% Steady state error 0.00 Table 3 controller Parameters and specifications Figure 7 simulated PID controller Figure 8 the real system with and without controller
  • 10. Computer Science & Information Technology (CS & IT) 348 Figure 9 (a) PID controller with Feed-forward Figure 9 (b) PID controller without Feed-forward 6. CONCLUSIONS The mathematical model for cruise control system has been derived successfully .simulated cruise control system for our plant (AMOR robot) and the effect of disturbance from the incline road and from the steering is also simulated and the parameters for the PID controller and for the Feed- forward controller that meet the system specification estimated . This result from the simulated model feed to the real system by written a program in C++ language and upload the C++ code to the AMR Robot microcontroller and the best results that meets our system specification and overcome the effect of disturbance is achieved . REFERENCES [1] Khairuddin Osman, Mohd. Fuaad Rahmat, Mohd Ashraf Ahmad Modelling and Controller Design for a Cruise Control System, 2009 5th International Colloquium on Signal Processing & Its Applications (CSPA).
  • 11. 349 Computer Science & Information Technology (CS & IT) [2] Lewis Paul H. and Yang Chang. 1997. Basic Control System Engineering. Prentice-Hall, Inc. New Jersey, USA. [3] ME 132, Spring 2005, UC Berkeley, A. Packard. [4] Karl.john Aström, control system design 2002. [5] Andres Escobar D.addaptive fuzzy control applied toa speed control The Online Journal on Electronics and Electrical Engineering (OJEEE) [6] Thanah hung tran modeling and contol of unmanned Ground Vehicle .Phd thesis september 2007. [7] Ashitey Trebi-Ollennu, John M. Dolan, and Pradeep Khosla , Adaptive Fuzzy Throttle Control for an All Terrain Vehicle. [8] T. Tekorius, D. Levisauskas. Comperative investigation of feed forward control algorithms electronic and electrical engineering ISSN1392-1215 2011. No. 9(115). [9] Kumeresan A. Danapalasingam, Anders la Cour-Harbo and Morten Bisgaard.Desturbance Effects in Nonlenear Control Systems and Fee-forward Control Strategy. 2009 IEEE International Conference on Control and Automation Christchurch, New Zealand, December 9-11, 2009. [10] Eduardo J. Adam * and Jacinto L. Marchetti. Feed-forward Controller Design Based on H∞ Analysis.E.J. Adam, J.L. Marchetti / Proceedings of ENPROMER 2001 Volume I (2001) 271- 276Dynamics, Operability and Process Control