Robotics I June 11, 2018

Size: px
Start display at page:

Download "Robotics I June 11, 2018"

Transcription

1 Exercise 1 Robotics I June 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: A planar R robot with L-shaped second link. Assign the link frames and define the joint variables q according to the Denavit-Hartenberg (DH) convention and complete the associated table of parameters. Determine the robot direct kinematics specifying the position p e (q) R 3 of the origin of frame RF e and the end-effector orientation as expressed by the rotation matri R e (q) SO(3). Sketch the robot in the zero configuration (q = 0); find and sketch also the configuration q s where the robot gripper is pointing in the direction and is the farthest away from axis. Draw the primary workspace of the robot using the symbolic values A B and C for the lengths. Provide all closed-form solutions to the inverse kinematics problem when the end-effector position p e R (i.e. reduced to the plane of motion) is given as input. Derive the Jacobian J in v e = J(q) q where v e = p e R is the linear velocity of the end-effector in the plane. Determine all singular configurations of the Jacobian matrix J(q). In each of these singularities provide a basis for the null space and the range space of J. Using the numerical data A = 0.6 B = 0.3 C = 0.4 [m] (1) find all joint configurations q sol associated to the end-effector position p e =( ) T [m]; for each q sol compute the joint velocity q sol that realizes the velocity v e = (1 0) T [m/s]; are these joint velocities equal or different in norm? why? Exercise For the robot in Exercise 1 find the minimum time rest-to-rest motion between q 0 = (1 0.5) T and q f = (0 0.) T [rad] when the joint velocities and accelerations are subject to the bounds q 1 V 1 = 0.5 [rad/s] q 1 A 1 = 0.8 [rad/s ] q V = 0.8 [rad/s] q A = 0.5 [rad/s ]. Draw accurately the minimum time velocity profiles of the two joints when a coordinated motion is also required. [180 minutes open books but no computer or smartphone] () 1

2 Solution June Exercise 1 A possible DH frame assignment and the associated table of parameters are reported in Fig. and Tab. 1 respectively. y 1 A q 1 q x1 D = B + C y e y x!" x e Figure : DH frame assignment for the planar R robot with a L-shaped second link. i α i a i d i θ i 1 0 A 0 q 1 0 D 0 q Table 1: Parameters associated to the DH frames in Fig.. Based on Tab. 1 the DH homogeneous transformation matrices are: cos q 1 sin q 1 0 A cos q 1 0 sin q 1 cos q 1 0 A sin q 0 1 A 1 (q 1 ) = = R 1 (q 1 ) 0 p 1 (q 1 ) 0 T cos q sin q 0 D cos q 1 sin q cos q 0 D sin q 1 A (q ) = = R (q ) 1 p (q ) 0 T where D = B + C > 0. Moreover the constant homogeneous transformation between the

3 (last) DH frame RF and the end-effector frame RF e is given by cos β sin β 0 0 sin β cos β 0 0 T e = = R e 0. 0 T with β = arctan(b/c) > 0. The requested direct kinematics is given by A cos q 1 + D cos(q 1 + q ) p e (q) = 0 p e (q) = 0 p 1 (q 1 ) + 0 R 1 (q 1 ) 1 pe (q) p (q ) = A sin q 1 + D sin(q 1 + q ) = 0 0 (3) and 0 R e (q) = 0 R 1 (q 1 ) 1 R (q ) R e = cos(q 1 + q + β) sin(q 1 + q + β) 0 sin(q 1 + q + β) cos(q 1 + q + β) 0. (4) It is evident from (3) that the kinematics of this robot is the same as that of a standard planar R arm once we use the value D as length of an equivalent straight second link. On the other hand the orientation of the end-effector frame is affected by the constant bias angle β see (4). A sketch of the robot in the zero configuration is given in Fig. 3a while Fig. 3b shows the requested configuration q s = (π/ arctan(b/c)) with the gripper pointing in the direction and placed the farthest away (at a distance A + C) from the axis. The primary workspace of the robot is drawn in Fig. 4 with inner radius and outer radius given respectively by r = A D R = A + D. y x e b x q = arctan(b/c) q 1 = q = 0 y 1 x 1 y x y 1 x 1 = A+C (a) (b) q 1 = p/ Figure 3: Two special robot postures: (a) the configuration q = 0 and (b) the configuration q s = (π/ arctan(b/c)) in which the robot gripper points in the direction while being the farthest away from the base axis. 3

