Robotics I. February 6, 2014

Size: px
Start display at page:

Download "Robotics I. February 6, 2014"

Transcription

1 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) target in the 3D Cartesian space. The tilt rotation is typically limited to maximum ±9 w.r.t. the vertical axis, or slightly more. The motion of the optical axis of the camera can be described with the Denavit-Hartenberg (DH) formalism, as that of a 2-dof simple robot manipulator. z z x y x y Figure 1: Pan-tilt cameras, with placement of the reference frame RF (shown for two of them) Assign the frames according to the DH convention and provide the associated table of parameters. Use mandatorily the reference frame RF = {x, y, z } as indicated in Fig. 1. One of the axes of the last frame should be coincident with the optical axis of the camera. Determine the unit vector of the pointing axis as a function of the joint angles q R 2. For a given target position p T = ( ) x T y T T z T, with z T (and sufficiently large), determine the value(s) of q that solve the pointing task. Is this inverse kinematics problem always solvable or well defined? Exercise 2 In a pick-and-place task, beside the desired initial Cartesian pose r at time t = t and the final pose r f at t = t f of the robot, it is common to assign two intermediate robot poses, r 1 at t = t 1 and r 2 at t = t 2 (with t < t 1 < t 2 < t f ), so as to shape the total robot motion in three phases: Lift off from r to r 1 ; Travel from r 1 to r 2 ; and, Set down from r 2 to r f. Smoothness of the trajectory is requested, with continuity up to the acceleration at any t [t, t f ]. The first and last phases are in guarded move, and should be performed with caution because of the closeness to environmental surfaces. Therefore, we require also zero velocity and acceleration at the initial and final poses. The four Cartesian poses r, r 1, r 2, and r f have been transformed into four configurations q, q 1, q 2, and q f of a robot with revolute joints by means if its inverse kinematics. axis. 1 Panning refers to left/right rotations around the vertical axis, tilting to up/down rotations around an horizontal 1

2 Define a trajectory for a generic joint q addressing the given task. Give the expressions used for each polynomial tract, formulate the problem, and provide the value of all coefficients using: t =, t 1 = 2, t 2 = 4, t 1 = 6 q = q(t ) =, q 1 = q(t 1 ) = 1, q 2 = q(t 2 ) = 8, q f = q(t f ) = 9 [deg]. Hint: You can solve the problem numerically (by a direct method) or analytically (by proper choosing the structure of the polynomials, so as to ease the analysis). Either way is fine. The former approach is rather straightforward, but only if you use a (simple) Matlab code (do not include this, just report the results as requested). The latter is more complex, though quite elegant (you can reduce the problem to the solution of a suitable linear system of two equations in two unknowns, which is indeed solvable in closed form). Exercise 3 Consider a robot manipulator with n joints, its configuration vector q R n, and a task described by r = r(q), with r R m. Assume that m = n and a desired task trajectory r d (t) is given. Prove that the kinematic control law q = J 1 (q) ṙ d + k J T (q) (r d r(q)), (1) with the task Jacobian matrix J(q) = r(q)/ q and a scalar k >, will force any initial error e() = r d () r(q()) at time t = to converge to zero, as long as no singularities of J(q) are encountered. Discuss the above controller in terms of off-line versus on-line computations needed. Next, assume that m < n. How can the kinematic control law (1) be modified in order to guarantee the same previous features? [21 minutes for all exercises; open books] 2

3 Solutions February 6, 214 Exercise 1 The DH frame assignment is shown in Fig. 2, with the associated parameters in Table 1. Note that a non-zero offset d 1 > is present, since the reference frame cannot be assigned arbitrarily, as specified by the text of the problem (otherwise, we could move up the origin O along z until intersecting the second joint axis). z x 2 z 1 = z 2 O 1 = O 2 x 1 d 1 O x y Figure 2: Assignment of Denavit-Hartenberg frames for a pan-tilt camera i α i a 1 d i θ i 1 π/2 d 1 q 1 2 q 2 Table 1: Denavit-Hartenberg parameters for the pan-tilt camera The optical axis of the camera is the unit axis x 2 of last frame, whose expression is given by 1 cos q 1 sin q 1 cos q 2 sin q 2 1 x 2 = R 1 (q 1 ) 1 R 2 (q 2 ) = sin q 1 cos q 1 sin q 2 cos q = cos q 1 cos q 2 sin q 1 cos q 2 sin q 2. For the pointing task, observe first that any 3D position p T = ( x T y T z T ) T of a target having z T is mapped into a single value of two task variables, namely the pan angle α and 3

