Exercise 2: Dynamics of the ABB IRB 120

Size: px
Start display at page:

Download "Exercise 2: Dynamics of the ABB IRB 120"

Transcription

1 Exercise 2: Dynamics of the ABB IRB 120 Dario Bellicoso, Remo Diethelm, Jemin Hwangbo, and Marco Hutter October 20, 2015 Abstract In this exercise you will learn how to calculate the equations of motion of an ABB robot arm and implement model-based control schemes. A MAT- LAB visualization of the robot arm is provided. You will have to implement the tools that compute the dynamics of the arm in your MATLAB scripts. Recalling what you learned in the last exercise, you will start by implementing the Jacobians of the center of masses, and then implement the mass matrix, the Coriolis and centrifugal terms, and the gravity terms. In the end, you will apply inverse-dynamics in order to have the robot follow a desired path with the end-effector. The partially implemented MATLAB scripts, as well as the visualizer, are available at exercise2. You can find some hints for MATLAB code at the end of this document. 1 Dynamics The robot arm and the dynamic properties are shown in figure 1. The kinematic and dynamic parameters are given and can be loaded using the provided MAT- LAB scripts. To initialize your workspace and to load the visualizer, run the init exercise.m script. 1

2 Figure 1: ABB IRB 120 with coordinate systems and joints Exercise 1.1 The provided MATLAB scripts generate gen coord.m, generate kin.m and generate dyn.m can be used to load the dynamic parameters (mass, inertia, COM location in the joint frame for each link) of the ABB IRB 120 as well as the forward kinematics. Using this information, find 1) the position and rotation Jacobians of the center of mass frames of each link, 2) position and rotation Jacobians of the end-effector, and 3) the time derivative of the position and rotation Jacobians of the end-effector by completing the implementation of generate jac.m. Solution % generate jacobians 2 function jac = generate jac(gen cor, kin, dyn) 3 % By calling: 4 % jac = generate jac(gen cor, kin, dyn) 5 % a struct 'jac' is returned that contains the translation and rotation 6 % jacobians of the center of masses 7 8 %% Setup 9 phi = gen cor.phi; 10 dphi = gen cor.dphi; 11 2

3 12 T Ik = kin.t Ik; 13 R Ik = kin.r Ik; 14 k omega hat k = kin.k omega hat k; 15 I r Ie = kin.i r Ie; k r ks = dyn.k r ks; jac.i Jp s = cell(6,1); 20 jac.i Jr = cell(6,1); 21 jac.i Jpe = sym(zeros(3,6)); 22 jac.i Jre = sym(zeros(3,6)); %% Compute link jacobians I Jp s = cell(6,1); 28 I Jr = cell(6,1); for k=1: % create containers 33 I Jp s{k} = sym(zeros(3,6)); 34 I Jr{k} = sym(zeros(3,6)); % translational jacobian at the center of gravity s in frame I 37 I r ks = [eye(3) zeros(3,1)]*t Ik{k}*[k r ks{k};1]; 38 I Jp s{k} = jacobian(i r ks,phi); % rotational jacobian in frame I 41 if k == 1 42 I Jr{1}(1:3,1) = R Ik{1} * k omega hat k{1}; 43 else 44 % copy columns of k 1 jacobian 45 I Jr{k} = I Jr{k 1}; % evaluate new column 48 I Jr{k}(1:3,k) = R Ik{k} * k omega hat k{k}; 49 end % simplify expressions 52 I Jp s{k} = simplify(i Jp s{k}); 53 I Jr{k} = simplify(i Jr{k}); end % Compute the end effector jacobians in frame I 58 I Jpe = jacobian(i r Ie,phi); 59 I Jre = I Jr{k}; % Compute the time derivative of the end effector Jacobians 62 I djpe = dadt(i Jpe,phi,dphi); 63 I djre = dadt(i Jre,phi,dphi); I Je = [I Jpe; I Jre]; 66 I dje = [I djpe; I djre]; % Generate function files from symbolic expressions 69 fprintf('generating Jacobian file... '); 70 matlabfunction(i Je, 'vars', {phi}, 'file', 'I Je fun'); 71 fprintf('done!\n') fprintf('generating dje file... '); 74 matlabfunction(i dje, 'vars', {phi,dphi}, 'file', 'I dje fun'); 75 fprintf('done!\n') % Store jacobians in output struct 78 jac.i Jp s = I Jp s; 3

4 79 jac.i Jr = I Jr; 80 jac.i Jpe = I Jpe; 81 jac.i Jre = I Jre; 82 jac.i djpe = I djpe; 83 jac.i djre = I djre; end 1 function da = dadt( A, q, dq ) 2 3 % Initialize da 4 da = sym(zeros(size(a))); 5 6 % Evaluate time differentiation of A 7 for i=1:size(a,1) 8 for j=1:size(a,2) 9 da(i,j) = jacobian(a(i,j),q)*dq; 10 end 11 end end Exercise 1.2 Find the linear I v 4s and the rotational I ω 4s velocities of the COM of the 4 th link in inertial frame if ϕ = [π/6, π/6, π/6, π/6, π/6, π/6] T and ϕ = [π/6, π/6, π/6, π/6, π/6, π/6] T. Solution 1.2 Recalling that in general it is: I v = I J P (φ) φ I ω = I J R (φ) φ using the results obtained from the first question one has: I v 4s = (2) and (1) I ω 4s = (3) Exercise 1.3 Using the methods you learned during the lecture, find the equations of motion (i.e. M( ϕ), b( ϕ, ϕ), g( ϕ)) by completing the implementation of the MATLAB script generate eom.m. 1 % generate equations of motion 2 function eom = generate eom(gen cor, kin, dyn, jac) 3 4 %% Setup 5 phi = gen cor.phi; 6 dphi = gen cor.dphi; 7 8 T Ik = kin.t Ik; 4