4 q =! r = "A D " q = 0 R = A + D Figure 4: Primary workspace of the planar R robot with a L-shaped second link and generic lengths A B and C (with D = B + C ). From the previous argument the inverse kinematics problem for this robot has two solutions (out of singularities). Given an end-effector position p e = (p x p y ) inside the primary workspace we have c = p x + p y A D ( 1 1) s = ± 1 c AD (5) and then (for each of the two possible signs of s ) q 1 = ATAN {p y (A + Dc ) p x Ds p x (A + Dc ) + p y Ds )} q = ATAN {s c }. (6) The requested (analytic) Jacobian is computed as J(q) = p e(q) q = ( (A sin q1 + D sin(q 1 + q )) D sin(q 1 + q ) A cos q 1 + D cos(q 1 + q ) D cos(q 1 + q ) with det J(q) = AD sin q. Singularities occur at q = {0 π} (with arbitrary q 1 ). For q = 0 (and a generic q 1 ) we have (A + D) sin q1 D sin q 1 D sin q1 J(q 1 0) = N {J} = ν R{J} = ρ (A + D) cos q 1 D cos q 1 A + D cos q 1 while at q = π (A D) sin q1 D sin q 1 J(q 1 π) = (A D) cos q 1 D cos q 1 where ν and ρ are two scaling factors. ) D sin q1 N {J} = ν R{J} = ρ A D cos q 1 Using the numerical data in (1) we have A = 0.6 and D = 0.5 [m]. For p e = ( ) T [m] we obtain from (5 6) the two inverse kinematic solutions ( ) ( 0 0 ) q sola = [rad] = π/ 90 q solb = [rad] = π/ 90. 4

5 In these two (nonsingular) configurations we solve the inverse differential kinematics problem for v e = (1 0) T [m/s] as q sola = J 1 (q sola ) v e = = [rad/s] q solb = J 1 (q solb ) v e = = [rad/s] The norms of these two joint velocity vectors are different namely q sola =.5860 q solb =. This should not come out unexpected because the given problem (including the direction of v e with the respect to the robot postures) has no special symmetries. Exercise The time-optimal profile for the desired rest-to-rest motion from q 0 to q f under the bounds given in () is bang-coast-bang in acceleration for the first joint and bang-bang only for the second. In fact the joint displacements are 1 1 = q f q 0 = = 0.7 and the condition for the existence of a time interval when a joints is cruising at its maximum velocity is satisfied for the first joint but not for the second: 1 = 1 > 0.35 = = V 1 = 0.7 < 1.8 = 0.8 A = V. A The minimum time for the first joint is then T 1 = 1A 1 + V1 V 1 A 1 =.650 [s]. For the second joint we have instead a triangular velocity profile that is symmetric w.r.t. the middle instant of motion T /. At t = T / the joint reaches its maximum velocity V m = A T / < V. The area under this velocity profile should be equal to the displacement (in absolute value) for the second joint. Thus (area =) T V m = A T 4 The minimum motion time is therefore = T = 4 =.3664 [s]. A T min = max{t 1 T } = max{ } =.650 [s]. and is imposed by the first joint. In order to have a coordinated joint motion the second joint should then slow down a bit by using an acceleration/deceleration ± A m (whose absolute value is less than A ) so as to complete its motion exactly at t = T min. Thus (area =) A m T min 4 = A m = 4 T min = [rad/s ]. Accordingly V m = A m T min / = [rad/s ] is the velocity reached by the second joint at the middle instant of motion. The velocity profiles of the two joints for the obtained coordinated motion in minimum time are shown in Fig. 5. 5

6 q 1 V 1 =0.5 q V m = T s1 =V 1 /A 1 =.65 T min =.65 t T min / T min =.65 t Figure 5: The profiles of the joint velocities achieving the desired coordinated motion in minimum time T min =.650 s. 6

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

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

, 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

Robotics I Midterm classroom test November 24, 2017

