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

Size: px
Start display at page:

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

Transcription

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 rotation matrix R YXZ α β γ. Check if the determinant of this matrix has the correct value. Provide the analytical solutions to the inverse representation problem of an orientation specified by a rotation matrix R = {R ij } using the above angles {α β γ}. Discuss singular cases. Find the mapping between the time derivative φ = α β γ of the above minimal representation and the angular velocity ω of the rigid body. Discuss the invertibility of this mapping. When the desired orientation R d and the desired angular velocity ω d are R d = ω d = [rad/s] determine all associated solutions φ d = {α d β d γ d } and φ d = α d βd γ d respectively to the inverse and the inverse differential problem. Check the correctness of the obtained results. Exercise y P P q q E - E x Figure : A planar RP robot and the generic setup of a desired motion task. Consider the planar RP robot in Fig.. Define a computational scheme that generates joint-space commands at the acceleration level realizing a cyclic trajectory such that: the robot end effector starts at rest from point P at t = and returns there at t = with zero velocity; the path traced by the end effector is a circle of suitable radius passing through the point P and having there its tangent orthogonal to the segment P P ; the timing law along the Cartesian path is a polynomial of the least possible degree. Determine first symbolically and then numerically: the Cartesian velocity v R and acceleration a R when passing through the point P ; the associated joint velocity q R and joint acceleration q R of the RP robot; the numerical values of the above four quantities when using the data.5.5 P = [m] P = [m] = 3. [s]..5 How can the scheme be made robust w.r.t. disturbances and/or initial trajectory errors? [8 minutes open books but no computer or smartphone]

2 Solution July 8 Exercise he elementary rotation matrices around the three coordinate axes are cos α sin α R Y α = R X β = cos β sin β sin α cos α sin β cos β R Z γ = cos γ sin γ sin γ cos γ. Being the sequence YXZ of rotations defined around fixed axes i.e. of the Roll-Pitch-Yaw type the rotation matrix representing the final orientation of the rigid body is obtained by multiplying the elementary matrices in the following order: R YXZ α β γ = R Z γr X βr Y α cos α cos γ sin α sin β sin γ cos β sin γ sin α cos γ + cos α sin β sin γ = cos α sin γ + sin α sin β cos γ cos β cos γ sin α sin γ cos α sin β cos γ. sin α cos β sin β cos α cos β It is tedious but straightforward to check that det R YXZ = +. Given a rotation matrix R = {R ij } that uniquely specifies the orientation of a rigid body the inverse representation problem is solved as follows. he angle β is given by the analytic formula { } β = AAN R 3 ± R3 + R 33. Provided that R3 + R33 = cos β this formula provides two different solution values β and β depending on the choice of the sign in the second argument. For each of these the following formulas provide an associated solution pair α i γ i for i = : α = AAN { R 3 cos β R 33 cos β } γ = AAN { R cos β R cos β }. 3 herefore in the generic case two different solution triples are found φ = {α β γ } and φ = {α β γ }. In the singular case i.e. when R 3 = R 33 = and thus cos β = the problem reduces to cos α cos γ sin α sin β sin γ sin α cos γ + cos α sin β sin γ R R 3 cos α sin γ + sin α sin β cos γ sin α sin γ cos α sin β cos γ = R R 3. 4 sin β ± When R 3 = sin β = then β = π/ and the set of equations in 4 allows only to specify the sum of the two other angles as α + γ = AAN {R 3 R }. Similarly when R 3 = sin β = then β = π/ and the set of equations in 4 allows only to specify the difference of the two other angles as α γ = AAN {R 3 R }.

3 he mapping between the time derivative φ = α β γ of the above minimal representation and the angular velocity ω can be obtained in different ways. he easiest is probably to reinterpret eq. as a ZXY Euler sequence with reverse order of angles {γ β α} and to compute the three contributions to ω due to the variation of each angle around its current rotation axis. We have ω = ω γ Z + ω βx + ω α Y = γ + R Z γ β + R Z γr X β = γ + = cos γ sin γ β + cos β sin γ cos γ cos β cos γ sin γ sin β cos β sin γ cos β cos γ sin β α β γ α = β γ φ. α When det = cos β = we have a singularity of the transformation. herefore when β = ±π/ the dimension of the range of drops to two and there exists a one-dimensional subspace of angular velocities ω that cannot be represented by any choice of φ. hese are all ω = ω x ω y ω z R 3 which are orthogonal to the second column of i.e. such that With the data R d = ω x cos γ + ω y sin γ =. ω d = [rad/s] we see that this is not a singular situation R d3. herefore from eqs. 3 we find two solutions to the inverse representation problem: φ d = { } { π α d β d γ d = π } φ d = { } { α d β d γ d = π π π }. Accordingly we obtain two different transformation matrices d β d γ d = d β d γ d = γ d = I and therefore two different solutions to the inverse differential problem namely α d φ d = β d = d β d γ d ω d = [rad/s] φ d = α d β d γ d = d β d γ d ω d = [rad/s]. Indeed we can immediately check that d β d γ d φ d = d β d γ d φ d = ω d. 3

