Robot Manipulator Control. Hesheng Wang Dept. of Automation

Size: px
Start display at page:

Download "Robot Manipulator Control. Hesheng Wang Dept. of Automation"

Transcription

1 Robot Manipulator Control Hesheng Wang Dept. of Automation

2 Introduction Industrial robots work based on the teaching/playback scheme Operators teach the task procedure to a robot he robot plays back eecute the motion Intelligent robots work without teaching Robots plan its motion automatically Robots eecute the motion planned o carry out tasks successfully, a robot needs to input proper inputs to their joint actuators to eecute the motion taught/planned.

3 Problem Definition Robot Control is a problem of designing a proper input to force a robot to carry out a task or a motion as precisely as possible. Robot control problems can be classified as follows according to the reuirements: Position control: Control a robot to a desired position rajectory control: Control a robot to follow a desired geometric path or a time-varying trajectory Force control: Control a robot to apply a desired force to the environment or other objects Hybrid position/force control: Control position and force of a robot.

4 Controller o control motion of a robot based on the information collected by the sensors and instructions. Motion instruction Controller Robot Sensor Feedback

5 Control Method Open-loop Control: Directly compute the motion input from the motion command without using feedback information. reference Controller robot -simple - big errors - no robustness

6 Control Method Closed-loop control: Control the robot based on the instruction and the sensor feedback. - High accuracy - Robust reference Controller Robot Sensor feedback

7 Review of Stability heory

8 Nonlinear State-Variables Systems he robot dynamics has the form: τ G C H, From dynamic euation: τ H G C H, y τ H G C H, State euation of robot dynamics y,, Let

9 Nonlinear State-Variables Systems In general, the state euation of nonlinear systems: f,u System input y h,u System output State variables vector

10 Positive-Definite Matri An n n matri H is positive - definite if n H, R and An nn matrih is positive- semidefinite if n H, R An n n matri H is negative - definite if n H, R and An nn matrih is negative- semidefinite if n H, R All eigenvalues of a positive-definite matri are positive. All eigenvalues of a positive-semidefinite matri are non-negative All eigenvalues of a negative-definite matri are negative. All eigenvalues of a negative-semidefinite matri are non-positive

11 Euilibrium Point Euilibrium point: A state e of a system in which the velocity of the system is eual to zero. System : Let f,t the euilibrium point satisfies f e,t Euilibrium point of a system may not be uniue Ball staying on the top Ball staying at the bottom

12 Lyapunov Stability X e is stable in the sense of Lyapunov at t, if starting close enough to e at t, the system will always stay close to e at later time. Definition : e is stable in the sense of Lyapunov at t if for any given, there eists a positive, t such that if t -, t, then t -, t t e e e System trajectory

13 Lyapunov Stability It should be noted that stability does not mean that the state of the system will go to the euilibrium point as time goes to the infinity. e Ball staying on the top Instable e Stable with or without friction

14 Asymptotic Stability Xe is asymptotically stable if it is both stable and convergent. i.e. there eists a positive such that if t e, then limt t e e

15 Global Eponential Stability eis globally eponentially stable if there eists and such that for, t - a e t e e a t - e Eponential function rajectory of the error t

16 Lyapunov heorem Given the nonlinear system: f, with an euilibrium point at the origin =. Let N be a neighborhood of the origin. Suppose that is within the region N. he origin is stable in the sense of Lyapunov if there eists a scalar function V such that V is positive-definite in region N V is negative-definite or negative-semidefinite in region N he origin is asymptotically stable if V is positive-definite in region N V is negative-definite in region N If the N is the entire state space, the stability is global; otherwise, the stability is local

17 LaSalle heorem Given the nonlinear system: f with an euilibrium point at the origin =. Suppose that there eists a scalar function V such that V is positive-definite, V t he system will be convergent to the maimum invariant set within the region defined by V t. If the maimum invariant set contains the origin only, the origin is asymptotically stable.

18 Stability Analysis Barbalat Lemma : If ft is uniformly continuous and if t lim f t dt a a, then lim t t f t Uniform continuity : A function ft is uniformly continuous if any, there eists such that for any t and t if t - t, then ft - ft for A sufficient condition for uniform continuity: A differentiable function ft is uniformly continuous if its derivative is bounded.

19 Position Control Position control is a problem of properly designing joint inputs of a robot manipulator so as to drive it to a desired configuration position and orientation he desired position is a constant vector he desired velocity and acceleration are zero. Position control can be classified into Position control in joint space Position control in Cartesian space.