Robotics I Midterm classroom test November 24, 2017 xercise [8 points] Robotics I Midterm classroom test November, 7 Consider the -dof (RPR) planar robot in ig., where the joint coordinates r = ( r r r have been defined in a free, arbitrary way, with reference

More information

Example: RR Robot. Illustrate the column vector of the Jacobian in the space at the end-effector point.

Example: RR Robot. Illustrate the column vector of the Jacobian in the space at the end-effector point. Forward kinematics: X e = c 1 + c 12 Y e = s 1 + s 12 = s 1 s 12 c 1 + c 12, = s 12 c 12 Illustrate the column vector of the Jacobian in the space at the end-effector point. points in the direction perpendicular

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

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

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

Ch. 5: Jacobian. 5.1 Introduction

Ch. 5: Jacobian. 5.1 Introduction 5.1 Introduction relationship between the end effector velocity and the joint rates differentiate the kinematic relationships to obtain the velocity relationship Jacobian matrix closely related to the

More information

Advanced Robotic Manipulation

Advanced Robotic Manipulation Advanced Robotic Manipulation Handout CS37A (Spring 017) Solution Set #3 Problem 1 - Inertial properties In this problem, you will explore the inertial properties of a manipulator at its end-effector.

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

INSTRUCTIONS TO CANDIDATES:

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

More information

DYNAMICS OF PARALLEL MANIPULATOR

DYNAMICS OF PARALLEL MANIPULATOR DYNAMICS OF PARALLEL MANIPULATOR PARALLEL MANIPULATORS 6-degree of Freedom Flight Simulator BACKGROUND Platform-type parallel mechanisms 6-DOF MANIPULATORS INTRODUCTION Under alternative robotic mechanical

More information

Robotics: Tutorial 3

Robotics: Tutorial 3 Robotics: Tutorial 3 Mechatronics Engineering Dr. Islam Khalil, MSc. Omar Mahmoud, Eng. Lobna Tarek and Eng. Abdelrahman Ezz German University in Cairo Faculty of Engineering and Material Science October

More information

ECE569 Exam 1 October 28, Name: Score: /100. Please leave fractions as fractions, but simplify them, etc.

ECE569 Exam 1 October 28, Name: Score: /100. Please leave fractions as fractions, but simplify them, etc. ECE569 Exam 1 October 28, 2015 1 Name: Score: /100 This exam is closed-book. You must show ALL of your work for full credit. Please read the questions carefully. Please check your answers carefully. Calculators

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

Kinematics of a UR5. Rasmus Skovgaard Andersen Aalborg University

Kinematics of a UR5. Rasmus Skovgaard Andersen Aalborg University Kinematics of a UR5 May 3, 28 Rasmus Skovgaard Andersen Aalborg University Contents Introduction.................................... Notation.................................. 2 Forward Kinematics for

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

Given U, V, x and θ perform the following steps: a) Find the rotation angle, φ, by which u 1 is rotated in relation to x 1

Given U, V, x and θ perform the following steps: a) Find the rotation angle, φ, by which u 1 is rotated in relation to x 1 1 The Jacobian can be expressed in an arbitrary frame, such as the base frame located at the first joint, the hand frame located at the end-effector, or the global frame located somewhere else. The SVD

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

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

Chapter 3 + some notes on counting the number of degrees of freedom

Chapter 3 + some notes on counting the number of degrees of freedom Chapter 3 + some notes on counting the number of degrees of freedom Minimum number of independent parameters = Some number of dependent parameters minus the number of relationships (equations) you can

More information

ME5286 Robotics Spring 2017 Quiz 2

ME5286 Robotics Spring 2017 Quiz 2 Page 1 of 5 ME5286 Robotics Spring 2017 Quiz 2 Total Points: 30 You are responsible for following these instructions. Please take a minute and read them completely. 1. Put your name on this page, any other

More information

Robotics I Kinematics, Dynamics and Control of Robotic Manipulators. Velocity Kinematics

Robotics I Kinematics, Dynamics and Control of Robotic Manipulators. Velocity Kinematics Robotics I Kinematics, Dynamics and Control of Robotic Manipulators Velocity Kinematics Dr. Christopher Kitts Director Robotic Systems Laboratory Santa Clara University Velocity Kinematics So far, we ve

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

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

Exercise 1b: Differential Kinematics of the ABB IRB 120