4 Exercise A generic circle with center at P = x y and radius R is defined by the quadratic equation x x + y y = R. 5 he unknown quantities in 5 can be determined by imposing the passage through the two points P = x y and P = x y i.e. x x + y y = R x x + y y = R whose solution for x y R generates two families of circles with increasing radius placed symmetrically with respect to the line passing through P and P. he additional condition of having a desired value for the path tangent at some point along the path will specify completely one circle in each family. he situation is particularly simple when requiring that the path tangent in P should be orthogonal to the segment P P. In fact this implies directly that the center P lies on this segment and therefore it coincides with its midpoint. A single circle is obtained in this special case with P = P + P = x + x y + y = y x y R = P P x x = + y y. 6 A parametric representation of the circular path 5 is given by x coss + φ ps = + R sins + φ s [ π] 7 where the circular path is traced counterclockwise for increasing s and the angle φ characterizes the starting point chosen on the circle. Being P the starting point i.e. for s = we have x x x cos φ x cos φ + R = R = y sin φ y sin φ y y 8 and thus φ = AAN{y y x x }. 9 he timing law st is given by a cubic polynomial which has in fact the least possible degree that guarantees satisfaction of the four boundary conditions herefore s = s = π ṡ = ṡ =. st = π 3 3 t t. For t = / it is s/ = π and thus pπ = P as it can be easily checked from 6 8. Differentiating twice 7 and respectively in space and time we obtain p s = dps sins + φ = R p s = d ps ds coss + φ ds = R coss + φ sins + φ 4

5 and herefore ṡt = dst dt = π t ṗt = p sṡt = Rπ t st = d st dt = π t. t t sins + φ coss + φ and thus using also 8 v = ṗ = p πṡ 3Rπ sin φ = = 3π y y. cos φ x x Similarly pt = p s st + p sṡ t = Rπ 44Rπ t sins + φ coss + φ t t coss + φ sins + φ 3 and thus being s/ = and using 8 a = p = p πṡ 9Rπ cos φ = = 9π x x sin φ. 4 y y Having fully specified the Cartesian trajectory and obtained in particular the requested quantities v and a consider now the execution of this trajectory by the RP robot. At t = the robot end effector should be placed in P. Solving this inverse kinematics problem we have q AAN{y x } q = = 5 q x + y where for simplicity we considered only the robot configuration facing point P i.e. with q >. he robot should start at rest and so q =. From this initial robot state which is matched with the Cartesian trajectory at the initial time t = we generate the desired cyclic trajectory using the acceleration command obtained by solving the second-order inverse differential kinematics or qt = J qt pt Jqt qt t [ ] 6 where pt is given by eq. 3 and we assumed that kinematic singularities are not encountered. he analytic Jacobian J and its time derivative J needed within 6 are found by differentiating the direct kinematics of the RP robot q cos q p = fq = q sin q yielding q sin q cos q ṗ = Jq q with Jq = q cos q sin q 5

6 and p = Jq q + Jq q with Jq = q sin q q q cos q q sin q q cos q q q sin q q cos q. When passing through the point P the robot configuration is q q AAN{y x } = q =. 7 x + y hus the joint velocity at t = / when the robot end effector is in P will be q = J q ṗ = J q v = 3π sin q q q cos q cos q q sin q y y x x 8 where the values of q / and q / are given by eq. 7 and we used v as defined in. Similarly the requested joint acceleration at t = / is q = J q p Jq q = J q a Jq q [ = q sin q cos q q cos q q sin q q sin q q q cos q q cos q q q sin q 9π x x y y q sin q q cos q q ] where the values of q / and q / are given by eq. 7 q/ comes from eq. 8 and we used a as defined in 4. Substituting the numerical values.5 P = [m] P =.5 [m].5 = 3. [s] we obtain from 6 and 9 x.5 P = = [m] R = =.559 [m] φ = =.4636 [rad].5 y and thus from 7 ps = We evaluate then and 4 obtaining v = coss s [ π]..5 sins [m/s] a = [m/s ]