20 Joint Servo System Reference Computer D/A Converter Amplifier Actuator Link Sensor Computer or MPU: carry out the necessary computation in a control law D/A converter: ransform digital output of the computer to analogical voltages Amplifier: Amplify the input voltage to the actuator. Actuator: Drive the link Sensors encoder, etc: Measure the joint angle and velocity.

21 Actuator Dynamics An actuator usually delivers torue to a robot link via a reduction mechanism. i s i Motor Motor shaft m, i link Motor torue: Reduction gears m H m s L Gear ratio: s orue consumed by the reduction mechanism L, i Load of the link

22 Dynamics of DC motor Consider the euivalent circuit of a DC motor m Ki 3 K : motor torue proportional constant Applying Kirchnoff s voltage law di L Kbi Ri V 4 dt K b : back electromotive force emf constant + R V L Neglecting the inductance and considering : K b s i Ri V 5 R: Armature resistance L: Armature inductance V: Armature voltage i

23 Robot Dynamics with Actuator Dynamics Combining and 5 leads to the relationship between motor input voltage and the torue delivered to the link: L Ks R V H m s KK R b i s Substituting this into the robot dynamics: H H B H S, m G u If s i are very large, H m B G If there is no gravity: H u m B u H u B m i diag Ks R H s diag i mi s i i Ks V, R KiK R bi V Linear system Kns,..., R n n V n

24 PD Feedback Control Control objective: Control the position of the robot to a desired position d. Control Law : u -A - B : B A : he closed-loop dynamics: H H d : S, G Position error Position gain matri Velocity gain matri he euilibrium point: Δe A G AΔ B At the euilibrium point, the position error is not zero. he error is called offset error

25 PD Feedback Control Stability of the euilibrium point H U t V Introduce the following candidate of Lyapunov function Gravitational Potential energy A H U t V G U Form the closed-loop dynamics and noting B t V Vt is a Lyapunov function of the closed-loop dynamics, so the euilibrium is stable. However, the position error does not go to zero he position goes to zero when there is no gravity force

26 Offset Error he PD controller leads to an offset error: Δ A G How to kill the offset error Design a robot such that the gravity term is zero Increase the gain- high-gain control Having a gear-ratio reduction mechanism leads to high gain control Compensate for the gravity force on-line

27 PD Feedback Plus Gravity Compensation Control Law : u -A - B G Gravity compensator he gravity force is calculated on-line so as to cancel its effect his controller was developed by Arimoto and akegaki, 98 he closed-loop dynamics: H H S, AΔ B he euilibrium point:, Δ

28 Convergence of Position Error Introduce the following candidate of Lyapunov function V t H Α V t H H A Form the closed-loop dynamics and noting V t S, B B From the closed - loop dynamics andvt, the invariant set with V t contains only,. herefore, LaSalle heorem means lim t, lim t,

29 PID Feedback Control Control Law : u -K - K K K K 3 K 3 t dt : position error gain matri P - gain : velocity gain matri D - gain : Integral gain matri I - gain By introducing I-feedback, it can kill the offset error in PD feedback control However, the PID controller only gives local asymptotic stability. he proof is very complicated

30 Position Control in Cartesian Space Why? Most tasks are specified in a Cartesian space. We need to position the end-effector to desired position and orientation Control in the joint space will lead to offset errors due to errors in robot kinematics models. Difference from joint space control Directly use feedback of position in Cartesian space.

31 Position Control in Cartesian Space - - Law : Control G B A J u Cartesian space position error in : Robot Jacobian : d J B A J S H H Δ, Α H t V J J constant vector is a and d, B S B Α J H H t V hen, From LaSalle heorem, we can further prove lim t Position of the end-effector Desired position he closed-loop dynamics Consider the positive-definite function: herefore, he system is stable.

32 rajectory racking Control rajectory tracking control is a problem of designing proper joint inputs for a robot to trace a pre-specified trajectory presented by d d d d t, d t and d t t : desired position t : desired velocity t : desired acceleration In trajectory tracking, the nonlinear inertia, centrifugal and Coriolis forces play important roles. heir compensation is one of the key issues in controller design

33 Computed orue Method Linearization of the nonlinear dynamics Change the nonlinear system to a linear system by state feedback. he idea is to use on-line measurement of position and velocity to compensate for the nonlinear forces. he robot dynamics H H S, G τ Design the joint input as follows: τ H S, G τ' Substituting it to the dynamics: H τ' A new input 3

34 Computed orue Method Design the new input as follows: τ' H u 4 Substituting this into e. 3 in the previous slide: u 5 New input his is a linear system. It is easy to design the following controller: u t d t K t K t 6 where t t t, t t t he closed-loop system is t K t K t d d d 7 7 Is a second order system. It is asymptotically stable if K and K and positive-definite. hen from, 3 and 5, joint input is τ H S, G H d t K t K t 8 d