Exercise 1b: Differential Kinematics of the ABB IRB 120 Exercise 1b: Differential Kinematics of the ABB IRB 120 Marco Hutter, Michael Blösch, Dario Bellicoso, Samuel Bachmann October 5, 2016 Abstract The aim of this exercise is to calculate the differential

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

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

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

The Principle of Virtual Power Slide companion notes

The Principle of Virtual Power Slide companion notes The Principle of Virtual Power Slide companion notes Slide 2 In Modules 2 and 3 we have seen concepts of Statics and Kinematics in a separate way. In this module we shall see how the static and the kinematic

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

Lecture PowerPoints. Chapter 10 Physics for Scientists and Engineers, with Modern Physics, 4 th edition Giancoli

Lecture PowerPoints. Chapter 10 Physics for Scientists and Engineers, with Modern Physics, 4 th edition Giancoli Lecture PowerPoints Chapter 10 Physics for Scientists and Engineers, with Modern Physics, 4 th edition Giancoli 2009 Pearson Education, Inc. This work is protected by United States copyright laws and is

More information

Final Exam April 30, 2013

Final Exam April 30, 2013 Final Exam Instructions: You have 120 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

Planar Rigid Body Kinematics Homework

Planar Rigid Body Kinematics Homework Chapter 2: Planar Rigid ody Kinematics Homework Chapter 2 Planar Rigid ody Kinematics Homework Freeform c 2018 2-1 Chapter 2: Planar Rigid ody Kinematics Homework 2-2 Freeform c 2018 Chapter 2: Planar

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

Figure 1. A planar mechanism. 1

Figure 1. A planar mechanism. 1 ME 352 - Machine Design I Summer Semester 201 Name of Student Lab Section Number EXAM 1. OPEN BOOK AND CLOSED NOTES. Wednesday, July 2nd, 201 Use the blank paper provided for your solutions. Write on one

More information

1. This is a CLOSED BOOK, CLOSED NOTES exam. A list of equations for your reference is provided below.

1. This is a CLOSED BOOK, CLOSED NOTES exam. A list of equations for your reference is provided below. _ Instructions 1. This is a CLOSED BOOK, CLOSED NOTES exam. A list of equations for your reference is provided below. 2. Begin each problem on the printed sheet and continue on the lined paper provided.

More information

Lecture Note 8: Inverse Kinematics