5 9 R Ik = kin.r Ik; k I s = dyn.k I s; 12 m = dyn.m; 13 I g acc = dyn.i g acc; 14 k r ks = dyn.k r ks; I Jp s = jac.i Jp s; 17 I Jr = jac.i Jr; eom.m = sym(zeros(6,6)); 20 eom.c = sym(zeros(6,6)); 21 eom.g = sym(zeros(6,1)); 22 eom.n = sym(zeros(6,1)); 23 eom.u = sym(zeros(1,1)); %% Compute mass matrix 27 fprintf('computing mass matrix M... '); 28 M = sym(zeros(6,6)); 29 for k = 1:length(phi) 30 M = M + m{k}*i Jp s{k}'*i Jp s{k} I Jr{k}'*R Ik{k}*k I s{k}*r Ik{k}'*I Jr{k}; 32 end % Use symmetry of B matrix to make computation time shorter 35 fprintf('simplifying... '); 36 for k = 1:length(phi) 37 for h = k:length(phi) 38 m kh = simplify(m(k,h)); 39 if h == k 40 M(k,h) = m kh; 41 else 42 M(k,h) = m kh; 43 M(h,k) = m kh; 44 end 45 end 46 end 47 fprintf('done!\n'); %% Compute gravity terms 51 fprintf('computing gravity vector g... '); 52 Upot = sym(0); 53 for k=1:length(phi) 54 Upot = Upot m{k}*i g acc'*[eye(3)... zeros(3,1)]*t Ik{k}*[k r ks{k};1]; 55 end 56 g = jacobian(upot, phi)'; 57 fprintf('simplifying... '); 58 g = simplify(g); 59 fprintf('done!\n'); %% Compute nonlinear terms vector 63 fprintf('computing coriolis and centrifugal vector b and... simplifying... '); 64 b = sym(zeros(6,1)); 65 for k=1:6 66 fprintf('b%i... ',k); 67 djp s = simplify(dadt(jac.i Jp s{k},gen cor.phi, gen cor.dphi)); 68 djr s = simplify(dadt(jac.i Jr{k},gen cor.phi, gen cor.dphi)); 69 omega i = simplify(jac.i Jr{k}*gen cor.dphi); b = b + simplify(i Jp s{k}' * m{k} * djp s * dphi) simplify(i Jr{k}' * R Ik{k} * k I s{k} * R Ik{k}' *... djr s * dphi)

6 73 I Jr{k}' * cross( omega i, R Ik{k} * k I s{k} *... R Ik{k}' * I Jr{k} * dphi ); 74 end 75 fprintf('done!\n'); %% Compute energy 79 fprintf('computing energy U... '); 80 Ukin = 0.5*dphi'*M*dphi; 81 U = Ukin + Upot; 82 fprintf('simplifying... '); 83 U = simplify(u); 84 fprintf('done!\n'); %% Generate matlab functions 88 fprintf('generating eom scripts... '); 89 fprintf('m... '); 90 matlabfunction(m, 'vars', {phi}, 'file', 'M fun'); 91 fprintf('g... '); 92 matlabfunction(g, 'vars', {phi}, 'file', 'g fun'); 93 fprintf('b... '); 94 matlabfunction(b, 'vars', {phi, dphi}, 'file', 'b fun'); 95 fprintf('u... '); 96 matlabfunction(u, 'vars', {phi, dphi}, 'file', 'U fun'); 97 fprintf('done!\n'); %% Store the expressions 101 eom.m = M; 102 eom.g = g; 103 eom.b = b; 104 eom.u = U; end 2 Model-based control In this section you will write three controllers that use the model of the robot arm to perform motion and force tracking tasks. Use the provided abb dynamics mdl.mdl Simulink model to simulate the dynamics of the arm. You can choose to implement your controllers by writing the appropriate MATLAB scripts or by implementing the control scheme in Simulink. In this section, a PD controller is a controller that generates a signal Y such as: Y = k p ( x des x) k d ẋ, (4) where denotes a row-wise multiplication. The interpretation of the control action Y depends on the controller and is described in each of the following subsections. 2.1 Joint space control Exercise 2.1 Implement a PD controller in joint space that counteracts the effect of the gravity. This controller can be written as τ = C( ϕ, ϕ, ϕ des ). The PD controller here outputs the desired joint torque directly. 1 2 function [ tau ] = control pd g( phi des, phi, phi dot ) 6

7 3 4 %CONTROLLER1 Joint space controller with gravity compensation 5 6 % Gains 7 % Here the controller response is mainly inertia dependent 8 % so the gains have to be tuned joint wise 9 kp = 0.01 * [5000,3000,5,1,0.5,0.01]'; 10 kd = 0.05 * [3000,2000,5,1,0.5,0.01]'; % Joint wise feedback 13 tau = kp.* (phi des phi) kd.* phi dot g fun(phi); end Exercise 2.2 Does the end-effector position converge to the desired position? What would happen if you neglect the gravitational compensation? Solution 2.2 Recall that the equations of motion are expressed by: M( ϕ) + b( ϕ, ϕ) + g( ϕ) = τ (5) A PD control that compensates for gravity can be chosen as: τ = k p ( ϕ des ϕ) k d ϕ + g( ϕ) (6) Under this control action, at steady state (i.e. ϕ 0, ϕ 0) one has: Hence, by choosing k pi > 0 i, one has: kp ( ϕ des ϕ) = 0 (7) ϕ des ϕ = 0 = ϕ = ϕ des (8) By exactly compensating gravity, we have proven that the desired joint position ϕ des is an asymptotically stable equilibrium point. Consider now the realistic case in which the model of the arm is not perfectly known. The controller will be: τ = k p ( ϕ des ϕ) k d ϕ + ˆ g( ϕ) (9) where g( ϕ) R 6 is the available estimate of the effect of gravity on each joint. The equations of motion at steady state are now: The steady state is now: kp ( ϕ des ϕ) + g( ϕ) = g( ϕ) (10) ( ϕ des ϕ) = k 1 p ( g( ϕ) g( ϕ)) (11) where kp 1 is the 6 1 vector whose elements are the inverse of those of k p. This shows in the realistic case of imperfect cancellation of gravity the system exhibits a steady state error. This can be reduced by increasing the gains k pi, which in turn leads to a (potentially undesirable) more aggressive control action. 7