35 Controller: τ Computed orue Method H S, G H d t K t K t It uses real trajectory of a robot manipulator to compensate for its nonlinear forces centrifugal and Coriolis forces on-line. he on-line compensation reuires an efficient algorithm to solve the inverse dynamics in real-time. he recursive Newton-Euler formulation can solve the inverse dynamics in real-time. he measurement errors of joint positions and velocities will greatly affect the control performance

Control of industrial robots. Centralized control

Control of industrial robots. Centralized control Control of industrial robots Centralized control Prof. Paolo Rocco (paolo.rocco@polimi.it) Politecnico di Milano ipartimento di Elettronica, Informazione e Bioingegneria Introduction Centralized control

More information

Adaptive Robust Tracking Control of Robot Manipulators in the Task-space under Uncertainties

Adaptive Robust Tracking Control of Robot Manipulators in the Task-space under Uncertainties Australian Journal of Basic and Applied Sciences, 3(1): 308-322, 2009 ISSN 1991-8178 Adaptive Robust Tracking Control of Robot Manipulators in the Task-space under Uncertainties M.R.Soltanpour, M.M.Fateh

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

Video 8.1 Vijay Kumar. Property of University of Pennsylvania, Vijay Kumar

Video 8.1 Vijay Kumar. Property of University of Pennsylvania, Vijay Kumar Video 8.1 Vijay Kumar 1 Definitions State State equations Equilibrium 2 Stability Stable Unstable Neutrally (Critically) Stable 3 Stability Translate the origin to x e x(t) =0 is stable (Lyapunov stable)

More information

Seul Jung, T. C. Hsia and R. G. Bonitz y. Robotics Research Laboratory. University of California, Davis. Davis, CA 95616

Seul Jung, T. C. Hsia and R. G. Bonitz y. Robotics Research Laboratory. University of California, Davis. Davis, CA 95616 On Robust Impedance Force Control of Robot Manipulators Seul Jung, T C Hsia and R G Bonitz y Robotics Research Laboratory Department of Electrical and Computer Engineering University of California, Davis

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

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

(Refer Slide Time: 00:01:30 min)

(Refer Slide Time: 00:01:30 min) Control Engineering Prof. M. Gopal Department of Electrical Engineering Indian Institute of Technology, Delhi Lecture - 3 Introduction to Control Problem (Contd.) Well friends, I have been giving you various

More information

Exponential Controller for Robot Manipulators

Exponential Controller for Robot Manipulators Exponential Controller for Robot Manipulators Fernando Reyes Benemérita Universidad Autónoma de Puebla Grupo de Robótica de la Facultad de Ciencias de la Electrónica Apartado Postal 542, Puebla 7200, México

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

GAIN SCHEDULING CONTROL WITH MULTI-LOOP PID FOR 2- DOF ARM ROBOT TRAJECTORY CONTROL

GAIN SCHEDULING CONTROL WITH MULTI-LOOP PID FOR 2- DOF ARM ROBOT TRAJECTORY CONTROL GAIN SCHEDULING CONTROL WITH MULTI-LOOP PID FOR 2- DOF ARM ROBOT TRAJECTORY CONTROL 1 KHALED M. HELAL, 2 MOSTAFA R.A. ATIA, 3 MOHAMED I. ABU EL-SEBAH 1, 2 Mechanical Engineering Department ARAB ACADEMY

More information

Lecture «Robot Dynamics»: Dynamics 2

Lecture «Robot Dynamics»: Dynamics 2 Lecture «Robot Dynamics»: Dynamics 2 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) office hour: LEE

More information

Control of Mobile Robots

Control of Mobile Robots Control of Mobile Robots Regulation and trajectory tracking Prof. Luca Bascetta (luca.bascetta@polimi.it) Politecnico di Milano Dipartimento di Elettronica, Informazione e Bioingegneria Organization and

More information

The basic principle to be used in mechanical systems to derive a mathematical model is Newton s law,

The basic principle to be used in mechanical systems to derive a mathematical model is Newton s law, Chapter. DYNAMIC MODELING Understanding the nature of the process to be controlled is a central issue for a control engineer. Thus the engineer must construct a model of the process with whatever information

More information

ADAPTIVE FORCE AND MOTION CONTROL OF ROBOT MANIPULATORS IN CONSTRAINED MOTION WITH DISTURBANCES

