Neural Networks Lecture 10: Fault Detection and Isolation (FDI) Using Neural Networks

Size: px
Start display at page:

Download "Neural Networks Lecture 10: Fault Detection and Isolation (FDI) Using Neural Networks"

Transcription

1 Neural Networks Lecture 10: Fault Detection and Isolation (FDI) Using Neural Networks H.A. Talebi Farzaneh Abdollahi Department of Electrical Engineering Amirkabir University of Technology Winter A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 1/37

2 An Actuator Additive FDI [1] Example:FDI on Robotic Manipulation An Actuator Gain FDI [1] Example Flexible Joint Manipulator A Sensor and Actuator FDI [1] Example of Satellite Attitude Control H. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 2/37

3 Additive FDI Consider the nonlinear dynamics: ẋ = f (x, u) + N 1 (x, u) + T F (x, u, t) (1) f : known nonlinear fcn. N 1 (x, u): Unmodeled dynamics and uncertainties of nominal model (fault free), estimated by NN1 TF (x, u, t): vector valued fcn. of unknown actuator fault Objective: Diagnose and Isolate Actuator Fault: (T F ) By defining a Hurwitz matrix A, (1) can be rewritten ẋ = Ax + g(x, u) + N 1 (x, u) + T F (x, u, t) g(x, u) = f (x, u) Ax M(s) = (si A) 1. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 3/37

4 Additive FDI H. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 4/37

5 NN2 T f is estimated by NN 2 : ˆTf (x, Ŵ, ˆV, t) = Ŵ σ( ˆV x) A three layer MLP Series Parallel identifier The estimated model ˆx = Aˆx + g(x, u) + N 1 (x, u) + Ŵ σ( ˆV x) It has been shown that by updating the weights of NN 2 : Ŵ = η 1 ( J ) ρ Ŵ 1 x Ŵ ˆV = η 2 ( J ˆV ) ρ 2 x ˆV x = x ˆx J = 1 2 ( x T x): objective fcn to be minimized then x, W = W Ŵ, Ṽ = V ˆV are ultimately bounded The main advantage of the given approach: fault detection and Isolation is provided in a unified fashion. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 5/37

6 Example:FDI on Robotic Manipulation Dynamic of a robot manipulator M(q) q + C(q, q) + G(q) = τ + τ F q: manipulator joints position q: joint velocity τ: applied torque τf : unknown fault Based[ on the defined ] model: [ 0 T f = M 1 ; f (x, u) = τ F q M 1 (q)(τ C(q, q) + G(q) + τ F ) ]. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 6/37

7 Experimental Results on Puma 560 H. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 7/37

8 Example Puma 560 It has 6 joints The unmodelled dynamics (for Ex. friction in joint which are not modeled precisely) are estimated by N 1 The modified fault free description of Puma: M(q) q + C(q, q) + G(q) + N 1 (q, q, τ) = τ Define θ = q At this stage, a PD controller is considered to control the robots behavior: τ C = K p (θ ref θ) + K v ( θ ref θ) + G Desired position: θ ref = θ H + 0.3sin(t) θ H = [0 π/2 π/ ]. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 8/37

9 Fault Free Experimental Results (a)-(c) joint positions; (d)-(f) Joint velocities. Solid lines: actual measurements; Dashed lines: their estimates.. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 9/37

10 Faulty Experimental Results Consider a constant actuator fault 5Nm in the first three joints: τ F = [ ] Estimate τ F by NN2: a three layer NN input layers: 12 neurons (θ, θ) hidden layer 10 neurons output layer 6 neurons ˆτ F. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 10/37

11 The outputs of the neural network estimating the faults H. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 11/37

12 Experimental Results with 5 Nm fault (a)-(c) Joint positions (d)-(f)joint velocities. Solid lines: actual measurements Dashed lines:their estimates. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 12/37

13 An Actuator Gain FDI [1] Consider the nonlinear fault free dynamics: ẋ = f (x, u) + η x (x, u, t) (2) y(t) = Cx(t) + η y (x, u, t) u R m : input; x R n : state;y R m : output f : known nonlinear fcn. η x (x, u, t) R n R m R R n : Plant unmodeled dynamics and noise η y (x, u, t) R n R m R R m : Sensor unmodeled dynamics and disturbances C: an m n conts. matrix Assume a multiplicative actuator fault occur: u(t) u f (t) = T A (x, u, t)u(t) TA (x, u, t) = diag{t Ai (x, u, t)}, i = 1,..., m unknown matrix. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 13/37

14 An Actuator Gain FDI The faulty dynamics: ẋ = f (x, u f ) + η x (x, u, t) (3) y(t) = Cx(t) + η y (x, u, t) Objective: Diagnose and Isolate Actuator Fault: (T F ) By defining a Hurwitz matrix A, (3) can be rewritten ẋ = Ax + g(x, u f ) + η x (x, u, t) y(t) = Cx(t) + η y (x, u, t) g(x, u) = f (x, u) Ax M(s) = (si A) 1. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 14/37

15 An Actuator Gain FDI H. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 15/37

16 An Actuator Gain FDI The following assumptions should be made to facilitate the FDI design The nonlinear sys (3) is observable The nominal closed loop sys is asym. stable (ẋ = f (x, k(cx))) η x, η y are uniformly bounded η x η x, η y η y [ ] x ˆx g is Lipshtiz in x and u: g(x, u) g(ˆx, û) lg u û T f is estimated by NN 1 : ˆT f (x, Ŵ, ˆV, t) = Ŵ σ( ˆV x) A three layer MLP The estimated model ẋ = Aˆx + g(ˆx, û f ) ŷ(t) = C ˆx û f = Ŵ σ( ˆV x)u. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 16/37

17 An Actuator Gain FDI It has been shown that by updating the weights of NN 1 : Ŵ = η 1 ( J Ŵ ) ρ 1 ỹ Ŵ ˆV = η 2 ( J ˆV ) ρ 2 ỹ ˆV x = x ˆx ỹ = y ŷ W = W Ŵ Ṽ = V ˆV J = 1 2 (ỹ T ỹ): objective fcn to be minimized then x, ỹ, W, Ṽ are ultimately bounded This FDI can diagnose and isloate simultaneous fault. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 17/37

18 Example of Flexible Joint Manipulator [?] The dynamical model: D l (q 1 ) q 1 + C 1 (q 1, q 1 ) + g(q 1 ) + B 1 q 1 = τ s J q 2 + τ s + B 2 q 2 = τ q2 R n : motor shaft position g(q 1 ) R n : gravity force C 1 (q 1, q 1 ) R n : centrifugal and Coriolis force B1 R n n, B 2 R n n : viscus damping of input and output shaft D1 (q 1 ) R n n, J R n n robot and actuator inertia matrix τ input torque τ s = K(q 2 q 1 ) + β(q 1, q 2, q 1, q 2 ): reaction torque from rotational spring K: stiffness matrix of rotational spring represent the flexibility between the input and output shaft β(q1, q 2, q 1, q 2 ): a combination of nonlinear spring and friction at output shafts of the manipulator The output vector y = [q21 q 22 q 21 q 22 ] T. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 18/37 q1 R n : link position