8 2.2 Inverse dynamics control Exercise 2.3 Implement a PD controller in the operational space that fully counteracts all the non-linearity of the system. This controller can be written as τ = C( ϕ, ϕ, x E,des ), where x E,des is the desired end effector position in the operational space. The PD controller here outputs the desired acceleration in operational space. Use the provided model function or Simulink block to test your controller. Solution function [ tau ] = control inv dyn( x des, phi, phi dot ) 3 4 %CONTROLLER2 Inverse dynamic controller with a pd control from... position to acceleration 5 6 % Gains 7 kp = 10 * [1,1,1,0.5,0.5,0.5]'; 8 kd = 10 * [1,1,1,1,1,1]'; 9 10 % Find jacobians, positions and orientation 11 J e = I Je fun(phi); 12 J e dot = I dje fun(phi, phi dot); 13 TIe = T IE fun(phi); 14 r Ie = TIe(1:3, 4); 15 RIe = TIe(1:3, 1:3); 16 qie = rotmattoquat(rie); % Define error orientation in Angle & Axis 19 qerror = quatmult(invertquat(qie), x des(4:7)); 20 ErrorAxisInEframe = qerror(2:4)./ norm(qerror(2:4)); 21 ErrorAxisInInertialFrame = RIe * ErrorAxisInEframe; 22 ErrorAngle = 2 * acos(qerror(1)); % PD law, the orientation feedback is a torque around error... rotation axis proportional to the error angle. 25 x dot = J e * phi dot; 26 x ddot des = kp.* ([x des(1:3) r Ie; ErrorAngle *... ErrorAxisInInertialFrame]) kd.* x dot; 27 phi dot dot = J e \ x ddot des J e \ J e dot * phi dot; %Inverse dynamics 30 tau = M fun(phi) * phi dot dot + b fun(phi, phi dot) + g fun(phi); end Exercise 2.4 The simulator inputs a constant desired position and zero initial velocity to the controller. How would the end-effector trajectory look like (assuming perfect knowledge of the model)? Solution 2.4 The end effector position trajectory forms a line. The end effector orientation trajectory has a constant axis of rotation (i.e. the quaternion trajectory is a geodesic). 8

9 Figure 2: Robot arm cleaning a window 2.3 Operational space control Exercise 2.5 As shown in figure 2, there is a window at x = 0.1. Write a controller that wipes the window. This controller applies a constant force on the wall in x-axis and follows a trajectory defined on y,z-plane. It can be written as ~τ = C(~ ϕ, ϕ ~, ~xe,des, Fx ). PD controller here outputs the desired acceleration in the operational space. 1 2 function [ tau ] = control op space( x des, phi, phi dot, Fx ) 3 4 %CONTROLLER3 operational space controller % Gains kp = 20 * [0,1,1,0.01,0.01,0.01]'; kd = 40.0 * [1,1,1,1,1,1]'; % Endeffector force F e = [Fx, 0, 0, 0, 0, 0]'; % Find jacobians, positions and orientation 9