ADAPTIVE FORCE AND MOTION CONTROL OF ROBOT MANIPULATORS IN CONSTRAINED MOTION WITH DISTURBANCES ADAPTIVE FORCE AND MOTION CONTROL OF ROBOT MANIPULATORS IN CONSTRAINED MOTION WITH DISTURBANCES By YUNG-SHENG CHANG A THESIS PRESENTED TO THE GRADUATE SCHOOL OF THE UNIVERSITY OF FLORIDA IN PARTIAL FULFILLMENT

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

Video 5.1 Vijay Kumar and Ani Hsieh

Video 5.1 Vijay Kumar and Ani Hsieh Video 5.1 Vijay Kumar and Ani Hsieh Robo3x-1.1 1 The Purpose of Control Input/Stimulus/ Disturbance System or Plant Output/ Response Understand the Black Box Evaluate the Performance Change the Behavior

More information

3. Fundamentals of Lyapunov Theory

3. Fundamentals of Lyapunov Theory Applied Nonlinear Control Nguyen an ien -.. Fundamentals of Lyapunov heory he objective of this chapter is to present Lyapunov stability theorem and illustrate its use in the analysis and the design of

More information

FEEDBACK CONTROL SYSTEMS

FEEDBACK CONTROL SYSTEMS FEEDBAC CONTROL SYSTEMS. Control System Design. Open and Closed-Loop Control Systems 3. Why Closed-Loop Control? 4. Case Study --- Speed Control of a DC Motor 5. Steady-State Errors in Unity Feedback Control

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

Introduction to centralized control

Introduction to centralized control ROBOTICS 01PEEQW Basilio Bona DAUIN Politecnico di Torino Control Part 2 Introduction to centralized control Independent joint decentralized control may prove inadequate when the user requires high task

More information

Trigonometric Saturated Controller for Robot Manipulators

Trigonometric Saturated Controller for Robot Manipulators Trigonometric Saturated Controller for Robot Manipulators FERNANDO REYES, JORGE BARAHONA AND EDUARDO ESPINOSA Grupo de Robótica de la Facultad de Ciencias de la Electrónica Benemérita Universidad Autónoma

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

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

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

Electrical Machine & Automatic Control (EEE-409) (ME-II Yr) UNIT-3 Content: Signals u(t) = 1 when t 0 = 0 when t <0

Electrical Machine & Automatic Control (EEE-409) (ME-II Yr) UNIT-3 Content: Signals u(t) = 1 when t 0 = 0 when t <0 Electrical Machine & Automatic Control (EEE-409) (ME-II Yr) UNIT-3 Content: Modeling of Mechanical : linear mechanical elements, force-voltage and force current analogy, and electrical analog of simple

More information

Gain Scheduling Control with Multi-loop PID for 2-DOF Arm Robot Trajectory Control

Gain Scheduling Control with Multi-loop PID for 2-DOF Arm Robot Trajectory Control Gain Scheduling Control with Multi-loop PID for 2-DOF Arm Robot Trajectory Control Khaled M. Helal, 2 Mostafa R.A. Atia, 3 Mohamed I. Abu El-Sebah, 2 Mechanical Engineering Department ARAB ACADEMY FOR

More information

Passivity-based Control of Euler-Lagrange Systems

Passivity-based Control of Euler-Lagrange Systems Romeo Ortega, Antonio Loria, Per Johan Nicklasson and Hebertt Sira-Ramfrez Passivity-based Control of Euler-Lagrange Systems Mechanical, Electrical and Electromechanical Applications Springer Contents

More information

MECHATRONICS ENGINEERING TECHNOLOGY. Modeling a Servo Motor System

MECHATRONICS ENGINEERING TECHNOLOGY. Modeling a Servo Motor System Modeling a Servo Motor System Definitions Motor: A device that receives a continuous (Analog) signal and operates continuously in time. Digital Controller: Discretizes the amplitude of the signal and also

More information

Robust Control of Cooperative Underactuated Manipulators

Robust Control of Cooperative Underactuated Manipulators Robust Control of Cooperative Underactuated Manipulators Marcel Bergerman * Yangsheng Xu +,** Yun-Hui Liu ** * Automation Institute Informatics Technology Center Campinas SP Brazil + The Robotics Institute

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

Feedback Control Systems

Feedback Control Systems ME Homework #0 Feedback Control Systems Last Updated November 06 Text problem 67 (Revised Chapter 6 Homework Problems- attached) 65 Chapter 6 Homework Problems 65 Transient Response of a Second Order Model

More information

Predictive Cascade Control of DC Motor

Predictive Cascade Control of DC Motor Volume 49, Number, 008 89 Predictive Cascade Control of DC Motor Alexandru MORAR Abstract: The paper deals with the predictive cascade control of an electrical drive intended for positioning applications.

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

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

