Remote Visual Servo Tracking Control of Drone Taking Account of Time Delays

Size: px
Start display at page:

Download "Remote Visual Servo Tracking Control of Drone Taking Account of Time Delays"

Transcription

1 Proceedings of the SICE Annual Conference 217 September 19-22, 217, Kanazawa University, Kanazawa, Japan Remote Visual Servo Tracking Control of Drone Taking Account of Time Delays Junpei Shirai 1, Takashi Yamaguchi 1 and Kiyotsugu Takaba 1 1 Department Electrical and Electronic Engineering, Ritsumeikan University ( ktakaba@fcritsumeiacjp) Abstract: The use of drones has recently been expected in many applications such as exploration in dangerous areas, security surveillance, and logistics Accurate position control of the drones is required in these applications This work is concerned with the remote position tracking control of a quadrotor-type drone via visual feedback control The transient response or stability of the drone may be significantly deteriorated by the adverse effect of the time delays due to wireless communication and image processing In this work, we construct the LQI optimal servo control system for the linearized drone model with state augmentation to cope with the time delays The effectiveness of the proposed method is verified by a simulation and an experiment Keywords: LQI optimal servomechanism, visual feedback, time delay, state augmentation 1 INTRODUCTION We consider the control of a quadrotor-type drone which is a kind of small unmanned aerial vehicle The drone is controlled only by the angular speeds of four electric rotors Due to the recent development of electronic devices and sensors, high spec drones have come to be available at inexpensive costs The drones are expected in many applications such as exploration at disaster sites, security surveillance[2], and logistics Accurate automatic position control of the drones is essential in these applications In this paper, we will consider the remote position tracking control of the drone via visual feedback using a built-in camera The transient response or stability of the drone may be significantly deteriorated by the adverse effect of the time delays due to wireless communication and image processing Several researches have been reported on how to cope with these time-delays For instance, Kiset al[4] employed the state prediction control technique to compensate the delay due to image processing under the situation that the position of the drone is measured bya camerafixed on the ground In this paper, we will consider the remote position tracking control based on the visual information obtained from a built-in camera rather than a ground-fixed camera We will design the LQI optimal servomechanism for the augmented linear state space model which includes the information about the time delays [5-7] An experimental result will also be presented in order to verify the effectiveness of the proposed method 2 MODELING 21 Coordinate systems and rotation matrices Fig1 shows the coordinate systems of the drone The inertial fixed frame is a system of coordinates whose origin is located at the center of the marker fixed on the ground The x-axis points towards the north, the y-axis points towards the west, and the z-axis points towards the Junpei Sirai is the presenter of this paper outward direction from the center of the earth The Body fixed frame is a system of coordinates whose origin is fixed at the center of gravity of the drone The X-axis of the body frame is the optic axis of the front camera fixed to the drone The Y-axis points towards the left direction, and Z-axis points towards the up direction The rotation angles, namely roll, pitch, and yaw, are denoted by θ, φ, and, ψ respectively The orientation of the drone is defined in the order of the roll, pitch, and the yaw angles Hence, the rotation matrix R(Θ) which converts the orientation in the body frame to that in the inertial frame is expressed by R(Θ) = R(ψ)R(φ)R(θ), R(ψ), R(φ), and R(θ) are the rotation matrices of the rotations around the x, y, and z-axes, respectively Fig 1 Coordinate systems 22 Equations of motion This section introduce the modeling of the drone [?, 3] The translational and rotational motions of the drone are expressed by the nonlinear differential equations as m ξ + mge z = R(Θ)E z u (1) η = J 1 (τ C(η, η) η) (2) PR1/ SICE 1589

2 that the internal controller has the PD control structure described by θ(t) = b(θ(t) θ(t L 1 )) a θ(t), mÿ(t) = mgθ K ẏ(t), (7a) (7b) Fig 2 Rotations of the drone The physical parameters of the drone are defined in Table 1 In particular, the drone of (1), (2) is driven by the torque τ and the thrust u in the Z-direction Table 1 Physical parameters m the mass ξ=(x, y, z) T the position in the inertial frame g the acceleration of gravity 98[m/s 2 ] E z = [,, 1] T the unit vector in the z-direction η=(ψ, φ, θ) T (yaw, pitch, roll) J = diag(i x, I y, I z ) the inertia matrix τ=(τ ψ,τ φ,τ θ ) T the vector of torques C(η, η) the Coriolis term u the thrust in the Z-direction Linearizing (1) and (2) about the hovering states, ie η =, η =, u = mg, yields the following four decoupled sub-systems: mẍ = mgφ, (3) I x φ = τ φ, mÿ = mgθ, (4) I y θ = τ θ, m z = u mg, (5) I z ψ = τ ψ, (6) I x, I y,andi z are the moments of inertia around the center of gravity in the body frame In this paper, we are interested in the tracking control in the crosswise direction, equivalently in the y-axis Since the sub-systems (3) (6) are decoupled each other, we have only to consider the equations in (4) 23 Internal control law In this work, we will use the quadrotor-type drone AR Drone 2 (Parrot Inc) for the experiment in Section 4 Although the inputs in the model (1), (2) are the torque τ and the thrust u, the AR Drone 2 incorporates the internal controller which converts the command angles η d = (ψ d,φ d,θ d ) and the vertical velocity command ż d into (τ, u) Since the internal controller is a black box, it is impossible to modify the controller, and we need to estimate its structure and feedback gains Thus, we assume the term K y is added in order to account for air resistance Since the drone is remotely controlled by the PC through wireless communication, there exist an input delay L 1 and an measurement delay L 2 The input delay L 1 is due to wireless communication, and the measurement delay L 2 is caused by both wireless communication and image processing The detail of the system configuration and problem setting will be described in Section discrete-time modeling We discretize (7a) at sampling period Δt to design a digital controller for the drone The state space model of the continuous time system (7a) is expressed as ẋ(t) = A c x(t) + B c u(t L 1 ), y(t) = C c x(t), θ θ x(t) =, u(t) = θ y d (t), y(t) = y(t), ẏ 1 b a A c = 1 g K v C c = [ 1 ],, B c = a = a /I y, b = b /I y, K v = K /m b, (8a) (8b) We make the following assumption about the time delays Assumption 1: The time delays L 1 and L 2 can be divided by the sampling period Δt Namely, there exist positive integers l 1 and l 2 such that L 1 = l 1 Δt and L 2 = l 2 Δt By the zeroth-order hold discretization of (8), we obtain the discrete-time state space model as x[k + 1] = Ax[k] + Bu[k l 1 ], y[k] = Cx[k], A = e A cδt, B = e A cδt Δt e A cτ dτb c, C c = C, (9a) (9b) a discrete-time or sampled-data signal is denoted by f [k] := f (kδt), k =, 1, 2,, and the control input is given through the zeroth-order hold as u(kδt + τ) = u[k], τ [, 1), k =, 1, 2, We put the following assumption for the later discussion on the servomechanism design 159