7 he robot configurations at the initial time t = and at the halftime t = / =.6 s are computed from eqs. 5 and 7 q = while 8 and 9 yield q.6 =.588 [rad].88 [m].473 [rad/s].699 [m/s] q.6 = q.6 =.49 [rad].58 [m].735 [rad/s ].655 [m/s ] he planned Cartesian task is sketched in Fig. while the evolution of the joint positions and velocities associated to the computational scheme 6 are shown in Figs. 3 and 4.. y P v a P R P q q x Figure : he planned Cartesian motion with the RP robot in the correct initial position at t =.. robot joint variables.8 joint/blue [rad] joint/red [m] time s Figure 3: Joint positions of the RP robot while executing the task in Fig.. 7

8 .5 robot joint velocities joint/blue [rad/s] joint/red [m/s] time s Figure 4: Joint velocities of the RP robot while executing the task in Fig.. Finally if there is an initial mismatch of the robot state with respect to the desired Cartesian trajectory p d t at t = or if an external disturbance will bring the robot end effector out of its nominal trajectory a feedback modification of the scheme 6 is needed. In order to recover the tracking errors the following control law should be used q = J q p d + K D ṗ d Jq q + K P p d fq Jq q with diagonal gain matrices K P > and K D > and where the desired motion in position velocity and acceleration is specified by 7 and 3 respectively. he control law robustifies the robot behavior also with respect to numerical approximations due to a discretetime implementation of the scheme. 8

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

Robotics I. Figure 1: Initial placement of a rigid thin rod of length L in an absolute reference frame.

Robotics I. Figure 1: Initial placement of a rigid thin rod of length L in an absolute reference frame. Robotics I September, 7 Exercise Consider the rigid body in Fig., a thin rod of length L. The rod will be rotated by an angle α around the z axis, then by an angle β around the resulting x axis, and finally

More information

Robotics I. June 6, 2017

Robotics I. June 6, 2017 Robotics I June 6, 217 Exercise 1 Consider the planar PRPR manipulator in Fig. 1. The joint variables defined therein are those used by the manufacturer and do not correspond necessarily to a Denavit-Hartenberg

More information

Robotics I June 11, 2018

Robotics I June 11, 2018 Exercise 1 Robotics I June 11 018 Consider the planar R robot in Fig. 1 having a L-shaped second link. A frame RF e is attached to the gripper mounted on the robot end effector. A B y e C x e Figure 1:

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

Differential Kinematics

Differential Kinematics Differential Kinematics Relations between motion (velocity) in joint space and motion (linear/angular velocity) in task space (e.g., Cartesian space) Instantaneous velocity mappings can be obtained through

More information

Inverse differential kinematics Statics and force transformations

Inverse differential kinematics Statics and force transformations Robotics 1 Inverse differential kinematics Statics and force transformations Prof Alessandro De Luca Robotics 1 1 Inversion of differential kinematics! find the joint velocity vector that realizes a desired

More information

Robotics I. February 6, 2014

Robotics I. February 6, 2014 Robotics I February 6, 214 Exercise 1 A pan-tilt 1 camera sensor, such as the commercial webcams in Fig. 1, is mounted on the fixed base of a robot manipulator and is used for pointing at a (point-wise)

More information

Position and orientation of rigid bodies

Position and orientation of rigid bodies Robotics 1 Position and orientation of rigid bodies Prof. Alessandro De Luca Robotics 1 1 Position and orientation right-handed orthogonal Reference Frames RF A A p AB B RF B rigid body position: A p AB

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

Robotics I. Classroom Test November 21, 2014

Robotics I. Classroom Test November 21, 2014 Robotics I Classroom Test November 21, 2014 Exercise 1 [6 points] In the Unimation Puma 560 robot, the DC motor that drives joint 2 is mounted in the body of link 2 upper arm and is connected to the joint

More information

Robotics I. Test November 29, 2013

Robotics I. Test November 29, 2013 Exercise 1 [6 points] Robotics I Test November 9, 013 A DC motor is used to actuate a single robot link that rotates in the horizontal plane around a joint axis passing through its base. The motor is connected

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

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

Robotics 1 Inverse kinematics

Robotics 1 Inverse kinematics Robotics 1 Inverse kinematics Prof. Alessandro De Luca Robotics 1 1 Inverse kinematics what are we looking for? direct kinematics is always unique; how about inverse kinematics for this 6R robot? Robotics

More information

Trajectory tracking & Path-following control

Trajectory tracking & Path-following control Cooperative Control of Multiple Robotic Vehicles: Theory and Practice Trajectory tracking & Path-following control EECI Graduate School on Control Supélec, Feb. 21-25, 2011 A word about T Tracking and

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

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

Lecture Note 4: General Rigid Body Motion

Lecture Note 4: General Rigid Body Motion ECE5463: Introduction to Robotics Lecture Note 4: General Rigid Body Motion Prof. Wei Zhang Department of Electrical and Computer Engineering Ohio State University Columbus, Ohio, USA Spring 2018 Lecture

More information

Lecture D4 - Intrinsic Coordinates