Modelling of Ball and Plate System Based on First Principle Model and Optimal Control

Modelling of Ball and Plate System Based on First Principle Model and Optimal Control 2017 21st International Conference on Process Control (PC) June 6 9, 2017, Štrbské Pleso, Slovakia Modelling of Ball and Plate System Based on First Principle Model and Optimal Control František Dušek,

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

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

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

Automatic Control Systems. -Lecture Note 15-

Automatic Control Systems. -Lecture Note 15- -Lecture Note 15- Modeling of Physical Systems 5 1/52 AC Motors AC Motors Classification i) Induction Motor (Asynchronous Motor) ii) Synchronous Motor 2/52 Advantages of AC Motors i) Cost-effective ii)

More information

Virtual Passive Controller for Robot Systems Using Joint Torque Sensors

Virtual Passive Controller for Robot Systems Using Joint Torque Sensors NASA Technical Memorandum 110316 Virtual Passive Controller for Robot Systems Using Joint Torque Sensors Hal A. Aldridge and Jer-Nan Juang Langley Research Center, Hampton, Virginia January 1997 National

More information

Neural Network Sliding-Mode-PID Controller Design for Electrically Driven Robot Manipulators

Neural Network Sliding-Mode-PID Controller Design for Electrically Driven Robot Manipulators Neural Network Sliding-Mode-PID Controller Design for Electrically Driven Robot Manipulators S. E. Shafiei 1, M. R. Soltanpour 2 1. Department of Electrical and Robotic Engineering, Shahrood University

More information

Adaptive Jacobian Tracking Control of Robots With Uncertainties in Kinematic, Dynamic and Actuator Models

Adaptive Jacobian Tracking Control of Robots With Uncertainties in Kinematic, Dynamic and Actuator Models 104 IEEE TRANSACTIONS ON AUTOMATIC CONTROL, VOL. 51, NO. 6, JUNE 006 Adaptive Jacobian Tracking Control of Robots With Uncertainties in Kinematic, Dynamic and Actuator Models C. C. Cheah, C. Liu, and J.

More information

Fuzzy Based Robust Controller Design for Robotic Two-Link Manipulator

Fuzzy Based Robust Controller Design for Robotic Two-Link Manipulator Abstract Fuzzy Based Robust Controller Design for Robotic Two-Link Manipulator N. Selvaganesan 1 Prabhu Jude Rajendran 2 S.Renganathan 3 1 Department of Instrumentation Engineering, Madras Institute of

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

EML5311 Lyapunov Stability & Robust Control Design

EML5311 Lyapunov Stability & Robust Control Design EML5311 Lyapunov Stability & Robust Control Design 1 Lyapunov Stability criterion In Robust control design of nonlinear uncertain systems, stability theory plays an important role in engineering systems.

More information

Control of Robotic Manipulators

Control of Robotic Manipulators Control of Robotic Manipulators Set Point Control Technique 1: Joint PD Control Joint torque Joint position error Joint velocity error Why 0? Equivalent to adding a virtual spring and damper to the joints

More information

Analysis and Design of Control Dynamics of Manipulator Robot s Joint Drive

Analysis and Design of Control Dynamics of Manipulator Robot s Joint Drive Journal of Mechanics Engineering and Automation 8 (2018) 205-213 doi: 10.17265/2159-5275/2018.05.003 D DAVID PUBLISHING Analysis and Design of Control Dynamics of Manipulator Robot s Joint Drive Bukhar

More information

Feedback Control of Linear SISO systems. Process Dynamics and Control

Feedback Control of Linear SISO systems. Process Dynamics and Control Feedback Control of Linear SISO systems Process Dynamics and Control 1 Open-Loop Process The study of dynamics was limited to open-loop systems Observe process behavior as a result of specific input signals

More information

Appendix W. Dynamic Models. W.2 4 Complex Mechanical Systems. Translational and Rotational Systems W.2.1

Appendix W. Dynamic Models. W.2 4 Complex Mechanical Systems. Translational and Rotational Systems W.2.1 Appendix W Dynamic Models W.2 4 Complex Mechanical Systems W.2.1 Translational and Rotational Systems In some cases, mechanical systems contain both translational and rotational portions. The procedure

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

Index. Index. More information. in this web service Cambridge University Press

Index. Index. More information.  in this web service Cambridge University Press A-type elements, 4 7, 18, 31, 168, 198, 202, 219, 220, 222, 225 A-type variables. See Across variable ac current, 172, 251 ac induction motor, 251 Acceleration rotational, 30 translational, 16 Accumulator,

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

Dynamics. describe the relationship between the joint actuator torques and the motion of the structure important role for