3 Assumption 2: (i) (A, B) is stabilizable, and (C, A) is detectable A I B (ii) has full row rank C 3 CONTROLLER DESIGN In this section, we will design a controller which achieves the desired tracking performance as well as compensating the time delays due to image processing and wireless communication, in the discrete-time setting 31 Problem Statement The schematic picture of the system configuration for our tracking control is shown in Fig3 By the in-front built-in camera, the drone captures the image of the target object expressed by the electric light balls, and send it to the PC The PC processes the image to detect the position of the target, and send back the control command to the drone All the communications between the PC and the drone are done by WiFi Since we are interested in the position tracking in the horizontal direction, the target object is constrained on the yz-plane Let the reference signal r[k] denote the y-position of the target object at step k regulator theory is applied to realize a good transient response (the objective (ii)) Fig4 illustrates the block diagram of the overall LQI servo control system, in which G(z) denotes the transfer function of the drone observer Drone Fig 4 LQI optimal servo control system with delays 32 Augmented state space model Recall that our control system contains the input delay l 1 due to wireless communication and the measurement delay l 2 due to wireless communication and image processing As is well known, the state augmentation [5-7] is an effective technique to cope with the time delays Define the augmented state vector including the measurement delays by X[k] xod [k], x x[k] od [k] = y[k l 2 ] y[k l 2 + 1] y[k 1], (1) It then follows from (9) that X[k + 1] = A ob X[k] + B ob u[k l 1 ], y[k l 2 ] = C ob X[k], (11a) (11b) Fig 3 System Configuration We wish to design the feedback controller which achieves the following control objectives (i) Robust servomechanism The output y[k] shouldtrackthe referencesignalr[k] without steady-state errors, namely lim r[k] y[k] = k for any step reference r[k] and for any initial conditions (ii) Rapid and smooth transient response For this purpose, we employ the LQI optimal servomechanism design [7], the integral action is incorporated in the controller to fulfill the objective (i) based on the internal model principle, and the LQ I p I p A ob =, B I p ob =, C A B C ob = [ 1 ] Furthermore, we define vector of delayed inputs by input u[k l 1 ] u[k l 1 + 1] x id [k] = u[k 1] This will be used in the next section 33 LQI optimal servomechanism We design the LQI optimal servo system to achieve the control objectives (i) and (ii) 1591