Lecture D4 - Intrinsic Coordinates J. Peraire 16.07 Dynamics Fall 2004 Version 1.1 Lecture D4 - Intrinsic Coordinates In lecture D2 we introduced the position, velocity and acceleration vectors and referred them to a fixed cartesian coordinate

More information

Kinematics. Basilio Bona. Semester 1, DAUIN Politecnico di Torino. B. Bona (DAUIN) Kinematics Semester 1, / 15

Kinematics. Basilio Bona. Semester 1, DAUIN Politecnico di Torino. B. Bona (DAUIN) Kinematics Semester 1, / 15 Kinematics Basilio Bona DAUIN Politecnico di Torino Semester 1, 2016-17 B. Bona (DAUIN) Kinematics Semester 1, 2016-17 1 / 15 Introduction The kinematic quantities used to represent a body frame are: position

More information

Robotics 1 Inverse kinematics

Robotics 1 Inverse kinematics Robotics 1 Inverse kinematics Prof. Alessandro De Luca Robotics 1 1 Inverse kinematics what are we looking for? direct kinematics is always unique; how about inverse kinematics for this 6R robot? Robotics

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

Robotics 1 Inverse kinematics

Robotics 1 Inverse kinematics Robotics 1 Inverse kinematics Prof. Alessandro De Luca Robotics 1 1 Inverse kinematics what are we looking for? direct kinematics is always unique; how about inverse kinematics for this 6R robot? Robotics

More information

Kinematics. Basilio Bona. Semester 1, DAUIN Politecnico di Torino. B. Bona (DAUIN) Kinematics Semester 1, / 15

Kinematics. Basilio Bona. Semester 1, DAUIN Politecnico di Torino. B. Bona (DAUIN) Kinematics Semester 1, / 15 Kinematics Basilio Bona DAUIN Politecnico di Torino Semester 1, 2014-15 B. Bona (DAUIN) Kinematics Semester 1, 2014-15 1 / 15 Introduction The kinematic quantities used are: position r, linear velocity

More information

13 Path Planning Cubic Path P 2 P 1. θ 2

13 Path Planning Cubic Path P 2 P 1. θ 2 13 Path Planning Path planning includes three tasks: 1 Defining a geometric curve for the end-effector between two points. 2 Defining a rotational motion between two orientations. 3 Defining a time function

More information

Kinematics. Basilio Bona. October DAUIN - Politecnico di Torino. Basilio Bona (DAUIN - Politecnico di Torino) Kinematics October / 15

Kinematics. Basilio Bona. October DAUIN - Politecnico di Torino. Basilio Bona (DAUIN - Politecnico di Torino) Kinematics October / 15 Kinematics Basilio Bona DAUIN - Politecnico di Torino October 2013 Basilio Bona (DAUIN - Politecnico di Torino) Kinematics October 2013 1 / 15 Introduction The kinematic quantities used are: position r,

More information

Control of Electromechanical Systems

Control of Electromechanical Systems Control of Electromechanical Systems November 3, 27 Exercise Consider the feedback control scheme of the motor speed ω in Fig., where the torque actuation includes a time constant τ A =. s and a disturbance

More information

MEEN 363 Notes Copyright, Dara W. Childs

MEEN 363 Notes Copyright, Dara W. Childs MEEN 363 Notes Copyright, Dara W. Childs Lecture 1. PARTICLE KINEMATICS IN A PLANE Kinematics: Geometric in nature, defines motion without regard to forces that cause motion or result from motion. Kinetics:

More information

Name: MATH 3195 :: Fall 2011 :: Exam 2. No document, no calculator, 1h00. Explanations and justifications are expected for full credit.

Name: MATH 3195 :: Fall 2011 :: Exam 2. No document, no calculator, 1h00. Explanations and justifications are expected for full credit. Name: MATH 3195 :: Fall 2011 :: Exam 2 No document, no calculator, 1h00. Explanations and justifications are expected for full credit. 1. ( 4 pts) Say which matrix is in row echelon form and which is not.

More information

Robot Control Basics CS 685

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

More information

DIFFERENTIAL KINEMATICS. Geometric Jacobian. Analytical Jacobian. Kinematic singularities. Kinematic redundancy. Inverse differential kinematics

DIFFERENTIAL KINEMATICS. Geometric Jacobian. Analytical Jacobian. Kinematic singularities. Kinematic redundancy. Inverse differential kinematics DIFFERENTIAL KINEMATICS relationship between joint velocities and end-effector velocities Geometric Jacobian Analytical Jacobian Kinematic singularities Kinematic redundancy Inverse differential kinematics

More information

Rigid Geometric Transformations

Rigid Geometric Transformations Rigid Geometric Transformations Carlo Tomasi This note is a quick refresher of the geometry of rigid transformations in three-dimensional space, expressed in Cartesian coordinates. 1 Cartesian Coordinates

