Robotics 2 Robots with kinematic redundancy

Size: px
Start display at page:

Download "Robotics 2 Robots with kinematic redundancy"

Transcription

1 Robotics 2 Robots with kinematic redundancy Prof. Alessandro De Luca

2 Redundant robots! direct kinematics of the task r = f(q) f: Q! R joint space (dim Q = N) task space (dim R = M)! a robot is (kinematically) redundant for the task if N > M (more degrees of freedom than strictly needed for executing the task)! r may contain the position and/or the orientation of the end-effector or, more in general, be any parameterization of the task (even not in the Cartesian workspace)! redundancy of a robot is thus a relative concept, i.e., it holds with respect to a given task Robotics 2 2

3 Some tasks and their dimensions TASKS [for the end-effector (E-E)]! position in the plane! position in 3D space! orientation in the plane! pointing in 3D space! position and orientation in 3D space dimension M a planar robot with N=3 joints is redundant for the task of positioning its E-E in the plane (M=2), but NOT for the task of positioning AND orienting the E-E in the plane (M=3) Robotics 2 3

4 Typical cases of redundant robots! 6R robot mounted on a linear track/rail! for positioning and orienting its end-effector in 3D space! 6-dof robot used for arc welding tasks! task does not prescribe the final roll angle of the welding gun! manipulator on a mobile base! dexterous robot hands! team of cooperating manipulators (or mobile robots)! humanoid robots...! kinematic redundancy is not the only type! redundancy of components (actuators, sensors)! redundancy in the control/supervision architecture Robotics 2 4

5 Uses of robot redundancy! avoid collision with obstacles (in Cartesian space)! or kinematic singularities (in joint space)! stay within the admissible joint ranges! increase manipulability in specified directions! uniformly distribute/limit joint velocities and/or accelerations! minimize energy consumption or needed motion torques! optimize execution time! increase dependability with respect to faults!... all objectives should be quantitatively measurable Robotics 2 5

6 DLR robots: LWR-III and Justin 7R LWR-III lightweight manipulator: elastic joints (HD), joint torque sensing, 13.5 kg weight = payload!! Justin two-arm upper-body humanoid: 43R actuated = two arms (2!7) + torso (3 * ) + head (2) + two hands (2!12), 45 kg weight Robotics 2 * = one joint is dependent on the motion of the other two 6

7 Justin carrying a trailer video motion planning for DLR Justin robot in the configuration space, avoiding Cartesian obstacles and using robot redundancy Robotics 2 7

8 Dual-arm redundancy video DIS, Uni Napoli two 6R Comau robots, one mounted on a linear track (+1P) coordinated 6D motion using the null-space of the robot on the right (N-M=1) Robotics 2 8

9 Motion cueing from redundancy video Max Planck Institute for Biological Cybernetics, Tübingen a 6R KUKA KR500 mounted on a linear track (+1P) with a sliding cabin (+1R), used as an emulation platform for dynamic human perception (N-M=2) Robotics 2 9

10 Self-motion video video 8R Dexter: self-motion with constant 6D pose of E-E (N-M=2) Nakamura s Lab, Uni Tokyo 6R robot with spherical shoulder in compliant tasks for the Cartesian E-E position (N-M=3) Robotics 2 10

11 Obstacle avoidance video 6R planar arm moving on a given geometric path for the E-E (N-M=4) Robotics 2 11

12 video Mobile manipulators N u available commands < N generalized coordinates!! video Unicycle + 2R planar arm (N=5, N u =4): E-E trajectory control on a circle, with pointing task for first link (N u -M=1) Magellan + 3R arm (N=6, N u =5): E-E trajectory control on a circle, with E-E pointing task (N u -M=0!!) Robotics 2 12

13 Humanoid robots HRP2 a hyper-redundant system, but with a few non-actuated dofs (at the base!) built by Kawada Industries, Inc. for the Humanoid Robotics Project (HRP) sponsored by the Japanese Ministry of Economy, Trade, and Industry Robotics 2 13

14 HRP2 humanoid robot in action video whole body motion/navigation avoiding obstacles JRL CNRS-AIST Joint Research Lab, Toulouse-Tsukuba E. Yoshida, C. Esteves, T. Sakaguchi, J.-P. Laumond, and K. Yokoi Smooth collision avoidance: Practical issues in dynamic humanoid motion IEEE Int. Conf. on Intelligent Robotics and Systems, 2006 Robotics 2 14

15 Disadvantages of redundancy! potential benefits should be traded off against! a greater structural complexity of construction! mechanical (more links, transmissions,...)! more actuators, sensors,...! costs! more complicated algorithms for inverse kinematics and motion control Robotics 2 15

16 Inverse kinematics problem! find q(t) that realizes the task: f(q(t)) = r(t) (at all times t)! infinite solutions exist when the robot is redundant (even for r(t) = r = constant) N = 3 > 2 = M r = constant E-E position! the robot arm may have internal displacements that are unobservable at the task level (e.g., not contributing to E-E motion)! these joint displacements can be chosen so as to improve/optimize in some way the behavior of the robotic system! self-motion: an arm reconfiguration in the joint space that does not change/affect the value of the task variables r! solutions are mainly sought at differential level (e.g., velocity) Robotics 2 16

17 . Redundancy resolution via optimization of an objective function! Local! Global given r(t) and q(t), t = kt s given r(t), t " [t 0, t 0 +T], q(t 0 ) optimization of H(q, q! ) optimization of H(q, q )d" t 0 + T # t 0 q (kt s ) ON-LINE q(t), t " [t 0, t 0 + T] q((k +1)T s ) = q(kt s ) + T s " q (kt s ) discrete-time form OFF-LINE relatively EASY (a LQ problem) quite DIFFICULT (nonlinear TPBV problems arise) Robotics 2 17

18 1 Local resolution methods three classes of methods for solving r = J(q) q! Jacobian-based methods (here, analytic Jacobian in general!) among the infinite solutions, one is chosen, e.g., that minimizes a suitable (possibly weighted) norm! 2 null-space methods a term is added to the previous solution so as not to affect execution of the task trajectory, i.e., belonging to the null-space N(J(q))! 3 task augmentation methods redundancy is reduced/eliminated by adding S " N-M further auxiliary tasks (when S = N-M, the problem has been squared ) Robotics 2 18