4 Firstly, we introduce the discrete-time integrator as k 1 W[k] = E[i 1] + W[], i=1 E[k] := E[k] = r[k l 2 ] y[k l 2 ] is the tracking error It is easily seen from the above equation that W[k + 1] = W[k] + E[k] (12) Furthermore, define to obtain X[k] X m [k] W[k], x id [k] r R 1 X m [k + 1] = ÂX m [k] + ˆBu[k] + R, y[k l 2 ] = ĈX m [k], A ob B ob C ob 1 1 Â =, ˆB =, 1 1 Ĉ = [ 1 ] (13a) (13b) For the moment, we assume that all the state variables can be accurately measured Then, we will design the feedback controller in the form of u[k] = K X X[k] + K W W[k] + K xid x id [k] + u, (14) K X, K W, K xd,andu are the feedback gains and the feedforward term to be designed In order to eliminate the constant term R on the righthand side of (13a), we introduce the steady-state values x,ū of the state x and the input u By Assumption 2 (ii), when the control objective (i) is achieved, the steady-state values x and ū satisfy [ x = ū] [ A I B (15) C ] r Note that the steady-state value W of the integrator is arbitrary Thus, the steady-state value of the augmented state vector is given by r X[k] ū X m [k] = W[k], X =, x id = x id [k] r (16) ū x Evaluating the equation (14) at k leads to u = K X X + K W W + K xid x id + ū (17) Consequently, by defining X[k] X m [k] = X m [k] X m = W[k], x id [k] X[k] = X[k] X, W[k] = W[k] W, x id [k] = x id [k] x id, ũ[k] = u[k] ū we get the state space model without any constant terms of the error system by X m [k + 1] = Â X m [k] + ˆBũ[k] (18) For the control objective (ii), we introduce the performance index ) J = (E[k] 2 + Q w W[k] 2 + Rũ[k] 2 (19) k= Minimization of J means that the tracking error should rapidly converge to zero without excessive variations of the control input and integrator Assumption 3: The weights Q w, R are positive constants Using the augmented state vector X m [k], the performance index J is rewritten as ( J = X m [k] T Q X m [k] + Rũ[k] 2), (2) k= Q = diag(, C T C, Q w, ) From the above observation, we can apply the LQ optimal regulator theory to (18),(2) in order to obtain the desired controller The optimal feedback gain is given by K = [ K X K W K xid ] = (R + ˆB T P ˆB) 1 ˆB T PÂ, (21) P is the positive semi-definite stabilizing solution to the algebraic Riccati equation (ARE) P = Â T PÂ Â T P ˆB(R + ˆB T P ˆB) 1 ˆB T PÂ + Q (22) The existence and uniqueness of such a solution P is guaranteed by the following proposition Proposition 1: Under Assumptions 2 and 3, (Â, ˆB) is stabilizable, and (Q, Â) is detectable Hence, there exists a unique positive semi-definite solution to the ARE (22), and it is also a stabilizing solution Proof: Omitted It should be noted that, since W is arbitrary, the optimal cost J = X m[]p T X m [] can be further minimized by choosing W as W = PT X[] XW + P Wxd x d [], (23) P WW P XW and P WW are the sub-matrices of P 1592

5 34 Minimal-order observer Since some components of X[k] andx xid [k] cannot be directly measured, we introduce the minimal order observer for the state space model of (11) Note that (C ob, A ob ) is detectable from Assumption 2(i) We partition the state equation (11a) as X[k] = x 1 [k + 1] = A 12 x 2 [k], (24) x 2 [k + 1] = A 22 x 2 [k] + B 2 u[k l 1 ], (25) [ x1 [k] x 2 [k] ] = y[k l 2 ] y[k l 2 + 1], y[k 1] x[k] I p I A11 A p A ob = 12 = A 21 A 22, I p C A B1, B ob = = B 2, B We need to estimate x 2 [k] by a minimal-order observer, while x 1 [k] is directly measurable By applying the minimal-order observer theory (eg Th 43 [4]) to (24) and (25), we obtain z[k + 1] = A z z[k] + A z Lx 1 [k] + B 2 u[k l 1 ] (26) ˆx 2 [k] = z[k] + Lx 1 (27) 4 SIMULATION AND EXPERIMENT We perform the experiment based on the system configuration of Fig3 In this experiment, two electric light balls are located at x = [m], z = 1[m], and y =, 1[m], respectively Either one of the light balls is turned on, and the other is turned off The bright light ball is the target object The switching times of the light balls are [s] and 15[s] Table2 shows the specifications of the drone used in this experiment The sampling period is set to Δt = 1/3[s], which is equal to the frame rate of the built-in camera The system parameter values are summarized in Table3 These values are obtained by direct measurement, or by system identification The drone is stabilized in the x- and z-directions to x = 2[m] and z = 1[m] by the other decoupled controllers For the LQ regulator and observer design, we choose Q w = 1, R = 3, γ = 86 so that the overshoot is less than 25[%] and the settling time is less than 1[s] Table 2 Specification of the drone model size mass constraint of input power sensor AR Drone 2 (Parrot) 515[cm] 52[cm] 472 [g] 15[rad] Brushless motor 35,[rpm] HD camera 72p 3[fps] Ultrasonic sensor Altimeter Gyro sensor Table 3 system parameter Inertia moment I x = 33, I y = 33, I z = 62[kg m 2 ] Time delay L 1 = 133, L 2 = 566 [s] Internal controller a = 12, b = 627, K v = A z A 22 LA 12, and the state estimate ˆX[k] is given by x1 [k] ˆX[k] = (28) ˆx 2 [k] We design the observer gain L so that the absolute value of every eigenvalue of A z is less γ, theparameter γ (, 1) prescribes the convergence rate of the state estimation errors With the aid of the regional pole placement technique [9], it turns out that such a gain L can be obtained by solving the linear matrix inequality (LMI) described below Proposition 2: For a given constant γ (, 1), assume that there exist a symmetric matrix P L and a matrix Q L satisfying γ 2 P L γq L γq T L γ 2 P L A T 22 P LA 22 A T 12 Q L Q T L A > 12 Then, the absolute values of all the eigenvalues of A z = A 22 LA 12 are less than γ for L = P 1 L Q L Simulation result We perform a numerical simulation to verify the effectiveness of the proposed method for time delay compensation Fig 5 illustrates the following three responses Red line: The LQI optimal controller is designed and applied to the plant model without any time delays (ideal response) Blue line: The LQI optimal controller is designed ignoring the time delays, ie assuming L 1 = L 2 =, and is applied to the plant model with the delays Green line: The proposed servo controller taking account of the delays is applied to the plant model with the time delays It is seen that the proposed controller significantly improves the transient response in comparison with the controller without time delay compensation which has a large overshoot and a long settling time In the experiment applying the controller without time delay compensation, the drone went out of the field of view of the built-in camera because of the large overshoot, and failed to track the target object

6 position[m] 1 5 w/o delay compensation ideal response with delay compensation reference time[s] Fig 5 Simulation result 42 Experimental result Fig6 shows the experimental result of the proposed controller with time delay compensation position[m] angle[rad] experiment simulation reference time[s] (a) position (y-axis) experiment simulation time[s] (b) input Fig 6 Experimental result with time delay compensation It is seen from Fig 6(a) that the proposed controller achieves a good transient response close to the simulation result, though the output is slightly oscillating This oscillationiscausedbydisturbancesdue toairflow and/or neglected nonlinear dynamics As observed from Fig 6(b), the control input is saturated when the reference position is switched, and this cause the overshoot in the output We need to compensate the input saturation in order to reduce the overshoot REFERENCES [1] M-D Hua, T Hamel, P Morin, and C Samson: Introduction to feedback control of underactuated VTOL vehicles: A review of basice control design ideas and principles, IEEE Control Systems Magazine, vol 33, no 1, pp 61-75, 213 [2] T Pobkrut, T Eamsa-ard, and T Kerdcharoen: Sensor drone for aerial odor mapping for agriculture and security services, Proc of 13th ECTI-CON,216 [3] LRG Carrillo, AED López, R Lozano, and C Pégard: Quad Rotorcraft Control: Vision-Based Hovering and Navigation, Springer-Verlag, 213 [4] L Kis and B Lantos, Time-delay extended state estimation and control of a quadrotor helicopter, Proc 2th Mediterranean Conf on Control & Automation (MED212), 212 [5] T Fujinaka and M Araki: Discrete-time optimal control of systems with unilateral time-delays, Automatica, vol 23, no 6, pp , 1987 [6] J Chu: Application of a discrete optimal tracking controller to an industrial elecric heater with pure delays, J Process Control, vol 5, no 1, pp 3-8, 1995 [7] F Liao, K Takaba, and T Katayama: Design of an optimal preview servomechanism for discrete-time systems in a multirate setting, Dynamics of Continuous, Discrete and Impulsive Systems: Series B, vol 1, pp , 23 [8] THagiwara: Introduction to Digital Control, Corona Publishing CoLtd, 1999 (in Japanese) [9] M Chiali, P Gahinet, and P Apkarian: Robust pole placement in LMI regions, IEEE Trans Automat Contr, vol 44, no 12, pp , 1999 [1] L Zaccarian and AR Teel: Modern Anti-windup Synthesis: Control Augmentation for Actuator Saturation, Princeton Univ Press, CONCLUSION We have studied the deign and experiment of the remote tracking control system of the drone via visual feedback To compensate the time delays due to wireless communication and image processing, we have designed the tracking control system by combining the LQI optimal servomechanism and the state augmentation technique The experimental result demonstrates the effectiveness of the proposed method As a future work, we will need to study the control theory for nonlinear time delay systems in order to realize the tracking control of the drone in a broader operating region It also remains to apply anti-wind up control [1] in order to compensate the input saturation as pointed out in the previous section 1594

The PVTOL Aircraft. 2.1 Introduction

The PVTOL Aircraft. 2.1 Introduction 2 The PVTOL Aircraft 2.1 Introduction We introduce in this chapter the well-known Planar Vertical Take-Off and Landing (PVTOL) aircraft problem. The PVTOL represents a challenging nonlinear systems control

More information

Aerial Robotics. Vision-based control for Vertical Take-Off and Landing UAVs. Toulouse, October, 2 nd, Henry de Plinval (Onera - DCSD)

Aerial Robotics. Vision-based control for Vertical Take-Off and Landing UAVs. Toulouse, October, 2 nd, Henry de Plinval (Onera - DCSD) Aerial Robotics Vision-based control for Vertical Take-Off and Landing UAVs Toulouse, October, 2 nd, 2014 Henry de Plinval (Onera - DCSD) collaborations with P. Morin (UPMC-ISIR), P. Mouyon (Onera), T.

More information

Multi-layer Flight Control Synthesis and Analysis of a Small-scale UAV Helicopter

Multi-layer Flight Control Synthesis and Analysis of a Small-scale UAV Helicopter Multi-layer Flight Control Synthesis and Analysis of a Small-scale UAV Helicopter Ali Karimoddini, Guowei Cai, Ben M. Chen, Hai Lin and Tong H. Lee Graduate School for Integrative Sciences and Engineering,

More information

IMPULSIVE CONTROL OF DISCRETE-TIME NETWORKED SYSTEMS WITH COMMUNICATION DELAYS. Shumei Mu, Tianguang Chu, and Long Wang

IMPULSIVE CONTROL OF DISCRETE-TIME NETWORKED SYSTEMS WITH COMMUNICATION DELAYS. Shumei Mu, Tianguang Chu, and Long Wang IMPULSIVE CONTROL OF DISCRETE-TIME NETWORKED SYSTEMS WITH COMMUNICATION DELAYS Shumei Mu Tianguang Chu and Long Wang Intelligent Control Laboratory Center for Systems and Control Department of Mechanics

More information

Spacecraft Attitude Control with RWs via LPV Control Theory: Comparison of Two Different Methods in One Framework

Spacecraft Attitude Control with RWs via LPV Control Theory: Comparison of Two Different Methods in One Framework Trans. JSASS Aerospace Tech. Japan Vol. 4, No. ists3, pp. Pd_5-Pd_, 6 Spacecraft Attitude Control with RWs via LPV Control Theory: Comparison of Two Different Methods in One Framework y Takahiro SASAKI,),

More information

Nonlinear control of underactuated vehicles with uncertain position measurements and application to visual servoing

Nonlinear control of underactuated vehicles with uncertain position measurements and application to visual servoing Nonlinear control of underactuated vehicles with uncertain position measurements and application to visual servoing Henry de Plinval Pascal Morin Philippe Mouyon Abstract The paper concerns the stabilization

More information

Robot Dynamics - Rotary Wing UAS: Control of a Quadrotor

Robot Dynamics - Rotary Wing UAS: Control of a Quadrotor Robot Dynamics Rotary Wing AS: Control of a Quadrotor 5-85- V Marco Hutter, Roland Siegwart and Thomas Stastny Robot Dynamics - Rotary Wing AS: Control of a Quadrotor 7..6 Contents Rotary Wing AS. Introduction

More information