More information

Minimal representations of orientation

Minimal representations of orientation Robotics 1 Minimal representations of orientation (Euler and roll-pitch-yaw angles) Homogeneous transformations Prof. lessandro De Luca Robotics 1 1 Minimal representations rotation matrices: 9 elements

More information

Rigid Geometric Transformations

Rigid Geometric Transformations Rigid Geometric Transformations Carlo Tomasi This note is a quick refresher of the geometry of rigid transformations in three-dimensional space, expressed in Cartesian coordinates. 1 Cartesian Coordinates

More information

Math 302 Outcome Statements Winter 2013

Math 302 Outcome Statements Winter 2013 Math 302 Outcome Statements Winter 2013 1 Rectangular Space Coordinates; Vectors in the Three-Dimensional Space (a) Cartesian coordinates of a point (b) sphere (c) symmetry about a point, a line, and a

More information

Lecture 7: Kinematics: Velocity Kinematics - the Jacobian

Lecture 7: Kinematics: Velocity Kinematics - the Jacobian Lecture 7: Kinematics: Velocity Kinematics - the Jacobian Manipulator Jacobian c Anton Shiriaev. 5EL158: Lecture 7 p. 1/?? Lecture 7: Kinematics: Velocity Kinematics - the Jacobian Manipulator Jacobian

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

ROBOTICS 01PEEQW. Basilio Bona DAUIN Politecnico di Torino

ROBOTICS 01PEEQW. Basilio Bona DAUIN Politecnico di Torino ROBOTICS 01PEEQW Basilio Bona DAUIN Politecnico di Torino Kinematic Functions Kinematic functions Kinematics deals with the study of four functions(called kinematic functions or KFs) that mathematically

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

Interpolated Rigid-Body Motions and Robotics

Interpolated Rigid-Body Motions and Robotics Interpolated Rigid-Body Motions and Robotics J.M. Selig London South Bank University and Yuanqing Wu Shanghai Jiaotong University. IROS Beijing 2006 p.1/22 Introduction Interpolation of rigid motions important

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

Ridig Body Motion Homogeneous Transformations

Ridig Body Motion Homogeneous Transformations Ridig Body Motion Homogeneous Transformations Claudio Melchiorri Dipartimento di Elettronica, Informatica e Sistemistica (DEIS) Università di Bologna email: claudio.melchiorri@unibo.it C. Melchiorri (DEIS)

More information

MATH H53 : Mid-Term-1

MATH H53 : Mid-Term-1 MATH H53 : Mid-Term-1 22nd September, 215 Name: You have 8 minutes to answer the questions. Use of calculators or study materials including textbooks, notes etc. is not permitted. Answer the questions

More information

Kinematics. Chapter Multi-Body Systems

Kinematics. Chapter Multi-Body Systems Chapter 2 Kinematics This chapter first introduces multi-body systems in conceptual terms. It then describes the concept of a Euclidean frame in the material world, following the concept of a Euclidean

More information

Exam 1 January 31, 2012

Exam 1 January 31, 2012 Exam 1 Instructions: You have 60 minutes to complete this exam. This is a closed-book, closed-notes exam. You are allowed to use a calculator during the exam. Usage of mobile phones and other electronic

More information

Lecture Notes Multibody Dynamics B, wb1413

Lecture Notes Multibody Dynamics B, wb1413 Lecture Notes Multibody Dynamics B, wb1413 A. L. Schwab & Guido M.J. Delhaes Laboratory for Engineering Mechanics Mechanical Engineering Delft University of Technolgy The Netherlands June 9, 29 Contents

More information

ME Machine Design I. EXAM 1. OPEN BOOK AND CLOSED NOTES. Wednesday, September 30th, 2009

ME Machine Design I. EXAM 1. OPEN BOOK AND CLOSED NOTES. Wednesday, September 30th, 2009 ME - Machine Design I Fall Semester 009 Name Lab. Div. EXAM. OPEN BOOK AND CLOSED NOTES. Wednesday, September 0th, 009 Please use the blank paper provided for your solutions. Write on one side of the paper

More information

3 Space curvilinear motion, motion in non-inertial frames

3 Space curvilinear motion, motion in non-inertial frames 3 Space curvilinear motion, motion in non-inertial frames 3.1 In-class problem A rocket of initial mass m i is fired vertically up from earth and accelerates until its fuel is exhausted. The residual mass

More information

Institute of Geometry, Graz, University of Technology Mobile Robots. Lecture notes of the kinematic part of the lecture