19 Jacobian-based methods we look for a solution to J = 1 N M r = J(q) q q = K(q) r K = in the form minimum requirement for K: J(q)K(q)J(q) = J(q) ( K = generalized inverse of J) M N " r #$( J(q) ) J(q) [ K(q) r ] = J(q)K(q)J(q) q = J(q) q = r example: if J = [J a J b ], det(j a ) # 0, one such generalized inverse of J is K r = (actually, this is a stronger right-inverse) # % $ J "1 a 0 & ( ' Robotics 2 19

20 Pseudoinverse! J # always exists, and is the unique matrix satisfying J J # J = J J # J J # = J # (J J # ) T = J J # (J # J) T = J # J! if J is full (row) rank, J # = J T (J J T ) -1 ; else, it is computed numerically using the SVD (Singular Value Decomposition) of J (pinv of Matlab)! the pseudo-inverse joint velocity is the only that minimizes the 1 norm q 2 2 = 1 2 task error norm q = J # (q) r q T q... a very common choice: K = J # among all joint velocities that minimize the 1 r 2 " J(q) q 2 { (q)}! if the task is feasible ( r "Im J ), there will be no task error Robotics 2 20

21 Weighted pseudoinverse q = J # w (q) r another choice: K = # J w! if J is full (row) rank, = W -1 J T (J W -1 J T ) -1 q! the solution minimizes the weighted norm 1 2 T 2 q! = w 1 2 q! # J w Wq! W > 0, symmetric (often diagonal)! large weight W i small q i (e.g., weights can be chosen proportionally to the inverse of the joint ranges)! it is NOT a pseudoinverse (4th relation does not hold...) but shares similar properties. Robotics 2 21

22 Singular Value Decomposition (SVD)! the SVD routine of Matlab applied to J provides two orthonormal matrices U M!M and V N!N, and a matrix # M!N of the form $ # 1 & # " = & 2 & & %! # M 0 Mx(N-M) where = rank(j) " M, so that their product is ' ) ) ) J = U " V T " 1 # " 2 # # " $ > 0, " $+1 = = " M = 0 ) singular values of J (! the columns of U are eigenvectors of JJ T (associated to its nonnegative eigenvalues $ i2 ), the columns of V are eigenvectors of J T J! the last N - columns of V are a basis for the null space of J Jv i = " i u i (i =1,,#) Jv i = 0 (i = " +1,,N) Robotics 2 22

23 Computation of pseudoinverses! show that the pseudoinverse of J is equal to for any rank of J J # = V " # U T "# = # J w & 1 ( # ( 1 (! ( ( ( ( ( ( ' 0 (N%M)xM ) # $ *! show that matrix is obtained by solving the constrained linearquadratic (LQ) optimization problem (with W>0, symmetric, and assuming J of full rank) min 1 q 2 2 w s.t. J(q) q " r = 0 and that the pseudoinverse is a particular case for W=I! show that a weighted pseudoinverse of J can be computed by SVD/ pinv as J a = J W -1/2 = W -1/2 pinv(j a ) # J w Robotics 2 23

24 unconstrained minimization of a suitable objective function SOLUTION Singularity robustness Damped Least Squares (DLS) min q µ 2 q r 2 " J q 2 = H( q ) q = J DLS (q) r = J T! induces a robust behavior when crossing singularities, but in the basic version gives always a task error e = µ 2 JJ T + µ 2 I M r! thus, J DLS is not a generalized inverse K ( JJ T + µ 2 I ) "1 M r ( ) "1! using SVD of J=U % V T J DLS = V" DLS U T with " DLS = compromise between large joint velocity and task accuracy (as in N=M case) % # diag{ i # 2 i + µ } ( ' * ' 2 * ' &!&' diag{0} * ' * ' * ' 0 (N-M)x$ 0 (N-M)x(N-$) * & )! choice of a variable damping factor µ 2 (q) $ 0, as a function of the minimum singular $ m (q) value of J measure of distance to singularity! numerical filtering: introduces damping only/mostly in non-feasible directions for the task (see Maciejewski and Klein, J of Rob Syst, 1988) Robotics 2 24

25 Behavior of DLS solution q 1 2µ % 1/# for # $ 0 PINV " & ' 0 for # = 0 DLS " # # 2 + µ 2 µ " a. comparison of joint velocity norm with PINV (pseudoinverse) or DLS solutions in a direction of a singular vector u, when the associated singular value $ 0 PINV goes to infinity (and then is 0 at $ = 0) DLS peaks a value of 1/2µ at $ = µ (and then smoothly goes to 0...) ' b. graphical interpretation of the damping effect (here M=N=2, for simplicity) J 1 q = r 1 q 2 one equality constraint minimum norm solution q 1 q 2 J 1 q = r 1 two equality constraints exact (unique) solution J 2 q = r 2 q 1 q 2 J 1 q = r 1 J 2 q = r 2 approximate (damped) solution two (almost dependent) equality constraints H( q ) = µ2 q q 1 r 2 - J exact (ill-conditioned) solution Robotics 2 25 q 2

26 Numerical example of DLS solution planar 2R arm, unit links, close to a singular configuration (stretched): q 1 =45, q 2 =1.5 ) " q DLS =.472 % $ ' #.055& (µ 2 = 10-3 ) (& ( µ) " q DLS =.133 % $ ' #.066& (µ 2 = 10) " r = -1/ 2 % $ ' # 1/ 2& (J) [rad/s] # q * 1& = % ( $ "1' iso-level curves of H [rad/s] # q * 1& = % ( $ "1' exact solution (µ=0) H = µ2 q r 2 - J q 2 µ q e % H min Robotics 2 26

27 Limits of Jacobian-based methods! no guarantee that singularities are globally avoided during task execution! despite joint velocities are kept to a minimum, this is only a local property and avalanche phenomena may occur! typically lead to non-repeatable motion in the joint space! cyclic motions in task space do not map to cyclic motions in joint space after 1 tour q in q fin # q in t q(t) = q in + # K(q) r (")d" Robotics

28 Drift with Jacobian pseudoinverse! a 7R KUKA LWR4 robot moves in the vicinity of a human operator! we command a cyclic Cartesian path (only in position, M=3), to be repeated several times using the pseudoinverse solution! (unexpected) collision of a link occurs during the third cycle... video Robotics 2 28

29 a particular solution (here, the pseudoinverse) in (J T ) 2 Null-space methods.. general solution of J q = r even more in general q = K 1 r + I "K 2 J q = J # r + ( I " J # J) q 0 ( ) q 0... but with less nice properties! orthogonal. projection of q 0 in )(J) symmetric K 1, K 2 generalized inverses of J (J K i J = J) all solutions of the associated homogeneous equation Jq = 0 (self-motions) idempotent: [I J # J] 2 = [I J # J] [I J # J] # = [I J # J].. J # r orthogonal to [I J # J]q 0 properties of projector [I J # J]. how do we choose q 0? Robotics 2 29.

30 Geometric view on Jacobian null space in the space of velocity commands Jq = r Jq = r Jq = 0 q 2 J # r minimum norm solution final solution final solution (closest to ) q 0...its projection the null space (I - J # J) q 0 q 2 generic/preferred joint velocity.... q 0 null space correction q 1 J # r q 1 subspace ker {J} Jq = 0 a correction is added to the original pseudoinverse (minimum norm) solution i) which is in the null space of the Jacobian ii) and possibly satisfies additional criteria or objectives Robotics 2 30