4 the tilt angle β, as α = ATAN2 { y T, x T }, β = ATAN2 { z T, x 2 T + yt 2 }. (2) When the target is on the (positive) z axis, α is not defined 2. Otherwise, the mapping in (2) is surjective (but not injective, since all Cartesian points on a half-ray from the origin give the same values of (α, β)). If there were no base offset (d 1 = ), these two angles would also coincide with the values (q 1, q 2 ), in the same order, solution of the inverse kinematics problem. Nevertheless, simple geometry shows that the inverse kinematics solution for the two-dimensional pointing task is given by q 1 = ATAN2 { y T, x T }, q 2 = ATAN2 { z T d 1, x 2 T + yt 2 }, (3) except for the singular case y T = x T =, where the angle q 1 is not specified (any value of q 1 satisfies the problem). Note that there is no choice of signs for angle q 2, because of the range limitation of this joint (moreover, the target position is assumed to lie in the Cartesian region with positive values of z T d 1 ). Exercise 2 A numerical procedure for obtaining the solution is detailed in steps A E below. We may call this a brute force approach. A. Define the interpolating polynomials for the three phases L = Lift off (degree 4), T = Travel (degree 3), and S = Set down (degree 4): q L (t) = a L + a L1 t + a L2 t 2 + a L3 t 3 + a L4 t 4 t [t, t 1 ] q T (t) = a T + a T 1 t + a T 2 t 2 + a T 3 t 3 t [t 1, t 2 ] q S (t) = a S + a S1 t + a S2 t 2 + a S3 t 3 + a S4 t 4 t [t 1, t f ]. The trajectory will be the concatenation of these three polynomials for the motion interval t [t, t f ]: q L (t) for t [t, t 1 ] q 434 (t) = q T (t) for t [t 1, t 2 ] (5) q S (t) for t [t 2, t f ]. B. The 14 unknown coefficients are organized in the vector x T = ( a L a L1 a L2 a L3 a L4 a T a T 1 a T 2 a T 3 a S a S1 a S2 a S3 a S4 ). (6) C. Impose the requested 14 boundary conditions on the 14 coefficients: (4) q L (t ) = q q L (t ) = q L (t ) = q L (t 1 ) = q 1 q L (t 1 ) = q T (t 1 ) q L (t 1 ) = q T (t 1 ) (continuity of velocity and acceleration at t 1 ) q T (t 1 ) = q 1 q T (t 2 ) = q 2 q T (t 2 ) = q S (t 2 ) q T (t 2 ) = q S (t 2 ) (continuity of velocity and acceleration at t 2 ) q S (t 2 ) = q 2 q S (t f ) = q f q S (t f ) = q S (t f ) =. (7) 2 In order to be interpreted as trigonometric values (sine and cosine of q some angle), the arguments q of each of the two ATAN2 functions in the eqs. (2) should be divided, respectively by x 2 T + yt 2 and by x 2 T + yt 2 + zt 2. When x 2 T + yt 2, this division by a (positive) value can be avoided. Instead, for x 2 T = yt 2 =, the pan angle α would remain anyway undefined. So, such divisions are skipped altogether in eqs. (2), while introducing a preliminary warning in (or close to) a singularity. Similar arguments hold for eqs. (3). 4

5 D. Following the same order, the conditions (7) can be written in matrix form as A x = b, (8) with A = 1 t t 2 t 3 t 4 1 2t 3t 2 4t 3 2 6t 12t 2 1 t 1 t 2 1 t 3 1 t t 1 3t 2 1 4t t 1 3t t 1 12t t 1 1 t 1 t 2 1 t t 2 t 2 2 t t 2 3t t 2 3t 2 2 4t t 2 2 6t 2 12t t 2 t 2 2 t 3 2 t t f t 2 f t 3 f t 4 f 1 2t f 3t 2 f 4t 3 f (9) 2 6t f 12t 2 f and b = ( q q 1 q 1 q 2 q 2 q f ) T. It can be shown that matrix A in (9) is always non-singular as long as t < t 1 < t 2 < t f, a condition which is satisfied by assumption. Using the problem data, we have A = and b = ( ) T. 5

