Robot Control Basics CS 685

Size: px
Start display at page:

Download "Robot Control Basics CS 685"

Transcription

1 Robot Control Basics CS 685

2 Control basics Use some concepts from control theory to understand and learn how to control robots Control Theory general field studies control and understanding of behavior of dynamical systems (robots, epidemics, biological systems, stock markets etc.)

3 Control basics Basic ingredients - state of the system current position of the robot - dynamics behavior of the systems as a function of time (description how system state changes as a function of time) - system of differential equations x = v cosθ y = v sinθ θ = ω x = [x, y,θ] x = f( x, u ) - control input which can affect the behavior u = [v,ω] - controller which takes some function of the goal, the state

4 Control basics Basic ingredients - controller which takes some function of the goal, the state - y output, measurement of some aspect of the state Feedback control how to compute the control based on output (state) and the desired objective r + - u x y Difference equations (examples) x k+1 = f( x k, u k )

5 Simple control strategies Moving to a point go to a point Consider a problem of moving to a point (x,y) How to control angular and linear velocity of the mobile robot Linear velocity proportional to distance Angular velocity steer towards the goal Following a line steer toward a line Angular velocity proportional to the combination distance from the line and also to alignment with the line

6 Moving to a point Differential drive robot go from the current pose to desired point with coordinates [x,y ] T [x, y, ] T = tan 1 y x v = K v p (x x) 2 +(y y) 2 )! = K h ( ) [x,y ] T [x, y, ] T y x {I} {R} Source P. Corke: Robotics, Vision and Control. Springer

7 Moving to a line Equation of a line Shortest distance of the robot the line Orientation of the line [x, y, ] T {I} {R} ax + by + c =0 d = [a, b, c][x, y, 1]T p a2 + b 2 = tan 1 d = K d d K d > 0 Steer towards the line and align the robot with the line a b h = K h ( )! = K d d + K h ( )

8 Following a path Same as going to the point now sequence of waypoints x(t),y(t) [x,y ] T = tan 1 y y p x x e = K v (x x) 2 +(y y) 2 ) d [x, y, ] T {I} {R} d distance behind the pursuit point v = K v e + K i Z! = K h ( ) edt Source P. Corke: Robotics, Vision and Control. Springer

9 More suitable alternative Feedback control Use state feedback controller At each instance of time compute a control law Given the current error between current and desired position Δy

10 Kinematic Position Control The kinematic of a differential drive mobile robot described in the initial frame {x I, y I, θ} is given by, Δy I x! cosθ = y! sinθ! θ 0 0 v 0 ω 1 relating the linear velocities in the direction of the x I and y I of the initial frame. Let α denote the angle between the x R axis of the robots reference frame and the vector connecting the center of the axle of the wheels with the final position. R. Siegwart, I. Nourbakhsh

11 Motion Control (kinematic control) 3.6 The objective of a kinematic controller is to follow a trajectory described by its position and/or velocity profiles as function of time. Motion control is not straight forward because mobile robots are non-holonomic systems. However, it has been studied by various research groups and some adequate solutions for (kinematic) motion control of a mobile robot system are available. Most controllers are not considering the dynamics of the system R. Siegwart, I. Nourbakhsh

12 Motion Control: Feedback Control Set intermediate positions lying on the requested path. Given a goal how to compute the control commands for linear and angular velocities to reach the desired configuration Problem statement Given arbitrary position and orientation of the robot how to reach desired goal orientation and position [x, y,θ] [x g, y g,θ g ] Δy R. Siegwart, I. Nourbakhsh

13 Motion Control: Feedback Control, Problem Statement y R ω (t) start v(t) θ x R e goal Find a control matrix K, if exists k11 k12 k13 K = k with k ij =k(t,e) such that the control of v(t) and ω(t) k k v( t) = K e = K ω ( t) R x y θ drives the error e to zero. lim e( t) = 0 t R. Siegwart, I. Nourbakhsh

14 Motion Control: Kinematic Position Control The kinematic of a differential drive mobile robot described in the initial frame {x I, y I, θ} is given by, I x! y!! θ = cosθ sinθ 0 0 v 0 ω 1 where and are the linear velocities in the direction of the x I and y I of the initial frame. Let α denote the angle between the x R axis of the robots reference frame and the vector connecting the center of the axle of the wheels with the final position.

15 Kinematic Position Control: Coordinates Transformation Coordinates transformation into polar coordinates with its origin at goal position: Δy System description, in the new polar coordinates α For from for

16 Kinematic Position Control: Remarks The coordinates transformation is not defined at x = y = 0; as in such a point the determinant of the Jacobian matrix of the transformation is not defined, i.e. it is unbounded For the forward direction of the robot points toward the goal, for it is the backward direction. By properly defining the forward direction of the robot at its initial configuration, it is always possible to have at t = 0. However this does not mean that α remains in I 1 for all time t.

17 Kinematic Position Control: The Control Law It can be shown, that with the feedback controlled system will drive the robot to ρ, α, β = 0, 0, 0 The control signal v has always constant sign, the direction of movement is kept positive or negative during movement ( ) ( ) parking maneuver is performed always in the most natural way and without ever inverting its motion.

