Position and orientation of rigid bodies

Size: px
Start display at page:

Download "Position and orientation of rigid bodies"

Transcription

1 Robotics 1 Position and orientation of rigid bodies Prof. Alessandro De Luca Robotics 1 1

2 Position and orientation right-handed orthogonal Reference Frames RF A A p AB B RF B rigid body position: A p AB (vector! R 3 ), expressed in RF A (use of coordinates I other than Cartesian is possible, e.g. cylindrical or spherical) orientation: orthonormal 3x3 matrix (R T = R -1 " A R B B R A = I), with det = +1 A R B = [ A x B A y B A z B ] x A y A z A (x B y B z B ) are unit vectors (with unitary norm) of frame RF A (RF B ) components in A R B are the direction cosines of the axes of RF B with respect to (w.r.t.) RF A Robotics 1 2

3 orthonormal, with det = +1 A R B = orientation of RF i w.r.t. RF k Rotation matrix x A T x B x A T y B x A T z B y A T x B y A T y B y A T z B z A T x B z A T y B z A T z B chain rule property k R i! i R j = k R j orientation of RF j w.r.t. RF i direction cosine of z B w.r.t. x A algebraic structure of a group SO(3) (neutral element = I; inverse element = R T ) orientation of RF j w.r.t. RF k NOTE: in general, the product of rotation matrices does not commute! Robotics 1 3

4 Change of coordinates z 0 0 p x z 1 P 0 P = 0 p y 0 p z = 1 p x 0 x p y 0 y p z 0 z 1 1 p x y 1 = 0 x 1 0 y 1 0 z 1 1 p y RF 1 1 p z RF 0 y 0 = 0 R 1 1 P x 0 x 1 the rotation matrix 0 R 1 (i.e., the orientation of RF 1 w.r.t. RF 0 ) represents also the change of coordinates of a vector from RF 1 to RF 0 Robotics 1 4

5 Ex: Orientation of frames in a plane (elementary rotation around z-axis) v y C O # P # u x B 0 OP RF C RF 0 x y z = x = OB xb = u cos # - v sin #$ y = OC + Cy = u sin # + v cos #$ z = w or 0 x C 0 y C 0 z C cos # $sin # $0 sin # $ cos # u v w = R z (#) C OP u v w similarly: R x (#) = cos # sin # 0 sin # cos #$ R z (-#) = R zt (#) R y (#) = cos # 0 sin # sin # 0 cos #$ Robotics 1 5

6 Ex: Rotation of a vector around z y y # v v x = v cos %$ y = v sin %$ x = v cos (% + #) = v (cos % cos # - sin % sin #) x = x cos # - y sin # O %$ x x y = v sin (% + #) = v (sin % cos # + cos % sin #) x = x sin # + y cos # or z = z x y z = cos # sin # 0 sin # cos # x y z = R z (#) x y z as before! Robotics 1 6

7 Equivalent interpretations of a rotation matrix the same rotation matrix, e.g., R z (#), may represent: v RF C P RF C # v # # RF 0 RF 0 the orientation of a rigid body with respect to a reference frame RF 0 ex: [ 0 x c 0 y c 0 z c ] = R z (#) the change of coordinates from RF C to RF 0 ex: 0 P = R z (#) C P the vector rotation operator ex: v = R z (#) v the rotation matrix 0 R C is an operator superposing frame RF 0 to frame RF C Robotics 1 7

8 Composition of rotations 1 R 2 brings RF 0 on RF 1 2 brings RF 1 on RF 2 R 3 brings RF 2 on RF 3 0 R 1 p 23 = 0 3 p p 01 = 0 p 12 = 0 RF 1 RF 0 a comment on computational complexity RF 2 RF 3 0 p = ( 0 R 1 1 R 2 2 R 3 ) 3 p = 0 R 3 3 p 63 products 42 summations 0 p = 0 R 1 ( 1 R 2 ( 2 R 33 p)) 27 products 18 summations 2 p Robotics 1 1 p 8

9 Axis/angle representation r z z 0 P v r DATA unit vector r (!r! = 1)$ # (positive if counterclockwise, as seen from an observer placed like r) x 0 z 1 r x RF 1 #$ v RF 0 y 1 r y y 0 RF 1 is the result of rotating RF 0 by an angle # around the unit vector r DIRECT PROBLEM find R(#,r) = [ 0 x 1 0 y 1 0 z 1 ] such that 0 P= R(#,r) 1 P 0 v = R(#,r) 0 v x 1 Robotics 1 9

10 Axis/angle: Direct problem z 1 3 z 0 1 C C -1 = C T 2 R z (#) r y 1 R(#,r) = C R z (#) C T concatenation of three rotations C = n s r RF 1 RF 0 y 0 after the first rotation the z-axis coincides with r x 0 x 1 sequence of 3 rotations that bring frame RF 0 to superpose with frame RF 1 n and s are orthogonal unit vectors such that n " s = r, or n y s z - s y n z = r x n z s x - s z n x = r y n x s y - s x n y = r z Robotics 1 10

11 Axis/angle: Direct problem solution R(#,r) = C R z (#) C T R(#,r) = n s r c# - s# 0 s# c# n T s T r T = r r T + (n n T + s s T ) c# + (s n T - n s T ) s# taking into account that C C T = n n T + s s T + r r T = I, and that depends only on r and #!! 0 -r z r y s n T - n s T = 0 -r x = S(r) R(#,r) = r r T + (I - r r T ) c# + S(r) s# 0 skew-symmetric(r): r " v = S(r)v = - S(v)r = R T (-#,r) = R(-#,-r) Robotics 1 11

12 Rodriguez formula v = R(#,r) v v = v cos # + (r " v) sin # + (1 - cos #)(r T v) r proof: R(#,r) v = (r r T + (I - r r T ) cos # + S(r) sin #)v = r r T v (1 - cos #) + v cos # + (r " v) sin # q.e.d. Robotics 1 14

13 Unit quaternion " to eliminate undetermined and singular cases arising in the axis/angle representation, one can use the unit quaternion representation Q = {-,.} = {cos(#/2), sin(#/2) r} a scalar 3-dim vector " - 2 +!.! 2 = 1 (thus, unit... ) " (#, r) and (-#, -r) gives the same quaternion Q " the absence of rotation is associated to Q = {1, 0} " unit quaternions can be composed with special rules (in a similar way as in the product of rotation matrices) Q 1 *Q 2 = { T. 2, ". 2 } Robotics 1 20

14 Robotics 1 Minimal representations of orientation (Euler and roll-pitch-yaw angles) Homogeneous transformations Prof. Alessandro De Luca Robotics 1 1

15 Minimal representations rotation matrices: 9 elements - 3 orthogonality relationships - 3 unitary relationships = 3 independent variables direct problem inverse problem sequence of 3 rotations around independent axes fixed (a i ) or moving/current (a i ) axes possible different sequences (e.g., XYX) actually, only 12 since {(a 1 α 1 ), (a 2 α 2 ), (a 3 α 3 )} { (a 3 α 3 ), (a 2 α 2 ), (a 1 α 1 )} Robotics 1 2

16 x z z R z (ψ) = ZX Z Euler angles 1 2 R z (φ) = RF φ φ x RF y y cos φ sin φ 0 sin φ cos φ θ z x x z RF cos ψ sin ψ 0 sin ψ cos ψ z z ψ y θ y x ψ R x (θ) = cos θ sin θ 0 sin θ cos θ x y y RF Robotics 1 3

17 ZX Z Euler angles direct problem: given φ, θ, ψ ; find R R ZX Z (φ, θ, ψ) = R Z (φ) R X (θ) R Z (ψ) order of definition in concatenation = cφ cψ - sφ cθ sψ - cφ sψ - sφ cθ cψ sφ sθ sφ cψ + cφ cθ sψ - sφ sψ + cφ cθ cψ - cφ sθ sθ sψ sθ cψ cθ given a vector v = (x,y,z ) expressed in RF, its expression in the coordinates of RF is v = R ZX Z (φ, θ, ψ) v the orientation of RF is the same that would be obtained with the sequence of rotations: ψ around z, θ around x (fixed), φ around z (fixed) Robotics 1 4

18 x x z Roll-Pitch-Yaw angles 1 ROLL z 2 z R X (ψ) = ψ ψ y y cos ψ sin ψ 0 sin ψ cos ψ C 2 R Z (φ)c 2 T with R Z (φ) = z 3 θ x x YAW cos φ sin φ 0 sin φ cos φ θ z y y z y x PITCH φ C 1 R Y (θ)c 1 T φ with R Y (θ) = cos θ 0 sin θ sin θ 0 cos θ Robotics 1 6 z x y y

19 Roll-Pitch-Yaw angles (fixed XYZ) direct problem: given ψ, θ, φ ; find R R RPY (ψ, θ, φ) = R Z (φ) R Y (θ) R X (ψ) order of definition cφ cθ cφ sθ sψ - sφ cψ cφ sθ cψ + sφ sψ = sφ cθ sφ sθ sψ + cφ cψ sφ sθ cψ - cφ sψ - sθ cθ sψ cθ cψ inverse problem: given R = {r ij }; find ψ, θ, φ note the order of products! r r 33 2 = c 2 θ, r 31 = -sθ θ = ATAN2{-r 31, ± r r 332 } if r r (i.e., cθ 0) two symmetric values w.r.t. π/2 r 32 /cθ = sψ, r 33 /cθ = cψ ψ = ATAN2{r 32 /cθ, r 33 /cθ} similarly... φ = ATAN2{ r 21 /cθ, r 11 /cθ } singularities for θ = ± π/2 Robotics 1 7

20 Homogeneous transformations P B p A p RF B A p AB affine relationship O B RF A O A A p = A p AB + A R B B p A p hom = A p A R B A p AB B p = = A T B B p hom linear relationship vector in homogeneous coordinates 4x4 matrix of homogeneous transformation Robotics 1 9

21 Properties of T matrix describes the relation between reference frames (relative pose = position & orientation) transforms the representation of a position vector (applied vector from the origin of the frame) from a given frame to another frame it is a roto-translation operator on vectors in the three-dimensional space it is always invertible ( A T B ) -1 = B T A can be composed, i.e., A T C = A T B B T C note: it does not commute! Robotics 1 10

22 Inverse of a homogeneous transformation A p = A p AB + A R B B p B p = B p BA + B R A A p = - A R B T A p AB + A R B T A p A R B A p AB B R A B p BA = A R B T - A R B T A p AB A T B B T ( A T B ) -1 A Robotics 1 11

23 Defining a robot task y E RF E absolute definition of task task definition relative to the robot end-effector z E RF B RF T W T T = W T B B T E E T T known, once the robot direct kinematics of the is placed robot arm (function of q) RF W B T E (q) = W T B -1 W T T E T T -1 = cost Robotics 1 12

24 Final comments on T matrices they are the main tool for computing the direct kinematics of robot manipulators they are used in many application areas (in robotics and beyond) in the positioning of a vision camera (matrix b T c with the extrinsic parameters of the camera posture) in computer graphics, for the real-time visualization of 3D solid objects when changing the observation point A T B = A R B α x α y α z A p AB σ all zero in robotics coefficients of perspective deformation scaling coefficient always unitary in robotics Robotics 1 13

25 Robotics 1 Direct kinematics Prof. Alessandro De Luca Robotics 1 1

26 Kinematics of robot manipulators! study of geometric and time properties of the motion of robotic structures, without reference to the causes producing it! robot seen as (open) kinematic chain of rigid bodies interconnected by (revolute or prismatic) joints Robotics 1 2

27 ! functional aspects Motivations! definition of robot workspace! calibration! operational aspects task execution (actuation by motors) task definition and performance two different spaces related by kinematic (and dynamic) maps! trajectory planning! programming! motion control Robotics 1 3

28 Kinematics formulation and parameterizations JOINT space r = f(q) DIRECT INVERSE! choice of parameterization q TASK (Cartesian) space q = (q 1,,q n ) q = f -1 (r) r = (r 1,,r m )! unambiguous and minimal characterization of the robot configuration! n = # degrees of freedom (dof) = # robot joints (rotational or translational)! choice of parameterization r! compact description of positional and/or orientation (pose) components of interest to the required task! m! 6, and usually m! n (but this is not strictly needed) Robotics 1 4

29 Open kinematic chains q 2 q n RF E q 1 q 3 q 4 e.g., the relative angle between a link and the following one r = (r 1,,r m ) e.g., it describes the pose of frame RF E! m = 2! pointing in space! positioning in the plane! m = 3! orientation in space! positioning and orientation in the plane Robotics 1 5

30 Classification by kinematic type (first 3 dofs) SCARA (RRP) cartesian or gantry (PPP) cylindric (RPP) polar or spherical (RRP) articulated or anthropomorphic (RRR) P = 1-dof translational (prismatic) joint R = 1-dof rotational (revolute) joint Robotics 1 6

31 Direct kinematic map! the structure of the direct kinematics function depends from the chosen r r = f r (q)! methods for computing f r (q)! geometric/by inspection! systematic: assigning frames attached to the robot links and using homogeneous transformation matrices Robotics 1 7

32 y Example: direct kinematics of 2R arm l 1 l 2 q 1 q 2 P " p q = q 1 y p x x r = q 2 p x p y " p x = l 1 cos q 1 + l 2 cos(q 1 +q 2 ) p y = l 1 sin q 1 + l 2 sin(q 1 +q 2 ) " = q 1 + q 2 for more general cases we need a method! n = 2 m = 3 Robotics 1 8

33 Numbering links and joints link 1 joint 2 link i-1 joint i+1 joint n joint 1 link 0 (base) joint i-1 joint i link i link n (end effector) revolute prismatic Robotics 1 9

34 Relation between joint axes axis of joint i axis of joint i+1 90 A # i $ % $ 90 B common normal (axis of link i) a i = distance AB between joint axes (always well defined) # i = twist angle between joint axes [projected on a plane % orthogonal to the link axis] with sign (pos/neg)! Robotics 1 10

35 Relation between link axes link i-1 axis of joint i link i axis of link i-1 C D & i ' $ axis of link i d i = distance CD (a variable if joint i is prismatic) & i = angle (a variable if joint i is revolute) between link axes [projected on a plane ' orthogonal to the joint axis] with sign (pos/neg)! Robotics 1 11

36 Frame assignment by Denavit-Hartenberg (DH) joint axis i-1 link i-1 joint axis i link i joint axis i+1 frame RF i is attached to link i a i z i # i d i z i-1 x i-1 O i x i & i O i-1 axis around which the link rotates or along which the link slides common normal to joint axes i and i+1 Robotics 1 12

37 axis of joint i-1 Denavit-Hartenberg parameters link i-1 axis of joint i D link i a i axis of joint i+1 z i # i d i z i-1 x i-1 O i x i & i O i-1! unit vector z i along axis of joint i+1! unit vector x i along the common normal to joint i and i+1 axes (i ( i+1)! a i = distance DO i positive if oriented as x i (constant = length of link i)! d i = distance O i-1 D positive if oriented as z i-1 (variable if joint i is PRISMATIC)! # i = twist angle between z i-1 and z i around x i (constant)! & i = angle between x i-1 and x i around z i-i (variable if joint i is REVOLUTE) Robotics 1 13

38 Homogeneous transformation between DH frames (from frame i-1 to frame i )! roto-translation around and along z i-1 c& i -s& i s& i c& i i-1 A i (q i ) = d = i c& i -s& i 0 0 s& i c& i d i rotational joint ) q i = & i prismatic joint ) q i = d i! roto-translation around and along x i i A i = a i 0 c# i -s# i 0 0 s# i c# i always a constant matrix Robotics 1 15

39 Denavit-Hartenberg matrix i-1 A i (q i ) = i-1 A i (q i ) i A i = c& i -c# i s& i s# i s& i a i c& i s& i c# i c& i -s# i c& i a i s& i 0 s# i c# i d i compact notation: c = cos, s = sin Robotics 1 16

40 Direct kinematics of manipulators description internal to the robot y E slide s using: product 0 A 1 (q 1 ) 1 A 2 (q 2 ) n-1 A n (q n ) q=(q 1,,q n ) x E z E approach a normal n z 0 RF B y 0 x 0 B T E = B T 0 0 A 1 (q 1 ) 1 A 2 (q 2 ) n-1 A n (q n ) n T E r = f r (q) external description using r = (r 1,,r m ) B T E = R p = n s a p alternative descriptions of robot direct kinematics Robotics 1 17

41 Example: SCARA robot q 3 q 2 q 1 q 4 Robotics 1 18

42 Step 1: joint axes all parallel (or coincident) twists # i = 0 or % J1 shoulder J2 elbow J3 prismatic J4 revolute Robotics 1 19

43 Step 2: link axes the vertical heights of the link axes are arbitrary (for the time being) a 1 a 2 a 3 = 0 Robotics 1 20

44 Step 3: frames z 1 y i axes for i > 0 are not shown (and not needed; they form right-handed frames) z 0 x z 2 = z 3 1 x 2 x 3 x 4 z 4 = a axis (approach) x 0 y 0 Robotics 1 21

45 Step 4: DH parameters table i # i $ a i d i & i z 1 x z 2 = z a 1 d 1 q a 2 0 q 2 x 4 x 2 x q % 0 d 4 q 4 z 0 z 4 x 0 y 0 note: d 1 and d 4 could have been chosen = 0! moreover, here it is d 4 < 0!! Robotics 1 22

46 Step 5: transformation matrices 0 A 1 (q 1 )= 1 A 2 (q 2 )= c& 1 - s& 1 0 a 1 c& 1 s& 1 c& 1 0 a 1 s& d c& 2 - s& 2 0 a 2 c& 2 s& 2 c& 2 0 a 2 s& q = (q 1, q 2, q 3, q 4 ) = (& 1, & 2, d 3, & 4 ) 2 A 3 (q 3 )= 3 A 4 (q 4 )= d c& 4 s& s& 4 -c& d 4 1 Robotics 1 23

47 Step 6: direct kinematics 0 A 3 (q 1,q 2,q 3 )= 3 A 4 (q 4 )= R(q 1,q 2,q 4 )=[ n s a ] 0 A 4 (q 1,q 2,q 3,q 4 )= c 12 -s 12 0 a 1 c 1 + a 2 c 12 s 12 c 12 0 a 1 s 1 + a 2 s d 1 +q 3 1 c 4 s s 4 -c d 4 1 c 124 s a 1 c 1 + a 2 c 12 s 124 -c a 1 s 1 + a 2 s d 1 +q 3 +d p = p(q 1,q 2,q 3 ) Robotics 1 24

48 Robotics 1 Differential kinematics Prof. Alessandro De Luca Robotics 1 1

49 Differential kinematics relationship between motion (velocity) in the joint space and motion (linear and angular velocity) in the task (Cartesian) space instantaneous velocity mappings can be obtained through time derivation of the direct kinematics function or geometrically at the differential level different treatments arise for rotational quantities establish the link between angular velocity and time derivative of a rotation matrix time derivative of the angles in a minimal representation of orientation Robotics 1 2

50 Linear and angular velocity of the robot end-effector.. ω 2 = z 1 2. ω n = z n-1 n ω v ω 1 = z 0 1. v 3 = z 2 d 3. ω i = z i-1 i alternative definitions of the e-e direct kinematics r = (p,φ) R p T = v and ω are vectors, namely elements of vector spaces: they can be obtained as the sum of contributions of the joint velocities (in any order) on the other hand, φ (and dφ/dt) is not an element of a vector space: a minimal representation of a sequence of rotations is not obtained by summing the corresponding minimal representations (angles φ) in general, ω dφ/dt Robotics 1 4

51 Finite and infinitesimal translations finitex, y, z or infinitesimal dx, dy, dz translations (linear displacements) always commute z y z z x y z y = x same final position y Robotics 1 5

52 initial orientation z Finite rotations do not commute example y φ X = 90 z y x z mathematical fact: ω is NOT an exact differential form (the integral of ω over time depends on the integration path!) x z φ Z = 90 φ Z = 90 x y φ X = 90 x z y x different final orientations note: finite rotations still commute when Robotics 1 made around the same fixed axis 6 y

53 Infinitesimal rotations commute! infinitesimal rotations dφ X, dφ Y, dφ Z around x,y,z axes R X (φ X ) = cos φ X sin φ X 0 sin φ X cos φ X R X (dφ X ) = dφ X 0 dφ X 1 R Y (φ Y ) = cos φ Y 0 sin φ Y R Z (φ Z ) = sin φ Y 0 cos φ Y 1 dφ Z 0 R Y (dφ Y ) = 1 0 dφ Y dφ Y 0 1 cos φ Z sin φ Z 0 sin φ Z cos φ Z R(dφ) = R(dφ X, dφ Y, dφ Z ) = in any sequence R Z (dφ Z ) = 1 dφ z dφ Y dφ z 1 dφ X dφ Y dφ X 1 = I + S(dφ) dφ Z neglecting second- and third-order (infinitesimal) terms Robotics 1 7

54 Time derivative of a rotation matrix let R = R(t) be a rotation matrix, given as a function of time since I = R(t)R T (t), taking the time derivative of both sides yields 0 = d[r(t)r T (t)]/dt = dr(t)/dt R T (t) + R(t) dr T (t)/dt = dr(t)/dt R T (t) + [dr(t)/dt R T (t)] T thus dr(t)/dt R T (t) = S(t) is a skew-symmetric matrix let p(t) = R(t)p a vector (with constant norm) rotated over time comparing dp(t)/dt = dr(t)/dt p = S(t)R(t) p = S(t) p(t) dp(t)/dt = ω(t) p(t) = S(ω(t)) p(t) we get S = S(ω). R = S(ω) R. S(ω) = R R T ω p. p Robotics 1 8

55 Robot Jacobian matrices analytical Jacobian (obtained by time differentiation) r = p φ = f r (q). p f r = = r (q). = J r (q) q q q.. φ geometric Jacobian (no derivatives) v ω =. p ω J = L (q). = J(q) q J A (q) q. Robotics 1 11

56 Geometric Jacobian always a 6 x n matrix end-effector instantaneous velocity v E ω E = J L (q) J A (q) q. = J L1 (q) J A1 (q) J Ln (q) J An (q). q 1. q n superposition of effects.. v E = J L1 (q) q J Ln (q) q n.. ω E = J A1 (q) q J An (q) q n contribution to the linear. e-e velocity due to q 1 contribution to the angular. e-e velocity due to q 1 linear and angular velocity belong to (linear) vector spaces in R 3 Robotics 1 14

57 Contribution of a prismatic joint Note: joints beyond the i-th one are considered to be frozen, so that the distal part of the robot is a single rigid body.. J Li (q) q i = z i-1 d i z i-1 E RF 0 q i = d i. J Li (q) q i prismatic i-th joint. z i-1 d i. J Ai (q) q i 0 Robotics 1 15

58 Contribution of a revolute joint. J Li (q) q i.. J Ai (q) q i = z i-1 θ i z i-1 O i-1 p i-1,e RF 0 q i = θ i. J Li (q) q i. J Ai (q) q i revolute i-th joint (z i-1 p i-1,e ) θ i. z i-1 θ i. Robotics 1 16

59 Expression of geometric Jacobian. p 0,E ( =) ω E v E ω E = J L (q) J A (q) q. = J L1 (q) J A1 (q) J Ln (q) J An (q). q 1. q n prismatic i-th joint revolute i-th joint this can be also computed as J Li (q) z i-1 z i-1 p i-1,e = p 0,E q i J Ai (q) 0 z i-1 z i-1 = 0 R 1 (q 1 ) i-2 R i-1 (q i-1 ) p i-1,e = p 0,E (q 1,,q n ) - p 0,i-1 (q 1,,q i-1 ) all vectors should be expressed in the same reference frame (here, the base frame RF 0 ) Robotics 1 17

60 space of joint velocities Robot Jacobian decomposition in linear subspaces and duality J space of task (Cartesian) velocities dual spaces 0 0 ℵ(J) R(J) R(J T ) + ℵ(J) = R n R(J) + ℵ(J T ) = R m R(J T ) ℵ(J T ) 0 0 dual spaces space of joint torques J T space of task (Cartesian) forces (in a given configuration q) Robotics 1 26

61 Mobility analysis ρ(j) = ρ(j(q)), R(J) = R(J(q)), ℵ(J T )= ℵ(J T (q)) are locally defined, i.e., they depend on the current configuration q R(J(q)) = subspace of all generalized velocities (with linear and/or angular components) that can be instantaneously realized by the robot end-effector when varying the joint velocities in the configuration q if J(q) has max rank (typically = m) in the configuration q, the robot end-effector can be moved in any direction of the task space R m if ρ(j(q)) < m, there exist directions in R m along which the robot endeffector cannot instantaneously move these directions lie in ℵ(J T (q)), namely the complement of R(J(q)) to the task space R m, which is of dimension m - ρ(j(q)) when ℵ(J(q)) {0} (this is always the case if m<n, i.e., in robots that are redundant for the task), there exist non-zero joint velocities that produce zero end-effector velocity ( self motions ) Robotics 1 27

62 Kinematic singularities configurations where the Jacobian loses rank loss of instantaneous mobility of the robot end-effector for m=n, they correspond in general to Cartesian poses that lead to a number of inverse kinematic solutions that differs from the generic case in a singular configuration, one cannot find a joint velocity that realizes a desired end-effector velocity in an arbitrary direction of the task space close to a singularity, large joint velocities may be needed to realize some (even small) velocity of the end-effector finding and analyzing in advance all singularities of a robot helps in avoiding them during trajectory planning and motion control when m = n: find the configurations q such that det J(q) = 0 when m < n: find the configurations q such that all m m minors of J are singular (or, equivalently, such that det [J(q) J T (q)] = 0) finding all singular configurations of a robot with a large number of joints, or the actual distance from a singularity, is a hard computational task Robotics 1 28

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

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

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

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

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

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

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

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

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

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

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

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

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

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

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

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

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

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

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

Lecture Notes - Modeling of Mechanical Systems

Lecture Notes - Modeling of Mechanical Systems Thomas Bak Lecture Notes - Modeling of Mechanical Systems February 19, 2002 Aalborg University Department of Control Engineering Fredrik Bajers Vej 7C DK-9220 Aalborg Denmark 2 Table of Contents Table

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

(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

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

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

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

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

Chapter 1. Rigid Body Kinematics. 1.1 Introduction

Chapter 1. Rigid Body Kinematics. 1.1 Introduction Chapter 1 Rigid Body Kinematics 1.1 Introduction This chapter builds up the basic language and tools to describe the motion of a rigid body this is called rigid body kinematics. This material will be the

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

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

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

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

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

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

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

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

Robot Modeling and Control

Robot Modeling and Control Robot Modeling and Control First Edition Mark W. Spong, Seth Hutchinson, and M. Vidyasagar JOHN WILEY & SONS, INC. New York / Chichester / Weinheim / Brisbane / Singapore / Toronto Preface TO APPEAR i

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

PHYS 705: Classical Mechanics. Rigid Body Motion Introduction + Math Review

PHYS 705: Classical Mechanics. Rigid Body Motion Introduction + Math Review 1 PHYS 705: Classical Mechanics Rigid Body Motion Introduction + Math Review 2 How to describe a rigid body? Rigid Body - a system of point particles fixed in space i r ij j subject to a holonomic constraint:

More information

DYNAMICS OF PARALLEL MANIPULATOR

DYNAMICS OF PARALLEL MANIPULATOR DYNAMICS OF PARALLEL MANIPULATOR The 6nx6n matrices of manipulator mass M and manipulator angular velocity W are introduced below: M = diag M 1, M 2,, M n W = diag (W 1, W 2,, W n ) From this definitions

More information

16.333: Lecture #3. Frame Rotations. Euler Angles. Quaternions

16.333: Lecture #3. Frame Rotations. Euler Angles. Quaternions 16.333: Lecture #3 Frame Rotations Euler Angles Quaternions Fall 2004 16.333 3 1 Euler Angles For general applications in 3D, often need to perform 3 separate rotations to relate our inertial frame to

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

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

Chapter 6. Screw theory for instantaneous kinematics. 6.1 Introduction. 6.2 Exponential coordinates for rotation

Chapter 6. Screw theory for instantaneous kinematics. 6.1 Introduction. 6.2 Exponential coordinates for rotation Screw theory for instantaneous kinematics 6.1 Introduction Chapter 6 Screw theory was developed by Sir Robert Stawell Ball [111] in 1876, for application in kinematics and statics of mechanisms (rigid

More information

Trajectory Planning from Multibody System Dynamics

Trajectory Planning from Multibody System Dynamics Trajectory Planning from Multibody System Dynamics Pierangelo Masarati Politecnico di Milano Dipartimento di Ingegneria Aerospaziale Manipulators 2 Manipulator: chain of

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

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

Robotics & Automation. Lecture 06. Serial Kinematic Chain, Forward Kinematics. John T. Wen. September 11, 2008

Robotics & Automation. Lecture 06. Serial Kinematic Chain, Forward Kinematics. John T. Wen. September 11, 2008 Robotics & Automation Lecture 06 Serial Kinematic Chain, Forward Kinematics John T. Wen September 11, 2008 So Far... We have covered rigid body rotational kinematics: representations of SO(3), change of

More information

Linear Algebra & Geometry why is linear algebra useful in computer vision?

Linear Algebra & Geometry why is linear algebra useful in computer vision? Linear Algebra & Geometry why is linear algebra useful in computer vision? References: -Any book on linear algebra! -[HZ] chapters 2, 4 Some of the slides in this lecture are courtesy to Prof. Octavia

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

Rigid Body Motion. Greg Hager Simon Leonard

Rigid Body Motion. Greg Hager Simon Leonard Rigid ody Motion Greg Hager Simon Leonard Overview Different spaces used in robotics and why we need to get from one space to the other Focus on Cartesian space Transformation between two Cartesian coordinate

More information

Introduction to Mobile Robotics Compact Course on Linear Algebra. Wolfram Burgard, Bastian Steder

Introduction to Mobile Robotics Compact Course on Linear Algebra. Wolfram Burgard, Bastian Steder Introduction to Mobile Robotics Compact Course on Linear Algebra Wolfram Burgard, Bastian Steder Reference Book Thrun, Burgard, and Fox: Probabilistic Robotics Vectors Arrays of numbers Vectors represent

More information

Linear Algebra & Geometry why is linear algebra useful in computer vision?

Linear Algebra & Geometry why is linear algebra useful in computer vision? Linear Algebra & Geometry why is linear algebra useful in computer vision? References: -Any book on linear algebra! -[HZ] chapters 2, 4 Some of the slides in this lecture are courtesy to Prof. Octavia

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

Lecture Note 7: Velocity Kinematics and Jacobian

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

More information

A geometric interpretation of the homogeneous coordinates is given in the following Figure.

A geometric interpretation of the homogeneous coordinates is given in the following Figure. Introduction Homogeneous coordinates are an augmented representation of points and lines in R n spaces, embedding them in R n+1, hence using n + 1 parameters. This representation is useful in dealing with

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

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

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

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

More information

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

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

More information

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

Lecture Note 5: Velocity of a Rigid Body

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

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

Robotics. Kinematics. Marc Toussaint University of Stuttgart Winter 2017/18

Robotics. Kinematics. Marc Toussaint University of Stuttgart Winter 2017/18 Robotics Kinematics 3D geometry, homogeneous transformations, kinematic map, Jacobian, inverse kinematics as optimization problem, motion profiles, trajectory interpolation, multiple simultaneous tasks,

More information

Introduction to Mobile Robotics Compact Course on Linear Algebra. Wolfram Burgard, Cyrill Stachniss, Maren Bennewitz, Diego Tipaldi, Luciano Spinello

Introduction to Mobile Robotics Compact Course on Linear Algebra. Wolfram Burgard, Cyrill Stachniss, Maren Bennewitz, Diego Tipaldi, Luciano Spinello Introduction to Mobile Robotics Compact Course on Linear Algebra Wolfram Burgard, Cyrill Stachniss, Maren Bennewitz, Diego Tipaldi, Luciano Spinello Vectors Arrays of numbers Vectors represent a point

More information

Homogeneous Transformations

Homogeneous Transformations Purpose: Homogeneous Transformations The purpose of this chapter is to introduce you to the Homogeneous Transformation. This simple 4 x 4 transformation is used in the geometry engines of CAD systems and

More information

Robotics - Homogeneous coordinates and transformations. Simone Ceriani

Robotics - Homogeneous coordinates and transformations. Simone Ceriani Robotics - Homogeneous coordinates and transformations Simone Ceriani ceriani@elet.polimi.it Dipartimento di Elettronica e Informazione Politecnico di Milano 5 March 0 /49 Outline Introduction D space

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

Introduction to Mobile Robotics Compact Course on Linear Algebra. Wolfram Burgard, Cyrill Stachniss, Kai Arras, Maren Bennewitz

Introduction to Mobile Robotics Compact Course on Linear Algebra. Wolfram Burgard, Cyrill Stachniss, Kai Arras, Maren Bennewitz Introduction to Mobile Robotics Compact Course on Linear Algebra Wolfram Burgard, Cyrill Stachniss, Kai Arras, Maren Bennewitz Vectors Arrays of numbers Vectors represent a point in a n dimensional space

More information

Mobile Robotics 1. A Compact Course on Linear Algebra. Giorgio Grisetti

Mobile Robotics 1. A Compact Course on Linear Algebra. Giorgio Grisetti Mobile Robotics 1 A Compact Course on Linear Algebra Giorgio Grisetti SA-1 Vectors Arrays of numbers They represent a point in a n dimensional space 2 Vectors: Scalar Product Scalar-Vector Product Changes

More information

Lecture Note 7: Velocity Kinematics and Jacobian

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

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

Pose estimation from point and line correspondences

Pose estimation from point and line correspondences Pose estimation from point and line correspondences Giorgio Panin October 17, 008 1 Problem formulation Estimate (in a LSE sense) the pose of an object from N correspondences between known object points

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

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

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

Chapter 2 Homogeneous Transformation Matrix

Chapter 2 Homogeneous Transformation Matrix Chapter 2 Homogeneous Transformation Matrix Abstract The transformation of frames is a fundamental concept in the modeling and programming of a robot. In this Chapter, we present a notation that allows

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

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

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

Homogeneous Coordinates

Homogeneous Coordinates Homogeneous Coordinates Basilio Bona DAUIN-Politecnico di Torino October 2013 Basilio Bona (DAUIN-Politecnico di Torino) Homogeneous Coordinates October 2013 1 / 32 Introduction Homogeneous coordinates

More information

On the Observability and Self-Calibration of Visual-Inertial Navigation Systems

On the Observability and Self-Calibration of Visual-Inertial Navigation Systems Center for Robotics and Embedded Systems University of Southern California Technical Report CRES-08-005 R B TIC EMBEDDED SYSTEMS LABORATORY On the Observability and Self-Calibration of Visual-Inertial

More information

1 Coordinate Transformation

1 Coordinate Transformation 1 Coordinate Transformation 1.1 HOMOGENEOUS COORDINATES A position vector in a three-dimensional space (Fig. 1.1.1) may be represented (i) in vector form as r m = O m M = x m i m + y m j m + z m k m (1.1.1)

More information

MSMS Vectors and Matrices

MSMS Vectors and Matrices MSMS Vectors and Matrices Basilio Bona DAUIN Politecnico di Torino Semester 1, 2015-2016 B. Bona (DAUIN) MSMS-Vectors and matrices Semester 1, 2015-2016 1 / 39 Introduction Most of the topics introduced

More information

Generalization of the Euler Angles

Generalization of the Euler Angles The Journal of the Astronautical Sciences, Vol. 51, No. 2, AprilJune 2003, pp. 123123 Generalization of the Euler Angles Malcolm D. Shuster 1 and F. Landis Markley 2 Abstract It is shown that the Euler

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

Methods in Computer Vision: Introduction to Matrix Lie Groups

Methods in Computer Vision: Introduction to Matrix Lie Groups Methods in Computer Vision: Introduction to Matrix Lie Groups Oren Freifeld Computer Science, Ben-Gurion University June 14, 2017 June 14, 2017 1 / 46 Definition and Basic Properties Definition (Matrix

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

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

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

ROBOTICS: ADVANCED CONCEPTS & ANALYSIS

ROBOTICS: ADVANCED CONCEPTS & ANALYSIS ROBOTICS: ADVANCED CONCEPTS & ANALYSIS MODULE 4 KINEMATICS OF PARALLEL ROBOTS Ashitava Ghosal 1 1 Department of Mechanical Engineering & Centre for Product Design and Manufacture Indian Institute of Science

More information

Robotics, Geometry and Control - Rigid body motion and geometry

Robotics, Geometry and Control - Rigid body motion and geometry Robotics, Geometry and Control - Rigid body motion and geometry Ravi Banavar 1 1 Systems and Control Engineering IIT Bombay HYCON-EECI Graduate School - Spring 2008 The material for these slides is largely

More information

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

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

More information

Chapter 2 Math Fundamentals

Chapter 2 Math Fundamentals Chapter 2 Math Fundamentals Part 1 2.1 Conventions and Definitions 2.2 Matrices 2.3 Fundamentals of Rigid Transforms 1 Outline 2.1 Conventions and Definitions 2.2 Matrices 2.3 Fundamentals of Rigid Transforms

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

Advanced Robotic Manipulation

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

More information

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

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

Additional Problem (HW 10)

Additional Problem (HW 10) 1 Housekeeping - Three more lectures left including today: Nov. 20 st, Nov. 27 th, Dec. 4 th - Final Eam on Dec. 11 th at 4:30p (Eploratory Planetary 206) 2 Additional Problem (HW 10) z h y O Choose origin

More information