6 E. By using Matlab, the linear system of equations (8) is solved as x = A 1 b, providing the desired coefficients of the three polynomials: x T = ( a L a L1 a L2 a L3 a L4 a T a T 1 a T 2 a T 3 a S a S1 a S2 a S3 a S4 ) = ( ). (1) Figure 3 shows the position, velocity, and acceleration of the obtained trajectory. It can be noted that the trajectory is fully symmetric because of the specific data distribution. As requested, the solution trajectory q 434 (t) is continuous up to the acceleration, and has zero initial and final values of the first two time derivatives. Once the above numerical procedure has been coded (e.g., in Matlab), it can be used for other sets of data. For instance, we can change just the timing through the same knots, i.e., t =, t 1 = 1, t 2 = 4, t 1 = 6 q =, q 1 = 1, q 2 = 8, q f = 9 [deg]. (11) Figure 4 shows the resulting trajectory. Symmetry of motion is now lost. Matrix A in (9) is clearly sparse. As a matter of fact, no special structure has been exploited in order to reduce the number of independent equations to be solved numerically. A more careful definition of the interpolating polynomials can lead instead to a complete analytical solution in closed form. For this, normalization of time is used in each motion phase, together with a symmetric definition of the first and last quartic polynomials (reversing time for the latter). Moreover, a similar idea is used as in spline interpolation in order to break the problem in three separate parts. The analytical solution is found by the procedure a f below. For the time being, assume that q q 1 and q 2 q f. Special cases will be treated at the end. a. Define the quartic polynomial in the Lift off phase as q L (τ 1 ) = q + (q 1 q ) ( a 13 τ1 3 + a 14 τ1 4 ), τ1 = t t [, 1]. (12) t 1 t It is easy to see that, by construction, q L (τ 1 ) satisfies the three initial boundary conditions at t = t (or, τ 1 = ) on position, velocity, and acceleration. Moreover, q L (1) = q + (q 1 q ) (a 13 + a 14 ) = q 1 a 13 + a 14 = 1. Therefore, for the derivatives and their values at t = t 1 (or, τ 1 = 1) we have and q L (τ 1 ) = q 1 q ( 3 a13 τ a 14 τ 3 ) 1 t 1 t q L (τ 1 ) = q 1 q ( 6 a13 (t 1 t ) 2 τ a 14 τ1 2 ) b. Define the quartic polynomial in the Set down phase as q L (1) = q 1 q t 1 t (3 + a 14 ) (13) q L (1) = 6(q 1 q ) (t 1 t ) 2 (1 + a 14). (14) q S (τ 3 ) = q f + (q 2 q f ) ( a 33 (1 τ 1 ) 3 + a 34 (1 τ 1 ) 4), τ 3 = t t 2 [, 1]. (15) 6

7 By construction, q S (τ 3 ) satisfies the three final boundary conditions at t = t f (or, τ 3 = 1) on position, velocity, and acceleration. Moreover, q S () = q f + (q 2 q f ) (a 33 + a 34 ) = q 2 a 33 + a 34 = 1. Therefore, for the derivatives and their values at t = t 2 (or, τ 3 = ) we have and q S (τ 3 ) = q f q 2 ( 3 a33 (1 τ 3 ) a 34 (1 τ 3 ) 3) q S () = q f q 2 (3 + a 34 ) (16) q S (τ 3 ) = q f q 2 ( ) 2 ( 6 a33 (1 τ 3 ) + 12 a 34 (1 τ 3 ) 2) q S () = 6(q f q 2 ) ( ) 2 (1 + a 34). c. For the cubic polynomial in the Travel phase, we choose the symmetric form q T (τ 2 ) = q 2 τ 2 + q 1 (1 τ 2 ) + a 21 τ 2 (1 τ 2 ) 2 + a 22 τ 2 2 (1 τ 2 ), τ 2 = t t 1 t 2 t 1 [, 1]. (18) By construction, q T (τ 2 ) satisfies the interpolating conditions on position in t = t 1 (τ 2 = ) and t = t 2 (τ 2 = 1). Denote at this stage the (yet unknown) velocities at the internal knots as v 1 and v 2, respectively. By imposing q T () = v 1, q T (1) = v 2, the cubic polynomial (18) becomes fully specified as q T (τ 2 ) = q 1 + (q 2 q 1 )τ 2 + [v 1 (t 2 t 1 ) + (q 2 q 1 )] τ 2 (1 τ 2 ) 2 + [(q 2 q 1 ) v 2 (t 2 t 1 )] τ 2 2 (1 τ 2 ), (19) for τ 2 [, 1]. For later use, we compute also the expression of its acceleration: q T (τ 2 ) = 6(q 2 q 1 ) (t 2 t 1 ) 2 (1 2τ 2) + 1 t 2 t 1 (6(v 1 + v 2 ) τ 2 2(2v 1 + v 2 )). (2) (17) d. Using the expressions in (13) and (16), and imposing the equalities q L (1) = v 1, q S () = v 2, we solve for the coefficients of q L (τ 1 ) and q S (τ 3 ) as a 14 = v 1 t 1 t q 1 q 3, a 13 = 1 a 14 = 4 v 1 t 1 t q 1 q (21) and a 34 = v 2 q f q 2 3, a 33 = 1 a 34 = 4 v 2 q f q 2. (22) e. Having tailored the solution as above, we are left only with the problem of finding the correct values v 1 and v 2. For this, the conditions of continuity of the acceleration at the intermediate knots are used, namely q L (1) = q T (), q T (1) = q S (). 7