18 Question: How to select the constant parameters k s so as to achieve that the error will go to zero Digression eigenvectors and eigenvalues review

19 Eigenvalues and Eigenvectors Motivated by solution to differential equations For square matrices! " v w $! = A % " v w $ % Suppose solution have this form of exponentials For scalar ODE s Substitute back to the equation and denote x as then eq. above is

20 Eigenvalues and Eigenvectors eigenvalue eigenvector Solve the equation: x is in the null space of λ is chosen such that (1) has a null space Computation of eigenvalues and eigenvectors (for dim 2,3) 1. Compute determinant 2. Find roots (eigenvalues) of the polynomial such that determinant = 0 3. For each eigenvalue solve the equation (1) For larger matrices alternative ways of computation

21 For the previous example Eigenvalues and Eigenvectors We will get special solutions to ODE Their linear combination is also a solution (due to the linearity of ) In the context of diff. equations special meaning Any solution can be expressed as linear combination Individual solutions correspond to modes

22 Eigenvalues and Eigenvectors Only special vectors are eigenvectors - such vectors whose direction will not be changed by the transformation A (only scale) - they correspond to normal modes of the system act independently Examples eigenvalues 2, 3 eigenvectors Whatever A does to an arbitrary vector is fully determined by its eigenvalues and eigenvectors

23 Previously - Eigenvalues and Eigenvectors For the previous example We will get special solutions to ODE The linear combination is also a solution (due to the linearity of ) In the context of diff. equations special meaning Any solution can be expressed as linear combination Individual solutions correspond to modes

24 Eigenvalues of linear system Given linear system of differential equations ẋ = Ax For 2 dimesional system (A is 2 x 2), A has two eigenvalues Define = 1 2 and = if if < 0 > 0 > 0 saddle node we have two cases 1. eigenvalues positive < 0 2. eigenvalues negative : stable nodes of the system

25 Kinematic Position Control: Resulting Path 3.6.2

26 Linearization But our system is not linear, e.g. cannot be written in the form ẋ = Ax

27 Some terminology We have derived kinematics equations of the robot Non-linear differential equation In our case x = f 1 (x,y,θ,v,ω) x = f (x,u) y = f 2 (x,y,θ,v,ω) θ = f 3 (x, y,θ,v,ω)

28 Jacobian Matrix Suppose you have two dim function Gradient operator Jacobian is defined as F x = J F Linearization of a function F (x) =F (x 0 )+J F (x 0 )dx Linearization of system of diff. equations ẋ = J F (x 0 )dx + F (x 0 )

29 Kinematic Position Control: Stability Issue Continuous linear time-invariant system is exponentially stable if and only of the system has eigenvalues (i.e. poles of input-to-output systems) with strictly negative real parts Exponential Stability is a form of asymptotic stability In practice the system will not blow up give unbounded output, when given an finite input and non-zero initial condition

30 Kinematic Position Control: Stability Issue It can further be shown, that the closed loop control system is locally exponentially stable if > β α ρ Proof: linearize around equilibrium for small x -> cos x = 1, sin x = x k ρ 0 ; k < 0 ; k k > 0 and the characteristic polynomial of the matrix A of all roots have negative real parts.