Intermediate Process Control CHE576 Lecture Notes # 2

Intermediate Process Control CHE576 Lecture Notes # 2 Intermediate Process Control CHE576 Lecture Notes # 2 B. Huang Department of Chemical & Materials Engineering University of Alberta, Edmonton, Alberta, Canada February 4, 2008 2 Chapter 2 Introduction

More information

A Comparison of Closed-Loop Performance of Multirotor Configurations Using Non-Linear Dynamic Inversion Control

A Comparison of Closed-Loop Performance of Multirotor Configurations Using Non-Linear Dynamic Inversion Control Aerospace 2015, 2, 325-352; doi:10.3390/aerospace2020325 OPEN ACCESS aerospace ISSN 2226-4310 www.mdpi.com/journal/aerospace Article A Comparison of Closed-Loop Performance of Multirotor Configurations

More information

COMBINED ADAPTIVE CONTROLLER FOR UAV GUIDANCE

COMBINED ADAPTIVE CONTROLLER FOR UAV GUIDANCE COMBINED ADAPTIVE CONTROLLER FOR UAV GUIDANCE B.R. Andrievsky, A.L. Fradkov Institute for Problems of Mechanical Engineering of Russian Academy of Sciences 61, Bolshoy av., V.O., 199178 Saint Petersburg,

More information

Chapter 2 Review of Linear and Nonlinear Controller Designs

Chapter 2 Review of Linear and Nonlinear Controller Designs Chapter 2 Review of Linear and Nonlinear Controller Designs This Chapter reviews several flight controller designs for unmanned rotorcraft. 1 Flight control systems have been proposed and tested on a wide

More information

Nonlinear Landing Control for Quadrotor UAVs

Nonlinear Landing Control for Quadrotor UAVs Nonlinear Landing Control for Quadrotor UAVs Holger Voos University of Applied Sciences Ravensburg-Weingarten, Mobile Robotics Lab, D-88241 Weingarten Abstract. Quadrotor UAVs are one of the most preferred

More information

Autonomous Mobile Robot Design

Autonomous Mobile Robot Design Autonomous Mobile Robot Design Topic: Guidance and Control Introduction and PID Loops Dr. Kostas Alexis (CSE) Autonomous Robot Challenges How do I control where to go? Autonomous Mobile Robot Design Topic:

More information

Nonlinear Control of a Quadrotor Micro-UAV using Feedback-Linearization

Nonlinear Control of a Quadrotor Micro-UAV using Feedback-Linearization Proceedings of the 2009 IEEE International Conference on Mechatronics. Malaga, Spain, April 2009. Nonlinear Control of a Quadrotor Micro-UAV using Feedback-Linearization Holger Voos University of Applied

More information

4F3 - Predictive Control

4F3 - Predictive Control 4F3 Predictive Control - Lecture 3 p 1/21 4F3 - Predictive Control Lecture 3 - Predictive Control with Constraints Jan Maciejowski jmm@engcamacuk 4F3 Predictive Control - Lecture 3 p 2/21 Constraints on

More information

Control System Design

Control System Design ELEC4410 Control System Design Lecture 19: Feedback from Estimated States and Discrete-Time Control Design Julio H. Braslavsky julio@ee.newcastle.edu.au School of Electrical Engineering and Computer Science

More information

ON CHATTERING-FREE DISCRETE-TIME SLIDING MODE CONTROL DESIGN. Seung-Hi Lee

ON CHATTERING-FREE DISCRETE-TIME SLIDING MODE CONTROL DESIGN. Seung-Hi Lee ON CHATTERING-FREE DISCRETE-TIME SLIDING MODE CONTROL DESIGN Seung-Hi Lee Samsung Advanced Institute of Technology, Suwon, KOREA shl@saitsamsungcokr Abstract: A sliding mode control method is presented

More information

Chapter 4 The Equations of Motion

Chapter 4 The Equations of Motion Chapter 4 The Equations of Motion Flight Mechanics and Control AEM 4303 Bérénice Mettler University of Minnesota Feb. 20-27, 2013 (v. 2/26/13) Bérénice Mettler (University of Minnesota) Chapter 4 The Equations

More information

EL 625 Lecture 10. Pole Placement and Observer Design. ẋ = Ax (1)

EL 625 Lecture 10. Pole Placement and Observer Design. ẋ = Ax (1) EL 625 Lecture 0 EL 625 Lecture 0 Pole Placement and Observer Design Pole Placement Consider the system ẋ Ax () The solution to this system is x(t) e At x(0) (2) If the eigenvalues of A all lie in the

More information

State Regulator. Advanced Control. design of controllers using pole placement and LQ design rules

State Regulator. Advanced Control. design of controllers using pole placement and LQ design rules Advanced Control State Regulator Scope design of controllers using pole placement and LQ design rules Keywords pole placement, optimal control, LQ regulator, weighting matrixes Prerequisites Contact state

More information

D(s) G(s) A control system design definition

D(s) G(s) A control system design definition R E Compensation D(s) U Plant G(s) Y Figure 7. A control system design definition x x x 2 x 2 U 2 s s 7 2 Y Figure 7.2 A block diagram representing Eq. (7.) in control form z U 2 s z Y 4 z 2 s z 2 3 Figure

More information

Nonlinear Robust Tracking Control of a Quadrotor UAV on SE(3)

Nonlinear Robust Tracking Control of a Quadrotor UAV on SE(3) 22 American Control Conference Fairmont Queen Elizabeth Montréal Canada June 27-June 29 22 Nonlinear Robust Tracking Control of a Quadrotor UAV on SE(3) Taeyoung Lee Melvin Leok and N. Harris McClamroch

More information

Simulation of Backstepping-based Nonlinear Control for Quadrotor Helicopter

Simulation of Backstepping-based Nonlinear Control for Quadrotor Helicopter APPLICATIONS OF MODELLING AND SIMULATION http://amsjournal.ams-mss.org eissn 2680-8084 VOL 2, NO. 1, 2018, 34-40 Simulation of Backstepping-based Nonlinear Control for Quadrotor Helicopter M.A.M. Basri*,

More information

Quadrotor Modeling and Control

Quadrotor Modeling and Control 16-311 Introduction to Robotics Guest Lecture on Aerial Robotics Quadrotor Modeling and Control Nathan Michael February 05, 2014 Lecture Outline Modeling: Dynamic model from first principles Propeller

More information

Quadcopter Dynamics 1

Quadcopter Dynamics 1 Quadcopter Dynamics 1 Bréguet Richet Gyroplane No. 1 1907 Brothers Louis Bréguet and Jacques Bréguet Guidance of Professor Charles Richet The first flight demonstration of Gyroplane No. 1 with no control

More information

4F3 - Predictive Control

4F3 - Predictive Control 4F3 Predictive Control - Lecture 2 p 1/23 4F3 - Predictive Control Lecture 2 - Unconstrained Predictive Control Jan Maciejowski jmm@engcamacuk 4F3 Predictive Control - Lecture 2 p 2/23 References Predictive

More information

Nonlinear Tracking Control of Underactuated Surface Vessel

Nonlinear Tracking Control of Underactuated Surface Vessel American Control Conference June -. Portland OR USA FrB. Nonlinear Tracking Control of Underactuated Surface Vessel Wenjie Dong and Yi Guo Abstract We consider in this paper the tracking control problem

More information

Position Control for a Class of Vehicles in SE(3)