Institute of Geometry, Graz, University of Technology   Mobile Robots. Lecture notes of the kinematic part of the lecture Institute of Geometry, Graz, University of Technology www.geometrie.tugraz.at Institute of Geometry Mobile Robots Lecture notes of the kinematic part of the lecture Anton Gfrerrer nd Edition 4 . Contents

More information

Zeros and zero dynamics

Zeros and zero dynamics CHAPTER 4 Zeros and zero dynamics 41 Zero dynamics for SISO systems Consider a linear system defined by a strictly proper scalar transfer function that does not have any common zero and pole: g(s) =α p(s)

More information

Interpolation. Create a program for linear interpolation of a three axis manufacturing machine with a constant

Interpolation. Create a program for linear interpolation of a three axis manufacturing machine with a constant QUESTION 1 Create a program for linear interpolation of a three axis manufacturing machine with a constant velocity profile. The inputs are the initial and final positions, feed rate, and sample period.

More information

EXAM 1. OPEN BOOK AND CLOSED NOTES Thursday, February 18th, 2010

EXAM 1. OPEN BOOK AND CLOSED NOTES Thursday, February 18th, 2010 ME 35 - Machine Design I Spring Semester 010 Name of Student Lab. Div. Number EXAM 1. OPEN BOOK AND CLOSED NOTES Thursday, February 18th, 010 Please use the blank paper provided for your solutions. Write

More information

General Theoretical Concepts Related to Multibody Dynamics

General Theoretical Concepts Related to Multibody Dynamics General Theoretical Concepts Related to Multibody Dynamics Before Getting Started Material draws on two main sources Ed Haug s book, available online: http://sbel.wisc.edu/courses/me751/2010/bookhaugpointers.htm

More information

Rotation Basics. I. Angular Position A. Background

Rotation Basics. I. Angular Position A. Background Rotation Basics I. Angular Position A. Background Consider a student who is riding on a merry-go-round. We can represent the student s location by using either Cartesian coordinates or by using cylindrical

More information

Kinematics (2) - Motion in Three Dimensions

Kinematics (2) - Motion in Three Dimensions Kinematics (2) - Motion in Three Dimensions 1. Introduction Kinematics is a branch of mechanics which describes the motion of objects without consideration of the circumstances leading to the motion. 2.

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

Lie Groups for 2D and 3D Transformations

Lie Groups for 2D and 3D Transformations Lie Groups for 2D and 3D Transformations Ethan Eade Updated May 20, 2017 * 1 Introduction This document derives useful formulae for working with the Lie groups that represent transformations in 2D and

More information

8 Velocity Kinematics

8 Velocity Kinematics 8 Velocity Kinematics Velocity analysis of a robot is divided into forward and inverse velocity kinematics. Having the time rate of joint variables and determination of the Cartesian velocity of end-effector

More information

CONSTANT KINETIC ENERGY ROBOT TRAJECTORY PLANNING

CONSTANT KINETIC ENERGY ROBOT TRAJECTORY PLANNING PERIODICA POLYTECHNICA SER. MECH. ENG. VOL. 43, NO. 2, PP. 213 228 (1999) CONSTANT KINETIC ENERGY ROBOT TRAJECTORY PLANNING Zoltán ZOLLER and Peter ZENTAY Department of Manufacturing Engineering Technical

More information

Advanced Robotic Manipulation

Advanced Robotic Manipulation Lecture Notes (CS327A) Advanced Robotic Manipulation Oussama Khatib Stanford University Spring 2005 ii c 2005 by Oussama Khatib Contents 1 Spatial Descriptions 1 1.1 Rigid Body Configuration.................

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

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

Test 2 Review Math 1111 College Algebra

Test 2 Review Math 1111 College Algebra Test 2 Review Math 1111 College Algebra 1. Begin by graphing the standard quadratic function f(x) = x 2. Then use transformations of this graph to graph the given function. g(x) = x 2 + 2 *a. b. c. d.

More information

Curves in the configuration space Q or in the velocity phase space Ω satisfying the Euler-Lagrange (EL) equations,

Curves in the configuration space Q or in the velocity phase space Ω satisfying the Euler-Lagrange (EL) equations, Physics 6010, Fall 2010 Hamiltonian Formalism: Hamilton s equations. Conservation laws. Reduction. Poisson Brackets. Relevant Sections in Text: 8.1 8.3, 9.5 The Hamiltonian Formalism We now return to formal

More information

1. Vectors and Matrices

1. Vectors and Matrices E. 8.02 Exercises. Vectors and Matrices A. Vectors Definition. A direction is just a unit vector. The direction of A is defined by dir A = A, (A 0); A it is the unit vector lying along A and pointed like

More information

Handout 6: Rotational motion and moment of inertia. Angular velocity and angular acceleration