8 Using eqs. (14) and (17), substituting therein the coefficients given by (21) and (22), and evaluating (2) at τ 2 = and τ 2 = 1 yields q L (1) = 6v 1 t 1 t 12(q 1 q ) (t 1 t ) 2 = 2(v 2 + 2v 1 ) t 2 t 1 + 6(q 2 q 1 ) (t 2 t 1 ) 2 = q T () q T (1) = 2(v 1 + 2v 2 ) t 2 t 1 6(q 2 q 1 ) (t 2 t 1 ) 2 = 6v (q f q 2 ) ( ) 2 = q S (). (23) After some manipulation, the following linear system of two equations in two unknowns in matrix form is obtained: ( ) ( ) ( ) v1 6 (t2 t 1 ) + 4 (t 1 t ) 2 (t 1 t ) v1 Since M v 2 = = 2 ( ) 6 (t 2 t 1 ) + 4 ( ) 6(q 2 q 1 ) t 1 t + 12(q 1 q ) t 2 t 1 t 2 t 1 t 1 t 6 (q 2 q 1 ) t 2 t (q f q 2 ) t 2 t 1 = ( n1 n 2 ) v 2 = n. det M = 12 { 3(t 2 t 1 ) 3 + 2(t 2 t 1 ) [(t 1 t ) + ( )] + (t 1 t )( ) }, (25) (24) its solution is ) ( v1 v 2 = M 1 n = 1 det M ( 6 (t2 t 1 ) + 4 ( ) 2 (t 1 t ) 2 ( ) 6 (t 2 t 1 ) + 4 (t 1 t ) ) ( ) n1, (26) n 2 where n 1 and n 2 are defined in (24), and eq. (25) is used for the determinant. The closed form solution of the problem is found by replacing the analytical expressions of v 1 and v 2 in eq. (19) for q T (τ 2 ) and in eqs. (21 22) for q L (τ 1 ) and q S (τ 3 ). f. Using the problem data, we obtain v 1 = v 2 = 22.5 [deg/s] (27) and so a 13 =.5, a 14 = 1.5, a 33 =.5, a 34 = 1.5. Indeed, the resulting trajectory is the same as the one obtained with the numerical method. However, since the symbolic expressions of the used polynomials are different, also the associated numerical values of the coefficients will be different. In Fig. 3, the computed values (27) are shown as magenta dots in the velocity plots. Note also that identical values are obtained for the coefficients of the two quartic polynomials, because of the symmetric nature of the given data. For the alternative data in (11), we obtain instead (see the plots in Fig. 4) v 1 = , v 2 = [deg/s] (28) and a 13 = , a 14 =.8582, a 33 = 1.126, a 34 =.126. To complete the analysis, we have to consider the degenerate (or singular) cases, namely when q = q 1 and/or q 2 = q f. The numerical approach is totally unaffected by any repetition of values 8

9 at the knots (i.e., matrix A does not lose rank). On the other hand, in the more tailored analytical approach some changes are needed. In fact, the expressions of the quartic polynomials (12) and (15) would be forced to become constant in such cases (while they should not, unless q = q 1 = q 2 = q f and no motion is needed). In a singular case, it is sufficient to replace the previous definitions by when q 1 = q, and/or by q L (τ 1 ) = q + v 1 (t 1 t ) ( τ1 4 τ1 3 ), τ1 = t t [, 1] t 1 t q S (τ 3 ) = q f + v 2 ( ) ( (1 τ 3 ) 3 (1 τ 3 ) 4), τ 3 = t t 2 [, 1] when q 2 = q f. In this way, we have in particular q L (1) = 6v 1 t 1 t, q S () = 6v 2 that coincide with the expressions in (23) of the accelerations at the intermediate knots, respectively when q 1 = q and when q 2 = q f. Therefore, v 1 and v 2 can be found using (26) as before. For instance, consider the double degenerate case t =, t 1 = 2, t 2 = 4, t 1 = 6 q = q 1 =, q 2 = q f = 9 [deg]. (29) Figure 5 shows the result obtained via the analytical method, yielding again v 1 = v 2 = 22.5 [deg/s] (the same trajectory would be obtained also with the numerical method). From the position profile, we can see that there is some motion also in the first and last time intervals, which is needed to guarantee continuity up to the acceleration in the intermediate knots. However, an under- and over-shooting is present, which makes this particular situation no longer interesting for a collision-free guarded motion of the robot, when close to environmental surfaces. Two different Matlab programs for the numerical solution and for the analytical solution (including treatment of degenerate cases) are available upon request. 9

10 1 polynomial trajectory 8 6 [deg] velocity with polynomial [deg/s] acceleration with polynomial [deg/s 2 ] Figure 3: Position (top, the red dots are the interpolated knots), velocity (center, the magenta dots are the computed v 1 and v 2 ), and acceleration (bottom) of the solution trajectory 1

11 1 polynomial trajectory [deg] velocity with polynomial [deg/s] acceleration with polynomial [deg/s 2 ] Figure 4: Position (top), velocity (center), and acceleration (bottom) of the solution trajectory for the motion task in (11): Same knots, but different timing 11

12 1 polynomial trajectory (singular case) 8 6 [deg] velocity with polynomial (singular case) [deg/s] acceleration with polynomial (singular case) [deg/s 2 ] Figure 5: Position (top), velocity (center), and acceleration (bottom) of the solution trajectory for the motion task in (29): Initial and first intermediate knot, as well as second intermediate and final knot have repeated position values 12

13 Exercise 3 The proof is based on Lyapunov stability, namely on the analysis of the time evolution of the error function V = 1 2 et e = 1 2 (r d r) T (r d r). Using eq. (1) and dropping dependencies, we have V = e T ė = e T (ṙ d ṙ) = e T ṙ d e T J q [ ] = e T ṙ d e T J J 1 ṙ d + k J T (r d r) = k e T JJ T e. (3) As long as J(q) is non-singular, we have J T e = (and so V = ) if and only if e =. Therefore, the controlled robot will be an asymptotically stable system, and the error e(t) will converge to zero from any initial condition e(). Note that, since the closed-loop system is still nonlinear, asymptotic stability (and convergence) will not be exponential in general. The two terms in the control law (1), the first with the inverse Jacobian and the second with the Jacobian transpose, need both to be computed on line (i.e., all vectors and matrices are evaluated at the current configuration q), even if the desired task trajectory r d (t), t [, T ], is completely known in advance for an arbitrary duration T. When the robot is kinematically redundant for the given task (m < n), we can just replace in (1) the inverse of the Jacobian J by its pseudoinverse J #. In fact, as long as the Jacobian is full (row) rank, it is JJ # = JJ T ( JJ T ) 1 = I. Therefore, we obtain the same cancellation of terms as in (3). 13

Robotics I. June 6, 2017

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

More information

Robotics I June 11, 2018

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

More information

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

, 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

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

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

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

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

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

The degree of a function is the highest exponent in the expression

The degree of a function is the highest exponent in the expression L1 1.1 Power Functions Lesson MHF4U Jensen Things to Remember About Functions A relation is a function if for every x-value there is only 1 corresponding y-value. The graph of a relation represents a function

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

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

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

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

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

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

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

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

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

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

Control of industrial robots. Centralized control

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

More information

22.3. Repeated Eigenvalues and Symmetric Matrices. Introduction. Prerequisites. Learning Outcomes

22.3. Repeated Eigenvalues and Symmetric Matrices. Introduction. Prerequisites. Learning Outcomes Repeated Eigenvalues and Symmetric Matrices. Introduction In this Section we further develop the theory of eigenvalues and eigenvectors in two distinct directions. Firstly we look at matrices where one

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

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

(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

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

MTH301 Calculus II Glossary For Final Term Exam Preparation

MTH301 Calculus II Glossary For Final Term Exam Preparation MTH301 Calculus II Glossary For Final Term Exam Preparation Glossary Absolute maximum : The output value of the highest point on a graph over a given input interval or over all possible input values. An

More information

Algebraic. techniques1

Algebraic. techniques1 techniques Algebraic An electrician, a bank worker, a plumber and so on all have tools of their trade. Without these tools, and a good working knowledge of how to use them, it would be impossible for them

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

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

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

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

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

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

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

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

Summer Assignment MAT 414: Calculus

Summer Assignment MAT 414: Calculus Summer Assignment MAT 414: Calculus Calculus - Math 414 Summer Assignment Due first day of school in September Name: 1. If f ( x) = x + 1, g( x) = 3x 5 and h( x) A. f ( a+ ) x+ 1, x 1 = then find: x+ 7,

More information

Kinematics

Kinematics Classical Mechanics Kinematics Velocities Idea 1 Choose the appropriate frame of reference. Useful frames: - Bodies are at rest - Projections of velocities vanish - Symmetric motion Change back to the

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

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

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

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

Quaternion Cubic Spline

Quaternion Cubic Spline Quaternion Cubic Spline James McEnnan jmcennan@mailaps.org May 28, 23 1. INTRODUCTION A quaternion spline is an interpolation which matches quaternion values at specified times such that the quaternion

More information

Lectures 9-10: Polynomial and piecewise polynomial interpolation

Lectures 9-10: Polynomial and piecewise polynomial interpolation Lectures 9-1: Polynomial and piecewise polynomial interpolation Let f be a function, which is only known at the nodes x 1, x,, x n, ie, all we know about the function f are its values y j = f(x j ), j

More information

A new large projection operator for the redundancy framework

A new large projection operator for the redundancy framework 21 IEEE International Conference on Robotics and Automation Anchorage Convention District May 3-8, 21, Anchorage, Alaska, USA A new large projection operator for the redundancy framework Mohammed Marey

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

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

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

Represent this system in terms of a block diagram consisting only of. g From Newton s law: 2 : θ sin θ 9 θ ` T

Represent this system in terms of a block diagram consisting only of. g From Newton s law: 2 : θ sin θ 9 θ ` T Exercise (Block diagram decomposition). Consider a system P that maps each input to the solutions of 9 4 ` 3 9 Represent this system in terms of a block diagram consisting only of integrator systems, represented

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

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

Dot Product August 2013

Dot Product August 2013 Dot Product 12.3 30 August 2013 Dot product. v = v 1, v 2,..., v n, w = w 1, w 2,..., w n The dot product v w is v w = v 1 w 1 + v 2 w 2 + + v n w n n = v i w i. i=1 Example: 1, 4, 5 2, 8, 0 = 1 2 + 4

More information

MEEN 363 Notes Copyright, Dara W. Childs

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

More information

Rigid Geometric Transformations

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

More information

Supporting Information

Supporting Information Supporting Information A: Calculation of radial distribution functions To get an effective propagator in one dimension, we first transform 1) into spherical coordinates: x a = ρ sin θ cos φ, y = ρ sin

More information

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

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

More information

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

4.3 TRIGONOMETRY EXTENDED: THE CIRCULAR FUNCTIONS

4.3 TRIGONOMETRY EXTENDED: THE CIRCULAR FUNCTIONS 4.3 TRIGONOMETRY EXTENDED: THE CIRCULAR FUNCTIONS MR. FORTIER 1. Trig Functions of Any Angle We now extend the definitions of the six basic trig functions beyond triangles so that we do not have to restrict

More information

ME 012 Engineering Dynamics

ME 012 Engineering Dynamics ME 012 Engineering Dynamics Lecture 7 Absolute Dependent Motion Analysis of Two Particles (Chapter 12, Section 10) Tuesday, Feb. 05, 2013 Today s Objectives: Understand translating frames of reference.

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

Chapter 2: Numeric, Cell, and Structure Arrays

Chapter 2: Numeric, Cell, and Structure Arrays Chapter 2: Numeric, Cell, and Structure Arrays Topics Covered: Vectors Definition Addition Multiplication Scalar, Dot, Cross Matrices Row, Column, Square Transpose Addition Multiplication Scalar-Matrix,

More information

Rigid Geometric Transformations

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

More information

Hermite Interpolation with Euclidean Pythagorean Hodograph Curves

Hermite Interpolation with Euclidean Pythagorean Hodograph Curves Hermite Interpolation with Euclidean Pythagorean Hodograph Curves Zbyněk Šír Faculty of Mathematics and Physics, Charles University in Prague Sokolovská 83, 86 75 Praha 8 zbynek.sir@mff.cuni.cz Abstract.

More information

Linear Algebra. The analysis of many models in the social sciences reduces to the study of systems of equations.

Linear Algebra. The analysis of many models in the social sciences reduces to the study of systems of equations. POLI 7 - Mathematical and Statistical Foundations Prof S Saiegh Fall Lecture Notes - Class 4 October 4, Linear Algebra The analysis of many models in the social sciences reduces to the study of systems

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

PURE MATHEMATICS Unit 1

PURE MATHEMATICS Unit 1 PURE MATHEMATICS Unit 1 FOR CAPE EXAMINATIONS DIPCHAND BAHALL CAPE is a registered trade mark of the Caribbean Examinations Council (CXC). Pure Mathematics for CAPE Examinations Unit 1 is an independent

More information

Repeated Eigenvalues and Symmetric Matrices

Repeated Eigenvalues and Symmetric Matrices Repeated Eigenvalues and Symmetric Matrices. Introduction In this Section we further develop the theory of eigenvalues and eigenvectors in two distinct directions. Firstly we look at matrices where one

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

ADDITIONAL MATHEMATICS

ADDITIONAL MATHEMATICS ADDITIONAL MATHEMATICS GCE NORMAL ACADEMIC LEVEL (016) (Syllabus 4044) CONTENTS Page INTRODUCTION AIMS ASSESSMENT OBJECTIVES SCHEME OF ASSESSMENT 3 USE OF CALCULATORS 3 SUBJECT CONTENT 4 MATHEMATICAL FORMULAE

More information

Background Mathematics (2/2) 1. David Barber

Background Mathematics (2/2) 1. David Barber Background Mathematics (2/2) 1 David Barber University College London Modified by Samson Cheung (sccheung@ieee.org) 1 These slides accompany the book Bayesian Reasoning and Machine Learning. The book and

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

Multi-body Singularity Equations IRI Technical Report

Multi-body Singularity Equations IRI Technical Report IRI-TR-10-02 Multi-body Singularity Equations IRI Technical Report On how to obtain the equations for computation with CUIK O. Bohigas-Nadal L. Ros Abstract This technical report explains how to obtain

More information

ACM/CMS 107 Linear Analysis & Applications Fall 2016 Assignment 4: Linear ODEs and Control Theory Due: 5th December 2016

ACM/CMS 107 Linear Analysis & Applications Fall 2016 Assignment 4: Linear ODEs and Control Theory Due: 5th December 2016 ACM/CMS 17 Linear Analysis & Applications Fall 216 Assignment 4: Linear ODEs and Control Theory Due: 5th December 216 Introduction Systems of ordinary differential equations (ODEs) can be used to describe

More information

Introduction. Chapter Points, Vectors and Coordinate Systems

Introduction. Chapter Points, Vectors and Coordinate Systems Chapter 1 Introduction Computer aided geometric design (CAGD) concerns itself with the mathematical description of shape for use in computer graphics, manufacturing, or analysis. It draws upon the fields

More information

Lecture 6. Numerical methods. Approximation of functions

Lecture 6. Numerical methods. Approximation of functions Lecture 6 Numerical methods Approximation of functions Lecture 6 OUTLINE 1. Approximation and interpolation 2. Least-square method basis functions design matrix residual weighted least squares normal equation

More information

Kinematic Analysis of the 6R Manipulator of General Geometry

Kinematic Analysis of the 6R Manipulator of General Geometry Kinematic Analysis of the 6R Manipulator of General Geometry Madhusudan Raghavan Powertrain Systems Research Lab General Motors R&D Center Warren, MI 48090-9055 and Bernard Roth, Professor Design Division

More information

Vectors To begin, let us describe an element of the state space as a point with numerical coordinates, that is x 1. x 2. x =

Vectors To begin, let us describe an element of the state space as a point with numerical coordinates, that is x 1. x 2. x = Linear Algebra Review Vectors To begin, let us describe an element of the state space as a point with numerical coordinates, that is x 1 x x = 2. x n Vectors of up to three dimensions are easy to diagram.

More information

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

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

More information

Directional Redundancy for Robot Control

Directional Redundancy for Robot Control ACCEPTED FOR PUBLICATION IN IEEE TRANSACTIONS ON AUTOMATIC CONTROL Directional Redundancy for Robot Control Nicolas Mansard, François Chaumette, Member, IEEE Abstract The paper presents a new approach

More information

SECTION 2.7: NONLINEAR INEQUALITIES

SECTION 2.7: NONLINEAR INEQUALITIES (Section 2.7: Nonlinear Inequalities) 2.77 SECTION 2.7: NONLINEAR INEQUALITIES We solved linear inequalities to find domains, and we discussed intervals in Section 1.4: Notes 1.24 to 1.30. In this section,

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

System Control Engineering

System Control Engineering System Control Engineering 0 Koichi Hashimoto Graduate School of Information Sciences Text: Feedback Systems: An Introduction for Scientists and Engineers Author: Karl J. Astrom and Richard M. Murray Text:

More information

The Reflexxes Motion Libraries. An Introduction to Instantaneous Trajectory Generation

The Reflexxes Motion Libraries. An Introduction to Instantaneous Trajectory Generation ICRA Tutorial, May 6, 2013 The Reflexxes Motion Libraries An Introduction to Instantaneous Trajectory Generation Torsten Kroeger 1 Schedule 8:30-10:00 Introduction and basics 10:00-10:30 Coffee break 10:30-11:30

More information

Tangent spaces, normals and extrema

Tangent spaces, normals and extrema Chapter 3 Tangent spaces, normals and extrema If S is a surface in 3-space, with a point a S where S looks smooth, i.e., without any fold or cusp or self-crossing, we can intuitively define the tangent

More information

Quaternion Dynamics, Part 1 Functions, Derivatives, and Integrals. Gary D. Simpson. rev 00 Dec 27, 2014.

Quaternion Dynamics, Part 1 Functions, Derivatives, and Integrals. Gary D. Simpson. rev 00 Dec 27, 2014. Quaternion Dynamics, Part 1 Functions, Derivatives, and Integrals Gary D. Simpson gsim100887@aol.com rev 00 Dec 27, 2014 Summary Definitions are presented for "quaternion functions" of a quaternion. Polynomial

More information

Decentralized Stabilization of Heterogeneous Linear Multi-Agent Systems

Decentralized Stabilization of Heterogeneous Linear Multi-Agent Systems 1 Decentralized Stabilization of Heterogeneous Linear Multi-Agent Systems Mauro Franceschelli, Andrea Gasparri, Alessandro Giua, and Giovanni Ulivi Abstract In this paper the formation stabilization problem

More information

Region 16 Board of Education. Precalculus Curriculum

Region 16 Board of Education. Precalculus Curriculum Region 16 Board of Education Precalculus Curriculum 2008 1 Course Description This course offers students an opportunity to explore a variety of concepts designed to prepare them to go on to study calculus.

More information

Course Outline and Objectives. MA 1453 Precalculus with Graphing Calculators

Course Outline and Objectives. MA 1453 Precalculus with Graphing Calculators Effective Fall 2011 Course Outline and Objectives MA 1453 Precalculus with Graphing Calculators TEXT: Precalculus, 5 th Edition, by Faires and DeFranza ISBN 978-0-8400-6862-0 NOTE: A graphing calculator

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

Limits of Exponential, Logarithmic, and Trigonometric Functions

Limits of Exponential, Logarithmic, and Trigonometric Functions Limits of Exponential, Logarithmic, and Trigonometric Functions by CHED on January 02, 2018 lesson duration of 3 minutes under Basic Calculus generated on January 02, 2018 at 01:54 am Tags: Limits and

More information

Vectors and 2D Kinematics. AIT AP Physics C

Vectors and 2D Kinematics. AIT AP Physics C Vectors and 2D Kinematics Coordinate Systems Used to describe the position of a point in space Coordinate system consists of a fixed reference point called the origin specific axes with scales and labels

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