Position Control for a Class of Vehicles in SE(3) Position Control for a Class of Vehicles in SE(3) Ashton Roza, Manfredi Maggiore Abstract A hierarchical design framework is presented to control the position of a class of vehicles in SE(3) that are propelled

More information

Mathematical Modelling and Dynamics Analysis of Flat Multirotor Configurations

Mathematical Modelling and Dynamics Analysis of Flat Multirotor Configurations Mathematical Modelling and Dynamics Analysis of Flat Multirotor Configurations DENIS KOTARSKI, Department of Mechanical Engineering, Karlovac University of Applied Sciences, J.J. Strossmayera 9, Karlovac,

More information

Investigation of the Dynamics and Modeling of a Triangular Quadrotor Configuration

Investigation of the Dynamics and Modeling of a Triangular Quadrotor Configuration Investigation of the Dynamics and Modeling of a Triangular Quadrotor Configuration TONI AXELSSON Master s Thesis at Aerospace Engineering Supervisor: Arne Karlsson Examiner: Arne Karlsson ISSN 1651-7660

More information

Visual Servoing for a Quadrotor UAV in Target Tracking Applications. Marinela Georgieva Popova

Visual Servoing for a Quadrotor UAV in Target Tracking Applications. Marinela Georgieva Popova Visual Servoing for a Quadrotor UAV in Target Tracking Applications by Marinela Georgieva Popova A thesis submitted in conformity with the requirements for the degree of Master of Applied Science Graduate

More information

Nonlinear and Neural Network-based Control of a Small Four-Rotor Aerial Robot

Nonlinear and Neural Network-based Control of a Small Four-Rotor Aerial Robot Nonlinear and Neural Network-based Control of a Small Four-Rotor Aerial Robot Holger Voos Abstract Small four-rotor aerial robots, so called quadrotor UAVs, have an enormous potential for all kind of neararea

More information

Adaptive Robust Control (ARC) for an Altitude Control of a Quadrotor Type UAV Carrying an Unknown Payloads

Adaptive Robust Control (ARC) for an Altitude Control of a Quadrotor Type UAV Carrying an Unknown Payloads 2 th International Conference on Control, Automation and Systems Oct. 26-29, 2 in KINTEX, Gyeonggi-do, Korea Adaptive Robust Control (ARC) for an Altitude Control of a Quadrotor Type UAV Carrying an Unknown

More information

Further results on global stabilization of the PVTOL aircraft

Further results on global stabilization of the PVTOL aircraft Further results on global stabilization of the PVTOL aircraft Ahmad Hably, Farid Kendoul 2, Nicolas Marchand, and Pedro Castillo 2 Laboratoire d Automatique de Grenoble, ENSIEG BP 46, 3842 Saint Martin

More information

Adaptive Trim and Trajectory Following for a Tilt-Rotor Tricopter Ahmad Ansari, Anna Prach, and Dennis S. Bernstein

Adaptive Trim and Trajectory Following for a Tilt-Rotor Tricopter Ahmad Ansari, Anna Prach, and Dennis S. Bernstein 7 American Control Conference Sheraton Seattle Hotel May 4 6, 7, Seattle, USA Adaptive Trim and Trajectory Following for a Tilt-Rotor Tricopter Ahmad Ansari, Anna Prach, and Dennis S. Bernstein Abstract

More information

Control Design. Lecture 9: State Feedback and Observers. Two Classes of Control Problems. State Feedback: Problem Formulation

Control Design. Lecture 9: State Feedback and Observers. Two Classes of Control Problems. State Feedback: Problem Formulation Lecture 9: State Feedback and s [IFAC PB Ch 9] State Feedback s Disturbance Estimation & Integral Action Control Design Many factors to consider, for example: Attenuation of load disturbances Reduction

More information

LOW ORDER H CONTROLLER DESIGN: AN LMI APPROACH

LOW ORDER H CONTROLLER DESIGN: AN LMI APPROACH LOW ORDER H CONROLLER DESIGN: AN LMI APPROACH Guisheng Zhai, Shinichi Murao, Naoki Koyama, Masaharu Yoshida Faculty of Systems Engineering, Wakayama University, Wakayama 640-8510, Japan Email: zhai@sys.wakayama-u.ac.jp

More information

Model Identification and Attitude Control Scheme for a Micromechanical Flying Insect

Model Identification and Attitude Control Scheme for a Micromechanical Flying Insect Model Identification and Attitude Control Scheme for a Micromechanical Flying Insect Xinyan Deng, Luca Schenato and Shankar Sastry Department of Electrical Engineering and Computer Sciences University

More information

CONTROL OF ROBOT CAMERA SYSTEM WITH ACTUATOR S DYNAMICS TO TRACK MOVING OBJECT

CONTROL OF ROBOT CAMERA SYSTEM WITH ACTUATOR S DYNAMICS TO TRACK MOVING OBJECT Journal of Computer Science and Cybernetics, V.31, N.3 (2015), 255 265 DOI: 10.15625/1813-9663/31/3/6127 CONTROL OF ROBOT CAMERA SYSTEM WITH ACTUATOR S DYNAMICS TO TRACK MOVING OBJECT NGUYEN TIEN KIEM

More information

LINEAR-QUADRATIC CONTROL OF A TWO-WHEELED ROBOT

LINEAR-QUADRATIC CONTROL OF A TWO-WHEELED ROBOT Доклади на Българската академия на науките Comptes rendus de l Académie bulgare des Sciences Tome 67, No 8, 2014 SCIENCES ET INGENIERIE Automatique et informatique Dedicated to the 145th Anniversary of

More information

QUADROTOR: FULL DYNAMIC MODELING, NONLINEAR SIMULATION AND CONTROL OF ATTITUDES

QUADROTOR: FULL DYNAMIC MODELING, NONLINEAR SIMULATION AND CONTROL OF ATTITUDES QUADROTOR: FULL DYNAMIC MODELING, NONLINEAR SIMULATION AND CONTROL OF ATTITUDES Somayeh Norouzi Ghazbi,a, Ali Akbar Akbari 2,a, Mohammad Reza Gharib 3,a Somaye_noroozi@yahoo.com, 2 Akbari@um.ac.ir, 3 mech_gharib@yahoo.com

More information

High Precision Control of Ball Screw Driven Stage Using Repetitive Control with Sharp Roll-off Learning Filter

High Precision Control of Ball Screw Driven Stage Using Repetitive Control with Sharp Roll-off Learning Filter High Precision Control of Ball Screw Driven Stage Using Repetitive Control with Sharp Roll-off Learning Filter Tadashi Takemura and Hiroshi Fujimoto The University of Tokyo --, Kashiwanoha, Kashiwa, Chiba,

More information

ENHANCED PROPORTIONAL-DERIVATIVE CONTROL OF A MICRO QUADCOPTER

ENHANCED PROPORTIONAL-DERIVATIVE CONTROL OF A MICRO QUADCOPTER ENHANCED PROPORTIONAL-DERIVATIVE CONTROL OF A MICRO QUADCOPTER Norman L. Johnson and Kam K. Leang Department of Mechanical Engineering University of Nevada, Reno Reno, Nevada 897-312, USA ABSTRACT This

More information

Autonomous Helicopter Landing A Nonlinear Output Regulation Perspective

Autonomous Helicopter Landing A Nonlinear Output Regulation Perspective Autonomous Helicopter Landing A Nonlinear Output Regulation Perspective Andrea Serrani Department of Electrical and Computer Engineering Collaborative Center for Control Sciences The Ohio State University

More information

Design and Control of Novel Tri-rotor UAV