Handout 6: Rotational motion and moment of inertia. Angular velocity and angular acceleration 1 Handout 6: Rotational motion and moment of inertia Angular velocity and angular acceleration In Figure 1, a particle b is rotating about an axis along a circular path with radius r. The radius sweeps

More information

MCE/EEC 647/747: Robot Dynamics and Control. Lecture 2: Rigid Motions and Homogeneous Transformations

MCE/EEC 647/747: Robot Dynamics and Control. Lecture 2: Rigid Motions and Homogeneous Transformations MCE/EEC 647/747: Robot Dynamics and Control Lecture 2: Rigid Motions and Homogeneous Transformations Reading: SHV Chapter 2 Mechanical Engineering Hanz Richter, PhD MCE503 p.1/22 Representing Points, Vectors

More information

Multiple Integrals and Vector Calculus (Oxford Physics) Synopsis and Problem Sets; Hilary 2015

Multiple Integrals and Vector Calculus (Oxford Physics) Synopsis and Problem Sets; Hilary 2015 Multiple Integrals and Vector Calculus (Oxford Physics) Ramin Golestanian Synopsis and Problem Sets; Hilary 215 The outline of the material, which will be covered in 14 lectures, is as follows: 1. Introduction

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

MEAM 520. More Velocity Kinematics

MEAM 520. More Velocity Kinematics MEAM 520 More Velocity Kinematics Katherine J. Kuchenbecker, Ph.D. General Robotics, Automation, Sensing, and Perception Lab (GRASP) MEAM Department, SEAS, University of Pennsylvania Lecture 12: October

More information

MECH 576 Geometry in Mechanics November 30, 2009 Kinematics of Clavel s Delta Robot

MECH 576 Geometry in Mechanics November 30, 2009 Kinematics of Clavel s Delta Robot MECH 576 Geometry in Mechanics November 3, 29 Kinematics of Clavel s Delta Robot The DELTA Robot DELTA, a three dimensional translational manipulator, appears below in Fig.. Figure : Symmetrical (Conventional)

More information

Rigid Object. Chapter 10. Angular Position. Angular Position. A rigid object is one that is nondeformable

Rigid Object. Chapter 10. Angular Position. Angular Position. A rigid object is one that is nondeformable Rigid Object Chapter 10 Rotation of a Rigid Object about a Fixed Axis A rigid object is one that is nondeformable The relative locations of all particles making up the object remain constant All real objects

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 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

Linear Algebra and Robot Modeling

Linear Algebra and Robot Modeling Linear Algebra and Robot Modeling Nathan Ratliff Abstract Linear algebra is fundamental to robot modeling, control, and optimization. This document reviews some of the basic kinematic equations and uses

More information

Robot Dynamics Instantaneous Kinematiccs and Jacobians

Robot Dynamics Instantaneous Kinematiccs and Jacobians Robot Dynamics Instantaneous Kinematiccs and Jacobians 151-0851-00 V Lecture: Tuesday 10:15 12:00 CAB G11 Exercise: Tuesday 14:15 16:00 every 2nd week Marco Hutter, Michael Blösch, Roland Siegwart, Konrad

More information

Lecture 8: Kinematics: Path and Trajectory Planning

Lecture 8: Kinematics: Path and Trajectory Planning Lecture 8: Kinematics: Path and Trajectory Planning Concept of Configuration Space c Anton Shiriaev. 5EL158: Lecture 8 p. 1/20 Lecture 8: Kinematics: Path and Trajectory Planning Concept of Configuration

More information

Upon successful completion of MATH 220, the student will be able to:

Upon successful completion of MATH 220, the student will be able to: MATH 220 Matrices Upon successful completion of MATH 220, the student will be able to: 1. Identify a system of linear equations (or linear system) and describe its solution set 2. Write down the coefficient

More information

The Calculus of Vec- tors

The Calculus of Vec- tors Physics 2460 Electricity and Magnetism I, Fall 2007, Lecture 3 1 The Calculus of Vec- Summary: tors 1. Calculus of Vectors: Limits and Derivatives 2. Parametric representation of Curves r(t) = [x(t), y(t),

More information

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

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

1 Geometry of R Conic Sections Parametric Equations More Parametric Equations Polar Coordinates...

1 Geometry of R Conic Sections Parametric Equations More Parametric Equations Polar Coordinates... Contents 1 Geometry of R 1.1 Conic Sections............................................ 1. Parametric Equations........................................ 3 1.3 More Parametric Equations.....................................

More information

Position and orientation of rigid bodies

Position and orientation of rigid bodies Robotics 1 Position and orientation of rigid bodies Prof. Alessandro De Luca Robotics 1 1 Position and orientation right-handed orthogonal Reference Frames RF A A z A p AB B RF B z B x B y A rigid body

More information

RELATIVE MOTION ANALYSIS: VELOCITY (Section 16.5)

RELATIVE MOTION ANALYSIS: VELOCITY (Section 16.5) RELATIVE MOTION ANALYSIS: VELOCITY (Section 16.5) Today s Objectives: Students will be able to: a) Describe the velocity of a rigid body in terms of translation and rotation components. b) Perform a relative-motion