10 14 J e = I Je fun(phi); 15 J e dot = I dje fun(phi, phi dot); 16 TIe = T IE fun(phi); 17 r Ie = TIe(1:3, 4); 18 RIe = TIe(1:3, 1:3); 19 qie = rotmattoquat(rie); % Project M b g to operational space 22 lambda = (J e') \ M fun(phi) / J e; 23 mu = (J e') \ b fun(phi, phi dot) lambda * J e dot * phi dot; 24 p = (J e') \ g fun(phi); % Define error orientation in Angle & Axis 27 qerror = quatmult(invertquat(qie), x des(4:7)); 28 ErrorAxisInEframe = qerror(2:4)./ norm(qerror(2:4)); 29 ErrorAxisInInertialFrame = RIe * ErrorAxisInEframe; 30 ErrorAngle = 2 * acos(qerror(1)); % PD law, the orientation feedback is a torque around error... rotation axis proportional to the error angle. 33 x dot = J e * phi dot; 34 F e des = lambda * (kp.* ([x des(1:3) r Ie; ErrorAngle *... ErrorAxisInInertialFrame]) kd.* x dot) F e + mu + p; % Map Force back to the joint space 38 tau = J e' * F e des; end 10

11 3 Some Matlab Tools 3.1 Generalized Coordinates We use generalized coordinates ϕ that can contain, in the case of free floating bodies, un-actuated base coordinates ϕ b in addition to the joint coordinates ϕ r : ( ) ϕb ϕ = (12) ϕ r 1 % define generalized coordinates 2 syms x q1 q2 real 3 phi = [x,q1,q2]'; 4 % define generalized velocities 5 syms Dx Dq1 Dq2 real 6 dphi = [Dx,Dq1,Dq2]'; 3.2 Position Vector A (position) vector from point O to P as a function of generalized coordinates ϕ expressed in frame B: B r OP = B r OP ( ϕ) (13) 1 % define certain parameters 2 syms l real 3 % position vector 4 r = [l*sin(q1),l*cos(q1),0]; 3.3 Velocity (in Moved Systems) The velocity is given through differentiation, whereby special attention is required when differentiating in a moving (with respect to inertial frame I) coordinates system B: d I r I r I r = dt d B r B r B r = dt (14) + B ω IB B r (15) In this document, O refers to the origin of a frame, I indicates the inertial frame and B a body fixed frame (which can be moved). In the case of rigid body kinematics, the body angular velocity is often indicated by Ω Ω = I ω IB (16) 1 % derivation of position vectors expressed in inertia frame 2 dr = dmatdt(r,q,dq); using the function 1 function [ da ] = dmatdt( A, q, dq ) 2 da = sym(zeros(size(a))); 11

12 3 for i=1:size(a,1) 4 for j=1:size(a,2) 5 da(i,j) = jacobian(a(i,j),q)*dq; 6 end 7 end 8 end 3.4 Rotation B y I y B x I z B z O j I x Figure 3: Rotated coordinate system B around z axis The rotation matrix R IB rotates a vector B r expressed in frame B to frame I: I r = R IBB r (17) B r = R BI I r R BI = R T IB (18) C r = R CI I r R CI = R CB R BI (19) In this tool we use the x-y-z convention. The symbolic rotational matrices can be generated using the following function 1 function R IB = eulertorotmat R IB(al,be,ga) 2 R IB = sym(zeros(3)); 3 R IB(1,1) = cos(be)*cos(ga); 4 R IB(2,1) = cos(ga)*sin(al)*sin(be) + cos(al)*sin(ga); 5 R IB(3,1) = (cos(al)*cos(ga)*sin(be)) +sin(al)*sin(ga); 6 R IB(1,2) = (cos(be)*sin(ga)); 7 R IB(2,2) = cos(al)*cos(ga) sin(al)*sin(be)*sin(ga); 8 R IB(3,2) = cos(ga)*sin(al) + cos(al)*sin(be)*sin(ga); 9 R IB(1,3) = sin(be); 10 R IB(2,3) = (cos(be)*sin(al)); 11 R IB(3,3) = cos(al)*cos(be); 12 end 3.5 Angular Velocity Given a rotation matrix R IB, the corresponding rotation speed I Ω of a rigid body with body fixed frame B is: Ω I = I ω IB = ṘIBR T IB (20) 0 Ω z Ω y unskew Ω x Ω = Ω z 0 Ω x, Ω = Ω y (21) Ω y Ω x 0 skew Ω z 12

13 1 % rotation matrix around z with vector phi 2 RIB = eulertorotmat R IB(0,0,phi); 3 % differentiate rotation matrix 4 drib = dmatdt(drib,q,dq); 5 % generate rotation speed and unskew it 6 I Omega = unskew(simplify(daib*aib')); with the skew and unskew function 1 % skew function 2 function A=skew(a) 3 A = [0 a(3) a(2); 4 a(3) 0 a(1); 5 a(2) a(1) 0]; 6 7 % unskew function 8 function a=unskew(a) 9 a = [A(3,2); A(1,3); A(2,1)]; 3.6 Jacobian The Jacobian J is given through: r 1 r 1 ϕ 1 ϕ 2... r r ( ϕ) J ( ϕ) = ϕ = 2 r 2 ϕ 1 ϕ r m ϕ 2... r m ϕ 1 r 1 ϕ n r 2 ϕ n r m ϕ n, ϕ R n 1, r R m 1 (22) Jacobians are used to map generalized velocities ϕ to Cartesian velocities r: r = J ϕ (23) and in its dual problem to map Cartesian forces F to generalized forces τ : τ = J T F (24) We differ between translational Jacobians J P specific point P and rotational Jacobians J R points of one single rigid body. = r P ( ϕ) ϕ, which correspond to a = Ω( ϕ) ϕ that are identical for all 1 % get jacobian from position vector 2 J = jacobian(r,q); 3 % get jacobian from rotation speed 4 Jr = jacobian(omega,dq); 13

Exercise 1b: Differential Kinematics of the ABB IRB 120

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

More information

Lecture «Robot Dynamics»: Dynamics and Control

Lecture «Robot Dynamics»: Dynamics and Control Lecture «Robot Dynamics»: Dynamics and Control 151-0851-00 V lecture: CAB G11 Tuesday 10:15 12:00, every week exercise: HG E1.2 Wednesday 8:15 10:00, according to schedule (about every 2nd week) Marco

More information

Lecture «Robot Dynamics»: Dynamics 2

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

More information

Video 8.1 Vijay Kumar. Property of University of Pennsylvania, Vijay Kumar

Video 8.1 Vijay Kumar. Property of University of Pennsylvania, Vijay Kumar Video 8.1 Vijay Kumar 1 Definitions State State equations Equilibrium 2 Stability Stable Unstable Neutrally (Critically) Stable 3 Stability Translate the origin to x e x(t) =0 is stable (Lyapunov stable)

More information

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

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

More information

Artificial Intelligence & Neuro Cognitive Systems Fakultät für Informatik. Robot Dynamics. Dr.-Ing. John Nassour J.

Artificial Intelligence & Neuro Cognitive Systems Fakultät für Informatik. Robot Dynamics. Dr.-Ing. John Nassour J. Artificial Intelligence & Neuro Cognitive Systems Fakultät für Informatik Robot Dynamics Dr.-Ing. John Nassour 25.1.218 J.Nassour 1 Introduction Dynamics concerns the motion of bodies Includes Kinematics

More information

Case Study: The Pelican Prototype Robot

Case Study: The Pelican Prototype Robot 5 Case Study: The Pelican Prototype Robot The purpose of this chapter is twofold: first, to present in detail the model of the experimental robot arm of the Robotics lab. from the CICESE Research Center,

More information

Dynamics. Basilio Bona. Semester 1, DAUIN Politecnico di Torino. B. Bona (DAUIN) Dynamics Semester 1, / 18

Dynamics. Basilio Bona. Semester 1, DAUIN Politecnico di Torino. B. Bona (DAUIN) Dynamics Semester 1, / 18 Dynamics Basilio Bona DAUIN Politecnico di Torino Semester 1, 2016-17 B. Bona (DAUIN) Dynamics Semester 1, 2016-17 1 / 18 Dynamics Dynamics studies the relations between the 3D space generalized forces

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

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

(W: 12:05-1:50, 50-N202)

(W: 12:05-1:50, 50-N202) 2016 School of Information Technology and Electrical Engineering at the University of Queensland Schedule of Events Week Date Lecture (W: 12:05-1:50, 50-N202) 1 27-Jul Introduction 2 Representing Position

More information

ROBOTICS Laboratory Problem 02

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

More information

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

Advanced Robotic Manipulation

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

More information

Robot 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

Multibody simulation

Multibody simulation Multibody simulation Dynamics of a multibody system (Newton-Euler formulation) Dimitar Dimitrov Örebro University June 8, 2012 Main points covered Newton-Euler formulation forward dynamics inverse dynamics

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

Introduction to centralized control

Introduction to centralized control ROBOTICS 01PEEQW Basilio Bona DAUIN Politecnico di Torino Control Part 2 Introduction to centralized control Independent joint decentralized control may prove inadequate when the user requires high task

More information

CONTROL OF ROBOT CAMERA SYSTEM WITH ACTUATOR S DYNAMICS TO TRACK MOVING OBJECT

CONTROL OF ROBOT CAMERA SYSTEM WITH ACTUATOR S DYNAMICS TO TRACK MOVING OBJECT Journal of Computer Science and Cybernetics, V.31, N.3 (2015), 255 265 DOI: 10.15625/1813-9663/31/3/6127 CONTROL OF ROBOT CAMERA SYSTEM WITH ACTUATOR S DYNAMICS TO TRACK MOVING OBJECT NGUYEN TIEN KIEM

More information

Robotics. Dynamics. University of Stuttgart Winter 2018/19

Robotics. Dynamics. University of Stuttgart Winter 2018/19 Robotics Dynamics 1D point mass, damping & oscillation, PID, dynamics of mechanical systems, Euler-Lagrange equation, Newton-Euler, joint space control, reference trajectory following, optimal operational

More information

Introduction to centralized control

Introduction to centralized control Industrial Robots Control Part 2 Introduction to centralized control Independent joint decentralized control may prove inadequate when the user requires high task velocities structured disturbance torques

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

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

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

Laboratory 11 Control Systems Laboratory ECE3557. State Feedback Controller for Position Control of a Flexible Joint

Laboratory 11 Control Systems Laboratory ECE3557. State Feedback Controller for Position Control of a Flexible Joint Laboratory 11 State Feedback Controller for Position Control of a Flexible Joint 11.1 Objective The objective of this laboratory is to design a full state feedback controller for endpoint position control

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

MSMS Matlab Problem 02

MSMS Matlab Problem 02 MSMS 2014-2015 Matlab Problem 02 Basilio Bona DAUIN PoliTo Problem formulation The planar system illustrated in Figure 1 consists of a cart C sliding with friction along the horizontal rail; the cart supports

More information

Lecture Note 12: Dynamics of Open Chains: Lagrangian Formulation

Lecture Note 12: Dynamics of Open Chains: Lagrangian Formulation ECE5463: Introduction to Robotics Lecture Note 12: Dynamics of Open Chains: Lagrangian Formulation Prof. Wei Zhang Department of Electrical and Computer Engineering Ohio State University Columbus, Ohio,

More information

Robot Dynamics - Rotary Wing UAS: Control of a Quadrotor

Robot Dynamics - Rotary Wing UAS: Control of a Quadrotor Robot Dynamics Rotary Wing AS: Control of a Quadrotor 5-85- V Marco Hutter, Roland Siegwart and Thomas Stastny Robot Dynamics - Rotary Wing AS: Control of a Quadrotor 7..6 Contents Rotary Wing AS. Introduction

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

Dynamics. describe the relationship between the joint actuator torques and the motion of the structure important role for

Dynamics. describe the relationship between the joint actuator torques and the motion of the structure important role for Dynamics describe the relationship between the joint actuator torques and the motion of the structure important role for simulation of motion (test control strategies) analysis of manipulator structures

More information

Lecture 9 Nonlinear Control Design

Lecture 9 Nonlinear Control Design Lecture 9 Nonlinear Control Design Exact-linearization Lyapunov-based design Lab 2 Adaptive control Sliding modes control Literature: [Khalil, ch.s 13, 14.1,14.2] and [Glad-Ljung,ch.17] Course Outline

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

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

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

MEM04: Rotary Inverted Pendulum

MEM04: Rotary Inverted Pendulum MEM4: Rotary Inverted Pendulum Interdisciplinary Automatic Controls Laboratory - ME/ECE/CHE 389 April 8, 7 Contents Overview. Configure ELVIS and DC Motor................................ Goals..............................................3

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

Quaternion-Based Tracking Control Law Design For Tracking Mode

Quaternion-Based Tracking Control Law Design For Tracking Mode A. M. Elbeltagy Egyptian Armed forces Conference on small satellites. 2016 Logan, Utah, USA Paper objectives Introduction Presentation Agenda Spacecraft combined nonlinear model Proposed RW nonlinear attitude

More information

Fuzzy Based Robust Controller Design for Robotic Two-Link Manipulator

Fuzzy Based Robust Controller Design for Robotic Two-Link Manipulator Abstract Fuzzy Based Robust Controller Design for Robotic Two-Link Manipulator N. Selvaganesan 1 Prabhu Jude Rajendran 2 S.Renganathan 3 1 Department of Instrumentation Engineering, Madras Institute of

More information

Rigid Manipulator Control

Rigid Manipulator Control Rigid Manipulator Control The control problem consists in the design of control algorithms for the robot motors, such that the TCP motion follows a specified task in the cartesian space Two types of task

More information

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

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

More information

1/30. Rigid Body Rotations. Dave Frank

1/30. Rigid Body Rotations. Dave Frank . 1/3 Rigid Body Rotations Dave Frank A Point Particle and Fundamental Quantities z 2/3 m v ω r y x Angular Velocity v = dr dt = ω r Kinetic Energy K = 1 2 mv2 Momentum p = mv Rigid Bodies We treat a rigid

More information

Lecture 12. Upcoming labs: Final Exam on 12/21/2015 (Monday)10:30-12:30

Lecture 12. Upcoming labs: Final Exam on 12/21/2015 (Monday)10:30-12:30 289 Upcoming labs: Lecture 12 Lab 20: Internal model control (finish up) Lab 22: Force or Torque control experiments [Integrative] (2-3 sessions) Final Exam on 12/21/2015 (Monday)10:30-12:30 Today: Recap

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

Lecture «Robot Dynamics»: Kinematics 2

Lecture «Robot Dynamics»: Kinematics 2 Lecture «Robot Dynamics»: Kinematics 2 151-0851-00 V lecture: CAB G11 Tuesday 10:15 12:00, every week exercise: HG E1.2 Wednesday 8:15 10:00, according to schedule (about every 2nd week) Marco Hutter,

More information

Video 3.1 Vijay Kumar and Ani Hsieh

Video 3.1 Vijay Kumar and Ani Hsieh Video 3.1 Vijay Kumar and Ani Hsieh Robo3x-1.3 1 Dynamics of Robot Arms Vijay Kumar and Ani Hsieh University of Pennsylvania Robo3x-1.3 2 Lagrange s Equation of Motion Lagrangian Kinetic Energy Potential

More information

Manipulator Dynamics 2. Instructor: Jacob Rosen Advanced Robotic - MAE 263D - Department of Mechanical & Aerospace Engineering - UCLA

Manipulator Dynamics 2. Instructor: Jacob Rosen Advanced Robotic - MAE 263D - Department of Mechanical & Aerospace Engineering - UCLA Manipulator Dynamics 2 Forward Dynamics Problem Given: Joint torques and links geometry, mass, inertia, friction Compute: Angular acceleration of the links (solve differential equations) Solution Dynamic

More information

sc Control Systems Design Q.1, Sem.1, Ac. Yr. 2010/11

sc Control Systems Design Q.1, Sem.1, Ac. Yr. 2010/11 sc46 - Control Systems Design Q Sem Ac Yr / Mock Exam originally given November 5 9 Notes: Please be reminded that only an A4 paper with formulas may be used during the exam no other material is to be

More information

Lab 6a: Pole Placement for the Inverted Pendulum

Lab 6a: Pole Placement for the Inverted Pendulum Lab 6a: Pole Placement for the Inverted Pendulum Idiot. Above her head was the only stable place in the cosmos, the only refuge from the damnation of the Panta Rei, and she guessed it was the Pendulum

More information

Introduction to Robotics

Introduction to Robotics J. Zhang, L. Einig 277 / 307 MIN Faculty Department of Informatics Lecture 8 Jianwei Zhang, Lasse Einig [zhang, einig]@informatik.uni-hamburg.de University of Hamburg Faculty of Mathematics, Informatics

More information

A Sliding Mode Controller Using Neural Networks for Robot Manipulator

A Sliding Mode Controller Using Neural Networks for Robot Manipulator ESANN'4 proceedings - European Symposium on Artificial Neural Networks Bruges (Belgium), 8-3 April 4, d-side publi., ISBN -9337-4-8, pp. 93-98 A Sliding Mode Controller Using Neural Networks for Robot

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 Khaled M. Helal, 2 Mostafa R.A. Atia, 3 Mohamed I. Abu El-Sebah, 2 Mechanical Engineering Department ARAB ACADEMY FOR

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

Kinetic energy. Analytical Mechanics: Link Mechanisms. Kinetic energy. Agenda. Kinematics of two link open mechanism.

Kinetic energy. Analytical Mechanics: Link Mechanisms. Kinetic energy. Agenda. Kinematics of two link open mechanism. Analtical Mechanics: Link Mechanisms Shinichi Hirai Dept. Robotics, Ritsumeikan Univ. Kinetic energ velocit of the center of mass of link : angular velocit of link : kinetic energ of link : ẋ c l c θ S

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

YTÜ Mechanical Engineering Department

YTÜ Mechanical Engineering Department YTÜ Mechanical Engineering Department Lecture of Special Laboratory of Machine Theory, System Dynamics and Control Division Coupled Tank 1 Level Control with using Feedforward PI Controller Lab Report

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

Linearize a non-linear system at an appropriately chosen point to derive an LTI system with A, B,C, D matrices

Linearize a non-linear system at an appropriately chosen point to derive an LTI system with A, B,C, D matrices Dr. J. Tani, Prof. Dr. E. Frazzoli 151-0591-00 Control Systems I (HS 2018) Exercise Set 2 Topic: Modeling, Linearization Discussion: 5. 10. 2018 Learning objectives: The student can mousavis@ethz.ch, 4th

More information

NMT EE 589 & UNM ME 482/582 ROBOT ENGINEERING. Dr. Stephen Bruder NMT EE 589 & UNM ME 482/582

NMT EE 589 & UNM ME 482/582 ROBOT ENGINEERING. Dr. Stephen Bruder NMT EE 589 & UNM ME 482/582 NMT EE 589 & UNM ME 482/582 ROBOT ENGINEERING NMT EE 589 & UNM ME 482/582 Simplified drive train model of a robot joint Inertia seen by the motor Link k 1 I I D ( q) k mk 2 kk Gk Torque amplification G

More information

Multibody simulation

Multibody simulation Multibody simulation Dynamics of a multibody system (Euler-Lagrange formulation) Dimitar Dimitrov Örebro University June 16, 2012 Main points covered Euler-Lagrange formulation manipulator inertia matrix

More information

Computer Exercise Modeling and control of a magnetic suspension system N S. magnetic. gravity. Figure 1: Sketch of the magnetic levitation system.

Computer Exercise Modeling and control of a magnetic suspension system N S. magnetic. gravity. Figure 1: Sketch of the magnetic levitation system. Control Systems Automatic I Computer Exercise Modeling and control of a magnetic suspension system magnetic N S x gravity N Figure 1: Sketch of the magnetic levitation system. Scope of the project and

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

(r i F i ) F i = 0. C O = i=1

(r i F i ) F i = 0. C O = i=1 Notes on Side #3 ThemomentaboutapointObyaforceF that acts at a point P is defined by M O (r P r O F, where r P r O is the vector pointing from point O to point P. If forces F, F, F 3,..., F N act on particles

More information

MCE493/593 and EEC492/592 Prosthesis Design and Control

MCE493/593 and EEC492/592 Prosthesis Design and Control MCE493/593 and EEC492/592 Prosthesis Design and Control Control Systems Part 3 Hanz Richter Department of Mechanical Engineering 2014 1 / 25 Electrical Impedance Electrical impedance: generalization of

More information

Mecanum-Wheeled Vehicle Base

Mecanum-Wheeled Vehicle Base Mecanum-Wheeled Vehicle Base Dan Fisher in partial fulfillment of ETLS 789 Simulation and Visualization of Dynamic Systems University of St. Thomas Dr. Michael Hennessey Fall 2014 Due December 18, 2014

More information

ADAPTIVE NEURAL NETWORK CONTROL OF MECHATRONICS OBJECTS

ADAPTIVE NEURAL NETWORK CONTROL OF MECHATRONICS OBJECTS acta mechanica et automatica, vol.2 no.4 (28) ADAPIE NEURAL NEWORK CONROL OF MECHARONICS OBJECS Egor NEMSE *, Yuri ZHUKO * * Baltic State echnical University oenmeh, 985, St. Petersburg, Krasnoarmeyskaya,

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

Robot Dynamics Lecture Notes. Robotic Systems Lab, ETH Zurich

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

More information

DC-motor PID control

DC-motor PID control DC-motor PID control This version: November 1, 2017 REGLERTEKNIK Name: P-number: AUTOMATIC LINKÖPING CONTROL Date: Passed: Chapter 1 Introduction The purpose of this lab is to give an introduction to

More information

Mechatronic System Case Study: Rotary Inverted Pendulum Dynamic System Investigation

Mechatronic System Case Study: Rotary Inverted Pendulum Dynamic System Investigation Mechatronic System Case Study: Rotary Inverted Pendulum Dynamic System Investigation Dr. Kevin Craig Greenheck Chair in Engineering Design & Professor of Mechanical Engineering Marquette University K.

More information

Autonomous Mobile Robot Design

Autonomous Mobile Robot Design Autonomous Mobile Robot Design Topic: Micro Aerial Vehicle Dynamics Dr. Kostas Alexis (CSE) Goal of this lecture The goal of this lecture is to derive the equations of motion that describe the motion of

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

State Feedback Controller for Position Control of a Flexible Link

State Feedback Controller for Position Control of a Flexible Link Laboratory 12 Control Systems Laboratory ECE3557 Laboratory 12 State Feedback Controller for Position Control of a Flexible Link 12.1 Objective The objective of this laboratory is to design a full state

More information

Robust Control of Robot Manipulator by Model Based Disturbance Attenuation

Robust Control of Robot Manipulator by Model Based Disturbance Attenuation IEEE/ASME Trans. Mechatronics, vol. 8, no. 4, pp. 511-513, Nov./Dec. 2003 obust Control of obot Manipulator by Model Based Disturbance Attenuation Keywords : obot manipulators, MBDA, position control,

More information

Balancing of an Inverted Pendulum with a SCARA Robot

Balancing of an Inverted Pendulum with a SCARA Robot Balancing of an Inverted Pendulum with a SCARA Robot Bernhard Sprenger, Ladislav Kucera, and Safer Mourad Swiss Federal Institute of Technology Zurich (ETHZ Institute of Robotics 89 Zurich, Switzerland

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

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

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 Benchmark Problem for Robust Control of a Multivariable Nonlinear Flexible Manipulator

A Benchmark Problem for Robust Control of a Multivariable Nonlinear Flexible Manipulator Proceedings of the 17th World Congress The International Federation of Automatic Control Seoul, Korea, July 6-11, 28 A Benchmark Problem for Robust Control of a Multivariable Nonlinear Flexible Manipulator

More information

Rotary Motion Servo Plant: SRV02. Rotary Experiment #11: 1-DOF Torsion. 1-DOF Torsion Position Control using QuaRC. Student Manual

Rotary Motion Servo Plant: SRV02. Rotary Experiment #11: 1-DOF Torsion. 1-DOF Torsion Position Control using QuaRC. Student Manual Rotary Motion Servo Plant: SRV02 Rotary Experiment #11: 1-DOF Torsion 1-DOF Torsion Position Control using QuaRC Student Manual Table of Contents 1. INTRODUCTION...1 2. PREREQUISITES...1 3. OVERVIEW OF

More information

Lecture 9 - Rotational Dynamics

Lecture 9 - Rotational Dynamics Lecture 9 - Rotational Dynamics A Puzzle... Angular momentum is a 3D vector, and changing its direction produces a torque τ = dl. An important application in our daily lives is that bicycles don t fall

More information

Example: Inverted pendulum on cart

Example: Inverted pendulum on cart Chapter 25 Eample: Inverted pendulum on cart The figure to the right shows a rigid body attached by an frictionless pin (revolute joint to a cart (modeled as a particle. Thecart slides on a horizontal

More information

An Inverse Dynamics Attitude Control System with Autonomous Calibration. Sanny Omar Dr. David Beale Dr. JM Wersinger

An Inverse Dynamics Attitude Control System with Autonomous Calibration. Sanny Omar Dr. David Beale Dr. JM Wersinger An Inverse Dynamics Attitude Control System with Autonomous Calibration Sanny Omar Dr. David Beale Dr. JM Wersinger Outline Attitude Determination and Control Systems (ADACS) Overview Coordinate Frames

More information

Ch. 5: Jacobian. 5.1 Introduction

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

More information

Lecture 9 Nonlinear Control Design. Course Outline. Exact linearization: example [one-link robot] Exact Feedback Linearization

Lecture 9 Nonlinear Control Design. Course Outline. Exact linearization: example [one-link robot] Exact Feedback Linearization Lecture 9 Nonlinear Control Design Course Outline Eact-linearization Lyapunov-based design Lab Adaptive control Sliding modes control Literature: [Khalil, ch.s 13, 14.1,14.] and [Glad-Ljung,ch.17] Lecture

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

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

Introduction to Haptic Systems Introduction to Haptic Systems Félix Monasterio-Huelin & Álvaro Gutiérrez & Blanca Larraga October 8, 2018 Contents Contents 1 List of Figures 1 1 Introduction 2 2 DC Motor 3 3 1 DOF DC motor model with

More information

Dynamics of Open Chains

Dynamics of Open Chains Chapter 9 Dynamics of Open Chains According to Newton s second law of motion, any change in the velocity of a rigid body is caused by external forces and torques In this chapter we study once again the

More information

Research Article On the Dynamics of the Furuta Pendulum

Research Article On the Dynamics of the Furuta Pendulum Control Science and Engineering Volume, Article ID 583, 8 pages doi:.55//583 Research Article On the Dynamics of the Furuta Pendulum Benjamin Seth Cazzolato and Zebb Prime School of Mechanical Engineering,

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

General procedure for formulation of robot dynamics STEP 1 STEP 3. Module 9 : Robot Dynamics & controls

General procedure for formulation of robot dynamics STEP 1 STEP 3. Module 9 : Robot Dynamics & controls Module 9 : Robot Dynamics & controls Lecture 32 : General procedure for dynamics equation forming and introduction to control Objectives In this course you will learn the following Lagrangian Formulation

More information

Simulation of joint position response of 60 kg payload 4-Axes SCARA configuration manipulator taking dynamical effects into consideration

Simulation of joint position response of 60 kg payload 4-Axes SCARA configuration manipulator taking dynamical effects into consideration Simulation of joint position response of 6 kg payload 4Axes SCARA configuration manipulator taking dynamical effects into consideration G. Purkayastha, S. Datta, S. Nandy, S.N. Shome Robotics & Automation

More information

Analysis and Design of Hybrid AI/Control Systems

Analysis and Design of Hybrid AI/Control Systems Analysis and Design of Hybrid AI/Control Systems Glen Henshaw, PhD (formerly) Space Systems Laboratory University of Maryland,College Park 13 May 2011 Dynamically Complex Vehicles Increased deployment

More information

ENGG 5402 Course Project: Simulation of PUMA 560 Manipulator

ENGG 5402 Course Project: Simulation of PUMA 560 Manipulator ENGG 542 Course Project: Simulation of PUMA 56 Manipulator ZHENG Fan, 115551778 mrzhengfan@gmail.com April 5, 215. Preface This project is to derive programs for simulation of inverse dynamics and control

More information

We are IntechOpen, the world s leading publisher of Open Access books Built by scientists, for scientists. International authors and editors

We are IntechOpen, the world s leading publisher of Open Access books Built by scientists, for scientists. International authors and editors We are IntechOpen, the world s leading publisher of Open Access books Built by scientists, for scientists 3,350 108,000 1.7 M Open access books available International authors and editors Downloads Our

More information

Natural and artificial constraints

Natural and artificial constraints FORCE CONTROL Manipulator interaction with environment Compliance control Impedance control Force control Constrained motion Natural and artificial constraints Hybrid force/motion control MANIPULATOR INTERACTION

More information

Modeling and Experimentation: Compound Pendulum

Modeling and Experimentation: Compound Pendulum Modeling and Experimentation: Compound Pendulum Prof. R.G. Longoria Department of Mechanical Engineering The University of Texas at Austin Fall 2014 Overview This lab focuses on developing a mathematical

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