Design and Control of Novel Tri-rotor UAV UKACC International Conference on Control Cardiff, UK, -5 September Design and Control of Novel Tri-rotor UAV Mohamed Kara Mohamed School of Electrical and Electronic Engineering The University of Manchester

More information

Regulating Web Tension in Tape Systems with Time-varying Radii

Regulating Web Tension in Tape Systems with Time-varying Radii Regulating Web Tension in Tape Systems with Time-varying Radii Hua Zhong and Lucy Y. Pao Abstract A tape system is time-varying as tape winds from one reel to the other. The variations in reel radii consist

More information

Robust Anti-Windup Compensation for PID Controllers

Robust Anti-Windup Compensation for PID Controllers Robust Anti-Windup Compensation for PID Controllers ADDISON RIOS-BOLIVAR Universidad de Los Andes Av. Tulio Febres, Mérida 511 VENEZUELA FRANCKLIN RIVAS-ECHEVERRIA Universidad de Los Andes Av. Tulio Febres,

More information

Flight control of unmanned helicopters is an area that poses

Flight control of unmanned helicopters is an area that poses F E A T U R E Experimental implementation of linear and nonlinear control laws DIGITAL VISION Stabilization of a Mini Rotorcraft with Four Rotors By Pedro Castillo, Rogelio Lozano, and Alejandro Dzul Flight

More information

CONTROL DESIGN FOR SET POINT TRACKING

CONTROL DESIGN FOR SET POINT TRACKING Chapter 5 CONTROL DESIGN FOR SET POINT TRACKING In this chapter, we extend the pole placement, observer-based output feedback design to solve tracking problems. By tracking we mean that the output is commanded

More information

Linear State Feedback Controller Design

Linear State Feedback Controller Design Assignment For EE5101 - Linear Systems Sem I AY2010/2011 Linear State Feedback Controller Design Phang Swee King A0033585A Email: king@nus.edu.sg NGS/ECE Dept. Faculty of Engineering National University

More information

Hover Control for Helicopter Using Neural Network-Based Model Reference Adaptive Controller

Hover Control for Helicopter Using Neural Network-Based Model Reference Adaptive Controller Vol.13 No.1, 217 مجلد 13 العدد 217 1 Hover Control for Helicopter Using Neural Network-Based Model Reference Adaptive Controller Abdul-Basset A. Al-Hussein Electrical Engineering Department Basrah University

More information

Gain-scheduling Control of a Quadrotor Using the Takagi-Sugeno Approach

Gain-scheduling Control of a Quadrotor Using the Takagi-Sugeno Approach Treball de Fi de Màster Master s degree in Automatic Control and Robotics Gain-scheduling Control of a Quadrotor Using the Takagi-Sugeno Approach MEMÒRIA Autor: Director/s: Convocatòria: Diego Ruiz Paz

More information

Approximate MLD System Model of Switched Linear Systems for Model Predictive Control

Approximate MLD System Model of Switched Linear Systems for Model Predictive Control Special Issue on SICE Annual Conference 2016 SICE Journal of Control Measurement and System Integration Vol. 10 No. 3 pp. 136 140 May 2017 Approximate MLD System Model of Switched Linear Systems for Model

More information

Adaptive Control of a Quadrotor UAV Transporting a Cable-Suspended Load with Unknown Mass

Adaptive Control of a Quadrotor UAV Transporting a Cable-Suspended Load with Unknown Mass rd IEEE Conference on Decision and Control December -7,. Los Angeles, California, USA Adaptive Control of a Quadrotor UAV Transporting a Cable-Suspended Load with Unknown Mass Shicong Dai, Taeyoung Lee,

More information

TTK4190 Guidance and Control Exam Suggested Solution Spring 2011

TTK4190 Guidance and Control Exam Suggested Solution Spring 2011 TTK4190 Guidance and Control Exam Suggested Solution Spring 011 Problem 1 A) The weight and buoyancy of the vehicle can be found as follows: W = mg = 15 9.81 = 16.3 N (1) B = 106 4 ( ) 0.6 3 3 π 9.81 =

More information

EEE 188: Digital Control Systems

EEE 188: Digital Control Systems EEE 88: Digital Control Systems Lecture summary # the controlled variable. Example: cruise control. In feedback control, sensors and measurements play an important role. In discrete time systems, the control

More information

Stabilization of discrete-time linear systems with saturating actuators using sliding modes: application to a twin-rotor system

Stabilization of discrete-time linear systems with saturating actuators using sliding modes: application to a twin-rotor system 2011 50th IEEE Conference on Decision and Control and European Control Conference (CDC-ECC) Orlando, FL, USA, December 12-15, 2011 1 Stabilization of discrete-time linear systems with saturating actuators

More information

Spectral factorization and H 2 -model following

Spectral factorization and H 2 -model following Spectral factorization and H 2 -model following Fabio Morbidi Department of Mechanical Engineering, Northwestern University, Evanston, IL, USA MTNS - July 5-9, 2010 F. Morbidi (Northwestern Univ.) MTNS

More information

Exam - TTK 4190 Guidance & Control Eksamen - TTK 4190 Fartøysstyring

Exam - TTK 4190 Guidance & Control Eksamen - TTK 4190 Fartøysstyring Page 1 of 6 Norges teknisk- naturvitenskapelige universitet Institutt for teknisk kybernetikk Faglig kontakt / contact person: Navn: Morten Pedersen, Universitetslektor Tlf.: 41602135 Exam - TTK 4190 Guidance

More information

Robot Control Basics CS 685

Robot Control Basics CS 685 Robot Control Basics CS 685 Control basics Use some concepts from control theory to understand and learn how to control robots Control Theory general field studies control and understanding of behavior

More information

System Types in Feedback Control with Saturating Actuators

System Types in Feedback Control with Saturating Actuators System Types in Feedback Control with Saturating Actuators Yongsoon Eun, Pierre T. Kabamba, and Semyon M. Meerkov Department of Electrical Engineering and Computer Science, University of Michigan, Ann

More information

CONSTRAINED MODEL PREDICTIVE CONTROL ON CONVEX POLYHEDRON STOCHASTIC LINEAR PARAMETER VARYING SYSTEMS. Received October 2012; revised February 2013

CONSTRAINED MODEL PREDICTIVE CONTROL ON CONVEX POLYHEDRON STOCHASTIC LINEAR PARAMETER VARYING SYSTEMS. Received October 2012; revised February 2013 International Journal of Innovative Computing, Information and Control ICIC International c 2013 ISSN 1349-4198 Volume 9, Number 10, October 2013 pp 4193 4204 CONSTRAINED MODEL PREDICTIVE CONTROL ON CONVEX

More information

A Comparative Analysis of Repetitive and Resonant Controllers to a Servo-Vision Ball and Plate System

A Comparative Analysis of Repetitive and Resonant Controllers to a Servo-Vision Ball and Plate System Preprints of the 19th World Congress The International Federation of Automatic Control A Comparative Analysis of Repetitive and Resonant Controllers to a Servo-Vision Ball and Plate System Rafael da Silveira

More information

Temperature Control of a Mold Model using Multiple-input Multiple-output Two Degree-of-freedom Generalized Predictive Control

Temperature Control of a Mold Model using Multiple-input Multiple-output Two Degree-of-freedom Generalized Predictive Control Temperature Control of a Mold Model using Multiple-input Multiple-output Two Degree-of-freedom Generalized Predictive Control Naoki Hosoya, Akira Yanou, Mamoru Minami and Takayuki Matsuno Graduate School