Lecture Note 8: Inverse Kinematics ECE5463: Introduction to Robotics Lecture Note 8: Inverse Kinematics Prof. Wei Zhang Department of Electrical and Computer Engineering Ohio State University Columbus, Ohio, USA Spring 2018 Lecture 8 (ECE5463

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

(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

EDEXCEL NATIONAL CERTIFICATE/DIPLOMA ADVANCED MECHANICAL PRINCIPLES AND APPLICATIONS UNIT 18 NQF LEVEL 3

EDEXCEL NATIONAL CERTIFICATE/DIPLOMA ADVANCED MECHANICAL PRINCIPLES AND APPLICATIONS UNIT 18 NQF LEVEL 3 EDEXCEL NATIONAL CERTIFICATE/DIPLOMA ADVANCED MECHANICAL PRINCIPLES AND APPLICATIONS UNIT 18 NQF LEVEL 3 OUTCOME 3 BE ABLE TO DETERMINE RELATIVE AND RESULTANT VELOCITY IN ENGINEERING SYSTEMS Resultant

More information

LECTURE 20: Rotational kinematics

LECTURE 20: Rotational kinematics Lectures Page 1 LECTURE 20: Rotational kinematics Select LEARNING OBJECTIVES: i. ii. iii. iv. v. vi. vii. viii. Introduce the concept that objects possess momentum. Introduce the concept of impulse. Be

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

Kinematic Analysis of a Pentapod Robot

Kinematic Analysis of a Pentapod Robot Journal for Geometry and Graphics Volume 10 (2006), No. 2, 173 182. Kinematic Analysis of a Pentapod Robot Gert F. Bär and Gunter Weiß Dresden University of Technology Institute for Geometry, D-01062 Dresden,

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

ME 115(b): Homework #2 Solution. Part (b): Using the Product of Exponentials approach, the structure equations take the form:

ME 115(b): Homework #2 Solution. Part (b): Using the Product of Exponentials approach, the structure equations take the form: ME 5(b): Homework #2 Solution Problem : Problem 2 (d,e), Chapter 3 of MLS. Let s review some material from the parts (b) of this problem: Part (b): Using the Product of Exponentials approach, the structure

More information

Kinematics. Félix Monasterio-Huelin, Álvaro Gutiérrez & Blanca Larraga. September 5, Contents 1. List of Figures 1.

Kinematics. Félix Monasterio-Huelin, Álvaro Gutiérrez & Blanca Larraga. September 5, Contents 1. List of Figures 1. Kinematics Féli Monasterio-Huelin, Álvaro Gutiérre & Blanca Larraga September 5, 2018 Contents Contents 1 List of Figures 1 List of Tables 2 Acronm list 3 1 Degrees of freedom and kinematic chains of rigid

More information

Moving Reference Frame Kinematics Homework

Moving Reference Frame Kinematics Homework Chapter 3 Moving Reference Frame Kinematics Homework Freeform c 2016 3-1 3-2 Freeform c 2016 Homework 3. Given: n L-shaped telescoping arm is pinned to ground at point. The arm is rotating counterclockwise

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

General Physics I. Lecture 8: Rotation of a Rigid Object About a Fixed Axis. Prof. WAN, Xin ( 万歆 )

General Physics I. Lecture 8: Rotation of a Rigid Object About a Fixed Axis. Prof. WAN, Xin ( 万歆 ) General Physics I Lecture 8: Rotation of a Rigid Object About a Fixed Axis Prof. WAN, Xin ( 万歆 ) xinwan@zju.edu.cn http://zimp.zju.edu.cn/~xinwan/ New Territory Object In the past, point particle (no rotation,

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

Screw Theory and its Applications in Robotics

Screw Theory and its Applications in Robotics Screw Theory and its Applications in Robotics Marco Carricato Group of Robotics, Automation and Biomechanics University of Bologna Italy IFAC 2017 World Congress, Toulouse, France Table of Contents 1.

More information

Lecture «Robot Dynamics»: Kinematics 2

Lecture «Robot Dynamics»: Kinematics 2 Lecture «Robot Dynamics»: Kinematics 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) Marco Hutter,

More information

Lecture Note 8: Inverse Kinematics

Lecture Note 8: Inverse Kinematics ECE5463: Introduction to Robotics Lecture Note 8: Inverse Kinematics Prof. Wei Zhang Department of Electrical and Computer Engineering Ohio State University Columbus, Ohio, USA Spring 2018 Lecture 8 (ECE5463

More information

General Physics I. Lecture 8: Rotation of a Rigid Object About a Fixed Axis. Prof. WAN, Xin ( 万歆 )

General Physics I. Lecture 8: Rotation of a Rigid Object About a Fixed Axis. Prof. WAN, Xin ( 万歆 ) General Physics I Lecture 8: Rotation of a Rigid Object About a Fixed Axis Prof. WAN, Xin ( 万歆 ) xinwan@zju.edu.cn http://zimp.zju.edu.cn/~xinwan/ New Territory Object In the past, point particle (no rotation,

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

EXAM 1. OPEN BOOK AND CLOSED NOTES.

EXAM 1. OPEN BOOK AND CLOSED NOTES. ME 35 - Machine Design I Summer Semester 013 Name of Student Lab Section Number EXAM 1. OPEN BOOK AND CLOSED NOTES. Wednesday, June 6th, 013 Use the blank paper provided for your solutions. Write on one

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

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

Chap. 10: Rotational Motion

Chap. 10: Rotational Motion Chap. 10: Rotational Motion I. Rotational Kinematics II. Rotational Dynamics - Newton s Law for Rotation III. Angular Momentum Conservation (Chap. 10) 1 Newton s Laws for Rotation n e t I 3 rd part [N

More information

Robotics & Automation. Lecture 17. Manipulability Ellipsoid, Singularities of Serial Arm. John T. Wen. October 14, 2008

Robotics & Automation. Lecture 17. Manipulability Ellipsoid, Singularities of Serial Arm. John T. Wen. October 14, 2008 Robotics & Automation Lecture 17 Manipulability Ellipsoid, Singularities of Serial Arm John T. Wen October 14, 2008 Jacobian Singularity rank(j) = dimension of manipulability ellipsoid = # of independent

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

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

PLANAR KINETICS OF A RIGID BODY FORCE AND ACCELERATION

PLANAR KINETICS OF A RIGID BODY FORCE AND ACCELERATION PLANAR KINETICS OF A RIGID BODY FORCE AND ACCELERATION I. Moment of Inertia: Since a body has a definite size and shape, an applied nonconcurrent force system may cause the body to both translate and rotate.

More information

Chapter 10. Rotation of a Rigid Object about a Fixed Axis

Chapter 10. Rotation of a Rigid Object about a Fixed Axis Chapter 10 Rotation of a Rigid Object about a Fixed Axis Angular Position Axis of rotation is the center of the disc Choose a fixed reference line. Point P is at a fixed distance r from the origin. A small

More information

Robot Dynamics Lecture Notes. Robotic Systems Lab, ETH Zurich

Robot Dynamics Lecture Notes. Robotic Systems Lab, ETH Zurich Robot Dynamics Lecture Notes Robotic Systems Lab, ETH Zurich HS 217 Contents 1 Introduction 1 1.1 Nomenclature.............................. 2 1.2 Operators................................ 3 2 Kinematics

More information

RECURSIVE INVERSE DYNAMICS

RECURSIVE INVERSE DYNAMICS We assume at the outset that the manipulator under study is of the serial type with n+1 links including the base link and n joints of either the revolute or the prismatic type. The underlying algorithm

More information

Fundamentals Physics. Chapter 10 Rotation

Fundamentals Physics. Chapter 10 Rotation Fundamentals Physics Tenth Edition Halliday Chapter 10 Rotation 10-1 Rotational Variables (1 of 15) Learning Objectives 10.01 Identify that if all parts of a body rotate around a fixed axis locked together,

More information

Lecture «Robot Dynamics» : Kinematics 3

Lecture «Robot Dynamics» : Kinematics 3 Lecture «Robot Dynamics» : Kinematics 3 151-0851-00 V lecture: CAB G11 Tuesday 10:15-12:00, every week exercise: HG G1 Wednesday 8:15-10:00, according to schedule (about every 2nd week) office hour: LEE

More information

Lecture 10. Rigid Body Transformation & C-Space Obstacles. CS 460/560 Introduction to Computational Robotics Fall 2017, Rutgers University

Lecture 10. Rigid Body Transformation & C-Space Obstacles. CS 460/560 Introduction to Computational Robotics Fall 2017, Rutgers University CS 460/560 Introduction to Computational Robotics Fall 017, Rutgers University Lecture 10 Rigid Body Transformation & C-Space Obstacles Instructor: Jingjin Yu Outline Rigid body, links, and joints Task

More information

Inverting: Representing rotations and translations between coordinate frames of reference. z B. x B x. y B. v = [ x y z ] v = R v B A. y B.

Inverting: Representing rotations and translations between coordinate frames of reference. z B. x B x. y B. v = [ x y z ] v = R v B A. y B. Kinematics Kinematics: Given the joint angles, comute the han osition = Λ( q) Inverse kinematics: Given the han osition, comute the joint angles to attain that osition q = Λ 1 ( ) s usual, inverse roblems

More information

UNIT 2 KINEMATICS OF LINKAGE MECHANISMS

UNIT 2 KINEMATICS OF LINKAGE MECHANISMS UNIT 2 KINEMATICS OF LINKAGE MECHANISMS ABSOLUTE AND RELATIVE VELOCITY An absolute velocity is the velocity of a point measured from a fixed point (normally the ground or anything rigidly attached to the

More information

Rotation. Rotational Variables

Rotation. Rotational Variables Rotation Rigid Bodies Rotation variables Constant angular acceleration Rotational KE Rotational Inertia Rotational Variables Rotation of a rigid body About a fixed rotation axis. Rigid Body an object that

More information

Kinematic Isotropy of the H4 Class of Parallel Manipulators

Kinematic Isotropy of the H4 Class of Parallel Manipulators Kinematic Isotropy of the H4 Class of Parallel Manipulators Benoit Rousseau 1, Luc Baron 1 Département de génie mécanique, École Polytechnique de Montréal, benoit.rousseau@polymtl.ca Département de génie

More information

ROBOTICS Laboratory Problem 02

ROBOTICS Laboratory Problem 02 ROBOTICS 2015-2016 Laboratory Problem 02 Basilio Bona DAUIN PoliTo Problem formulation The planar system illustrated in Figure 1 consists of a cart C sliding with or without friction along the horizontal

More information

Linköping University Electronic Press

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

More information

Physics 2212 K Quiz #1 Solutions Summer q in = ρv = ρah = ρa 4

Physics 2212 K Quiz #1 Solutions Summer q in = ρv = ρah = ρa 4 Physics 2212 K Quiz #1 Solutions Summer 2016 I. (18 points A uniform infinite insulating slab of charge has a positive volume charge density ρ, and a thickness 2t, extending from t to +t in the z direction.

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

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

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

Rotational Kinematics and Dynamics. UCVTS AIT Physics

Rotational Kinematics and Dynamics. UCVTS AIT Physics Rotational Kinematics and Dynamics UCVTS AIT Physics Angular Position Axis of rotation is the center of the disc Choose a fixed reference line Point P is at a fixed distance r from the origin Angular Position,

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

Linear and Angular Velocities 2/4. Instructor: Jacob Rosen Advanced Robotic - MAE 263D - Department of Mechanical & Aerospace Engineering - UCLA

Linear and Angular Velocities 2/4. Instructor: Jacob Rosen Advanced Robotic - MAE 263D - Department of Mechanical & Aerospace Engineering - UCLA Linear and ngular elocities 2/4 Instructor: Jacob osen dvanced obotic - ME 263D - Department of Mechanical & erospace Engineering - UL Jacobian Matri - alculation Methods Differentiation the Forward Kinematics

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

Chapter 8 Rotational Motion

Chapter 8 Rotational Motion Chapter 8 Rotational Motion Chapter 8 Rotational Motion In this chapter you will: Learn how to describe and measure rotational motion. Learn how torque changes rotational velocity. Explore factors that

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

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

CHAPTER OBJECTIVES Use various methods to determine the deflection and slope at specific pts on beams and shafts: 2. Discontinuity functions

CHAPTER OBJECTIVES Use various methods to determine the deflection and slope at specific pts on beams and shafts: 2. Discontinuity functions 1. Deflections of Beams and Shafts CHAPTER OBJECTIVES Use various methods to determine the deflection and slope at specific pts on beams and shafts: 1. Integration method. Discontinuity functions 3. Method

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

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

Planar Rigid Body Kinematics Homework

Planar Rigid Body Kinematics Homework Chapter 2 Planar Rigid ody Kinematics Homework Freeform c 2016 2-1 2-2 Freeform c 2016 Homework 2. Given: The pulley shown below freely rotates about point C and interacts with two rubber belts (one horizontal,

More information

ROTATING RING. Volume of small element = Rdθbt if weight density of ring = ρ weight of small element = ρrbtdθ. Figure 1 Rotating ring

ROTATING RING. Volume of small element = Rdθbt if weight density of ring = ρ weight of small element = ρrbtdθ. Figure 1 Rotating ring ROTATIONAL STRESSES INTRODUCTION High centrifugal forces are developed in machine components rotating at a high angular speed of the order of 100 to 500 revolutions per second (rps). High centrifugal force

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

Chapter 2 Coordinate Systems and Transformations

Chapter 2 Coordinate Systems and Transformations Chapter 2 Coordinate Systems and Transformations 2.1 Coordinate Systems This chapter describes the coordinate systems used in depicting the position and orientation (pose) of the aerial robot and its manipulator

More information

Namee of Student. link and I R 2 ?? = 0. and Δ θ. Calculate the. in the next. iteration. 1. = 6cm and θ * 9 = 135.

Namee of Student. link and I R 2 ?? = 0. and Δ θ. Calculate the. in the next. iteration. 1. = 6cm and θ * 9 = 135. ME 52 - Machine Design I Fall Semester 2010 EXAM 1. OPEN BOOK AND CLOSED NOTES. Namee of Student Lab. Div. Number Wednesday, September 29th, 2010 Use the blank paper provided for your solutions. Write

More information

STATICALLY INDETERMINATE STRUCTURES

STATICALLY INDETERMINATE STRUCTURES STATICALLY INDETERMINATE STRUCTURES INTRODUCTION Generally the trusses are supported on (i) a hinged support and (ii) a roller support. The reaction components of a hinged support are two (in horizontal

More information