31 Quadcopters model Popular unmanned areal vehicles (description adopted from (Robotics, Vision and control book, P. Corke T 3 T 4 ω 3 x ω 4 T 1 T 2 y ω 1 z ω 2 2 Upward thrust T i = bω i moving up in the negative z dir. Lift const. b depends on air density, blade radius and chord length

32 Quadcopters Translational dynamics (Newton s law includes mass/ acceleration/ forces) (Gravity Total thrust (rotated to the world frame)! m v = " 0 0 mg $! 0 R B % " Rotations are generated by pairwise differences in rotor thrusts (d distance from the center) Rolling and pitching torques around x and y Torque in z yaw torque Q i = kω i 2 τ z = (Q 1 Q 2 +Q 3 Q 4 ) 0 0 T $, T = T i i=1..4 % Torque applied by the motor as opposed to Aerodynamic drag τ x = dt 4 dt 2 τ x = db(ω 4 2 ω 2 2 ) τ y = db(ω 1 2 ω 3 2 )

33 Quadcopter dynamics! " Rotational Dynamics, rot. acceleration in the airframe, Euler s eq. of motion J ω = ω J ω + Γ, Where J is 3x3 inertia matrix Γ = [τ x,τ y,τ z ] T Forces and torques acting of the airframe obtained integrating forward the eq. above and Newton s second law (prev. slide) T τ x τ y τ z $! = % " b b b b 0 db 0 db db 0 db 0 k k k k The goal of control is then derive proper thrust and torque to achieve desired goal compute the rotor speeds! $ % " Substitute these to translational and rotational dynamics and get forward dynamics equations of quadropter ω 1 2 ω 2 2 ω 3 2 ω 4 2 $ %! " ω 1 2 ω 2 2 ω 3 2 ω 4 2 $! = A 1 % " T τ x τ y τ z $ %

34 Inertia Matrix Rotational Inertia of a body in 3D is represented by a 3x3 symmetric matrix J! J = " J xx J xy J xz J xy J yy J yz J xz J yz J zz $ % Diagonal elements are moments of inertia and offdiagonal are products of inertia Inertia matrix is a constant and depends on the mass and the shape of the body

Manipulator Dynamics 2. Instructor: Jacob Rosen Advanced Robotic - MAE 263D - Department of Mechanical & Aerospace Engineering - UCLA

Manipulator Dynamics 2. Instructor: Jacob Rosen Advanced Robotic - MAE 263D - Department of Mechanical & Aerospace Engineering - UCLA Manipulator Dynamics 2 Forward Dynamics Problem Given: Joint torques and links geometry, mass, inertia, friction Compute: Angular acceleration of the links (solve differential equations) Solution Dynamic

More information

Artificial Intelligence & Neuro Cognitive Systems Fakultät für Informatik. Robot Dynamics. Dr.-Ing. John Nassour J.

Artificial Intelligence & Neuro Cognitive Systems Fakultät für Informatik. Robot Dynamics. Dr.-Ing. John Nassour J. Artificial Intelligence & Neuro Cognitive Systems Fakultät für Informatik Robot Dynamics Dr.-Ing. John Nassour 25.1.218 J.Nassour 1 Introduction Dynamics concerns the motion of bodies Includes Kinematics

More information

Rotational & Rigid-Body Mechanics. Lectures 3+4

Rotational & Rigid-Body Mechanics. Lectures 3+4 Rotational & Rigid-Body Mechanics Lectures 3+4 Rotational Motion So far: point objects moving through a trajectory. Next: moving actual dimensional objects and rotating them. 2 Circular Motion - Definitions

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

Translational and Rotational Dynamics!

Translational and Rotational Dynamics! Translational and Rotational Dynamics Robert Stengel Robotics and Intelligent Systems MAE 345, Princeton University, 217 Copyright 217 by Robert Stengel. All rights reserved. For educational use only.

More information

Today. Why idealized? Idealized physical models of robotic vehicles. Noise. Idealized physical models of robotic vehicles

Today. Why idealized? Idealized physical models of robotic vehicles. Noise. Idealized physical models of robotic vehicles PID controller COMP417 Introduction to Robotics and Intelligent Systems Kinematics and Dynamics Perhaps the most widely used controller in industry and robotics. Perhaps the easiest to code. You will also

More information

Review: control, feedback, etc. Today s topic: state-space models of systems; linearization

Review: control, feedback, etc. Today s topic: state-space models of systems; linearization Plan of the Lecture Review: control, feedback, etc Today s topic: state-space models of systems; linearization Goal: a general framework that encompasses all examples of interest Once we have mastered

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

CHAPTER 1. Introduction

CHAPTER 1. Introduction CHAPTER 1 Introduction Linear geometric control theory was initiated in the beginning of the 1970 s, see for example, [1, 7]. A good summary of the subject is the book by Wonham [17]. The term geometric

More information

ARW Lecture 04 Point Tracking

ARW Lecture 04 Point Tracking ARW Lecture 04 Point Tracking Instructor: Chris Clark Semester: Summer 2016 1 Figures courtesy of Siegwart & Nourbakhsh Planning Based Control Prior Knowledge Operator Commands Localization Path Planning

More information

Robot Dynamics - Rotary Wing UAS: Control of a Quadrotor

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

More information

Rotor reference axis

Rotor reference axis Rotor reference axis So far we have used the same reference axis: Z aligned with the rotor shaft Y perpendicular to Z and along the blade (in the rotor plane). X in the rotor plane and perpendicular do

More information

Quadcopter Dynamics 1

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

More information

Quaternion-Based Tracking Control Law Design For Tracking Mode

Quaternion-Based Tracking Control Law Design For Tracking Mode A. M. Elbeltagy Egyptian Armed forces Conference on small satellites. 2016 Logan, Utah, USA Paper objectives Introduction Presentation Agenda Spacecraft combined nonlinear model Proposed RW nonlinear attitude

More information

UAV Coordinate Frames and Rigid Body Dynamics

UAV Coordinate Frames and Rigid Body Dynamics Brigham Young University BYU ScholarsArchive All Faculty Publications 24-- UAV oordinate Frames and Rigid Body Dynamics Randal Beard beard@byu.edu Follow this and additional works at: https://scholarsarchive.byu.edu/facpub

More information

Rotational Motion. Chapter 4. P. J. Grandinetti. Sep. 1, Chem P. J. Grandinetti (Chem. 4300) Rotational Motion Sep.

Rotational Motion. Chapter 4. P. J. Grandinetti. Sep. 1, Chem P. J. Grandinetti (Chem. 4300) Rotational Motion Sep. Rotational Motion Chapter 4 P. J. Grandinetti Chem. 4300 Sep. 1, 2017 P. J. Grandinetti (Chem. 4300) Rotational Motion Sep. 1, 2017 1 / 76 Angular Momentum The angular momentum of a particle with respect

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

Classical Mechanics. Luis Anchordoqui

Classical Mechanics. Luis Anchordoqui 1 Rigid Body Motion Inertia Tensor Rotational Kinetic Energy Principal Axes of Rotation Steiner s Theorem Euler s Equations for a Rigid Body Eulerian Angles Review of Fundamental Equations 2 Rigid body

More information

Nonholonomic Constraints Examples

Nonholonomic Constraints Examples Nonholonomic Constraints Examples Basilio Bona DAUIN Politecnico di Torino July 2009 B. Bona (DAUIN) Examples July 2009 1 / 34 Example 1 Given q T = [ x y ] T check that the constraint φ(q) = (2x + siny

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

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

Extremal Trajectories for Bounded Velocity Differential Drive Robots

Extremal Trajectories for Bounded Velocity Differential Drive Robots Extremal Trajectories for Bounded Velocity Differential Drive Robots Devin J. Balkcom Matthew T. Mason Robotics Institute and Computer Science Department Carnegie Mellon University Pittsburgh PA 523 Abstract

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

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

(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

Linear Systems Theory

Linear Systems Theory ME 3253 Linear Systems Theory Review Class Overview and Introduction 1. How to build dynamic system model for physical system? 2. How to analyze the dynamic system? -- Time domain -- Frequency domain (Laplace

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

Phys 7221 Homework # 8

Phys 7221 Homework # 8 Phys 71 Homework # 8 Gabriela González November 15, 6 Derivation 5-6: Torque free symmetric top In a torque free, symmetric top, with I x = I y = I, the angular velocity vector ω in body coordinates with

More information

6. 3D Kinematics DE2-EA 2.1: M4DE. Dr Connor Myant

6. 3D Kinematics DE2-EA 2.1: M4DE. Dr Connor Myant DE2-EA 2.1: M4DE Dr Connor Myant 6. 3D Kinematics Comments and corrections to connor.myant@imperial.ac.uk Lecture resources may be found on Blackboard and at http://connormyant.com Contents Three-Dimensional

More information

Quadrotor Modeling and Control

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

More information

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

Time Response of Dynamic Systems! Multi-Dimensional Trajectories Position, velocity, and acceleration are vectors

Time Response of Dynamic Systems! Multi-Dimensional Trajectories Position, velocity, and acceleration are vectors Time Response of Dynamic Systems Robert Stengel Robotics and Intelligent Systems MAE 345, Princeton University, 217 Multi-dimensional trajectories Numerical integration Linear and nonlinear systems Linearization

More information

Lecture AC-1. Aircraft Dynamics. Copy right 2003 by Jon at h an H ow

Lecture AC-1. Aircraft Dynamics. Copy right 2003 by Jon at h an H ow Lecture AC-1 Aircraft Dynamics Copy right 23 by Jon at h an H ow 1 Spring 23 16.61 AC 1 2 Aircraft Dynamics First note that it is possible to develop a very good approximation of a key motion of an aircraft

More information

Control of a Car-Like Vehicle with a Reference Model and Particularization

Control of a Car-Like Vehicle with a Reference Model and Particularization Control of a Car-Like Vehicle with a Reference Model and Particularization Luis Gracia Josep Tornero Department of Systems and Control Engineering Polytechnic University of Valencia Camino de Vera s/n,

More information

CIS 4930/6930: Principles of Cyber-Physical Systems

CIS 4930/6930: Principles of Cyber-Physical Systems CIS 4930/6930: Principles of Cyber-Physical Systems Chapter 2: Continuous Dynamics Hao Zheng Department of Computer Science and Engineering University of South Florida H. Zheng (CSE USF) CIS 4930/6930:

More information

Lecture Note 1: Background

Lecture Note 1: Background ECE5463: Introduction to Robotics Lecture Note 1: Background Prof. Wei Zhang Department of Electrical and Computer Engineering Ohio State University Columbus, Ohio, USA Spring 2018 Lecture 1 (ECE5463 Sp18)

More information

Circumnavigation with a group of quadrotor helicopters

Circumnavigation with a group of quadrotor helicopters Circumnavigation with a group of quadrotor helicopters JOHANNA ORIHUELA SWARTLING Master s Degree Project Stockholm, Sweden March 2014 XR-EE-RT 2014:007 Abstract The primary goal of this thesis has been

More information

Modelling of Opposed Lateral and Longitudinal Tilting Dual-Fan Unmanned Aerial Vehicle

Modelling of Opposed Lateral and Longitudinal Tilting Dual-Fan Unmanned Aerial Vehicle Modelling of Opposed Lateral and Longitudinal Tilting Dual-Fan Unmanned Aerial Vehicle N. Amiri A. Ramirez-Serrano R. Davies Electrical Engineering Department, University of Calgary, Canada (e-mail: namiri@ucalgary.ca).

More information

Torque and Rotation Lecture 7

Torque and Rotation Lecture 7 Torque and Rotation Lecture 7 ˆ In this lecture we finally move beyond a simple particle in our mechanical analysis of motion. ˆ Now we consider the so-called rigid body. Essentially, a particle with extension

More information

Dynamic Modeling of Fixed-Wing UAVs

Dynamic Modeling of Fixed-Wing UAVs Autonomous Systems Laboratory Dynamic Modeling of Fixed-Wing UAVs (Fixed-Wing Unmanned Aerial Vehicles) A. Noth, S. Bouabdallah and R. Siegwart Version.0 1/006 1 Introduction Dynamic modeling is an important

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, Geometry and Control - A Preview

Robotics, Geometry and Control - A Preview Robotics, Geometry and Control - A Preview Ravi Banavar 1 1 Systems and Control Engineering IIT Bombay HYCON-EECI Graduate School - Spring 2008 Broad areas Types of manipulators - articulated mechanisms,

More information

1/30. Rigid Body Rotations. Dave Frank

1/30. Rigid Body Rotations. Dave Frank . 1/3 Rigid Body Rotations Dave Frank A Point Particle and Fundamental Quantities z 2/3 m v ω r y x Angular Velocity v = dr dt = ω r Kinetic Energy K = 1 2 mv2 Momentum p = mv Rigid Bodies We treat a rigid

More information

Autonomous Underwater Vehicles: Equations of Motion

Autonomous Underwater Vehicles: Equations of Motion Autonomous Underwater Vehicles: Equations of Motion Monique Chyba - November 18, 2015 Departments of Mathematics, University of Hawai i at Mānoa Elective in Robotics 2015/2016 - Control of Unmanned Vehicles

More information

Dynamics and Control of Rotorcraft

Dynamics and Control of Rotorcraft Dynamics and Control of Rotorcraft Helicopter Aerodynamics and Dynamics Abhishek Department of Aerospace Engineering Indian Institute of Technology, Kanpur February 3, 2018 Overview Flight Dynamics Model

More information

Chapters 10 & 11: Rotational Dynamics Thursday March 8 th

Chapters 10 & 11: Rotational Dynamics Thursday March 8 th Chapters 10 & 11: Rotational Dynamics Thursday March 8 th Review of rotational kinematics equations Review and more on rotational inertia Rolling motion as rotation and translation Rotational kinetic energy

More information

Game Physics. Game and Media Technology Master Program - Utrecht University. Dr. Nicolas Pronost

Game Physics. Game and Media Technology Master Program - Utrecht University. Dr. Nicolas Pronost Game and Media Technology Master Program - Utrecht University Dr. Nicolas Pronost Rigid body physics Particle system Most simple instance of a physics system Each object (body) is a particle Each particle

More information

Rotational motion of a rigid body spinning around a rotational axis ˆn;

Rotational motion of a rigid body spinning around a rotational axis ˆn; Physics 106a, Caltech 15 November, 2018 Lecture 14: Rotations The motion of solid bodies So far, we have been studying the motion of point particles, which are essentially just translational. Bodies with

More information

General Physics I. Lecture 10: Rolling Motion and Angular Momentum.

General Physics I. Lecture 10: Rolling Motion and Angular Momentum. General Physics I Lecture 10: Rolling Motion and Angular Momentum Prof. WAN, Xin (万歆) 万歆 ) xinwan@zju.edu.cn http://zimp.zju.edu.cn/~xinwan/ Outline Rolling motion of a rigid object: center-of-mass motion

More information

Rigid bodies - general theory

Rigid bodies - general theory Rigid bodies - general theory Kinetic Energy: based on FW-26 Consider a system on N particles with all their relative separations fixed: it has 3 translational and 3 rotational degrees of freedom. Motion

More information

Previously Monte Carlo Integration

Previously Monte Carlo Integration Previously Simulation, sampling Monte Carlo Simulations Inverse cdf method Rejection sampling Today: sampling cont., Bayesian inference via sampling Eigenvalues and Eigenvectors Markov processes, PageRank

More information

CP1 REVISION LECTURE 3 INTRODUCTION TO CLASSICAL MECHANICS. Prof. N. Harnew University of Oxford TT 2017

CP1 REVISION LECTURE 3 INTRODUCTION TO CLASSICAL MECHANICS. Prof. N. Harnew University of Oxford TT 2017 CP1 REVISION LECTURE 3 INTRODUCTION TO CLASSICAL MECHANICS Prof. N. Harnew University of Oxford TT 2017 1 OUTLINE : CP1 REVISION LECTURE 3 : INTRODUCTION TO CLASSICAL MECHANICS 1. Angular velocity and

More information

Lecture II: Rigid-Body Physics

Lecture II: Rigid-Body Physics Rigid-Body Motion Previously: Point dimensionless objects moving through a trajectory. Today: Objects with dimensions, moving as one piece. 2 Rigid-Body Kinematics Objects as sets of points. Relative distances

More information

Stress, Strain, Mohr s Circle

Stress, Strain, Mohr s Circle Stress, Strain, Mohr s Circle The fundamental quantities in solid mechanics are stresses and strains. In accordance with the continuum mechanics assumption, the molecular structure of materials is neglected

More information

Kinematics (special case) Dynamics gravity, tension, elastic, normal, friction. Energy: kinetic, potential gravity, spring + work (friction)

Kinematics (special case) Dynamics gravity, tension, elastic, normal, friction. Energy: kinetic, potential gravity, spring + work (friction) Kinematics (special case) a = constant 1D motion 2D projectile Uniform circular Dynamics gravity, tension, elastic, normal, friction Motion with a = constant Newton s Laws F = m a F 12 = F 21 Time & Position

More information

Dynamical Systems & Lyapunov Stability

Dynamical Systems & Lyapunov Stability Dynamical Systems & Lyapunov Stability Harry G. Kwatny Department of Mechanical Engineering & Mechanics Drexel University Outline Ordinary Differential Equations Existence & uniqueness Continuous dependence

More information

NONLINEAR PATH CONTROL FOR A DIFFERENTIAL DRIVE MOBILE ROBOT

NONLINEAR PATH CONTROL FOR A DIFFERENTIAL DRIVE MOBILE ROBOT NONLINEAR PATH CONTROL FOR A DIFFERENTIAL DRIVE MOBILE ROBOT Plamen PETROV Lubomir DIMITROV Technical University of Sofia Bulgaria Abstract. A nonlinear feedback path controller for a differential drive

More information

The Jacobian. Jesse van den Kieboom

The Jacobian. Jesse van den Kieboom The Jacobian Jesse van den Kieboom jesse.vandenkieboom@epfl.ch 1 Introduction 1 1 Introduction The Jacobian is an important concept in robotics. Although the general concept of the Jacobian in robotics

More information

A motion planner for nonholonomic mobile robots

A motion planner for nonholonomic mobile robots A motion planner for nonholonomic mobile robots Miguel Vargas Material taken form: J. P. Laumond, P. E. Jacobs, M. Taix, R. M. Murray. A motion planner for nonholonomic mobile robots. IEEE Transactions

More information

Chapter 1 Lecture 2. Introduction 2. Topics. Chapter-1

Chapter 1 Lecture 2. Introduction 2. Topics. Chapter-1 Chapter 1 Lecture 2 Introduction 2 Topics 1.4 Equilibrium of airplane 1.5 Number of equations of motion for airplane in flight 1.5.1 Degrees of freedom 1.5.2 Degrees of freedom for a rigid airplane 1.6

More information

EE Homework 3 Due Date: 03 / 30 / Spring 2015

EE Homework 3 Due Date: 03 / 30 / Spring 2015 EE 476 - Homework 3 Due Date: 03 / 30 / 2015 Spring 2015 Exercise 1 (10 points). Consider the problem of two pulleys and a mass discussed in class. We solved a version of the problem where the mass was

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

Topic # /31 Feedback Control Systems. Analysis of Nonlinear Systems Lyapunov Stability Analysis

Topic # /31 Feedback Control Systems. Analysis of Nonlinear Systems Lyapunov Stability Analysis Topic # 16.30/31 Feedback Control Systems Analysis of Nonlinear Systems Lyapunov Stability Analysis Fall 010 16.30/31 Lyapunov Stability Analysis Very general method to prove (or disprove) stability of

More information

In the presence of viscous damping, a more generalized form of the Lagrange s equation of motion can be written as

In the presence of viscous damping, a more generalized form of the Lagrange s equation of motion can be written as 2 MODELING Once the control target is identified, which includes the state variable to be controlled (ex. speed, position, temperature, flow rate, etc), and once the system drives are identified (ex. force,

More information

Lesson Rigid Body Dynamics

Lesson Rigid Body Dynamics Lesson 8 Rigid Body Dynamics Lesson 8 Outline Problem definition and motivations Dynamics of rigid bodies The equation of unconstrained motion (ODE) User and time control Demos / tools / libs Rigid Body

More information

Chapter 6: Momentum Analysis

Chapter 6: Momentum Analysis 6-1 Introduction 6-2Newton s Law and Conservation of Momentum 6-3 Choosing a Control Volume 6-4 Forces Acting on a Control Volume 6-5Linear Momentum Equation 6-6 Angular Momentum 6-7 The Second Law of

More information

9 Kinetics of 3D rigid bodies - rotating frames

9 Kinetics of 3D rigid bodies - rotating frames 9 Kinetics of 3D rigid bodies - rotating frames 9. Consider the two gears depicted in the figure. The gear B of radius R B is fixed to the ground, while the gear A of mass m A and radius R A turns freely

More information

Control of Mobile Robots Prof. Luca Bascetta

Control of Mobile Robots Prof. Luca Bascetta Control of Mobile Robots Prof. Luca Bascetta EXERCISE 1 1. Consider a wheel rolling without slipping on the horizontal plane, keeping the sagittal plane in the vertical direction. Write the expression

More information

Engineering Mechanics

Engineering Mechanics 2019 MPROVEMENT Mechanical Engineering Engineering Mechanics Answer Key of Objective & Conventional Questions 1 System of forces, Centoriod, MOI 1. (c) 2. (b) 3. (a) 4. (c) 5. (b) 6. (c) 7. (b) 8. (b)

More information

Chapter 4 The Equations of Motion

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

More information

3 2 6 Solve the initial value problem u ( t) 3. a- If A has eigenvalues λ =, λ = 1 and corresponding eigenvectors 1

3 2 6 Solve the initial value problem u ( t) 3. a- If A has eigenvalues λ =, λ = 1 and corresponding eigenvectors 1 Math Problem a- If A has eigenvalues λ =, λ = 1 and corresponding eigenvectors 1 3 6 Solve the initial value problem u ( t) = Au( t) with u (0) =. 3 1 u 1 =, u 1 3 = b- True or false and why 1. if A is

More information

EN Nonlinear Control and Planning in Robotics Lecture 2: System Models January 28, 2015

EN Nonlinear Control and Planning in Robotics Lecture 2: System Models January 28, 2015 EN53.678 Nonlinear Control and Planning in Robotics Lecture 2: System Models January 28, 25 Prof: Marin Kobilarov. Constraints The configuration space of a mechanical sysetm is denoted by Q and is assumed

More information

Lecture 13 REVIEW. Physics 106 Spring What should we know? What should we know? Newton s Laws

Lecture 13 REVIEW. Physics 106 Spring What should we know? What should we know? Newton s Laws Lecture 13 REVIEW Physics 106 Spring 2006 http://web.njit.edu/~sirenko/ What should we know? Vectors addition, subtraction, scalar and vector multiplication Trigonometric functions sinθ, cos θ, tan θ,

More information

, respectively to the inverse and the inverse differential problem. Check the correctness of the obtained results. Exercise 2 y P 2 P 1.

, respectively to the inverse and the inverse differential problem. Check the correctness of the obtained results. Exercise 2 y P 2 P 1. Robotics I July 8 Exercise Define the orientation of a rigid body in the 3D space through three rotations by the angles α β and γ around three fixed axes in the sequence Y X and Z and determine the associated

More information

Aircraft Maneuver Regulation: a Receding Horizon Backstepping Approach

Aircraft Maneuver Regulation: a Receding Horizon Backstepping Approach Aircraft Maneuver Regulation: a Receding Horizon Backstepping Approach Giuseppe Notarstefano and Ruggero Frezza Abstract Coordinated flight is a nonholonomic constraint that implies no sideslip of an aircraft.

More information

Lecture 41: Highlights

Lecture 41: Highlights Lecture 41: Highlights The goal of this lecture is to remind you of some of the key points that we ve covered this semester Note that this is not the complete set of topics that may appear on the final

More information

Rigid body simulation. Once we consider an object with spatial extent, particle system simulation is no longer sufficient

Rigid body simulation. Once we consider an object with spatial extent, particle system simulation is no longer sufficient Rigid body dynamics Rigid body simulation Once we consider an object with spatial extent, particle system simulation is no longer sufficient Rigid body simulation Unconstrained system no contact Constrained

More information

Chapter 6 Dynamics I: Motion Along a Line

Chapter 6 Dynamics I: Motion Along a Line Chapter 6 Dynamics I: Motion Along a Line Chapter Goal: To learn how to solve linear force-and-motion problems. Slide 6-2 Chapter 6 Preview Slide 6-3 Chapter 6 Preview Slide 6-4 Chapter 6 Preview Slide

More information

Physics 106a, Caltech 4 December, Lecture 18: Examples on Rigid Body Dynamics. Rotating rectangle. Heavy symmetric top

Physics 106a, Caltech 4 December, Lecture 18: Examples on Rigid Body Dynamics. Rotating rectangle. Heavy symmetric top Physics 106a, Caltech 4 December, 2018 Lecture 18: Examples on Rigid Body Dynamics I go through a number of examples illustrating the methods of solving rigid body dynamics. In most cases, the problem

More information

For a rigid body that is constrained to rotate about a fixed axis, the gravitational torque about the axis is

For a rigid body that is constrained to rotate about a fixed axis, the gravitational torque about the axis is Experiment 14 The Physical Pendulum The period of oscillation of a physical pendulum is found to a high degree of accuracy by two methods: theory and experiment. The values are then compared. Theory For

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

The Inverted Pendulum

The Inverted Pendulum Lab 1 The Inverted Pendulum Lab Objective: We will set up the LQR optimal control problem for the inverted pendulum and compute the solution numerically. Think back to your childhood days when, for entertainment

More information

2.010 Fall 2000 Solution of Homework Assignment 1

2.010 Fall 2000 Solution of Homework Assignment 1 2. Fall 2 Solution of Homework Assignment. Compact Disk Player. This is essentially a reprise of Problems and 2 from the Fall 999 2.3 Homework Assignment 7. t is included here to encourage you to review

More information

AB-267 DYNAMICS & CONTROL OF FLEXIBLE AIRCRAFT

AB-267 DYNAMICS & CONTROL OF FLEXIBLE AIRCRAFT FLÁIO SILESTRE DYNAMICS & CONTROL OF FLEXIBLE AIRCRAFT LECTURE NOTES LAGRANGIAN MECHANICS APPLIED TO RIGID-BODY DYNAMICS IMAGE CREDITS: BOEING FLÁIO SILESTRE Introduction Lagrangian Mechanics shall be

More information

Forces of Rolling. 1) Ifobjectisrollingwith a com =0 (i.e.no netforces), then v com =ωr = constant (smooth roll)

Forces of Rolling. 1) Ifobjectisrollingwith a com =0 (i.e.no netforces), then v com =ωr = constant (smooth roll) Physics 2101 Section 3 March 12 rd : Ch. 10 Announcements: Mid-grades posted in PAW Quiz today I will be at the March APS meeting the week of 15-19 th. Prof. Rich Kurtz will help me. Class Website: http://www.phys.lsu.edu/classes/spring2010/phys2101-3/

More information

Line following of a mobile robot

Line following of a mobile robot Line following of a mobile robot May 18, 004 1 In brief... The project is about controlling a differential steering mobile robot so that it follows a specified track. Steering is achieved by setting different

More information

Rotational Kinetic Energy

Rotational Kinetic Energy Lecture 17, Chapter 10: Rotational Energy and Angular Momentum 1 Rotational Kinetic Energy Consider a rigid body rotating with an angular velocity ω about an axis. Clearly every point in the rigid body

More information

Physics 312, Winter 2007, Practice Final

Physics 312, Winter 2007, Practice Final Physics 312, Winter 2007, Practice Final Time: Two hours Answer one of Question 1 or Question 2 plus one of Question 3 or Question 4 plus one of Question 5 or Question 6. Each question carries equal weight.

More information

Mathematical Models for the Triaxial Attitude Control Testbed

Mathematical Models for the Triaxial Attitude Control Testbed Draft Article (For Engineering Journals) Mathematical Models for the Triaxial Attitude Control Testbed Sangbum Cho, Jinglai Shen, N. Harris McClamroch Department of Aerospace Engineering University of

More information

Dynamics of Open Chains

Dynamics of Open Chains Chapter 9 Dynamics of Open Chains According to Newton s second law of motion, any change in the velocity of a rigid body is caused by external forces and torques In this chapter we study once again the

More information

PLANAR KINETIC EQUATIONS OF MOTION (Section 17.2)

PLANAR KINETIC EQUATIONS OF MOTION (Section 17.2) PLANAR KINETIC EQUATIONS OF MOTION (Section 17.2) We will limit our study of planar kinetics to rigid bodies that are symmetric with respect to a fixed reference plane. As discussed in Chapter 16, when

More information

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

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

More information

Autonomous Mobile Robot Design

Autonomous Mobile Robot Design Autonomous Mobile Robot Design Topic: Micro Aerial Vehicle Dynamics Dr. Kostas Alexis (CSE) Goal of this lecture The goal of this lecture is to derive the equations of motion that describe the motion of

More information

General Definition of Torque, final. Lever Arm. General Definition of Torque 7/29/2010. Units of Chapter 10

General Definition of Torque, final. Lever Arm. General Definition of Torque 7/29/2010. Units of Chapter 10 Units of Chapter 10 Determining Moments of Inertia Rotational Kinetic Energy Rotational Plus Translational Motion; Rolling Why Does a Rolling Sphere Slow Down? General Definition of Torque, final Taking

More information

Rotational Motion. Rotational Motion. Rotational Motion

Rotational Motion. Rotational Motion. Rotational Motion I. Rotational Kinematics II. Rotational Dynamics (Netwton s Law for Rotation) III. Angular Momentum Conservation 1. Remember how Newton s Laws for translational motion were studied: 1. Kinematics (x =

More information

Symmetries 2 - Rotations in Space

Symmetries 2 - Rotations in Space Symmetries 2 - Rotations in Space This symmetry is about the isotropy of space, i.e. space is the same in all orientations. Thus, if we continuously rotated an entire system in space, we expect the system

More information

Assignment 9. to roll without slipping, how large must F be? Ans: F = R d mgsinθ.

Assignment 9. to roll without slipping, how large must F be? Ans: F = R d mgsinθ. Assignment 9 1. A heavy cylindrical container is being rolled up an incline as shown, by applying a force parallel to the incline. The static friction coefficient is µ s. The cylinder has radius R, mass

More information

ENGG 5402 Course Project: Simulation of PUMA 560 Manipulator

ENGG 5402 Course Project: Simulation of PUMA 560 Manipulator ENGG 542 Course Project: Simulation of PUMA 56 Manipulator ZHENG Fan, 115551778 mrzhengfan@gmail.com April 5, 215. Preface This project is to derive programs for simulation of inverse dynamics and control

More information

1 Trajectory Generation

1 Trajectory Generation CS 685 notes, J. Košecká 1 Trajectory Generation The material for these notes has been adopted from: John J. Craig: Robotics: Mechanics and Control. This example assumes that we have a starting position

More information

A Blade Element Approach to Modeling Aerodynamic Flight of an Insect-scale Robot

A Blade Element Approach to Modeling Aerodynamic Flight of an Insect-scale Robot A Blade Element Approach to Modeling Aerodynamic Flight of an Insect-scale Robot Taylor S. Clawson, Sawyer B. Fuller Robert J. Wood, Silvia Ferrari American Control Conference Seattle, WA May 25, 2016

More information