Dynamics. describe the relationship between the joint actuator torques and the motion of the structure important role for Dynamics describe the relationship between the joint actuator torques and the motion of the structure important role for simulation of motion (test control strategies) analysis of manipulator structures

More information

(W: 12:05-1:50, 50-N202)

(W: 12:05-1:50, 50-N202) 2016 School of Information Technology and Electrical Engineering at the University of Queensland Schedule of Events Week Date Lecture (W: 12:05-1:50, 50-N202) 1 27-Jul Introduction 2 Representing Position

More information

Robot Dynamics II: Trajectories & Motion

Robot Dynamics II: Trajectories & Motion Robot Dynamics II: Trajectories & Motion Are We There Yet? METR 4202: Advanced Control & Robotics Dr Surya Singh Lecture # 5 August 23, 2013 metr4202@itee.uq.edu.au http://itee.uq.edu.au/~metr4202/ 2013

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

Linear Shaft Motor Sizing Application Note

Linear Shaft Motor Sizing Application Note Linear Shaft Motor Sizing Application Note By Jeramé Chamberlain One of the most straightforward tasks in the design of a linear motion system is to specify a motor and drive combination that can provide

More information

B1-1. Closed-loop control. Chapter 1. Fundamentals of closed-loop control technology. Festo Didactic Process Control System

B1-1. Closed-loop control. Chapter 1. Fundamentals of closed-loop control technology. Festo Didactic Process Control System B1-1 Chapter 1 Fundamentals of closed-loop control technology B1-2 This chapter outlines the differences between closed-loop and openloop control and gives an introduction to closed-loop control technology.

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 Control Systems Part 3 Hanz Richter Department of Mechanical Engineering 2014 1 / 25 Electrical Impedance Electrical impedance: generalization of

More information

PRECISION CONTROL OF LINEAR MOTOR DRIVEN HIGH-SPEED/ACCELERATION ELECTRO-MECHANICAL SYSTEMS. Bin Yao

PRECISION CONTROL OF LINEAR MOTOR DRIVEN HIGH-SPEED/ACCELERATION ELECTRO-MECHANICAL SYSTEMS. Bin Yao PRECISION CONTROL OF LINEAR MOTOR DRIVEN HIGH-SPEED/ACCELERATION ELECTRO-MECHANICAL SYSTEMS Bin Yao Intelligent and Precision Control Laboratory School of Mechanical Engineering Purdue University West

More information

Example: DC Motor Speed Modeling

Example: DC Motor Speed Modeling Page 1 of 5 Example: DC Motor Speed Modeling Physical setup and system equations Design requirements MATLAB representation and open-loop response Physical setup and system equations A common actuator in

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

An Adaptive Iterative Learning Control for Robot Manipulator in Task Space

An Adaptive Iterative Learning Control for Robot Manipulator in Task Space INT J COMPUT COMMUN, ISSN 84-9836 Vol.7 (22), No. 3 (September), pp. 58-529 An Adaptive Iterative Learning Control for Robot Manipulator in Task Space T. Ngo, Y. Wang, T.L. Mai, J. Ge, M.H. Nguyen, S.N.

More information

EN Nonlinear Control and Planning in Robotics Lecture 3: Stability February 4, 2015

EN Nonlinear Control and Planning in Robotics Lecture 3: Stability February 4, 2015 EN530.678 Nonlinear Control and Planning in Robotics Lecture 3: Stability February 4, 2015 Prof: Marin Kobilarov 0.1 Model prerequisites Consider ẋ = f(t, x). We will make the following basic assumptions

More information

LIAPUNOV S STABILITY THEORY-BASED MODEL REFERENCE ADAPTIVE CONTROL FOR DC MOTOR

LIAPUNOV S STABILITY THEORY-BASED MODEL REFERENCE ADAPTIVE CONTROL FOR DC MOTOR LIAPUNOV S STABILITY THEORY-BASED MODEL REFERENCE ADAPTIVE CONTROL FOR DC MOTOR *Ganta Ramesh, # R. Hanumanth Nayak *#Assistant Professor in EEE, Gudlavalleru Engg College, JNTU, Kakinada University, Gudlavalleru

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

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

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

Lecture Schedule Week Date Lecture (M: 2:05p-3:50, 50-N202)

Lecture Schedule Week Date Lecture (M: 2:05p-3:50, 50-N202) J = x θ τ = J T F 2018 School of Information Technology and Electrical Engineering at the University of Queensland Lecture Schedule Week Date Lecture (M: 2:05p-3:50, 50-N202) 1 23-Jul Introduction + Representing

More information

RobotDoc B A S I C M O T O R C O N T R O L