19 Numerical Data of Two Link Flexible Joint Manipulator J = diag{1.16, 1.16}, m = diag{1, 1} l 1 = l 2 = 1m, K = diag{100, 100}, η = 0.3, ρ 1 = ρ 2 = A = 2I 8 A PD controller is used to stabilize the open-loop system β is uncertainty in dynamics and unknown Sensory measurement is corrupted with a 10% Gaussian noise The NN FDI: A Three layer NN 10 neurons in input layer; 10 neurons in hidden layer; 2 neurons in output layer ( faults in actuator τ 1 and τ 2 The actuator { fault in both joints: diag{ } t [ ]secs T A = diag{1 1} otherwise. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 19/37

20 Example Flexible Joint Manipulator (a) angular velocities of the first link (b) angular velocity of the second link Red lines: real signals; Blue lines: the estimated signals by NN. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 20/37

21 (a) Estimated fault in the first actuator (b) Estimated fault in the second actuator (c) Estimated fault in the first actuator; a closer look (d) Estimated fault in the second actuator; a closer look. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 21/37

22 A Sensor and Actuator FDI [1] Consider the nonlinear dynamics: ẋ = f (x, u) + η x (x, u, t) + T A (x, u) (4) y(t) = Cx(t) + η y (x, u, t) + T s (x, u) u R m : input; x R n : state;y R m : output f : known nonlinear fcn. η x (x, u, t) R n R m R R n : Plant unmodeled dynamics and noise ηy (x, u, t) R n R m R R m : Sensor unmodeled dynamics and disturbances C: an m n conts. matrix T s R n R m R m : unknown sensor fault T A R n R m R n : unknown actuator fault. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 22/37

23 A Sensor and Actuator FDI Objective: Diagnose and Isolate Actuator and Sensor Faults: (T A, T S ) By defining a Hurwitz matrix A, (4) can be rewritten ẋ = Ax + g(x, u) + η x (x, u, t) + T A (x, u) y(t) = Cx(t) + η y (x, u, t) + T s (x, u) g(x, u) = f (x, u) Ax M(s) = (si A) 1. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 23/37

24 A Sensor and Actuator FDI. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 24/37

25 A Sensor and Actuator FDI The following assumptions should be made Sensor and actuator fault will not occur simultaneously The nonlinear sys (4) is observable The nominal closed loop sys is asym. stable (ẋ = f (x, k(cx))) η x, η y are uniformly bounded η x η x, η y η y g is Lipshtiz in x: g(x, u) g(ˆx, u) l g x ˆx T A is estimated by NN 1 and T S is estimated by NN 2 : ˆT A (ˆx, Ŵ 1, ˆV 1, t) = Ŵ 1 σ( ˆV 1 ˆx) ˆT S (ˆx, Ŵ2, ˆV 2, t) = Ŵ2σ( ˆV 2 ˆx) Each is a three layer MLP The estimated model ˆx = Aˆx + g(ˆx, u) + Ŵ 1 σ( ˆV 1 ˆx) ŷ(t) = C ˆx + Ŵ 2 σ( ˆV 2 ˆx). A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 25/37

26 A Sensor and Actuator FDI It has been shown that by updating the weights of NN 1 and NN 2 : Ŵ 1 = η 1 ( J ) ρ 1 ỹ Ŵ 1 Ŵ1 ˆV 1 = η 2 ( J ˆV ) ρ 2 ỹ ˆV 1 1 Ŵ 2 = η 3 ( J ) ρ Ŵ 3 ỹ Ŵ2 2 ˆV 3 = η 4 ( J ) ρ ˆV 4 ỹ ˆV 4 3 x = x ˆx ỹ = y ŷ Wi = W i Ŵi, i = 1, 2 Ṽ i = V i ˆV i, i = 1, 2 J = 1 2 (ỹ T ỹ): objective fcn to be minimized then x, ỹ, W i, Ṽ i, i = 1, 2 are ultimately bounded. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 26/37

27 Example of Satellite Attitude Control Dynamical equation of satellite attitude model with magnetorquer actuator H ω = S(ω)Hω + BM ω = [ω 1 ω 2 ω 3 ] T : angular velocity of satellite 0 B z (t) B y (t) B(t) = B z (t) 0 B x (t) : magnetic field matrix B y (t) B x (t) 0 H: Symmetric P.D. inertia matrix S(ω) = 0 ω 3 ω 2 ω 3 0 ω 1 : cross product matrix ω 2 ω 1 0 M: magnetic dipole of the coil. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 27/37

28 Example of Satellite Attitude Control To define it in standard state space representation: u = M; f (x, u) = H 1 (B(t)u S(ω)Hω); x = ω the unmodeled dynamics: η x = H 1 (B(t) B)u; B = 1 T T 0 B(t)dt Magnetorquer fault (actuator fault) is considered as an additive term τ a : ẋ = f (x, u) + η x +T A ; T A = H 1 τ a Magnetometer fault (sensor fault): B m = B + EB + B + ν Bm : measured magnetic field B: true magnetic field B: magnetic bias ν measurement noise E = 0 E z E y E z 0 E x : magnetormeter misalignment matrix E y E x 0 any fault or misalignment can be considered as uncertainty vector ηy or additive fault T S. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 28/37

29 Numerical Data of φrsted Satellite H = kg.m 2 All sensory measurements are assumed to be corrupted with 10% Gaussian noise The actuator fault is estimated by NN 1 and sensor fault by NN 2. They have: 3 layers 6 neurons in input layer; 5 neurons in hidden layer with sigmoidal activation fcn; 3 neurons in output layer with linear activation fcn. η1 = η 2 = 20; η 3 = η 4 = 0.1; ρ i = 1e 6, i = 1, 2, 3, 4 A = 2I 3 ˆTA = [ ˆT A1 ˆTA2 ˆTA3 ] T : output of NN 1 ˆTS = [ ˆT S1 ˆTS2 ] T : output of NN 2. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 29/37

30 Example of Satellite Attitude Control Note that: the output of the networks do not approach to zero due to presence of η y and η x Therefore a threshold should be considered for fault detection The threshold can be chosen by by adaptive, fuzzy or...approached In this simulation it has been chosen by trial and error A fault is detected if: ˆT Ai > th ai, i = 1,..., 3 (actuator fault) ˆT Si > th si, i = 1,..., 2 (sensor fault) t [t f, t f + t r ] th ai = [ ] threshold of i th actuator th si = [ ] threshold of i th sensor tr = 30sec.. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 30/37

31 Fault Free angular velocities, trajectory: 0.1sin(0.001t) Solid lines: actual velocities Dashed lines: Estimated velocities H. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 31/37

32 NN 1 and NN 2 responses to fault free operation Solid lines: estimated faults; Dashed lines: thresholds (a)-(c): Estimated actuator faults (d)-(e): Estimate sensor faults H. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 32/37

33 Angular velocities with bias fault: T A = [ ] T Solid lines: actual velocities Dashed lines: Estimated velocities H. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 33/37

34 NN 1 and NN 2 responses to bias fault: T A = [ ] T Solid lines: estimated faults; Dashed lines: thresholds (a)-(c): Estimated actuator faults (d)-(e): Estimate sensor faults H. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 34/37

35 NN 1 and NN 2 responses; traj: 0.1rad/s, fault: T S = [ ] T Solid lines: estimated faults; Dashed lines: thresholds (a)-(c): Estimated actuator faults (d)-(e): Estimate sensor faults H. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 35/37

36 NN 1 and NN 2 responses; traj: 0.1sin(0.001t), fault free, with sensor and state uncertainties Solid lines: estimated faults; Dashed lines: thresholds (a)-(c): Estimated actuator faults (d)-(e): Estimate sensor faults H. A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 36/37

37 References H.A.Talebi, F. Abdollahi, R.V.Patel, and K.Khorasani, Neural Network-Based State Estimation of Nonlinear Systems: Application to Fault Detection and Isolation. Springer, A. Talebi, Farzaneh Abdollahi Neural Networks Lecture 10 37/37

Introduction to Control (034040) lecture no. 2

Introduction to Control (034040) lecture no. 2 Introduction to Control (034040) lecture no. 2 Leonid Mirkin Faculty of Mechanical Engineering Technion IIT Setup: Abstract control problem to begin with y P(s) u where P is a plant u is a control signal

More information

Real-time Motion Control of a Nonholonomic Mobile Robot with Unknown Dynamics

Real-time Motion Control of a Nonholonomic Mobile Robot with Unknown Dynamics Real-time Motion Control of a Nonholonomic Mobile Robot with Unknown Dynamics TIEMIN HU and SIMON X. YANG ARIS (Advanced Robotics & Intelligent Systems) Lab School of Engineering, University of Guelph

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

ECEN 420 LINEAR CONTROL SYSTEMS. Lecture 6 Mathematical Representation of Physical Systems II 1/67

ECEN 420 LINEAR CONTROL SYSTEMS. Lecture 6 Mathematical Representation of Physical Systems II 1/67 1/67 ECEN 420 LINEAR CONTROL SYSTEMS Lecture 6 Mathematical Representation of Physical Systems II State Variable Models for Dynamic Systems u 1 u 2 u ṙ. Internal Variables x 1, x 2 x n y 1 y 2. y m Figure

More information

NMT EE 589 & UNM ME 482/582 ROBOT ENGINEERING. Dr. Stephen Bruder NMT EE 589 & UNM ME 482/582

NMT EE 589 & UNM ME 482/582 ROBOT ENGINEERING. Dr. Stephen Bruder NMT EE 589 & UNM ME 482/582 NMT EE 589 & UNM ME 482/582 ROBOT ENGINEERING NMT EE 589 & UNM ME 482/582 Simplified drive train model of a robot joint Inertia seen by the motor Link k 1 I I D ( q) k mk 2 kk Gk Torque amplification G

More information

Computational Intelligence Lecture 20:Neuro-Fuzzy Systems

Computational Intelligence Lecture 20:Neuro-Fuzzy Systems Computational Intelligence Lecture 20:Neuro-Fuzzy Systems Farzaneh Abdollahi Department of Electrical Engineering Amirkabir University of Technology Fall 2011 Farzaneh Abdollahi Computational Intelligence

More information

Design Artificial Nonlinear Controller Based on Computed Torque like Controller with Tunable Gain

Design Artificial Nonlinear Controller Based on Computed Torque like Controller with Tunable Gain World Applied Sciences Journal 14 (9): 1306-1312, 2011 ISSN 1818-4952 IDOSI Publications, 2011 Design Artificial Nonlinear Controller Based on Computed Torque like Controller with Tunable Gain Samira Soltani

More information

Neural Networks Lecture 4: Radial Bases Function Networks

Neural Networks Lecture 4: Radial Bases Function Networks Neural Networks Lecture 4: Radial Bases Function Networks H.A Talebi Farzaneh Abdollahi Department of Electrical Engineering Amirkabir University of Technology Winter 2011. A. Talebi, Farzaneh Abdollahi

More information

Nonlinear Control Lecture 7: Passivity

Nonlinear Control Lecture 7: Passivity Nonlinear Control Lecture 7: Passivity Farzaneh Abdollahi Department of Electrical Engineering Amirkabir University of Technology Fall 2011 Farzaneh Abdollahi Nonlinear Control Lecture 7 1/26 Passivity

More information

Robotics. Dynamics. University of Stuttgart Winter 2018/19

Robotics. Dynamics. University of Stuttgart Winter 2018/19 Robotics Dynamics 1D point mass, damping & oscillation, PID, dynamics of mechanical systems, Euler-Lagrange equation, Newton-Euler, joint space control, reference trajectory following, optimal operational

More information

A Crash Course on Kalman Filtering

A Crash Course on Kalman Filtering A Crash Course on Kalman Filtering Dan Simon Cleveland State University Fall 2014 1 / 64 Outline Linear Systems Probability State Means and Covariances Least Squares Estimation The Kalman Filter Unknown

More information

1. Consider the 1-DOF system described by the equation of motion, 4ẍ+20ẋ+25x = f.

1. Consider the 1-DOF system described by the equation of motion, 4ẍ+20ẋ+25x = f. Introduction to Robotics (CS3A) Homework #6 Solution (Winter 7/8). Consider the -DOF system described by the equation of motion, ẍ+ẋ+5x = f. (a) Find the natural frequency ω n and the natural damping ratio

More information

Nonlinear Control Lecture 4: Stability Analysis I

Nonlinear Control Lecture 4: Stability Analysis I Nonlinear Control Lecture 4: Stability Analysis I Farzaneh Abdollahi Department of Electrical Engineering Amirkabir University of Technology Fall 2010 Farzaneh Abdollahi Nonlinear Control Lecture 4 1/70

More information

Nonlinear Control Lecture 9: Feedback Linearization

Nonlinear Control Lecture 9: Feedback Linearization Nonlinear Control Lecture 9: Feedback Linearization Farzaneh Abdollahi Department of Electrical Engineering Amirkabir University of Technology Fall 2011 Farzaneh Abdollahi Nonlinear Control Lecture 9 1/75

More information

Computing Optimized Nonlinear Sliding Surfaces

Computing Optimized Nonlinear Sliding Surfaces Computing Optimized Nonlinear Sliding Surfaces Azad Ghaffari and Mohammad Javad Yazdanpanah Abstract In this paper, we have concentrated on real systems consisting of structural uncertainties and affected

More information

Neural Network-Based Adaptive Control of Robotic Manipulator: Application to a Three Links Cylindrical Robot

Neural Network-Based Adaptive Control of Robotic Manipulator: Application to a Three Links Cylindrical Robot Vol.3 No., 27 مجلد 3 العدد 27 Neural Network-Based Adaptive Control of Robotic Manipulator: Application to a Three Links Cylindrical Robot Abdul-Basset A. AL-Hussein Electrical Engineering Department Basrah

More information

Linköping University Electronic Press

Linköping University Electronic Press Linköping University Electronic Press Report Simulation Model of a 2 Degrees of Freedom Industrial Manipulator Patrik Axelsson Series: LiTH-ISY-R, ISSN 400-3902, No. 3020 ISRN: LiTH-ISY-R-3020 Available

More information

Rigid Manipulator Control

Rigid Manipulator Control Rigid Manipulator Control The control problem consists in the design of control algorithms for the robot motors, such that the TCP motion follows a specified task in the cartesian space Two types of task

More information

Neural network based robust hybrid control for robotic system: an H approach

Neural network based robust hybrid control for robotic system: an H approach Nonlinear Dyn (211) 65:421 431 DOI 117/s1171-1-992-4 ORIGINAL PAPER Neural network based robust hybrid control for robotic system: an H approach Jinzhu Peng Jie Wang Yaonan Wang Received: 22 February 21

More information

1 Kalman Filter Introduction

1 Kalman Filter Introduction 1 Kalman Filter Introduction You should first read Chapter 1 of Stochastic models, estimation, and control: Volume 1 by Peter S. Maybec (available here). 1.1 Explanation of Equations (1-3) and (1-4) Equation

More information

On-line Learning of Robot Arm Impedance Using Neural Networks

On-line Learning of Robot Arm Impedance Using Neural Networks On-line Learning of Robot Arm Impedance Using Neural Networks Yoshiyuki Tanaka Graduate School of Engineering, Hiroshima University, Higashi-hiroshima, 739-857, JAPAN Email: ytanaka@bsys.hiroshima-u.ac.jp

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

Lecture 9 Nonlinear Control Design

Lecture 9 Nonlinear Control Design Lecture 9 Nonlinear Control Design Exact-linearization Lyapunov-based design Lab 2 Adaptive control Sliding modes control Literature: [Khalil, ch.s 13, 14.1,14.2] and [Glad-Ljung,ch.17] Course Outline

More information

Introduction to Robotics

Introduction to Robotics J. Zhang, L. Einig 277 / 307 MIN Faculty Department of Informatics Lecture 8 Jianwei Zhang, Lasse Einig [zhang, einig]@informatik.uni-hamburg.de University of Hamburg Faculty of Mathematics, Informatics

More information

Robotics. Dynamics. Marc Toussaint U Stuttgart

Robotics. Dynamics. Marc Toussaint U Stuttgart Robotics Dynamics 1D point mass, damping & oscillation, PID, dynamics of mechanical systems, Euler-Lagrange equation, Newton-Euler recursion, general robot dynamics, joint space control, reference trajectory

More information

A Neural-Fuzzy Sliding Mode Observer for Robust Fault Diagnosis

A Neural-Fuzzy Sliding Mode Observer for Robust Fault Diagnosis 29 American Control Conference Hyatt Regency Riverfront, St. Louis, MO, USA June -2, 29 FrB.5 A Neural-Fuzzy Sliding Mode Observer for Robust Fault Diagnosis Qing Wu and Mehrdad Saif Abstract A robust

More information

A time-delayed observer for fault detection and isolation in

A time-delayed observer for fault detection and isolation in Robotica (6) volume 4, pp. 557 565. 6 Cambridge University Press doi:.7/s635747564 Printed in the United Kingdom A time-delayed observer for fault detection and isolation in industrial robots F. Caccavale,

More information

FAULT DETECTION for SPACECRAFT ATTITUDE CONTROL SYSTEM. M. Amin Vahid D. Mechanical Engineering Department Concordia University December 19 th, 2010

FAULT DETECTION for SPACECRAFT ATTITUDE CONTROL SYSTEM. M. Amin Vahid D. Mechanical Engineering Department Concordia University December 19 th, 2010 FAULT DETECTION for SPACECRAFT ATTITUDE CONTROL SYSTEM M. Amin Vahid D. Mechanical Engineering Department Concordia University December 19 th, 2010 Attitude control : the exercise of control over the orientation

More information

Fault-Tolerant Control Strategies for a Class of Euler-Lagrange Nonlinear Systems Subject to Simultaneous Sensor and Actuator Faults

Fault-Tolerant Control Strategies for a Class of Euler-Lagrange Nonlinear Systems Subject to Simultaneous Sensor and Actuator Faults Fault-Tolerant Control Strategies for a Class of Euler-Lagrange Nonlinear Systems Subject to Simultaneous Sensor and Actuator Faults Maryam Abdollahi A Thesis in The Department of Electrical and Computer

More information

Case Study: The Pelican Prototype Robot

Case Study: The Pelican Prototype Robot 5 Case Study: The Pelican Prototype Robot The purpose of this chapter is twofold: first, to present in detail the model of the experimental robot arm of the Robotics lab. from the CICESE Research Center,

More information

Nonlinear PD Controllers with Gravity Compensation for Robot Manipulators

Nonlinear PD Controllers with Gravity Compensation for Robot Manipulators BULGARIAN ACADEMY OF SCIENCES CYBERNETICS AND INFORMATION TECHNOLOGIES Volume 4, No Sofia 04 Print ISSN: 3-970; Online ISSN: 34-408 DOI: 0.478/cait-04-00 Nonlinear PD Controllers with Gravity Compensation

More information

ELEC4631 s Lecture 2: Dynamic Control Systems 7 March Overview of dynamic control systems

ELEC4631 s Lecture 2: Dynamic Control Systems 7 March Overview of dynamic control systems ELEC4631 s Lecture 2: Dynamic Control Systems 7 March 2011 Overview of dynamic control systems Goals of Controller design Autonomous dynamic systems Linear Multi-input multi-output (MIMO) systems Bat flight

More information

ADAPTIVE NEURAL NETWORK CONTROL OF MECHATRONICS OBJECTS

ADAPTIVE NEURAL NETWORK CONTROL OF MECHATRONICS OBJECTS acta mechanica et automatica, vol.2 no.4 (28) ADAPIE NEURAL NEWORK CONROL OF MECHARONICS OBJECS Egor NEMSE *, Yuri ZHUKO * * Baltic State echnical University oenmeh, 985, St. Petersburg, Krasnoarmeyskaya,

More information

Adaptive fuzzy observer and robust controller for a 2-DOF robot arm

Adaptive fuzzy observer and robust controller for a 2-DOF robot arm Adaptive fuzzy observer and robust controller for a -DOF robot arm S. Bindiganavile Nagesh, Zs. Lendek, A.A. Khalate, R. Babuška Delft University of Technology, Mekelweg, 8 CD Delft, The Netherlands (email:

More information

Fault Detection and Isolation of the Wind Turbine Benchmark: an Estimation-based Approach

Fault Detection and Isolation of the Wind Turbine Benchmark: an Estimation-based Approach Milano (Italy) August - September, 11 Fault Detection and Isolation of the Wind Turbine Benchmark: an Estimation-based Approach Xiaodong Zhang, Qi Zhang Songling Zhao Riccardo Ferrari Marios M. Polycarpou,andThomas

More information

MCE/EEC 647/747: Robot Dynamics and Control. Lecture 12: Multivariable Control of Robotic Manipulators Part II

MCE/EEC 647/747: Robot Dynamics and Control. Lecture 12: Multivariable Control of Robotic Manipulators Part II MCE/EEC 647/747: Robot Dynamics and Control Lecture 12: Multivariable Control of Robotic Manipulators Part II Reading: SHV Ch.8 Mechanical Engineering Hanz Richter, PhD MCE647 p.1/14 Robust vs. Adaptive

More information

Nonlinear Control Lecture 5: Stability Analysis II

Nonlinear Control Lecture 5: Stability Analysis II Nonlinear Control Lecture 5: Stability Analysis II Farzaneh Abdollahi Department of Electrical Engineering Amirkabir University of Technology Fall 2010 Farzaneh Abdollahi Nonlinear Control Lecture 5 1/41

More information

UAVBook Supplement Full State Direct and Indirect EKF

UAVBook Supplement Full State Direct and Indirect EKF UAVBook Supplement Full State Direct and Indirect EKF Randal W. Beard March 14, 217 This supplement will explore alternatives to the state estimation scheme presented in the book. In particular, we will

More information

Trajectory-tracking control of a planar 3-RRR parallel manipulator

Trajectory-tracking control of a planar 3-RRR parallel manipulator Trajectory-tracking control of a planar 3-RRR parallel manipulator Chaman Nasa and Sandipan Bandyopadhyay Department of Engineering Design Indian Institute of Technology Madras Chennai, India Abstract

More information

In this section of notes, we look at the calculation of forces and torques for a manipulator in two settings:

In this section of notes, we look at the calculation of forces and torques for a manipulator in two settings: Introduction Up to this point we have considered only the kinematics of a manipulator. That is, only the specification of motion without regard to the forces and torques required to cause motion In this

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

A Physically-Based Fault Detection and Isolation Method and Its Uses in Robot Manipulators

A Physically-Based Fault Detection and Isolation Method and Its Uses in Robot Manipulators des FA 4.13 Steuerung und Regelung von Robotern A Physically-Based Fault Detection and Isolation Method and Its Uses in Robot Manipulators Alessandro De Luca Dipartimento di Informatica e Sistemistica

More information

ME 132, Fall 2017, UC Berkeley, A. Packard 334 # 6 # 7 # 13 # 15 # 14

ME 132, Fall 2017, UC Berkeley, A. Packard 334 # 6 # 7 # 13 # 15 # 14 ME 132, Fall 2017, UC Berkeley, A. Packard 334 30.3 Fall 2017 Final # 1 # 2 # 3 # 4 # 5 # 6 # 7 # 8 NAME 20 15 20 15 15 18 15 20 # 9 # 10 # 11 # 12 # 13 # 14 # 15 # 16 18 12 12 15 12 20 18 15 Facts: 1.

More information

Application of Neural Networks for Control of Inverted Pendulum

Application of Neural Networks for Control of Inverted Pendulum Application of Neural Networks for Control of Inverted Pendulum VALERI MLADENOV Department of Theoretical Electrical Engineering Technical University of Sofia Sofia, Kliment Ohridski blvd. 8; BULARIA valerim@tu-sofia.bg

More information

Every real system has uncertainties, which include system parametric uncertainties, unmodeled dynamics

Every real system has uncertainties, which include system parametric uncertainties, unmodeled dynamics Sensitivity Analysis of Disturbance Accommodating Control with Kalman Filter Estimation Jemin George and John L. Crassidis University at Buffalo, State University of New York, Amherst, NY, 14-44 The design

More information

Lecture 9 Nonlinear Control Design. Course Outline. Exact linearization: example [one-link robot] Exact Feedback Linearization

Lecture 9 Nonlinear Control Design. Course Outline. Exact linearization: example [one-link robot] Exact Feedback Linearization Lecture 9 Nonlinear Control Design Course Outline Eact-linearization Lyapunov-based design Lab Adaptive control Sliding modes control Literature: [Khalil, ch.s 13, 14.1,14.] and [Glad-Ljung,ch.17] Lecture

More information

Control Systems Design, SC4026. SC4026 Fall 2010, dr. A. Abate, DCSC, TU Delft

Control Systems Design, SC4026. SC4026 Fall 2010, dr. A. Abate, DCSC, TU Delft Control Systems Design, SC426 SC426 Fall 2, dr A Abate, DCSC, TU Delft Lecture 5 Controllable Canonical and Observable Canonical Forms Stabilization by State Feedback State Estimation, Observer Design

More information

Topic # Feedback Control. State-Space Systems Closed-loop control using estimators and regulators. Dynamics output feedback

Topic # Feedback Control. State-Space Systems Closed-loop control using estimators and regulators. Dynamics output feedback Topic #17 16.31 Feedback Control State-Space Systems Closed-loop control using estimators and regulators. Dynamics output feedback Back to reality Copyright 21 by Jonathan How. All Rights reserved 1 Fall

More information

Several Extensions in Methods for Adaptive Output Feedback Control

Several Extensions in Methods for Adaptive Output Feedback Control Several Extensions in Methods for Adaptive Output Feedback Control Nakwan Kim Postdoctoral Fellow School of Aerospace Engineering Georgia Institute of Technology Atlanta, GA 333 5 Anthony J. Calise Professor

More information

Mechanical Engineering Department - University of São Paulo at São Carlos, São Carlos, SP, , Brazil

Mechanical Engineering Department - University of São Paulo at São Carlos, São Carlos, SP, , Brazil MIXED MODEL BASED/FUZZY ADAPTIVE ROBUST CONTROLLER WITH H CRITERION APPLIED TO FREE-FLOATING SPACE MANIPULATORS Tatiana FPAT Pazelli, Roberto S Inoue, Adriano AG Siqueira, Marco H Terra Electrical Engineering

More information

q 1 F m d p q 2 Figure 1: An automated crane with the relevant kinematic and dynamic definitions.

q 1 F m d p q 2 Figure 1: An automated crane with the relevant kinematic and dynamic definitions. Robotics II March 7, 018 Exercise 1 An automated crane can be seen as a mechanical system with two degrees of freedom that moves along a horizontal rail subject to the actuation force F, and that transports

More information

Chapter 3. State Feedback - Pole Placement. Motivation

Chapter 3. State Feedback - Pole Placement. Motivation Chapter 3 State Feedback - Pole Placement Motivation Whereas classical control theory is based on output feedback, this course mainly deals with control system design by state feedback. This model-based

More information

INSTRUCTIONS TO CANDIDATES:

INSTRUCTIONS TO CANDIDATES: NATIONAL NIVERSITY OF SINGAPORE FINAL EXAMINATION FOR THE DEGREE OF B.ENG ME 444 - DYNAMICS AND CONTROL OF ROBOTIC SYSTEMS October/November 994 - Time Allowed: 3 Hours INSTRCTIONS TO CANDIDATES:. This

More information

Dynamics. Basilio Bona. Semester 1, DAUIN Politecnico di Torino. B. Bona (DAUIN) Dynamics Semester 1, / 18

Dynamics. Basilio Bona. Semester 1, DAUIN Politecnico di Torino. B. Bona (DAUIN) Dynamics Semester 1, / 18 Dynamics Basilio Bona DAUIN Politecnico di Torino Semester 1, 2016-17 B. Bona (DAUIN) Dynamics Semester 1, 2016-17 1 / 18 Dynamics Dynamics studies the relations between the 3D space generalized forces

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

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

Advanced Robotic Manipulation

Advanced Robotic Manipulation Advanced Robotic Manipulation Handout CS37A (Spring 017 Solution Set # Problem 1 - Redundant robot control The goal of this problem is to familiarize you with the control of a robot that is redundant with

More information

Neural Networks Introduction

Neural Networks Introduction Neural Networks Introduction H.A Talebi Farzaneh Abdollahi Department of Electrical Engineering Amirkabir University of Technology Winter 2011 H. A. Talebi, Farzaneh Abdollahi Neural Networks 1/22 Biological

More information

L 1 Adaptive Controller for a Class of Systems with Unknown

L 1 Adaptive Controller for a Class of Systems with Unknown 28 American Control Conference Westin Seattle Hotel, Seattle, Washington, USA June -3, 28 FrA4.2 L Adaptive Controller for a Class of Systems with Unknown Nonlinearities: Part I Chengyu Cao and Naira Hovakimyan

More information

Comparison of four state observer design algorithms for MIMO system

Comparison of four state observer design algorithms for MIMO system Archives of Control Sciences Volume 23(LIX), 2013 No. 2, pages 131 144 Comparison of four state observer design algorithms for MIMO system VINODH KUMAR. E, JOVITHA JEROME and S. AYYAPPAN A state observer

More information

DO NOT DO HOMEWORK UNTIL IT IS ASSIGNED. THE ASSIGNMENTS MAY CHANGE UNTIL ANNOUNCED.

DO NOT DO HOMEWORK UNTIL IT IS ASSIGNED. THE ASSIGNMENTS MAY CHANGE UNTIL ANNOUNCED. EE 533 Homeworks Spring 07 Updated: Saturday, April 08, 07 DO NOT DO HOMEWORK UNTIL IT IS ASSIGNED. THE ASSIGNMENTS MAY CHANGE UNTIL ANNOUNCED. Some homework assignments refer to the textbooks: Slotine

More information

DO NOT DO HOMEWORK UNTIL IT IS ASSIGNED. THE ASSIGNMENTS MAY CHANGE UNTIL ANNOUNCED.

DO NOT DO HOMEWORK UNTIL IT IS ASSIGNED. THE ASSIGNMENTS MAY CHANGE UNTIL ANNOUNCED. EE 5 Homewors Fall 04 Updated: Sunday, October 6, 04 Some homewor assignments refer to the textboos: Slotine and Li, etc. For full credit, show all wor. Some problems require hand calculations. In those

More information

Lecture «Robot Dynamics»: Dynamics and Control

Lecture «Robot Dynamics»: Dynamics and Control Lecture «Robot Dynamics»: Dynamics and Control 151-0851-00 V lecture: CAB G11 Tuesday 10:15 12:00, every week exercise: HG E1.2 Wednesday 8:15 10:00, according to schedule (about every 2nd week) Marco

More information

A Sliding Mode Controller Using Neural Networks for Robot Manipulator

A Sliding Mode Controller Using Neural Networks for Robot Manipulator ESANN'4 proceedings - European Symposium on Artificial Neural Networks Bruges (Belgium), 8-3 April 4, d-side publi., ISBN -9337-4-8, pp. 93-98 A Sliding Mode Controller Using Neural Networks for Robot

More information

Research Article Extended and Unscented Kalman Filtering Applied to a Flexible-Joint Robot with Jerk Estimation

Research Article Extended and Unscented Kalman Filtering Applied to a Flexible-Joint Robot with Jerk Estimation Hindawi Publishing Corporation Discrete Dynamics in Nature and Society Volume 21, Article ID 482972, 14 pages doi:1.1155/21/482972 Research Article Extended and Unscented Kalman Filtering Applied to a

More information

ASTATISM IN NONLINEAR CONTROL SYSTEMS WITH APPLICATION TO ROBOTICS

ASTATISM IN NONLINEAR CONTROL SYSTEMS WITH APPLICATION TO ROBOTICS dx dt DIFFERENTIAL EQUATIONS AND CONTROL PROCESSES N 1, 1997 Electronic Journal, reg. N P23275 at 07.03.97 http://www.neva.ru/journal e-mail: diff@osipenko.stu.neva.ru Control problems in nonlinear systems

More information

Trajectory Tracking Control of a Very Flexible Robot Using a Feedback Linearization Controller and a Nonlinear Observer

Trajectory Tracking Control of a Very Flexible Robot Using a Feedback Linearization Controller and a Nonlinear Observer Trajectory Tracking Control of a Very Flexible Robot Using a Feedback Linearization Controller and a Nonlinear Observer Fatemeh Ansarieshlaghi and Peter Eberhard Institute of Engineering and Computational

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

Set-valued Observer-based Active Fault-tolerant Model Predictive Control

Set-valued Observer-based Active Fault-tolerant Model Predictive Control Set-valued Observer-based Active Fault-tolerant Model Predictive Control Feng Xu 1,2, Vicenç Puig 1, Carlos Ocampo-Martinez 1 and Xueqian Wang 2 1 Institut de Robòtica i Informàtica Industrial (CSIC-UPC),Technical

More information

Dynamics. 1 Copyright c 2015 Roderic Grupen

Dynamics. 1 Copyright c 2015 Roderic Grupen Dynamics The branch of physics that treats the action of force on bodies in motion or at rest; kinetics, kinematics, and statics, collectively. Websters dictionary Outline Conservation of Momentum Inertia

More information

sc Control Systems Design Q.1, Sem.1, Ac. Yr. 2010/11

sc Control Systems Design Q.1, Sem.1, Ac. Yr. 2010/11 sc46 - Control Systems Design Q Sem Ac Yr / Mock Exam originally given November 5 9 Notes: Please be reminded that only an A4 paper with formulas may be used during the exam no other material is to be

More information

AS3010: Introduction to Space Technology

AS3010: Introduction to Space Technology AS3010: Introduction to Space Technology L E C T U R E 22 Part B, Lecture 22 19 April, 2017 C O N T E N T S Attitude stabilization passive and active. Actuators for three axis or active stabilization.

More information

Nonlinear Model Predictive Control Tools (NMPC Tools)

Nonlinear Model Predictive Control Tools (NMPC Tools) Nonlinear Model Predictive Control Tools (NMPC Tools) Rishi Amrit, James B. Rawlings April 5, 2008 1 Formulation We consider a control system composed of three parts([2]). Estimator Target calculator Regulator

More information

Robust Control of Robot Manipulator by Model Based Disturbance Attenuation

Robust Control of Robot Manipulator by Model Based Disturbance Attenuation IEEE/ASME Trans. Mechatronics, vol. 8, no. 4, pp. 511-513, Nov./Dec. 2003 obust Control of obot Manipulator by Model Based Disturbance Attenuation Keywords : obot manipulators, MBDA, position control,

More information

Modeling and Simulation of the Nonlinear Computed Torque Control in Simulink/MATLAB for an Industrial Robot

Modeling and Simulation of the Nonlinear Computed Torque Control in Simulink/MATLAB for an Industrial Robot Copyright 2013 Tech Science Press SL, vol.10, no.2, pp.95-106, 2013 Modeling and Simulation of the Nonlinear Computed Torque Control in Simulink/MATLAB for an Industrial Robot Dǎnuţ Receanu 1 Abstract:

More information

LYAPUNOV-BASED ROBUST AND ADAPTIVE CONTROL OF NONLINEAR SYSTEMS USING A NOVEL FEEDBACK STRUCTURE

LYAPUNOV-BASED ROBUST AND ADAPTIVE CONTROL OF NONLINEAR SYSTEMS USING A NOVEL FEEDBACK STRUCTURE LYAPUNOV-BASED ROBUST AND ADAPTIVE CONTROL OF NONLINEAR SYSTEMS USING A NOVEL FEEDBACK STRUCTURE By PARAG PATRE A DISSERTATION PRESENTED TO THE GRADUATE SCHOOL OF THE UNIVERSITY OF FLORIDA IN PARTIAL FULFILLMENT

More information

DYNAMIC NEURAL NETWORK-BASED ROBUST CONTROL METHODS FOR UNCERTAIN NONLINEAR SYSTEMS

DYNAMIC NEURAL NETWORK-BASED ROBUST CONTROL METHODS FOR UNCERTAIN NONLINEAR SYSTEMS DYNAMIC NEURAL NETWORK-BASED ROBUST CONTROL METHODS FOR UNCERTAIN NONLINEAR SYSTEMS By HUYEN T. DINH A DISSERTATION PRESENTED TO THE GRADUATE SCHOOL OF THE UNIVERSITY OF FLORIDA IN PARTIAL FULFILLMENT

More information

Combined NN/RISE-based Asymptotic Tracking Control of a 3 DOF Robot Manipulator

Combined NN/RISE-based Asymptotic Tracking Control of a 3 DOF Robot Manipulator JIAS Journal of Intelligent Automation Systems Published online: 15 January 214 Combined NN/RISE-based Asymptotic Tracking Control of a 3 DOF Robot Manipulator Sara Yazdanzad a, Alireza Khosravi b,*, Abolfazl

More information

Design of Observer-based Adaptive Controller for Nonlinear Systems with Unmodeled Dynamics and Actuator Dead-zone

Design of Observer-based Adaptive Controller for Nonlinear Systems with Unmodeled Dynamics and Actuator Dead-zone International Journal of Automation and Computing 8), May, -8 DOI:.7/s633--574-4 Design of Observer-based Adaptive Controller for Nonlinear Systems with Unmodeled Dynamics and Actuator Dead-zone Xue-Li

More information

Manufacturing Equipment Control

Manufacturing Equipment Control QUESTION 1 An electric drive spindle has the following parameters: J m = 2 1 3 kg m 2, R a = 8 Ω, K t =.5 N m/a, K v =.5 V/(rad/s), K a = 2, J s = 4 1 2 kg m 2, and K s =.3. Ignore electrical dynamics

More information

General procedure for formulation of robot dynamics STEP 1 STEP 3. Module 9 : Robot Dynamics & controls

General procedure for formulation of robot dynamics STEP 1 STEP 3. Module 9 : Robot Dynamics & controls Module 9 : Robot Dynamics & controls Lecture 32 : General procedure for dynamics equation forming and introduction to control Objectives In this course you will learn the following Lagrangian Formulation

More information

Adaptive fuzzy observer and robust controller for a 2-DOF robot arm Sangeetha Bindiganavile Nagesh

Adaptive fuzzy observer and robust controller for a 2-DOF robot arm Sangeetha Bindiganavile Nagesh Adaptive fuzzy observer and robust controller for a 2-DOF robot arm Delft Center for Systems and Control Adaptive fuzzy observer and robust controller for a 2-DOF robot arm For the degree of Master of

More information

CONTROL OF THE NONHOLONOMIC INTEGRATOR

CONTROL OF THE NONHOLONOMIC INTEGRATOR June 6, 25 CONTROL OF THE NONHOLONOMIC INTEGRATOR R. N. Banavar (Work done with V. Sankaranarayanan) Systems & Control Engg. Indian Institute of Technology, Bombay Mumbai -INDIA. banavar@iitb.ac.in Outline

More information

Balancing of an Inverted Pendulum with a SCARA Robot

Balancing of an Inverted Pendulum with a SCARA Robot Balancing of an Inverted Pendulum with a SCARA Robot Bernhard Sprenger, Ladislav Kucera, and Safer Mourad Swiss Federal Institute of Technology Zurich (ETHZ Institute of Robotics 89 Zurich, Switzerland

More information

Application of Adaptive Thresholds in Robust Fault Detection of an Electro- Mechanical Single-Wheel Steering Actuator

Application of Adaptive Thresholds in Robust Fault Detection of an Electro- Mechanical Single-Wheel Steering Actuator Preprints of the 8th IFAC Symposium on Fault Detection, Supervision and Safety of Technical Processes (SAFEPROCESS) August 29-31, 212. Mexico City, Mexico Application of Adaptive Thresholds in Robust Fault

More information

MCE493/593 and EEC492/592 Prosthesis Design and Control

MCE493/593 and EEC492/592 Prosthesis Design and Control MCE493/593 and EEC492/592 Prosthesis Design and Control Electromechanical Actuators Part 2 Applications to Prosthetic Devices Hanz Richter Department of Mechanical Engineering 2014 1 / 19 Integrating actuators

More information

Neural Networks Lecture 2:Single Layer Classifiers

Neural Networks Lecture 2:Single Layer Classifiers Neural Networks Lecture 2:Single Layer Classifiers H.A Talebi Farzaneh Abdollahi Department of Electrical Engineering Amirkabir University of Technology Winter 2011. A. Talebi, Farzaneh Abdollahi Neural

More information

Neural Network Control of an Inverted Pendulum on a Cart

Neural Network Control of an Inverted Pendulum on a Cart Neural Network Control of an Inverted Pendulum on a Cart VALERI MLADENOV, GEORGI TSENOV, LAMBROS EKONOMOU, NICHOLAS HARKIOLAKIS, PANAGIOTIS KARAMPELAS Department of Theoretical Electrical Engineering Technical

More information

Intelligent Control. Module I- Neural Networks Lecture 7 Adaptive Learning Rate. Laxmidhar Behera

Intelligent Control. Module I- Neural Networks Lecture 7 Adaptive Learning Rate. Laxmidhar Behera Intelligent Control Module I- Neural Networks Lecture 7 Adaptive Learning Rate Laxmidhar Behera Department of Electrical Engineering Indian Institute of Technology, Kanpur Recurrent Networks p.1/40 Subjects

More information

SLIDING MODE FAULT TOLERANT CONTROL WITH PRESCRIBED PERFORMANCE. Jicheng Gao, Qikun Shen, Pengfei Yang and Jianye Gong

SLIDING MODE FAULT TOLERANT CONTROL WITH PRESCRIBED PERFORMANCE. Jicheng Gao, Qikun Shen, Pengfei Yang and Jianye Gong International Journal of Innovative Computing, Information and Control ICIC International c 27 ISSN 349-498 Volume 3, Number 2, April 27 pp. 687 694 SLIDING MODE FAULT TOLERANT CONTROL WITH PRESCRIBED

More information

3- DOF Scara type Robot Manipulator using Mamdani Based Fuzzy Controller

3- DOF Scara type Robot Manipulator using Mamdani Based Fuzzy Controller 659 3- DOF Scara type Robot Manipulator using Mamdani Based Fuzzy Controller Nitesh Kumar Jaiswal *, Vijay Kumar ** *(Department of Electronics and Communication Engineering, Indian Institute of Technology,

More information

Adaptive Control with a Nested Saturation Reference Model

Adaptive Control with a Nested Saturation Reference Model Adaptive Control with a Nested Saturation Reference Model Suresh K Kannan and Eric N Johnson School of Aerospace Engineering Georgia Institute of Technology, Atlanta, GA 3332 This paper introduces a neural

More information

Design of a Nonlinear Observer for a Very Flexible Parallel Robot

Design of a Nonlinear Observer for a Very Flexible Parallel Robot Proceedings of the 7th GACM Colloquium on Computational Mechanics for Young Scientists from Academia and Industry October 11-13, 217 in Stuttgart, Germany Design of a Nonlinear Observer for a Very Flexible

More information

Sensorless Torque/Force Control

Sensorless Torque/Force Control 4 Sensorless Torque/Force Control Islam S. M. Khalil and Asif Sabanovic Sabanci University Turkey 1. Introduction Motion control systems represent a main subsystem for majority of processing systems that

More information

Linearization problem. The simplest example

Linearization problem. The simplest example Linear Systems Lecture 3 1 problem Consider a non-linear time-invariant system of the form ( ẋ(t f x(t u(t y(t g ( x(t u(t (1 such that x R n u R m y R p and Slide 1 A: f(xu f(xu g(xu and g(xu exist and

More information

Introduction to centralized control

Introduction to centralized control Industrial Robots Control Part 2 Introduction to centralized control Independent joint decentralized control may prove inadequate when the user requires high task velocities structured disturbance torques

More information

Topography and Force Estimation in Atomic Force Microscopy by State and Parameter Estimation

Topography and Force Estimation in Atomic Force Microscopy by State and Parameter Estimation Topography and Force Estimation in Atomic Force Microscopy by State and Parameter Estimation Michael R. P. Ragazzon, J. Tommy Gravdahl, Kristin Y. Pettersen, Arnfinn A. Eielsen Department of Engineering

More information

TTK4150 Nonlinear Control Systems Solution 6 Part 2

TTK4150 Nonlinear Control Systems Solution 6 Part 2 TTK4150 Nonlinear Control Systems Solution 6 Part 2 Department of Engineering Cybernetics Norwegian University of Science and Technology Fall 2003 Solution 1 Thesystemisgivenby φ = R (φ) ω and J 1 ω 1

More information

A HYBRID SYSTEM APPROACH TO IMPEDANCE AND ADMITTANCE CONTROL. Frank Mathis

A HYBRID SYSTEM APPROACH TO IMPEDANCE AND ADMITTANCE CONTROL. Frank Mathis A HYBRID SYSTEM APPROACH TO IMPEDANCE AND ADMITTANCE CONTROL By Frank Mathis A THESIS Submitted to Michigan State University in partial fulfillment of the requirements for the degree of MASTER OF SCIENCE

More information

IROS 16 Workshop: The Mechatronics behind Force/Torque Controlled Robot Actuation Secrets & Challenges

IROS 16 Workshop: The Mechatronics behind Force/Torque Controlled Robot Actuation Secrets & Challenges Arne Wahrburg (*), 2016-10-14 Cartesian Contact Force and Torque Estimation for Redundant Manipulators IROS 16 Workshop: The Mechatronics behind Force/Torque Controlled Robot Actuation Secrets & Challenges

More information