More information

In most robotic applications the goal is to find a multi-body dynamics description formulated

In most robotic applications the goal is to find a multi-body dynamics description formulated Chapter 3 Dynamics Mathematical models of a robot s dynamics provide a description of why things move when forces are generated in and applied on the system. They play an important role for both simulation

More information

Chapter 3 Numerical Methods

Chapter 3 Numerical Methods Chapter 3 Numerical Methods Part 3 3.4 Differential Algebraic Systems 3.5 Integration of Differential Equations 1 Outline 3.4 Differential Algebraic Systems 3.4.1 Constrained Dynamics 3.4.2 First and Second

More information

Numerical Methods for Rigid Multibody Dynamics

Numerical Methods for Rigid Multibody Dynamics Numerical Methods for Rigid Multibody Dynamics Claus Führer Centre for Mathematical Sciences Lund University Lappenranta 2012 Unit 0: Preface These notes serve as a skeleton for the compact course. They

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

NATIONAL BOARD FOR HIGHER MATHEMATICS. M. A. and M.Sc. Scholarship Test. September 19, Time Allowed: 150 Minutes Maximum Marks: 30

NATIONAL BOARD FOR HIGHER MATHEMATICS. M. A. and M.Sc. Scholarship Test. September 19, Time Allowed: 150 Minutes Maximum Marks: 30 NATIONAL BOARD FOR HIGHER MATHEMATICS M. A. and M.Sc. Scholarship Test September 19, 2015 Time Allowed: 150 Minutes Maximum Marks: 30 Please read, carefully, the instructions on the following page 1 INSTRUCTIONS

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

Dynamics 12e. Copyright 2010 Pearson Education South Asia Pte Ltd. Chapter 20 3D Kinematics of a Rigid Body

Dynamics 12e. Copyright 2010 Pearson Education South Asia Pte Ltd. Chapter 20 3D Kinematics of a Rigid Body Engineering Mechanics: Dynamics 12e Chapter 20 3D Kinematics of a Rigid Body Chapter Objectives Kinematics of a body subjected to rotation about a fixed axis and general plane motion. Relative-motion analysis

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

RIGID BODY MOTION (Section 16.1)

RIGID BODY MOTION (Section 16.1) RIGID BODY MOTION (Section 16.1) There are cases where an object cannot be treated as a particle. In these cases the size or shape of the body must be considered. Rotation of the body about its center

More information

Final Exam December 15, 2014

Final Exam December 15, 2014 Final Exam Instructions: You have 120 minutes to complete this exam. This is a closed-book, closed-notes exam. You are allowed to use the ME approved calculator only during the exam. Usage of mobile phones

More information

Solution to Homework 8, Math 2568

Solution to Homework 8, Math 2568 Solution to Homework 8, Math 568 S 5.4: No. 0. Use property of heorem 5 to test for linear independence in P 3 for the following set of cubic polynomials S = { x 3 x, x x, x, x 3 }. Solution: If we use

More information

Week Quadratic forms. Principal axes theorem. Text reference: this material corresponds to parts of sections 5.5, 8.2,

Week Quadratic forms. Principal axes theorem. Text reference: this material corresponds to parts of sections 5.5, 8.2, Math 051 W008 Margo Kondratieva Week 10-11 Quadratic forms Principal axes theorem Text reference: this material corresponds to parts of sections 55, 8, 83 89 Section 41 Motivation and introduction Consider

More information

Lecture IV: Time Discretization

Lecture IV: Time Discretization Lecture IV: Time Discretization Motivation Kinematics: continuous motion in continuous time Computer simulation: Discrete time steps t Discrete Space (mesh particles) Updating Position Force induces acceleration.

More information

Chapter 9 Uniform Circular Motion

Chapter 9 Uniform Circular Motion 9.1 Introduction Chapter 9 Uniform Circular Motion Special cases often dominate our study of physics, and circular motion is certainly no exception. We see circular motion in many instances in the world;

More information

Circular Motion, Pt 2: Angular Dynamics. Mr. Velazquez AP/Honors Physics

Circular Motion, Pt 2: Angular Dynamics. Mr. Velazquez AP/Honors Physics Circular Motion, Pt 2: Angular Dynamics Mr. Velazquez AP/Honors Physics Formulas: Angular Kinematics (θ must be in radians): s = rθ Arc Length 360 = 2π rads = 1 rev ω = θ t = v t r Angular Velocity α av

More information