RobotDoc B A S I C M O T O R C O N T R O L RobotDoc B A S I C M O T O R C O N T R O L We d like to Describe a single joint of an otherwise complex robot Describe a controller for the single joint Describe how to deal with the math of multiple joints

More information

SRV02-Series Rotary Experiment # 1. Position Control. Student Handout

SRV02-Series Rotary Experiment # 1. Position Control. Student Handout SRV02-Series Rotary Experiment # 1 Position Control Student Handout SRV02-Series Rotary Experiment # 1 Position Control Student Handout 1. Objectives The objective in this experiment is to introduce the

More information

for Articulated Robot Arms and Its Applications

for Articulated Robot Arms and Its Applications 141 Proceedings of the International Conference on Information and Automation, December 15-18, 25, Colombo, Sri Lanka. 1 Forcefree Control with Independent Compensation for Articulated Robot Arms and Its

More information

Mechatronics Modeling and Analysis of Dynamic Systems Case-Study Exercise

Mechatronics Modeling and Analysis of Dynamic Systems Case-Study Exercise Mechatronics Modeling and Analysis of Dynamic Systems Case-Study Exercise Goal: This exercise is designed to take a real-world problem and apply the modeling and analysis concepts discussed in class. As

More information

H-infinity Model Reference Controller Design for Magnetic Levitation System

H-infinity Model Reference Controller Design for Magnetic Levitation System H.I. Ali Control and Systems Engineering Department, University of Technology Baghdad, Iraq 6043@uotechnology.edu.iq H-infinity Model Reference Controller Design for Magnetic Levitation System Abstract-

More information

ECE557 Systems Control

ECE557 Systems Control ECE557 Systems Control Bruce Francis Course notes, Version.0, September 008 Preface This is the second Engineering Science course on control. It assumes ECE56 as a prerequisite. If you didn t take ECE56,

More information

Overview of the Seminar Topic

Overview of the Seminar Topic Overview of the Seminar Topic Simo Särkkä Laboratory of Computational Engineering Helsinki University of Technology September 17, 2007 Contents 1 What is Control Theory? 2 History

More information

ENGG4420 LECTURE 7. CHAPTER 1 BY RADU MURESAN Page 1. September :29 PM

ENGG4420 LECTURE 7. CHAPTER 1 BY RADU MURESAN Page 1. September :29 PM CHAPTER 1 BY RADU MURESAN Page 1 ENGG4420 LECTURE 7 September 21 10 2:29 PM MODELS OF ELECTRIC CIRCUITS Electric circuits contain sources of electric voltage and current and other electronic elements such

More information

Neural Network Control of Robot Manipulators and Nonlinear Systems

Neural Network Control of Robot Manipulators and Nonlinear Systems Neural Network Control of Robot Manipulators and Nonlinear Systems F.L. LEWIS Automation and Robotics Research Institute The University of Texas at Arlington S. JAG ANNATHAN Systems and Controls Research

More information

WHAT A SINGLE JOINT IS MADE OF RA

WHAT A SINGLE JOINT IS MADE OF RA Anthropomorphic robotics WHAT A SINGLE JOINT IS MADE OF Notation d F ( mv) mx Since links are physical objects with mass dt J J f i i J = moment of inertia F r F r Moment of inertia Around an axis m3 m1

More information

Robotics I. April 1, the motion starts and ends with zero Cartesian velocity and acceleration;

Robotics I. April 1, the motion starts and ends with zero Cartesian velocity and acceleration; Robotics I April, 6 Consider a planar R robot with links of length l = and l =.5. he end-effector should move smoothly from an initial point p in to a final point p fin in the robot workspace so that the

More information

R10 JNTUWORLD B 1 M 1 K 2 M 2. f(t) Figure 1

R10 JNTUWORLD B 1 M 1 K 2 M 2. f(t) Figure 1 Code No: R06 R0 SET - II B. Tech II Semester Regular Examinations April/May 03 CONTROL SYSTEMS (Com. to EEE, ECE, EIE, ECC, AE) Time: 3 hours Max. Marks: 75 Answer any FIVE Questions All Questions carry

More information

Adaptive Tracking and Parameter Estimation with Unknown High-Frequency Control Gains: A Case Study in Strictification

Adaptive Tracking and Parameter Estimation with Unknown High-Frequency Control Gains: A Case Study in Strictification Adaptive Tracking and Parameter Estimation with Unknown High-Frequency Control Gains: A Case Study in Strictification Michael Malisoff, Louisiana State University Joint with Frédéric Mazenc and Marcio

More information

Sensorless Torque and Speed Control of Traction Permanent Magnet Synchronous Motor for Railway Applications based on Model Reference Adaptive System