More information

Triple Tilting Rotor mini-uav: Modeling and Embedded Control of the Attitude

Triple Tilting Rotor mini-uav: Modeling and Embedded Control of the Attitude 28 American Control Conference Westin Seattle Hotel, Seattle, Washington, USA June -3, 28 ThC6.4 Triple Tilting Rotor mini-uav: Modeling and Embedded Control of the Attitude J. Escareño, A. Sanchez, O.

More information

OPTIMAL TRAJECTORY PLANNING AND LQR CONTROL FOR A QUADROTOR UAV. Ian D. Cowling James F. Whidborne Alastair K. Cooke

OPTIMAL TRAJECTORY PLANNING AND LQR CONTROL FOR A QUADROTOR UAV. Ian D. Cowling James F. Whidborne Alastair K. Cooke OPTIMAL TRAJECTORY PLANNING AND LQR CONTROL FOR A QUADROTOR UAV Ian D. Cowling James F. Whidborne Alastair K. Cooke Department of Aerospace Sciences, Cranfield University, Bedfordshire, MK43 AL, U.K Abstract:

More information

Robust Anti-Windup Controller Synthesis: A Mixed H 2 /H Setting

Robust Anti-Windup Controller Synthesis: A Mixed H 2 /H Setting Robust Anti-Windup Controller Synthesis: A Mixed H /H Setting ADDISON RIOS-BOLIVAR Departamento de Sistemas de Control Universidad de Los Andes Av. ulio Febres, Mérida 511 VENEZUELA SOLBEN GODOY Postgrado

More information

Control Systems Lab - SC4070 Control techniques