31 necessary conditions + sufficient condition for a minimum Linear-Quadratic Optimization generalities 1 min x ( 2 x " x 0) T W( x " x 0 ) = H(x) s.t. J x = y T M x N " x L = #L #x " % L = Jx $ y = 0 = W( x $ x 0 ) + J T % = 0 " = ( JW #1 J T ) #1 ( Jx 0 # y) M!M invertible ( Jx! y) x!i R N, W > 0 (symmetric) M y!i R, &(J) = M L(x, ") = H(x) + " Lagrangian (with multipliers *) 2! x L = W > 0 T! 1 x x = x 0 " W "1 J T = Jx0! JW J "! y = T x " 1 T 0 " W J 0! ( JW "1 J T ) "1 ( Jx 0 " y) Robotics 2 31

32 PROBLEM Linear-Quadratic Optimization application to robot redundancy resolution 1 min q ( q 2 " q 0 ) T W q " J(q) q = r ( ) = H( q 0 q ). q 0 is a privileged joint velocity SOLUTION q = q 0 " W "1 J T ( ) ( JW "1 J T ) "1 J q 0 " r # J W q = J W# r + ( I " J # W J) q 0 minimum weighted. norm solution (for q 0 = 0) projection matrix in the null-space )(J) Robotics 2 32

33 projected gradient Projected Gradient (PG) q = J # r + ( I " J # J) q 0. the choice q 0 = + q H(q)! differentiable objective function realizes one step of a constrained optimization algorithm S q q 3 + q H. q - while executing the time-varying task r(t) the robot tries to increase the value of H(q) for a fixed r - q 2 N-dimensional S q = {q " I R N : f(q) = r - }. q = (I - J # J)+ q H (I - J # J)+ q H = 0 is a necessary condition q 1 of constrained optimality Robotics 2 33

34 Typical objective functions H(q)! manipulability (maximize the distance from singularities) H man (q) = det J(q)J T (q)! joint range (minimize the distance from the mid points of the joint ranges) q i " [q m,i,q M,i ] q i = q M,i + q m,i 2 H range (q) = 1 2N N ) i=1 q i " q i q M,i " q m,i! obstacle avoidance (maximize the minimum distance to Cartesian obstacles) # % $ & ( ' 2. q 0 = - + q H(q) also known as clearance H obs (q) = min a"robot b"obstacles a(q) #b 2 potential difficulties due to non-differentiability (this is a max-min problem) Robotics 2 34

35 Singularities of planar 3R arm the robot is redundant for a positioning task in the plane (M=2) H(q) = sin 2 q 2 + sin 2 q 3 unconstrained maxima of H(q) -, it is not H man but has the same minima iso-level curves of H(q) H(q) -, q 2, q 3 q 3, -, q 3, -, q 2, links of equal (unit) length q 2 independent from q 1! Robotics 2 35

36 Minimum distance computation in human-robot interaction LWR4 robot with a finite number of control points a(q) (8, including the E-E) a Kinect sensor monitors the workspace giving the depth of points b on obstacles that are fixed or moving (like a human) distances in 3D (and then the clearance) are computed in this case as min { } a" control points b " human body a(q) #b 2 Robotics 2 36

37 Comments on null-space methods! the projection matrix (I J # J) has dimension N!N, but only rank N-M (if J is full rank M), with some waste of information! actual (efficient) evaluation of the solution q = J # r + ( I " J # J) q 0 = q 0 + J # r - J but the pseudoinverse is needed anyway, and this is computationally intensive (SVD in the general case)! in principle, the complexity of a redundancy resolution method should depend only from the redundancy degree N M! a constrained optimization method is available, which is known to be more efficient than the projected gradient (PG) at least when the Jacobian has full rank q 0 ( ) Robotics 2 37

38 Decomposition of joint space! if &(J(q)) = M, there exists a decomposition of the set of joints (possibly, after a reordering) M! M " q = q a % $ # q ' M b & N-M such that J a (q) = " f " q a! from the implicit function theorem, there exists then a function g f(q a, q b ) = r q a = g(r, q b ) is nonsingular with " g $ = # " f " q & b %" q a ' ) ( #1 " f = # J #1 a (q) J " q b (q) b! the N-M variables q b can be selected independently (e.g., they are used for optimizing an objective function H(q), reduced via the use of g to a function of q b only)! q a = g(r, q b ) are then chosen so as to correctly execute the task Robotics 2 38

39 Reduced Gradient (RG)! H(q) = H(q a,q b ) = H(g(r,q b ),q b ) = H (q b ), with r at current value! the Reduced Gradient (w.r.t. q b only, but still keeping the effects of this choice into account) is " q b H' = 0 " q b H' = #( J #1 a J ) T b I! algorithm [ ] " q H ( " # q b H!! ) is a compact (i.e., N-M dimensional) necessary condition of constrained optimality q b = " q b H' J a q a + J b q b = r "1 q a = J a ( r " J b ) q b step in the gradient direction of the reduced (N-M)-dim space satisfaction of the M-dim task constraints Robotics 2 39

40 Comparison between PG and RG! Projected Gradient (PG)! Reduced Gradient (RG) q = " q a % $ # q ' = " J a $ b & # 0 q = J # r + ( I " J # J)# q H (1 % ' " r + (J a $ & # I (1 J b % ' ( J a & ( ( (1 J ) T ) b I ) H q! RG is analytically simpler and numerically faster than PG, but requires the search for a non-singular minor (J a ) of the robot Jacobian.! if r = cost & N-M=1 same (unique) direction for q, but RG has automatically a larger optimization step size! else, RG and PG methods provide always different evolutions Robotics 2 40

41 Analytic comparison PPR robot! q 1 q 2 q 3 # J = 1 0 "!s 3 & % $ 0 1!c ( = J a J b 3 ' RG: q = " 1 0% $ 0 1 ' $ # 0 0 ' & r + " $ $ # ( )!s 3 (!c 3 1 " q a = q 1 % $ # q ' q b = q 3 2 & q = J "1 # a & % ( $ 0 # r + "J a % ' $ I "1 J b % '(!s 3 (!c 3 1)) q H ' & ( ( "1 J b ) T I) ) qh & ( " J a ' PG: q = J # r + ( I " J # J)# q H J # = 1 1 +! 2 1 +! 2 2 # c 3! 2 s 3 c 3 & %! 2 s 3 c 3 1 +! 2 2 ( s 3 % $ "!s 3!c ( 3 ' ( I " J # J) = 1 1 +! 2! 2 2 # s 3 sym& % "! 2 s 3 c 3! 2 2 ( c 3 % $!s 3 "!c 3 1 ( ' always < 1!! Robotics 2 41

42 Joint range limits " % $ ' q = $ ' ( = T( $ ' $ # ' & absolute relative coordinates # & % ( " = % ( q = T -1 q % ( % $ ( ' "90 # $ i # +90 "90 # q i " q i"1 # +90 q 2 G S task: E-E linear path from S to G initial configuration q 4 q 1 numerical comparison among pseudoinverse (PS), projected gradient (PG), and reduced gradient (RG) methods Robotics 2 42

43 Numerical results minimizing distance from mid joint range joint 1 joint 2 joint 3 joint 4 upper limit steps of numerical simulation Robotics 2 43

44 Numerical results obstacle avoidance reduced gradient pseudoinverse q = J # r r r fixed obstacle x constrained maximization of H(q) = x sinq 4 " 3 # i=1! i sin( q 4 " q i ) Robotics 2 44

45 Numerical results self-motion for escaping singularities (optimal) max H(q) = 3 # i=1 sin 2 ( q i+1 " q i ) this function is actually NOT the manipulability index, but has the same minima (=0) r - 0 steps of numerical simulation RG is faster than PG (keeping the same accuracy on r) Robotics 2 45

46 3 Task augmentation methods! an auxiliary task is added (task augmentation) S f y (q) = y S. N-M corresponding to some desirable feature for the solution " r A = r $ % # y ' = & " f(q) % $ # f y (q) ' & r A =! a solution is chosen still in the form q = K A (q) r A " J(q) % $ # J y (q) ' q = J A (q) q & or adding a term in the null space of the augmented Jacobian J A Robotics 2 46 J A N M+S

47 Augmenting the task! advantage: better shaping of the inverse kinematic solution! disadvantage: algorithmic singularities are introduced when &(J) = M &(J y ) = S but &(J A ) < M+S it should always be "( J T ) # "( T J ) y = $ difficult to be obtained globally! rows of J AND rows of J y are all together linearly independent Robotics 2 47

48 Augmented task example r(t) N = 4, M = 2 absolute joint coordinates f y (q) = q 4 =,/2 (S = 1) last link to be held vertical Robotics 2 48

49 Extended Jacobian (S = N-M)! square J A : in the absence of algorithmic singularities, we can choose! the scheme is then repeatable q = J "1 A (q) r A! provided no singularities are encountered during a complete task cycle*! when the N-M conditions f y (q) = 0 correspond to necessary (& sufficient) conditions for constrained optimality of a given objective function H(q) (see RG method, slide #37), this scheme guarantees that constrained optimality is locally preserved during task execution! in the vicinity of algorithmic singularities, the execution of both the original task as well as the auxiliary task(s) are affected by errors (when using a DLS inversion) there exists an unexpected phenomenon in some 3R manipulators having generic kinematics: the robot may sometimes perform a pose change after a full cycle, even if no singularity has been encountered during motion (see J. Burdick, Mech. Mach. Theory, 30(1), 1995) Robotics 2 49

50 Extended Jacobian example MACRO-MICRO manipulator r(t) N = 4, M = 2 y(t) ( ) ( ) r = J q 1, q 4 y = J y q 1,q 2 q q " J A = * * % $ #* 0& ' 4!4 Robotics 2 50

51 Task Priority if the original (primary) task r = J(q) q has higher priority than the auxiliary (secondary) task r 2 = J 2 (q) q! we first address the task with highest priority q = J # r + (I " J # J)v = J # r +Pv! and then choose v so as to satisfy, if possible, also the secondary (lower priority) task r 2 = J 2 q = J 2 J # r + J 2 (I " J # J)v = J 2 J # r + (J 2 P)v the general solution for v takes the usual form v = (J 2 P) # ( r 2 " J 2 J # r ) + (I " (J 2 P) # (J 2 P))w w is available for execution of further tasks of lower (ordered) priorities Robotics 2 51

52 Task Priority (continue) " substituting the expression of v in q q = J # r +P(J 2 P) # ( r 2 " J 2 J # r ) +P(I " (J 2 P) # (J 2 P))w P [BP] # = [BP] # when matrix P is ( J 2 P) # possibly = 0 idempotent and symmetric " main advantage: highest priority task is ideally no longer affected by algorithmic singularities (damping is only in the secondary task) task 1: follow task 2: vertical third link WITHOUT task priority WITH task priority Robotics 2 52

53 A general task priority formulation! consider a large number p of tasks to be executed at best and with strict priorities by a robotic system having many dofs! everything should run efficiently in real time, with possible addition, deletion, swap, or reordering of tasks! a recursive formulation that reduces computations is convenient k-th task projector in the null-space of k-th task ( )! projector in the null-space of the augmented Jacobian of the first k tasks stack of first k tasks augmented Jacobian of first k tasks Robotics 2 53

54 Recursive solution with priorities - 1! start with the first task and reformulate the problem so as to provide always a solution, at least in terms of minimum error norm Robotics 2 54

55 Recursive solution with priorities - 2 prioritized solution up to task k-1 set of all solutions up to task k-1 LQ problem for k-th task initialization recursive formula (Siciliano, Slotine: ICAR 1991) prioritized solution up to task k correction needed when the solution up to task k-1 is not satisfying also task k over the steps, the search set is progressively reduced Robotics 2 55

56 Recursive solution with priorities properties and implementation! the solution considering the first k tasks with their priority satisfies also ( does not perturb ) the previous k-1 tasks since = (Maciejewski, Klein: IJRR 1985): check the four defining properties of a pseudoinverse! recursive expression also for the null-space projector (Baerlocher, Boulic: IROS 1998): for the proof, see Appendix A! in case the k-th task is not compatible with the previous ones (algorithmic singularity), use DLS instead of # in k-th solution... Robotics 2 56

57 A list of extensions (some still on-going research)! up to now, only basic redundancy resolution schemes! defined at first-order differential level (velocity)! it is possible to work in acceleration! useful for obtaining smoother motion! allows including the consideration of dynamics! seen within a planning, not a control perspective! take into account and recover errors in task execution by using kinematic control schemes! applied to robot manipulators with fixed base! extend to wheeled mobile manipulators! tasks specified only by equality constraints! add also linear inequalities in a complete QP formulation! in particular for humanoid robots in multiple complex tasks! consider hard limits in joint/command space Robotics 2 57

58 Resolution at acceleration level r = f(q) r = J(q) q! rewritten in the form J(q) q = r " J (q) q! = x to be chosen given (at time t) the problem is formally equivalent to the previous one, with acceleration in place of velocity commands! for instance, in the null-space method r = J(q) q + J (q) q. known q, q (at time t) q = J # (q) x + ( I - J # (q)j(q) ) q 0 solution with minimum acceleration norm 1 2 q 2 = " qh #K D q needed to damp/stabilize self-motions in the null space (K D > 0) Robotics 2 58

59 Dynamic redundancy resolution as Linear-Quadratic optimization problems! dynamic model of a robot manipulator (more later!) B(q) q + n(q, q ) = " J(q) q = x (= r " J (q) q ) N!N symmetric inertia matrix, positive definite for all q input torque vector (provided by the motors). Coriolis/centrifugal vector c(q,q) + gravity vector g(q) M-dimensional acceleration task! typical dynamic objectives to be locally minimized at (q,q) H 1 ( q ) = 1 2 " 2 = 1 2 q T B 2 (q) q + n T (q, q )B(q) q nt (q, q )n(q, q ). minimum torque norm H 2 ( q ) = 1 2 " 2 B #2 = 1 2 " T B -2 (q)" = 1 2 q T q + n T (q, q )B -1 (q) q nt (q, q )B -2 (q)n(q, q ) minimum torque (squared inverse inertia weighted) norm Robotics 2 59

60 Three dynamic solutions! by applying the general formula for LQ optimization problems ( ), check that the following closed-form expressions are obtained (in the assumption of full rank Jacobian J) minimum torque solution " 1 = ( J(q)B -1 (q)) # ( r - J (q) q + J(q)B -1 (q) n(q, q )) good for short trajectories (in fact, it is still only a local solution!) for longer trajectories it may lead to a torque explosion (whipping effect) minimum (squared inverse inertia weighted) torque solution " 2 = B(q)J # (q) r - J (q) q + J(q)B -1 (q) n(q, q ) ( ) good performance in general, to be preferred ( ) in slide #31! try also the constrained minimization of the (simple) inverse inertia weighted norm of the torque... a solution with a leading J T (q) term is obtained: what is its physical interpretation? " 3 = J T (q)( J(q)B -1 (q)j T (q)) # ( r - J (q) q + J(q)B -1 (q) n(q, q )) Robotics 2 60

61 Kinematic control! given a desired M-dimensional task r d (t), in order to recover a task error e = r d r due to initial mismatch or due to! disturbances! inherent linearization error in using the Jacobian (first-order motion)! discrete-time implementation we need to close a feedback loop on task execution, by replacing (with diagonal matrix gains K > 0 or K P, K D > 0) r d + K r d "r r in velocity-based... r r d + K D where r = f(q), r = J(q) q ( ) ( r d " r ) + K P ( r d "r) or in acceleration-based methods Robotics 2 61

62 Mobile manipulators! coordinates: q b of the base and q m of the manipulator! differential map: from available commands u b on the mobile base and u m on the manipulator to task output velocity q m r = f(q) (task output, e.g., the E-E pose) " q = q % b $ ' ( I R N # & q m q b = G(q b )u b q m = u m kinematic model of the wheeled base (with nonholonomic constraints) q b " u = u % b $ ' ( R N u I # & u m N u " N Robotics 2 62

63 Mobile manipulator Jacobian r = f(q) = f(q b, q m ) r = " f(q) q " q b + " f(q) q m = J b " q b (q) q b + J m (q) q m m ( ) u b = J b (q)g(q b )u b + J m (q)u m = J b (q)g(q b ) J m (q) = J NMM (q)u Nonholonomic Mobile Manipulator (NMM) Jacobian (M!N u )! most previous results follow by just replacing. J J NMM q u (redundancy if N u -M > 0) namely, the available velocity commands Robotics 2 63 # % $ u m & ( '

64 video Mobile manipulators Automatica Fair 2008 video car-like + 2R planar arm (N=6, N u =4): E-E trajectory control on a line (N u -M=2) with maximization of J NMM manipulability wheeled Justin: base with centered steering wheels (N b =3+4!2, N u =8) dancing in controlled but otherwise passive mode Robotics 2 64

65 Mobile manipulators issues in acceleration control with steering wheels! velocity commands of steering wheels do not affect the task velocity! solution: at the task acceleration level, using mixed commands! here 5: joint (3) and base linear (1) accelerations + steering velocity (1) video video without null-space stabilizing term with null-space stabilizing term car-like (rear-drive speed + front steering) + 3R arm (N=7, N u =5): E-E trajectory control on a circle (N u -M=2) Robotics 2 65

66 Quadratic Programming (QP) with equality and inequality constraints! minimize a quadratic objective function (typically positive definite, like when using norms of vectors) subject to linear equality and inequality constraints, all expressed in terms of joint velocity commands solution set, with only equality constraints within a given convex set QP complete formulation solution set, with only inequality constraints (non-negative) slack variables (possibly, also with prioritization of constraints) Robotics 2 66

67 Equality and inequality linear constraints feasible convex area (from inequalities) active inequality constraint NO exact solution here higher priority lower priority solution if ineq ineq inequality constraint inequality solution if ineq ineq minimum norm solution feasible convex area any priority order gives the same final solution equality constraint inequality equality (top priority) set of possible minimum error solutions if equality inequalities equality inequality... inequalities equality NO exact solution here inequality inequality feasible convex area Robotics 2 67

68 Equality and Inequality Tasks for the high-dof humanoid robot HRP2! a systematic task priority approach, with several simultaneous tasks video in any order of priority avoid the obstacle gaze at the object reach the object... while keeping balance! IEEE Int. Conf. on Robotics and Automation (ICRA) 2009 all subtasks are locally expressed by linear equalities or inequalities (possibly relaxed when needed) on joint velocities Robotics 2 68

69 Inclusion of hard limits in joint space Saturation in the Null Space (SNS) method! robot has limited capabilities: hard limits on joint ranges and/or on joint motion or commands (max velocity, acceleration, torque)! represented as box inequalities that can never be violated (at most, active constraints or saturated commands) kept separated from stack of tasks! (equality) tasks are usually executed in full (with priorities, if desired), but can be relaxed (scaled) in case of need (i.e., when robot capabilities are used at their limits)! saturate one overdriven joint command at a time, until a feasible and better performing solution is found Saturation in the Null Space = SNS! on-line decision: which joint commands to saturate and how, so that this does not affect task execution! for tasks that are (certainly) not feasible, SNS embeds the selection of a task scaling factor that preserves task direction with minimal scaling contains saturated joint scaling diagonal velocities Robotics 2 factor 0/1 matrix 69

70 Geometric view on SNS operation in the space of velocity commands NO exact solution here = = hard bounds (box inequality constraints) hard bounds (box inequality constraints) the total correction to the original pseudoinverse solution is always in the null space of the Jacobian (up to task scaling, if present) Robotics 2 70

71 Illustrative example - 1 consider a 4R robot with equal links of unitary length task: end-effector Cartesian position manipulator configuration differential map task Jacobian desired Cartesian velocity commanded joint velocity velocity limits Robotics 2 71

72 current configuration associated Jacobian Illustrative example - 2 desired end-effector velocity direct (velocity =) task scaling? saturating only the most violating velocity? Robotics 2 72

73 Joint velocity bounds joint space limits joint velocity bounds conversion: control sampling (piece-wise constant velocity commands) + max feasible velocities and decelerations to stay/stop within the joint range smooth velocity bound anticipates the reaching of a hard limit Robotics 2 73

74 SNS at velocity level Algorithm 1 initialization W : diagonal matrix with (j,j) element = 1 if joint j is enabled = 0 if joint j is disabled : vector with saturated velocities in correspondence of disabled joints s : current task scale factor s * : largest task scale factor so far Robotics 2 74

75 SNS at velocity level Algorithm 1 compute the joint velocity with initialized values check the joint velocity bounds compute the task scaling factor and the most critical joint if a larger task scaling factor is obtained save the current solution disable the most critical joint by forcing it at its saturated velocity Robotics 2 75

76 SNS at velocity level Algorithm 1 check if the task can be accomplished with the remaining enabled joints if NOT use the parameters that allow the largest task scaling factor and exit repeat until no joint limit is exceeded Robotics 2 76

77 Task scaling factor Algorithm 2 yields the best task scaling factor for the most critical joint in the current joint velocity solution Robotics 2 77

78 Simulation results 7-dof KUKA LWR IV [deg] [deg/s] [deg/s] [ms] Robotics 2 78

79 Simulation results for increasing V requested task move the end-effector through six desired Cartesian positions along linear paths with constant speed V Neglecting Constraint Task Scaling task redundancy degree = 7 3 = 4 robot starts at the configuration [deg] SNS approach Robotics 2 79

80 Experimental results KUKA LWR IV with hard joint-space limits IEEE Transactions on Robotics 2015 video Robotics 2 80

81 Variations of the SNS method SNS at the acceleration command level + consideration of multiple tasks with priority IEEE IROS 2012 video Robotics 2 81

82 Global solution for repeatable motion video (IEEE ICRA 2013)! for cyclic tasks: a bidirectional probabilistic search in the reduced space of extra degrees of freedom (dimension N-M)! including also collision avoidance (or other task constraints)! experiment with KUKA LWR4 at DIAG Robotics Lab (Dec 2012) video Robotics 2 82

83 Bibliography - 1! R. Cline, Representations for the generalized inverse of a partitioned matrix, J. SIAM, pp , 1964! T.L. Boullion, P. L. Odell, Generalized Inverse Matrices, Wiley-Interscience, 1971! A. Maciejewski, C. Klein, Obstacle avoidance for kinematically redundant manipulators in dynamically varying environments, Int. J. of Robotics Research, vol. 4, no. 3, pp , 1985! A. Maciejewski, C. Klein, Numerical filtering for the operation of robotic manipulators through kinematically singular configurations, J. of Robotic Systems, vol. 5, no. 6, pp , 1988! Y. Nakamura, Advanced Robotics: Redundancy and Optimization, Addison-Wesley, 1991! B. Siciliano, J.J. Slotine, A general framework for managing multiple tasks in highly redundant robotic systems, 5th Int. Conf. on Advanced Robotics, pp , 1991! P. Baerlocher, R. Boulic, Task-priority formulations for the kinematic control of highly redundant articulated structures, IEEE/RSJ Int. Conf. on Intelligent Robots and Systems, pp , 1998! P. Baerlocher, R. Boulic, An inverse kinematic architecture enforcing an arbitrary number of strict priority levels, The Visual Computer, vol. 6, no. 20, pp , 2004! A. Escande, N. Mansard, P.-B. Wieber, Fast resolution of hierarchized inverse kinematics with inequality constraints, IEEE Int. Conf. on Robotics and Automation, pp , 2010! O. Kanoun, F. Lamiraux, P.-B. Wieber, Kinematic control of redundant manipulators: Generalizing the taskpriority framework to inequality task, IEEE Trans. on Robotics, vol. 27, no. 4, pp , 2011! A. Escande, N. Mansard, P.-B. Wieber, Hierarchical quadratic programming, (including software), 26 Dec 2012 Robotics 2 83

84 Bibliography - 2! A. De Luca, G. Oriolo, The reduced gradient method for solving redundancy in robot arms, Robotersysteme, vol. 7, no. 2, pp , 1991! A. De Luca, G. Oriolo, B. Siciliano, Robot redundancy resolution at the acceleration level, Laboratory Robotics and Automation, vol. 4, no. 2, pp , 1992! A. De Luca, L. Lanari, G. Oriolo, Control of redundant robots on cyclic trajectories, IEEE Int. Conf. on Robotics and Automation, pp , 1992! A. De Luca, G. Oriolo, Reconfiguration of redundant robots under kinematic inversion, Advanced Robotics, vol. 10, n. 3, pp , 1996! A. De Luca, G. Oriolo, P. Robuffo Giordano, Kinematic control of nonholonomic mobile manipulators in the presence of steering wheels, IEEE Int. Conf. on Robotics and Automation, pp , 2010! F. Flacco, A. De Luca, O. Khatib, Motion control of redundant robots under joint constraints: Saturation in the null space, IEEE Int. Conf. on Robotics and Automation, pp , 2012! F. Flacco, A. De Luca, O. Khatib, Prioritized multi-task motion control of redundant robots under hard joint constraints, IEEE/RSJ Int. Conf. on Intelligent Robots and Systems, pp , 2012! F. Flacco, A. De Luca, Optimal redundancy resolution with task scaling under hard bounds in the robot joint space, IEEE Int. Conf. on Robotics and Automation, pp , 2013! F. Flacco, A. De Luca, "Fast redundancy resolution for high-dimensional robots executing prioritized tasks under hard bounds in the joint space, IEEE/RSJ Int. Conf. on Intelligent Robots and Systems, pp , 2013! F. Flacco, A. De Luca, O. Khatib, Control of redundant robots under hard joint constraints: Saturation in the null space, IEEE Transactions on Robotics, vol. 31, no. 3, pp , 2015! M. Cefalo, G. Oriolo, M. Vendittelli, "Planning safe cyclic motions under repetitive task constraints, IEEE Int. Conf. on Robotics and Automation, pp , 2013 Robotics 2 84

85 Appendix A - Recursive Task Priority proof of recursive expression for null-space projector! proof based on a result on pseudoinversion of partitioned matrices (Cline: J. SIAM 1964)! (i)! (i) + (ii) Q.E.D.! (ii)! if k-th task is scalar (Greville formula) Robotics 2 85 =

86 Experimental results KUKA LWR IV with joint-space limits + elbow and wrist Cartesian constraints IEEE ICRA 2012 video Robotics 2 86

Inverse differential kinematics Statics and force transformations

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

More information

Robotics 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

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

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

Operational Space Control of Constrained and Underactuated Systems

Operational Space Control of Constrained and Underactuated Systems Robotics: Science and Systems 2 Los Angeles, CA, USA, June 27-3, 2 Operational Space Control of Constrained and Underactuated Systems Michael Mistry Disney Research Pittsburgh 472 Forbes Ave., Suite Pittsburgh,

More information

Multi-Priority Cartesian Impedance Control

Multi-Priority Cartesian Impedance Control Multi-Priority Cartesian Impedance Control Robert Platt Jr. Computer Science and Artificial Intelligence Laboratory Massachusetts Institute of Technology rplatt@csail.mit.edu Muhammad Abdallah, Charles

More information

Robotics 2 Robot Interaction with the Environment

Robotics 2 Robot Interaction with the Environment Robotics 2 Robot Interaction with the Environment Prof. Alessandro De Luca Robot-environment interaction a robot (end-effector) may interact with the environment! modifying the state of the environment

More information

Reconstructing Null-space Policies Subject to Dynamic Task Constraints in Redundant Manipulators

Reconstructing Null-space Policies Subject to Dynamic Task Constraints in Redundant Manipulators Reconstructing Null-space Policies Subject to Dynamic Task Constraints in Redundant Manipulators Matthew Howard Sethu Vijayakumar September, 7 Abstract We consider the problem of direct policy learning

More information

Dynamic model of robots:

Dynamic model of robots: Robotics 2 Dynamic model of robots: Analysis, properties, extensions, parametrization, identification, uses Prof. Alessandro De Luca Analysis of inertial couplings! Cartesian robot! Cartesian skew robot!

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

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 3 Numerical Methods

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

More information

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

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

Dynamic model of robots:

Dynamic model of robots: Robotics 2 Dynamic model of robots: Analysis, properties, extensions, parametrization, identification, uses Prof. Alessandro De Luca Analysis of inertial couplings! Cartesian robot! Cartesian skew robot!

More information

REDUCING the torque needed to execute a given robot

REDUCING the torque needed to execute a given robot IEEE ROBOTICS AND AUTOMATION LETTERS. PREPRINT VERSION. ACCEPTED JANUARY, 29 Stable Torque Optimization for Redundant Robots using a Short Preview Khaled Al Khudir Gaute Halvorsen Leonardo Lanari Alessandro

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

, 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

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

Control of a Handwriting Robot with DOF-Redundancy based on Feedback in Task-Coordinates

Control of a Handwriting Robot with DOF-Redundancy based on Feedback in Task-Coordinates Control of a Handwriting Robot with DOF-Redundancy based on Feedback in Task-Coordinates Hiroe HASHIGUCHI, Suguru ARIMOTO, and Ryuta OZAWA Dept. of Robotics, Ritsumeikan Univ., Kusatsu, Shiga 525-8577,

More information

Adaptive Jacobian Tracking Control of Robots With Uncertainties in Kinematic, Dynamic and Actuator Models

Adaptive Jacobian Tracking Control of Robots With Uncertainties in Kinematic, Dynamic and Actuator Models 104 IEEE TRANSACTIONS ON AUTOMATIC CONTROL, VOL. 51, NO. 6, JUNE 006 Adaptive Jacobian Tracking Control of Robots With Uncertainties in Kinematic, Dynamic and Actuator Models C. C. Cheah, C. Liu, and J.

More information

Design and Control of Compliant Humanoids. Alin Albu-Schäffer. DLR German Aerospace Center Institute of Robotics and Mechatronics

Design and Control of Compliant Humanoids. Alin Albu-Schäffer. DLR German Aerospace Center Institute of Robotics and Mechatronics Design and Control of Compliant Humanoids Alin Albu-Schäffer DLR German Aerospace Center Institute of Robotics and Mechatronics Torque Controlled Light-weight Robots Torque sensing in each joint Mature

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

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

Control of Mobile Robots

Control of Mobile Robots Control of Mobile Robots Regulation and trajectory tracking Prof. Luca Bascetta (luca.bascetta@polimi.it) Politecnico di Milano Dipartimento di Elettronica, Informazione e Bioingegneria Organization and

More information

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

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

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

More information

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

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

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

Multiple-priority impedance control

Multiple-priority impedance control Multiple-priority impedance control Robert Platt Jr, Muhammad Abdallah, and Charles Wampler Abstract Impedance control is well-suited to robot manipulation applications because it gives the designer a

More information

ADAPTIVE FORCE AND MOTION CONTROL OF ROBOT MANIPULATORS IN CONSTRAINED MOTION WITH DISTURBANCES

ADAPTIVE FORCE AND MOTION CONTROL OF ROBOT MANIPULATORS IN CONSTRAINED MOTION WITH DISTURBANCES ADAPTIVE FORCE AND MOTION CONTROL OF ROBOT MANIPULATORS IN CONSTRAINED MOTION WITH DISTURBANCES By YUNG-SHENG CHANG A THESIS PRESENTED TO THE GRADUATE SCHOOL OF THE UNIVERSITY OF FLORIDA IN PARTIAL FULFILLMENT

More information

A Unified Quadratic-Programming-Based Dynamical System Approach to Joint Torque Optimization of Physically Constrained Redundant Manipulators

A Unified Quadratic-Programming-Based Dynamical System Approach to Joint Torque Optimization of Physically Constrained Redundant Manipulators 16 IEEE TRANSACTIONS ON SYSTEMS, MAN, AND CYBERNETICS PART B: CYBERNETICS, VOL. 34, NO. 5, OCTOBER 004 A Unified Quadratic-Programg-Based Dynamical System Approach to Joint Torque Optimization of Physically

More information

Robotics & Automation. Lecture 25. Dynamics of Constrained Systems, Dynamic Control. John T. Wen. April 26, 2007

Robotics & Automation. Lecture 25. Dynamics of Constrained Systems, Dynamic Control. John T. Wen. April 26, 2007 Robotics & Automation Lecture 25 Dynamics of Constrained Systems, Dynamic Control John T. Wen April 26, 2007 Last Time Order N Forward Dynamics (3-sweep algorithm) Factorization perspective: causal-anticausal

More information

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

Motion Planning of Discrete time Nonholonomic Systems with Difference Equation Constraints

Motion Planning of Discrete time Nonholonomic Systems with Difference Equation Constraints Vol. 18 No. 6, pp.823 830, 2000 823 Motion Planning of Discrete time Nonholonomic Systems with Difference Equation Constraints Hirohiko Arai The concept of discrete time nonholonomic systems, in which

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

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

IROS 16 Workshop: The Mechatronics behind Force/Torque Controlled Robot Actuation Secrets & Challenges

IROS 16 Workshop: The Mechatronics behind Force/Torque Controlled Robot Actuation Secrets & Challenges Arne Wahrburg (*), 2016-10-14 Cartesian Contact Force and Torque Estimation for Redundant Manipulators IROS 16 Workshop: The Mechatronics behind Force/Torque Controlled Robot Actuation Secrets & Challenges

More information

NONLINEAR PATH CONTROL FOR A DIFFERENTIAL DRIVE MOBILE ROBOT

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

More information

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

A SIMPLE ITERATIVE SCHEME FOR LEARNING GRAVITY COMPENSATION IN ROBOT ARMS

A SIMPLE ITERATIVE SCHEME FOR LEARNING GRAVITY COMPENSATION IN ROBOT ARMS A SIMPLE ITERATIVE SCHEME FOR LEARNING GRAVITY COMPENSATION IN ROBOT ARMS A. DE LUCA, S. PANZIERI Dipartimento di Informatica e Sistemistica Università degli Studi di Roma La Sapienza ABSTRACT The set-point

More information

Controlling the Apparent Inertia of Passive Human- Interactive Robots

Controlling the Apparent Inertia of Passive Human- Interactive Robots Controlling the Apparent Inertia of Passive Human- Interactive Robots Tom Worsnopp Michael Peshkin J. Edward Colgate Kevin Lynch Laboratory for Intelligent Mechanical Systems: Mechanical Engineering Department

More information

Chapter 3 Numerical Methods

Chapter 3 Numerical Methods Chapter 3 Numerical Methods Part 2 3.2 Systems of Equations 3.3 Nonlinear and Constrained Optimization 1 Outline 3.2 Systems of Equations 3.3 Nonlinear and Constrained Optimization Summary 2 Outline 3.2

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

Modelling and Control of Variable Stiffness Actuated Robots

Modelling and Control of Variable Stiffness Actuated Robots Modelling and Control of Variable Stiffness Actuated Robots Sabira Jamaludheen 1, Roshin R 2 P.G. Student, Department of Electrical and Electronics Engineering, MES College of Engineering, Kuttippuram,

More information

TASK-ORIENTED CONTROL OF HUMANOID ROBOTS THROUGH PRIORITIZATION

TASK-ORIENTED CONTROL OF HUMANOID ROBOTS THROUGH PRIORITIZATION c IEEE-RAS/RSJ International Conference on Humanoid Robots TASK-ORIENTED CONTROL OF HUMANOID ROBOTS THROUGH PRIORITIZATION LUIS SENTIS AND OUSSAMA KHATIB Artificial Intelligence Laboratory Stanford University

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

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

Reconfiguration Manipulability Analyses for Redundant Robots in View of Strucuture and Shape

Reconfiguration Manipulability Analyses for Redundant Robots in View of Strucuture and Shape SCIS & ISIS 2010, Dec. 8-12, 2010, Okayama Convention Center, Okayama, Japan Reconfiguration Manipulability Analyses for Redundant Robots in View of Strucuture and Shape Mamoru Minami, Tongxiao Zhang,

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

Real-time Motion Control of a Nonholonomic Mobile Robot with Unknown Dynamics

Real-time Motion Control of a Nonholonomic Mobile Robot with Unknown Dynamics Real-time Motion Control of a Nonholonomic Mobile Robot with Unknown Dynamics TIEMIN HU and SIMON X. YANG ARIS (Advanced Robotics & Intelligent Systems) Lab School of Engineering, University of Guelph

More information

Coupling Visual Servoing with Active Structure from Motion

Coupling Visual Servoing with Active Structure from Motion Coupling Visual Servoing with Active Structure from Motion Riccardo Spica, Paolo Robuffo Giordano, and François Chaumette Abstract In this paper we propose a solution for coupling the execution of a visual

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

Framework Comparison Between a Multifingered Hand and a Parallel Manipulator

Framework Comparison Between a Multifingered Hand and a Parallel Manipulator Framework Comparison Between a Multifingered Hand and a Parallel Manipulator Júlia Borràs and Aaron M. Dollar Abstract In this paper we apply the kineto-static mathematical models commonly used for robotic

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

Extremal Trajectories for Bounded Velocity Mobile Robots

Extremal Trajectories for Bounded Velocity Mobile Robots Extremal Trajectories for Bounded Velocity Mobile Robots Devin J. Balkcom and Matthew T. Mason Abstract Previous work [3, 6, 9, 8, 7, 1] has presented the time optimal trajectories for three classes of

More information

Posture regulation for unicycle-like robots with. prescribed performance guarantees

Posture regulation for unicycle-like robots with. prescribed performance guarantees Posture regulation for unicycle-like robots with prescribed performance guarantees Martina Zambelli, Yiannis Karayiannidis 2 and Dimos V. Dimarogonas ACCESS Linnaeus Center and Centre for Autonomous Systems,

More information

Exponential Controller for Robot Manipulators

Exponential Controller for Robot Manipulators Exponential Controller for Robot Manipulators Fernando Reyes Benemérita Universidad Autónoma de Puebla Grupo de Robótica de la Facultad de Ciencias de la Electrónica Apartado Postal 542, Puebla 7200, México

More information

Nonlinear PD Controllers with Gravity Compensation for Robot Manipulators

Nonlinear PD Controllers with Gravity Compensation for Robot Manipulators BULGARIAN ACADEMY OF SCIENCES CYBERNETICS AND INFORMATION TECHNOLOGIES Volume 4, No Sofia 04 Print ISSN: 3-970; Online ISSN: 34-408 DOI: 0.478/cait-04-00 Nonlinear PD Controllers with Gravity Compensation

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

Prioritized Inverse Kinematics with Multiple Task Definitions

Prioritized Inverse Kinematics with Multiple Task Definitions Prioritized Inverse Kinematics with Multiple Task Definitions Sang-ik An and Dongheui Lee 2 Abstract We are proposing a general framework that incorporates multiple task definitions in the prioritized

More information

Exploiting Redundancy to Reduce Impact Force*

Exploiting Redundancy to Reduce Impact Force* 1 of 6 Presented at IEEE/RSJ International Workshop on Intelligent Robots and Systems, Osaka, Japan, Nov. 1991. Exploiting Redundancy to Reduce Impact Force* Matthew Wayne Gertz**, Jin-Oh Kim, and Pradeep

More information

458 IEEE TRANSACTIONS ON CONTROL SYSTEMS TECHNOLOGY, VOL. 16, NO. 3, MAY 2008

458 IEEE TRANSACTIONS ON CONTROL SYSTEMS TECHNOLOGY, VOL. 16, NO. 3, MAY 2008 458 IEEE TRANSACTIONS ON CONTROL SYSTEMS TECHNOLOGY, VOL 16, NO 3, MAY 2008 Brief Papers Adaptive Control for Nonlinearly Parameterized Uncertainties in Robot Manipulators N V Q Hung, Member, IEEE, H D

More information

Kinematic representation! Iterative methods! Optimization methods

Kinematic representation! Iterative methods! Optimization methods Human Kinematics Kinematic representation! Iterative methods! Optimization methods Kinematics Forward kinematics! given a joint configuration, what is the position of an end point on the structure?! Inverse

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

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

RESEARCH SUMMARY ASHKAN JASOUR. February 2016

RESEARCH SUMMARY ASHKAN JASOUR. February 2016 RESEARCH SUMMARY ASHKAN JASOUR February 2016 My background is in systems control engineering and I am interested in optimization, control and analysis of dynamical systems, robotics, machine learning,

More information

Virtual Passive Controller for Robot Systems Using Joint Torque Sensors

Virtual Passive Controller for Robot Systems Using Joint Torque Sensors NASA Technical Memorandum 110316 Virtual Passive Controller for Robot Systems Using Joint Torque Sensors Hal A. Aldridge and Jer-Nan Juang Langley Research Center, Hampton, Virginia January 1997 National

More information

A Backstepping control strategy for constrained tendon driven robotic finger

A Backstepping control strategy for constrained tendon driven robotic finger A Backstepping control strategy for constrained tendon driven robotic finger Kunal Sanjay Narkhede 1, Aashay Anil Bhise 2, IA Sainul 3, Sankha Deb 4 1,2,4 Department of Mechanical Engineering, 3 Advanced

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

Partially Observable Markov Decision Processes (POMDPs)

Partially Observable Markov Decision Processes (POMDPs) Partially Observable Markov Decision Processes (POMDPs) Sachin Patil Guest Lecture: CS287 Advanced Robotics Slides adapted from Pieter Abbeel, Alex Lee Outline Introduction to POMDPs Locally Optimal Solutions

More information

Stable Limit Cycle Generation for Underactuated Mechanical Systems, Application: Inertia Wheel Inverted Pendulum

Stable Limit Cycle Generation for Underactuated Mechanical Systems, Application: Inertia Wheel Inverted Pendulum Stable Limit Cycle Generation for Underactuated Mechanical Systems, Application: Inertia Wheel Inverted Pendulum Sébastien Andary Ahmed Chemori Sébastien Krut LIRMM, Univ. Montpellier - CNRS, 6, rue Ada

More information

Observer Based Output Feedback Tracking Control of Robot Manipulators

Observer Based Output Feedback Tracking Control of Robot Manipulators 1 IEEE International Conference on Control Applications Part of 1 IEEE Multi-Conference on Systems and Control Yokohama, Japan, September 8-1, 1 Observer Based Output Feedback Tracking Control of Robot

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

COMPLIANT CONTROL FOR PHYSICAL HUMAN-ROBOT INTERACTION

COMPLIANT CONTROL FOR PHYSICAL HUMAN-ROBOT INTERACTION COMPLIANT CONTROL FOR PHYSICAL HUMAN-ROBOT INTERACTION Andrea Calanca Paolo Fiorini Invited Speakers Nevio Luigi Tagliamonte Fabrizio Sergi 18/07/2014 Andrea Calanca - Altair Lab 2 In this tutorial Review

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

Analysis of the Acceleration Characteristics of Non-Redundant Manipulators

Analysis of the Acceleration Characteristics of Non-Redundant Manipulators Analysis of the Acceleration Characteristics of Non-Redundant Manipulators Alan Bowling and Oussama Khatib Robotics Laboratory Computer Science Depart men t Stanford University Stanford, CA, USA 94305

More information

Neural Network Control of Robot Manipulators and Nonlinear Systems

Neural Network Control of Robot Manipulators and Nonlinear Systems Neural Network Control of Robot Manipulators and Nonlinear Systems F.L. LEWIS Automation and Robotics Research Institute The University of Texas at Arlington S. JAG ANNATHAN Systems and Controls Research

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

for Articulated Robot Arms and Its Applications

for Articulated Robot Arms and Its Applications 141 Proceedings of the International Conference on Information and Automation, December 15-18, 25, Colombo, Sri Lanka. 1 Forcefree Control with Independent Compensation for Articulated Robot Arms and Its

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

Explore Kapitza s Pendulum Behavior via Trajectory Optimization. Yifan Hou

Explore Kapitza s Pendulum Behavior via Trajectory Optimization. Yifan Hou 1 Introduction 12 course Explore Kapitza s Pendulum Behavior via Trajectory Optimization Project for: Mechanics of Manipulation, 16 741 Yifan Hou Andrew id: yifanh houyf11@gmail.com or yifanh@andrew.cmu.edu

More information

Vehicle Dynamics of Redundant Mobile Robots with Powered Caster Wheels

Vehicle Dynamics of Redundant Mobile Robots with Powered Caster Wheels Vehicle Dynamics of Redundant Mobile Robots with Powered Caster Wheels Yuan Ping Li * and Teresa Zielinska and Marcelo H. Ang Jr.* and Wei Lin * National University of Singapore, Faculty of Engineering,

More information

Robot Manipulator Control. Hesheng Wang Dept. of Automation

Robot Manipulator Control. Hesheng Wang Dept. of Automation Robot Manipulator Control Hesheng Wang Dept. of Automation Introduction Industrial robots work based on the teaching/playback scheme Operators teach the task procedure to a robot he robot plays back eecute

More information

Consideration of dynamics is critical in the analysis, design, and control of robot systems.

Consideration of dynamics is critical in the analysis, design, and control of robot systems. Inertial Properties in Robotic Manipulation: An Object-Level Framework 1 Oussama Khatib Robotics Laboratory Department of Computer Science Stanford University Stanford, CA 94305 Abstract Consideration

More information

Robotics. Dynamics. Marc Toussaint U Stuttgart

Robotics. Dynamics. Marc Toussaint U Stuttgart Robotics Dynamics 1D point mass, damping & oscillation, PID, dynamics of mechanical systems, Euler-Lagrange equation, Newton-Euler recursion, general robot dynamics, joint space control, reference trajectory

More information

Control of constrained spatial three-link flexible manipulators

Control of constrained spatial three-link flexible manipulators Control of constrained spatial three-link flexible manipulators Sinan Kilicaslan, M. Kemal Ozgoren and S. Kemal Ider Gazi University/Mechanical Engineering Department, Ankara, Turkey Middle East Technical

More information

GAIN SCHEDULING CONTROL WITH MULTI-LOOP PID FOR 2- DOF ARM ROBOT TRAJECTORY CONTROL

GAIN SCHEDULING CONTROL WITH MULTI-LOOP PID FOR 2- DOF ARM ROBOT TRAJECTORY CONTROL GAIN SCHEDULING CONTROL WITH MULTI-LOOP PID FOR 2- DOF ARM ROBOT TRAJECTORY CONTROL 1 KHALED M. HELAL, 2 MOSTAFA R.A. ATIA, 3 MOHAMED I. ABU EL-SEBAH 1, 2 Mechanical Engineering Department ARAB ACADEMY

More information

Constrained Optimization

Constrained Optimization 1 / 22 Constrained Optimization ME598/494 Lecture Max Yi Ren Department of Mechanical Engineering, Arizona State University March 30, 2015 2 / 22 1. Equality constraints only 1.1 Reduced gradient 1.2 Lagrange

More information

EE C128 / ME C134 Feedback Control Systems

EE C128 / ME C134 Feedback Control Systems EE C128 / ME C134 Feedback Control Systems Lecture Additional Material Introduction to Model Predictive Control Maximilian Balandat Department of Electrical Engineering & Computer Science University of

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

Combining Real and Virtual Sensors for Measuring Interaction Forces and Moments Acting on a Robot

Combining Real and Virtual Sensors for Measuring Interaction Forces and Moments Acting on a Robot 216 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS) Daejeon Convention Center October 9-14, 216, Daejeon, Korea Combining Real and Virtual Sensors for Measuring Interaction Forces

More information

Nonlinear dynamic inversion for redundant systems using the EKF formalism

Nonlinear dynamic inversion for redundant systems using the EKF formalism Nonlinear dynamic inversion for redundant systems using the EKF formalism Hélène Evain, Mathieu Rognant, Daniel Alazard, Jean Mignot To cite this version: Hélène Evain, Mathieu Rognant, Daniel Alazard,

More information

COMP 558 lecture 18 Nov. 15, 2010

COMP 558 lecture 18 Nov. 15, 2010 Least squares We have seen several least squares problems thus far, and we will see more in the upcoming lectures. For this reason it is good to have a more general picture of these problems and how to

More information

Statistical Visual-Dynamic Model for Hand-Eye Coordination

Statistical Visual-Dynamic Model for Hand-Eye Coordination The 2010 IEEE/RSJ International Conference on Intelligent Robots and Systems October 18-22, 2010, Taipei, Taiwan Statistical Visual-Dynamic Model for Hand-Eye Coordination Daniel Beale, Pejman Iravani

More information

An experimental robot load identification method for industrial application

An experimental robot load identification method for industrial application An experimental robot load identification method for industrial application Jan Swevers 1, Birgit Naumer 2, Stefan Pieters 2, Erika Biber 2, Walter Verdonck 1, and Joris De Schutter 1 1 Katholieke Universiteit

More information

ELEC4631 s Lecture 2: Dynamic Control Systems 7 March Overview of dynamic control systems

ELEC4631 s Lecture 2: Dynamic Control Systems 7 March Overview of dynamic control systems ELEC4631 s Lecture 2: Dynamic Control Systems 7 March 2011 Overview of dynamic control systems Goals of Controller design Autonomous dynamic systems Linear Multi-input multi-output (MIMO) systems Bat flight

More information