Sensorless Torque and Speed Control of Traction Permanent Magnet Synchronous Motor for Railway Applications based on Model Reference Adaptive System 5 th SASTech 211, Khavaran Higher-education Institute, Mashhad, Iran. May 12-14. 1 Sensorless Torue and Speed Control of Traction Permanent Magnet Synchronous Motor for Railway Applications based on Model

More information

Multibody simulation

Multibody simulation Multibody simulation Dynamics of a multibody system (Newton-Euler formulation) Dimitar Dimitrov Örebro University June 8, 2012 Main points covered Newton-Euler formulation forward dynamics inverse dynamics

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

INC 341 Feedback Control Systems: Lecture 3 Transfer Function of Dynamic Systems II

INC 341 Feedback Control Systems: Lecture 3 Transfer Function of Dynamic Systems II INC 341 Feedback Control Systems: Lecture 3 Transfer Function of Dynamic Systems II Asst. Prof. Dr.-Ing. Sudchai Boonto Department of Control Systems and Instrumentation Engineering King Mongkut s University

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

Robotics & Automation. Lecture 25. Dynamics of Constrained Systems, Dynamic Control. John T. Wen. April 26, 2007

Robotics & Automation. Lecture 25. Dynamics of Constrained Systems, Dynamic Control. John T. Wen. April 26, 2007 Robotics & Automation Lecture 25 Dynamics of Constrained Systems, Dynamic Control John T. Wen April 26, 2007 Last Time Order N Forward Dynamics (3-sweep algorithm) Factorization perspective: causal-anticausal

More information

Force/Position Regulation for Robot Manipulators with. Unmeasurable Velocities and Uncertain Gravity. Antonio Loria and Romeo Ortega

Force/Position Regulation for Robot Manipulators with. Unmeasurable Velocities and Uncertain Gravity. Antonio Loria and Romeo Ortega Force/Position Regulation for Robot Manipulators with Unmeasurable Velocities and Uncertain Gravity Antonio Loria and Romeo Ortega Universite de Tecnologie de Compiegne URA CNRS 87, HEUDIASYC, BP 69 6000,

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

Adaptive Neuro-Sliding Mode Control of PUMA 560 Robot Manipulator

Adaptive Neuro-Sliding Mode Control of PUMA 560 Robot Manipulator Journal of Automation, Mobile Robotics & Intelligent Systems VOLUME 1, N 4 216 Adaptive Neuro-Sliding Mode Control of PUMA 56 Robot Manipulator Submitted: 28 th June 216; accepted: 7 th October 216 Ali

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

Pierre Bigot 2 and Luiz C. G. de Souza 3

Pierre Bigot 2 and Luiz C. G. de Souza 3 INTERNATIONAL JOURNAL OF SYSTEMS APPLICATIONS, ENGINEERING & DEVELOPMENT Volume 8, 2014 Investigation of the State Dependent Riccati Equation (SDRE) adaptive control advantages for controlling non-linear

More information

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

DC Motor Position: System Modeling

DC Motor Position: System Modeling 1 of 7 01/03/2014 22:07 Tips Effects TIPS ABOUT BASICS INDEX NEXT INTRODUCTION CRUISE CONTROL MOTOR SPEED MOTOR POSITION SUSPENSION INVERTED PENDULUM SYSTEM MODELING ANALYSIS DC Motor Position: System

More information

An adaptive sliding mode control scheme for induction motor drives

An adaptive sliding mode control scheme for induction motor drives An adaptive sliding mode control scheme for induction motor drives Oscar Barambones, Patxi Alkorta, Aitor J. Garrido, I. Garrido and F.J. Maseda ABSTRACT An adaptive sliding-mode control system, which

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

DISTURBANCE ATTENUATION IN A MAGNETIC LEVITATION SYSTEM WITH ACCELERATION FEEDBACK

DISTURBANCE ATTENUATION IN A MAGNETIC LEVITATION SYSTEM WITH ACCELERATION FEEDBACK DISTURBANCE ATTENUATION IN A MAGNETIC LEVITATION SYSTEM WITH ACCELERATION FEEDBACK Feng Tian Department of Mechanical Engineering Marquette University Milwaukee, WI 53233 USA Email: feng.tian@mu.edu Kevin

More information

Trajectory Planning, Setpoint Generation and Feedforward for Motion Systems

Trajectory Planning, Setpoint Generation and Feedforward for Motion Systems 2 Trajectory Planning, Setpoint Generation and Feedforward for Motion Systems Paul Lambrechts Digital Motion Control (4K4), 23 Faculty of Mechanical Engineering, Control Systems Technology Group /42 2

More information