Control Systems Lab - SC4070 Control techniques Control Systems Lab - SC4070 Control techniques Dr. Manuel Mazo Jr. Delft Center for Systems and Control (TU Delft) m.mazo@tudelft.nl Tel.:015-2788131 TU Delft, February 16, 2015 (slides modified from

More information

Dynamic Modeling and Stabilization Techniques for Tri-Rotor Unmanned Aerial Vehicles

Dynamic Modeling and Stabilization Techniques for Tri-Rotor Unmanned Aerial Vehicles Technical Paper Int l J. of Aeronautical & Space Sci. 11(3), 167 174 (010) DOI:10.5139/IJASS.010.11.3.167 Dynamic Modeling and Stabilization Techniques for Tri-Rotor Unmanned Aerial Vehicles Dong-Wan Yoo*,

More information

Control of a Quadrotor Mini-Helicopter via Full State Backstepping Technique

Control of a Quadrotor Mini-Helicopter via Full State Backstepping Technique Proceedings of the 45th IEEE Conference on Decision & Control Manchester Grand Hyatt Hotel San Diego, CA, USA, December 3-5, 006 Control of a Quadrotor Mini-Helicopter via Full State Backstepping Technique

More information

4F3 - Predictive Control

4F3 - Predictive Control 4F3 Predictive Control - Discrete-time systems p. 1/30 4F3 - Predictive Control Discrete-time State Space Control Theory For reference only Jan Maciejowski jmm@eng.cam.ac.uk 4F3 Predictive Control - Discrete-time

More information

Eigenstructure Assignment for Helicopter Hover Control

Eigenstructure Assignment for Helicopter Hover Control Proceedings of the 17th World Congress The International Federation of Automatic Control Eigenstructure Assignment for Helicopter Hover Control Andrew Pomfret Stuart Griffin Tim Clarke Department of Electronics,

More information

Nonlinear Model Predictive Control for Unmanned Aerial Vehicles

Nonlinear Model Predictive Control for Unmanned Aerial Vehicles aerospace Article Nonlinear Model Predictive Control for Unmanned Aerial Vehicles Pengkai Ru and Kamesh Subbarao *, Department of Mechanical & Aerospace Engineering, University of Texas at Arlington, Arlington,

More information

Rotational Motion Control Design for Cart-Pendulum System with Lebesgue Sampling

Rotational Motion Control Design for Cart-Pendulum System with Lebesgue Sampling American Control Conference on O'Farrell Street, San Francisco, CA, USA June 9 - July, Rotational Motion Control Design for Cart-Pendulum System with Lebesgue Sampling Hiroshi Ohsaki, Masami Iwase and

More information

MAE 142 Homework #5 Due Friday, March 13, 2009

MAE 142 Homework #5 Due Friday, March 13, 2009 MAE 142 Homework #5 Due Friday, March 13, 2009 Please read through the entire homework set before beginning. Also, please label clearly your answers and summarize your findings as concisely as possible.

More information

EMBEDDED CONTROLLER BUILDING FOR BALL AND BEAM SYSTEM USING OPTIMAL CONTROL SYNTHESIS

EMBEDDED CONTROLLER BUILDING FOR BALL AND BEAM SYSTEM USING OPTIMAL CONTROL SYNTHESIS Journal of Engineering Science and Technology Vol. 12, No. 6 (2017) 1460-1474 School of Engineering, Taylor s University EMBEDDED CONTROLLER BUILDING FOR BALL AND BEAM SYSTEM USING OPTIMAL CONTROL SYNTHESIS

More information

Underactuated Dynamic Positioning of a Ship Experimental Results

Underactuated Dynamic Positioning of a Ship Experimental Results 856 IEEE TRANSACTIONS ON CONTROL SYSTEMS TECHNOLOGY, VOL. 8, NO. 5, SEPTEMBER 2000 Underactuated Dynamic Positioning of a Ship Experimental Results Kristin Y. Pettersen and Thor I. Fossen Abstract The

More information

Multi-Model Adaptive Regulation for a Family of Systems Containing Different Zero Structures

Multi-Model Adaptive Regulation for a Family of Systems Containing Different Zero Structures Preprints of the 19th World Congress The International Federation of Automatic Control Multi-Model Adaptive Regulation for a Family of Systems Containing Different Zero Structures Eric Peterson Harry G.

More information

SUCCESSIVE POLE SHIFTING USING SAMPLED-DATA LQ REGULATORS. Sigeru Omatu

SUCCESSIVE POLE SHIFTING USING SAMPLED-DATA LQ REGULATORS. Sigeru Omatu SUCCESSIVE POLE SHIFING USING SAMPLED-DAA LQ REGULAORS oru Fujinaka Sigeru Omatu Graduate School of Engineering, Osaka Prefecture University, 1-1 Gakuen-cho, Sakai, 599-8531 Japan Abstract: Design of sampled-data

More information

Research Article Stabilization Analysis and Synthesis of Discrete-Time Descriptor Markov Jump Systems with Partially Unknown Transition Probabilities

Research Article Stabilization Analysis and Synthesis of Discrete-Time Descriptor Markov Jump Systems with Partially Unknown Transition Probabilities Research Journal of Applied Sciences, Engineering and Technology 7(4): 728-734, 214 DOI:1.1926/rjaset.7.39 ISSN: 24-7459; e-issn: 24-7467 214 Maxwell Scientific Publication Corp. Submitted: February 25,

More information

A Model-Free Control System Based on the Sliding Mode Control Method with Applications to Multi-Input-Multi-Output Systems

A Model-Free Control System Based on the Sliding Mode Control Method with Applications to Multi-Input-Multi-Output Systems Proceedings of the 4 th International Conference of Control, Dynamic Systems, and Robotics (CDSR'17) Toronto, Canada August 21 23, 2017 Paper No. 119 DOI: 10.11159/cdsr17.119 A Model-Free Control System

More information

Optimal Polynomial Control for Discrete-Time Systems

Optimal Polynomial Control for Discrete-Time Systems 1 Optimal Polynomial Control for Discrete-Time Systems Prof Guy Beale Electrical and Computer Engineering Department George Mason University Fairfax, Virginia Correspondence concerning this paper should

More information

Cross-Coupling Control for Slippage Minimization of a Four-Wheel-Steering Mobile Robot

Cross-Coupling Control for Slippage Minimization of a Four-Wheel-Steering Mobile Robot Cross-Coupling Control for Slippage Minimization of a Four-Wheel-Steering Mobile Robot Maxim Makatchev Dept. of Manufacturing Engineering and Engineering Management City University of Hong Kong Hong Kong

More information

Position Control Using Acceleration- Based Identification and Feedback With Unknown Measurement Bias

Position Control Using Acceleration- Based Identification and Feedback With Unknown Measurement Bias Position Control Using Acceleration- Based Identification and Feedback With Unknown Measurement Bias Jaganath Chandrasekar e-mail: jchandra@umich.edu Dennis S. Bernstein e-mail: dsbaero@umich.edu Department

More information

Output Regulation of Uncertain Nonlinear Systems with Nonlinear Exosystems

Output Regulation of Uncertain Nonlinear Systems with Nonlinear Exosystems Output Regulation of Uncertain Nonlinear Systems with Nonlinear Exosystems Zhengtao Ding Manchester School of Engineering, University of Manchester Oxford Road, Manchester M3 9PL, United Kingdom zhengtaoding@manacuk

More information

Adaptive position tracking of VTOL UAVs

Adaptive position tracking of VTOL UAVs Joint 48th IEEE Conference on Decision and Control and 8th Chinese Control Conference Shanghai, P.R. China, December 16-18, 009 Adaptive position tracking of VTOL UAVs Andrew Roberts and Abdelhamid Tayebi

More information

Design and modelling of an airship station holding controller for low cost satellite operations

Design and modelling of an airship station holding controller for low cost satellite operations AIAA Guidance, Navigation, and Control Conference and Exhibit 15-18 August 25, San Francisco, California AIAA 25-62 Design and modelling of an airship station holding controller for low cost satellite

More information

Digital Passive Attitude and Altitude Control Schemes for Quadrotor Aircraft

Digital Passive Attitude and Altitude Control Schemes for Quadrotor Aircraft Institute for Software Integrated Systems Vanderbilt University Nashville, Tennessee, 37235 Digital Passive Attitude and Altitude Control Schemes for Quadrotor Aircraft Nicholas Kottenstette, and Joseph

More information

CONTROL OF TRMS AND MODELLING USING LPV

CONTROL OF TRMS AND MODELLING USING LPV Volume: 03 Issue: 08 Aug-2016 www.irjet.net p-issn: 2395-0072 CONTROL OF TRMS AND MODELLING USING LPV G.VINAY KUMAR, Dr.G.V.SIVA KRISHNA RAO 1PG Student, A.U. College of Engineering (A), Dept. Electrical

More information

Funnel control in mechatronics: An overview

Funnel control in mechatronics: An overview Funnel control in mechatronics: An overview Position funnel control of stiff industrial servo-systems C.M. Hackl 1, A.G. Hofmann 2 and R.M. Kennel 1 1 Institute for Electrical Drive Systems and Power Electronics

More information

1 x(k +1)=(Φ LH) x(k) = T 1 x 2 (k) x1 (0) 1 T x 2(0) T x 1 (0) x 2 (0) x(1) = x(2) = x(3) =

1 x(k +1)=(Φ LH) x(k) = T 1 x 2 (k) x1 (0) 1 T x 2(0) T x 1 (0) x 2 (0) x(1) = x(2) = x(3) = 567 This is often referred to as Þnite settling time or deadbeat design because the dynamics will settle in a Þnite number of sample periods. This estimator always drives the error to zero in time 2T or

More information

Automatic Control II Computer exercise 3. LQG Design

Automatic Control II Computer exercise 3. LQG Design Uppsala University Information Technology Systems and Control HN,FS,KN 2000-10 Last revised by HR August 16, 2017 Automatic Control II Computer exercise 3 LQG Design Preparations: Read Chapters 5 and 9

More information

Fast Seek Control for Flexible Disk Drive Systems

Fast Seek Control for Flexible Disk Drive Systems Fast Seek Control for Flexible Disk Drive Systems with Back EMF and Inductance Chanat La-orpacharapan and Lucy Y. Pao Department of Electrical and Computer Engineering niversity of Colorado, Boulder, CO

More information

EECS C128/ ME C134 Final Wed. Dec. 15, am. Closed book. Two pages of formula sheets. No calculators.

EECS C128/ ME C134 Final Wed. Dec. 15, am. Closed book. Two pages of formula sheets. No calculators. Name: SID: EECS C28/ ME C34 Final Wed. Dec. 5, 2 8- am Closed book. Two pages of formula sheets. No calculators. There are 8 problems worth points total. Problem Points Score 2 2 6 3 4 4 5 6 6 7 8 2 Total

More information

CBE507 LECTURE III Controller Design Using State-space Methods. Professor Dae Ryook Yang

CBE507 LECTURE III Controller Design Using State-space Methods. Professor Dae Ryook Yang CBE507 LECTURE III Controller Design Using State-space Methods Professor Dae Ryook Yang Fall 2013 Dept. of Chemical and Biological Engineering Korea University Korea University III -1 Overview States What

More information

Reverse Order Swing-up Control of Serial Double Inverted Pendulums

Reverse Order Swing-up Control of Serial Double Inverted Pendulums Reverse Order Swing-up Control of Serial Double Inverted Pendulums T.Henmi, M.Deng, A.Inoue, N.Ueki and Y.Hirashima Okayama University, 3-1-1, Tsushima-Naka, Okayama, Japan inoue@suri.sys.okayama-u.ac.jp

More information

WEIGHTING MATRICES DETERMINATION USING POLE PLACEMENT FOR TRACKING MANEUVERS

WEIGHTING MATRICES DETERMINATION USING POLE PLACEMENT FOR TRACKING MANEUVERS U.P.B. Sci. Bull., Series D, Vol. 75, Iss. 2, 2013 ISSN 1454-2358 WEIGHTING MATRICES DETERMINATION USING POLE PLACEMENT FOR TRACKING MANEUVERS Raluca M. STEFANESCU 1, Claudiu L. PRIOROC 2, Adrian M. STOICA

More information

Quadrotors Flight Formation Control Using a Leader-Follower Approach*

Quadrotors Flight Formation Control Using a Leader-Follower Approach* 23 European Conference (ECC) July 7-9, 23, Zürich, Switzerland. Quadrotors Flight Formation Using a Leader-Follower Approach* D. A. Mercado, R. Castro and R. Lozano 2 Abstract In this paper it is presented

More information

Module 9: State Feedback Control Design Lecture Note 1

Module 9: State Feedback Control Design Lecture Note 1 Module 9: State Feedback Control Design Lecture Note 1 The design techniques described in the preceding lectures are based on the transfer function of a system. In this lecture we would discuss the state

More information

On Separation Principle for a Class of Networked Control Systems

On Separation Principle for a Class of Networked Control Systems On Separation Principle for a Class of Networked Control Systems Dongxiao Wu Jun Wu and Sheng Chen Abstract In this contribution we investigate a class of observer-based discrete-time networked control

More information