MEM04: Rotary Inverted Pendulum

Size: px
Start display at page:

Download "MEM04: Rotary Inverted Pendulum"

Transcription

1 MEM4: Rotary Inverted Pendulum Interdisciplinary Automatic Controls Laboratory - ME/ECE/CHE 389 April 8, 7 Contents Overview. Configure ELVIS and DC Motor Goals Rotary-Pendulum Introduction Equations of Motion 3 3 Linearization of Rotary Pendulum Dynamics 4 3. Inclusion of actuator dynamics System Identification (Experimental Determination of Model Parameters) 5 4. Calculation of Pendulum Center of Mass Analytical Calculation of Moment of inertia J p Experimental Identification of Pendulum Moment of Inertia Gantry Control 8 6 Inverted Pendulum Control 9 6. Inverted Pendulum Control via LQR A Derivation of System Dynamics by Lagrange method B Linearized Dynamics 3 C Files 4 Overview This lab addresses the control of a pendulum swinging from a rotating beam. Their are two control problems to consider: the gantry (crane) problem where we would like move the rotary section about while minimizing the swing of the pendulum and the inverted pendulum problem where we would like to balance the pendulum in the inverted position. First, the model structure for the system is derived from first principles and simple experiments are carried out to determine the model parameter values. Then, the laboratory proceeds with control design for each case separately.

2 We control the system using full state feedback, and explore both pole placement and LQR as techniques for choosing the feedback gains. The necessary files to carry out the laboratory are available in the controls drive (T drive). The drive should be visible from the windows Computer pane T:\ME389 MEM4 GANTRY\ You can read files in this folder but cannot edit them. Copy the folder to the local C drive. The folder contains LabView files for controlling the hardware and Matlab files for analyzing the data. See Appendix C for a complete list of files.. Configure ELVIS and DC Motor ELVIS (Educational Laboratory Virtual Instrumentation Suite) To startup the ELVIS follow the procedure. The main VI for this lab is QNET ROTPEN Lab 3 Gantry Control ME389.vi Found in \ME389 VIs. There is a reference printed on the wall for starting the ELVIS (Education LabView Instrumentation Suite). 3. First confirm the prototyping board power is switched OFF, down position. Also switch the Communications to BYPASS. 4. Turn on the main power to the ELVIS with the switch located on the back of the ELVIS. The system power LED should light up. 5. Run QNET init elvis bypass.vi. The bypass is successful when the LED in the VI is lit. 6. Turn on the prototyping board power. The four LEDs +B, +5, -5, +5 should light up. If any are not fully lit, consult the TA. 7. Warning: If the motor spins when switching ON the prototyping board power, immediately switch OFF the Prototyping board power.. Goals. Model the rotary pendulum system as a state space system.. Use experimental techniques to determine the model parameters. 3. Control the pendulum in the Gantry position. 4. Balance control of the pendulum in the upright (inverted) position..3 Rotary-Pendulum Introduction The rotary-pendulum system consists of an actuated rotary arm controlled by an input torque, τ, and an unactuated pendulum connected to the arm at a pivot joint.

3 Figure : Rotary-pendulum system. Equations of Motion The rotary pendulum is an example of a manipulator system, i.e. a serial chain of robotic manipulator arms. The equations of motion of all manipulator systems take the characteristic form known as the manipulator equation, H(q) q + C(q, q) q + G(q) = Bu, () where q is a generalized coordinate vector, H is the inertial matrix, C captures Coriolis forces, and G captures potentials (such as gravity). The B matrix maps control inputs u into generalized forces. The matrices of () can be determined by Lagrange s method. However, the complete derivation provided in Appendix A of system dynamics is fairly involved and it s not necessary to understand for this course. For the rotary pendulum, we have q = θ, α] T, ] Jarm + m p r + m p lp sin α m p rl p cos α H(q) =, m p rl p cos α J p + m p lp C(q, q) = m plp α sin α + C arm m plp θ ] sin α m p rl p α sin α m, plp sin α C p ] G(q) =, m p gl p sin α ] B =, () where C arm and C p are damping coefficients that result from viscous friction at the joints. Note that the system matrices H(q), C(q, q) and G(q) are independent of the state θ. 3

4 3 Linearization of Rotary Pendulum Dynamics As explained in Appendix B, we can use taylor series expansion to obtain a linearized form of the manipulator equation. ẋ = Ax + Bu, (3) where x is the full system state (x = q, q] T = θ, α, θ, α] T ), and u = τ is the input torque. For rigid body systems that can be described by the manipulator equation (), the first order taylor series approximation around a fixed point (x, u ) is given by, A = ] I H(q), and B = C(q, q) x,u H(q) G(q) H B] x,u. (4) Computing H(q) = ] mp lp + J p l p m p r cos α l p m p r cos α m p lp sin α + m p r, (5) + J arm where = J p J arm + m pl 4 p sin α + m pl pr + J arm m p l p + J p m p r + J p l pm p sin α l pm pr cos α, (6) and G(q) = ], (7) gl p m p cos α we can write A = glpm pr cos α m plpr 3 cos α sin α (8) (gl p m p cos α(m p lp sin α + m p r + J arm )) ( m plp sin α(m p lp sin α + m p r + J arm )) B = where we have used θ = α and C arm = C p. 3. Inclusion of actuator dynamics x,u m p lp + J p, (9) l p m p r cos α x,u In the actual physical system the control input is not the torque, but is actually the voltage applied to the motor. The actuator dynamics must be included into the state equations since the computer does not control the motor torque directly but controls the voltage being applied to the motor. The torque generated at the arm pivot from the motor voltage, V m, is given by ) K t (V m K m θ τ =. () R m 4

5 The linear dynamics of the motor can be combined with the state space system (3)-(4) to obtain the complete dynamics ẋ = Ax + Bu, () where x = θ, α, θ, α] T, u = V m is the input motor voltage. This is achieved by the following transformation A A KtKm R m B ] B K t B, () R m which results in A = glp m p r cos α m p l3 p r cos α sin α K tk m (m R m plp + Jp) (gl pm p cos α(m plp sin α + m pr + J arm)) ( mpl p sin α(mpl p sin α + m pr + J arm)) + K tk m (m R m pl pr cos α) (3) x,u B = Kt R m m plp + Jp. (4) l pm pr cos α x,u For the inverted fixed point x =, π,, ] T, A = m pgrlp K tk m(j p+m pl p) J pj arm+j pm pr +J armm plp R m(j pj arm+j pm pr +J armm pl p ), B = m pgl p(j arm+m pr ) J pj arm+j pm pr +J armm pl p For the hanging fixed point x =,,, ] T, K tk m(m prl p) R m(j pj arm+j pm pr +J armm pl p ) A = m pgrlp K tk m(j p+m pl p) J pj arm+j pm pr +J armm plp R m(j pj arm+j pm pr +J armm pl p ), B = m pgl p(j arm+m pr ) J pj arm+j pm pr +J armm pl p K tk m(m prl p) R m(j pj arm+j pm pr +J armm pl p ) K t(j p+m pl p ) R m(j pj arm+j pm pr +J armm pl p ) K t(m prl p) R m(j pj arm+j pm pr +J armm pl p) K t(j p+m pl p ) R m(j pj arm+j pm pr +J armm pl p ) K t(m prl p) R m(j pj arm+j pm pr +J armm pl p).. 4 System Identification (Experimental Determination of Model Parameters) To use the dynamic model described by (), we have to plug in values for all the parameters. Some of these are known constants, such as the gravitational acceleration, g. Others are easy to measure directly, such as the pendulum length. The system identification procedure consists of three parts: Note, the system exhibits a hanging fixed point for any value of θ, thus there are actually a continuum of hanging fixed points, and any value of θ can be used to solve for the linear dynamics. 5

6 (a) Front View Pendulum where l p is the distance to the (b) Moment Inertial Diagram center of mass Figure : Free body diagrams of pendulum. Parameter Description Value Unit M p Mass of pendulum link.8 kg M p Mass of pendulum weight.9 kg L p Length of pendulum link.7 m L p Length of pendulum weight.9 m Table : Parameter values for Figure (b). 4. Calculation of Pendulum Center of Mass For a composite object, made of several bodies, the center of mass is given by x cm = n i= m ix i n i= m, (5) i where x cm is the distance from some reference point to the center of mass of the composite object and x i is the distance to the center of mass for each individual object. 6

7 Lab Work :. Using Table and equation (5) calculate the center of mass of the pendulum relative to the pivot location, l p. 4. Analytical Calculation of Moment of inertia J p The generalized equation for moment of inertia of an arbitrary rigid body about its axis of rotation is J = r dm, (6) M where r is the perpendicular distance between the element mass, dm, and the axis of rotation and the integral is calculated over the object s entire mass, M. Lab Work :. Use (6) to write an expression for the moment of inertia in terms of the parameters M p, M p, L p, and L p (a) Hint: For a uniform rod of length L and mass M, the elemental mass is dm = M L dx. Use Table and the obtained expression to determine the moment of inertia J p. 4.3 Experimental Identification of Pendulum Moment of Inertia Consider the unforced dynamics of the pendulum member alone, J p α + m p gl p sin α =. (7) The linearized dynamics of this system about and angle of α = are given by Recalling that the second order system J p α + m p gl p α =. (8) ÿ + ω ny =, (9) describes an oscillator with natural frequency ω n, we see that the simple pendulum has a natural frequency mgl p ω n =. () J p Measurements of the natural frequency and pendulum center of mass length can be used to calculate the pendulum moment of inertia. 7

8 Lab Work 3: Collect data to determine the natural frequency of the pendulum alone. This can be done by letting the pendulum swing while holding the rotary beam fixed and observing the time it takes for the pendulum to swing through a single period. The natural frequency is equivalent over the elapsed time required to complete a period cycle.. Use the Labview VI -QNET ROTPENT Simple Modeling.vi Found in directory: C:\ME389 VIs\QNET ROTPEN SimpleModeling. Enter amplitude =. V 3. Bring the pendulum to some angle and let it go allowing it to swing freely. What initial angle makes sense for this test? Think about problems that occur in the limit of small to large angles. 4. Determine the natural frequency from f n = n cyc t = number of cycles elapsed time () 5. Note, ω n = πf n. Use this value to calculate J p. 5 Gantry Control In this section, we consider control of the rotary system in the Gantry (crane) position. Imagine the rotary beam as a crane with the pendulum in the down position as a load to be displaced. We wish to move the load as fast as possible but minimize the amount of swinging. The model, determined in the previous sections, is given in state space form, ẋ = Ax + Bu, () y = Cx, (3) where x = θ α θ α] T and u is the input voltage to the motor. Lab Work 4: Gantry Model Analysis. Compute the open-loop poles of the system. Is the system stable? We assume measurements of all the states are available, i.e. y = x and C is the identity matrix. The controller is called a linear state feedback controller, i.e. it is of the form u = K(x x d ), (4) where K is a matrix of control gains. The control gains are K = k p,θ, k p,α, k d,θ, k d,α ] T, where k p,θ is a proportional gain on θ, k p,α is a proportional gain on α, k d,θ is a derivative gain on θ, and k d,α is a derivative gain on α: u = K(x x d ) = k p,θ (θ θ d ) k p,α (α α d ) k d,θ θ kd,α α. (5) 8

9 Lab Work 5: Gantry Proportional Controller Use proportional control to move the gantry to the desired position. Carry out the control design by first simulation and then implementation on the real hardware.. The proportional control can be implemented by setting the gain matrix to K = kp ].. This applies a proportional gain to the state θ relative to the desired angle, θ d, i.e. u = K(x x d ) = k p (θ θ d ). (6) 3. Use the Control implementation tab of the VI and set the first LQR gain to Kp and the others to zero. 4. Note the beam tracks the desired location, but there is lots of oscillation in the pendulum. Lab Work 6: Gantry LQR Controller Since, there is only one control variable, R is a scalar and the control law used to minimize the cost the function J is given by u = K(x x d ) = k p,θ (θ θ d ) k p,α (α α d ) k d,θ θ kd,α α. (7) Note that K is a 4 matrix. Now design and LQR controller to improve the pendulum damping. Use a Q matrix that penalizes non zero pendulum angles and non zero rotary beam locations. Carry out the control design by first simulation and then implementation on the real hardware. 6 Inverted Pendulum Control In this section, we consider control of the rotary system in the Inverted Pendulum position. The model, determined in the previous sections, is given in state space form, ẋ = Ax + Bu, (8) y = Cx, (9) where x = θ α θ α] T and u is the input voltage to the motor. Lab Work 7: Inverted Pendulum Model Analysis. Compute the open-loop poles of the system. Is the system stable? 9

10 Lab Work 8: Inverted Pendulum Pole-Placement Controller Carry out the control design by first simulation and then implementation on the real hardware.. Create a state space system in Matlab for the inverted pendulum case. Plot the open-loop pole locations of the inverted pendulum. 3. Verify that your system is controllable by using the Matlab ctrb command. 4. Choose the closed loop pole locations to be all in the LHP. You can mirror any RHP poles into the LHP. Use Matlab place command to do the pole placement. 5. Simulate the system response to initial conditions with Matlab initial. 6. If the system is stabilized with reasonable input voltages ( V), try it out on the real system. 7. Remember to start the pendulum in the upright position. Lab Work 9: Inverted Pendulum LQR Controller Since, there is only one control variable, R is a scalar and the control law used to minimize the cost the function J is given by u = K(x x d ) = k p,θ (θ θ d ) k p,α (α α d ) k d,θ θ kd,α α. (3) Note that K is a 4 matrix. Now design and LQR controller to improve the pendulum damping. Use a Q matrix that penalizes non zero pendulum angles and non zero rotary beam locations. Carry out the control design by first simulation and then implementation on the real hardware.

11 A Derivation of System Dynamics by Lagrange method The kinematics can be determined from Lagrange s equation, d L dt q L = Q D q (3) where L = T U, T is the kinetic energy, U is the potential energy, Q is a generalized force vector, and represents dissipative energy from damping. D The kinetic energy of the rotary arm is defined by the rotational kinetic energy T arm = J arm θ (3) and the kinetic energy of the pendulum is the sum of rotational kinetic energy and translational kinetic energy T pend = J p α + m pṙ T pṙ p (33) where r p is the position vector of the pendulum center of mass in 3D space, x p r sin θ + l p sin α cos θ r θc θ + l p αc α c θ l p θsα s θ r p = y p = h l p cos α, ṙ p = l p αs α, (34) z p r cos θ l p sin α sin θ r θs θ l p αc α s θ l p θsα c θ where c θ = cos θ, s θ = sin θ, c α = cos α, and s α = sin α. The coordinate values of x p and z p are determined from the top view of the system, figure??. To find T, expand the term ṙ T pṙ p, ṙ T pṙ p = Figure 3: Top view of the rotary pendulum system. ( r θc ) ( θ + l p αc α c θ l p θsα s θ + (lp αs α ) + r θs ) θ l p αc α s θ l p θsα c θ (35)

12 expanding the quadratics, combining terms, and making cancellations, ṙ T pṙ p = r θ c θ +r θc θ l p αc α c θ l p θsα s θ + l p α c αc θ + r θ s θ +r θs θ l p αc α s θ + l p θsα c θ + l p α c αs θ ṙ T pṙ p = r θ + lp α + lp θ s α + rl p θ αcα. 4 Thus, the energy terms can be written as T = J arm θ + J p α + m p U = m p gl p c α, 4 4 l p α θc α c θ s α s θ 5 + l p α θc α s θ s α c θ 5 + lp θ s αs θ + l p α s α 6 + lp θ s αc θ, 6 4 (36) (r θ + l p α + l p θ s α + rl p θ αcα ), (37) D = C arm θ + C p α, (39) and the Lagrange s equation terms can be written as ( L q = Jarm + m p r + m p lps αh ) ] θ + mp rl p αc α, (4) (J p + m p lp) α + m p rl p θcα ( ) d L (Jarm + m p r ) θ + m p l = ps α θ + m p l θ ] p αs α c α + m p rl p αc α m p rl p α s α, (4) dt q (J p + m p lp) α + m p rl p θcα m p rl p θ αsα ] L = m p lp θ. (4) s α c α m p rl p θ αsα m p gl p s α Finally, the resulting dynamics can be rearranged into the manipulator equation form (38) H(q) q + C(q, q) q + G(q) = Bu, (43) where ] Jarm + m p r + m p l H(q) = ps α m p rl p c α, m p rl p c α J p + m p lp C(q, q) = m plp α sin α + C arm m plp θ ] sin α m p rl p αs α m, plp sin α C p ] ] G(q) =, B =. m p gls α (44) Note, that the choice of C is not unique, and the identity sin α cos α = sin α was used to determine C.

13 B Linearized Dynamics For a general dynamic system ẋ = f(x, u), (45) a fixed point is an input and state combination (x, u ), such that the function f evaluates to zero, i.e. f(x, u ) =. The linearized dynamics of any system, ẋ = f(x, u), around a fixed point can be determined by Taylor series expansion thus at a fixed point ẋ = f(x, u) f(x, u ) + ẋ f x] f x] x=x,u=u (x x ) + x=x,u=u (x x ) + f u] For the general manipulator system, the dynamics are given by f u] x=x,u=u (u u ), (46) x=x,u=u (u u ). (47) q = H (q) Bu C(q, q) q G(q)]. (48) Defining the states as x = q, q] T, we can rewrite the dynamics in the state space form ] ] ] q q f (x, u) ẋ = = q H f(x, u) = (q) Bu C(q, q) q G(q)] f (x, u) Using (48) the terms of the Taylor series expansion can be written as ] f u = f I H, and (q)b x = f f q (49) ]. (5) Taking the partial derivative of f with respect to q, f = H Bu C(q, q) q G(q)] + H C(q, q) (q) q G(q) ], (5) which reduces to f = H (q) G(q), (5) x=x,u=u since at a fixed point q = and Bu C(q, q) q G(q)] =. Now, taking the partial derivative of f with respect to q, ] f C q = H (q) (q, q) q + C(q, q) = H (q)c(q, q), q (53) which reduces to f q = H (q)c(q, q). x=x,u=u (54) Thus, the linearized dynamics of the manipulator equation around a fixed point are given by where f A = x] f B = u] x=x,u=u = x=x,u=u = ẋ = Ax + Bu, (55) ] I H(q), (56) C(q, q) x,u H(q) G(q) H (q)b] 3 x,u. (57)

14 C Files The necessary files to carry out the lab can be found in T:\ME389 MEM4 GANTRY\. The files are separated in three directories. \ME389 VIs - Includes LabView files for controlling the hardware QNET ROTPEN Lab 3 Gantry Control ME389.vi - Can be used for carrying out control experiments in the hanging position. QNET ROTPEN Lab 4 Inv Pendulum Control.vi - Can be used for carrying out control experiments in the vertical balance position. Note: Ignore the warning for finding the missing file.. \GANTRY WorkingData - MATLAB files for plotting LabView Output 3. \Pendulum Simulation - MATLAB files for simulation Use ROTPEN ME389 GANTRY.m to simulate control the rotary pendulum in the hanging position for the gantry control problem. Plot Gantry SimData.m can be used to plot the results of the gantry control simulation. Use ROTPEN ME389 InvPend.m to simulate control the rotary pendulum in the inverted position for the balance control problem. Plot InvPend SimData.m can be used to plot the results of the gantry control simulation. 4

QNET Experiment #04: Inverted Pendulum Control. Rotary Pendulum (ROTPEN) Inverted Pendulum Trainer. Instructor Manual

QNET Experiment #04: Inverted Pendulum Control. Rotary Pendulum (ROTPEN) Inverted Pendulum Trainer. Instructor Manual Quanser NI-ELVIS Trainer (QNET) Series: QNET Experiment #04: Inverted Pendulum Control Rotary Pendulum (ROTPEN) Inverted Pendulum Trainer Instructor Manual Table of Contents 1 Laboratory Objectives1 2

More information

State Feedback MAE 433 Spring 2012 Lab 7

State Feedback MAE 433 Spring 2012 Lab 7 State Feedback MAE 433 Spring 1 Lab 7 Prof. C. Rowley and M. Littman AIs: Brandt Belson, onathan Tu Princeton University April 4-7, 1 1 Overview This lab addresses the control of an inverted pendulum balanced

More information

The Acrobot and Cart-Pole

The Acrobot and Cart-Pole C H A P T E R 3 The Acrobot and Cart-Pole 3.1 INTRODUCTION A great deal of work in the control of underactuated systems has been done in the context of low-dimensional model systems. These model systems

More information

Design and Comparison of Different Controllers to Stabilize a Rotary Inverted Pendulum

Design and Comparison of Different Controllers to Stabilize a Rotary Inverted Pendulum ISSN (Online): 347-3878, Impact Factor (5): 3.79 Design and Comparison of Different Controllers to Stabilize a Rotary Inverted Pendulum Kambhampati Tejaswi, Alluri Amarendra, Ganta Ramesh 3 M.Tech, Department

More information

The Control of an Inverted Pendulum

The Control of an Inverted Pendulum The Control of an Inverted Pendulum AAE 364L This experiment is devoted to the inverted pendulum. Clearly, the inverted pendulum will fall without any control. We will design a controller to balance the

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

The Control of an Inverted Pendulum

The Control of an Inverted Pendulum The Control of an Inverted Pendulum AAE 364L This experiment is devoted to the inverted pendulum. Clearly, the inverted pendulum will fall without any control. We will design a controller to balance the

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

The control of a gantry

The control of a gantry The control of a gantry AAE 364L In this experiment we will design a controller for a gantry or crane. Without a controller the pendulum of crane will swing for a long time. The idea is to use control

More information

Review: control, feedback, etc. Today s topic: state-space models of systems; linearization

Review: control, feedback, etc. Today s topic: state-space models of systems; linearization Plan of the Lecture Review: control, feedback, etc Today s topic: state-space models of systems; linearization Goal: a general framework that encompasses all examples of interest Once we have mastered

More information

Matlab-Based Tools for Analysis and Control of Inverted Pendula Systems

Matlab-Based Tools for Analysis and Control of Inverted Pendula Systems Matlab-Based Tools for Analysis and Control of Inverted Pendula Systems Slávka Jadlovská, Ján Sarnovský Dept. of Cybernetics and Artificial Intelligence, FEI TU of Košice, Slovak Republic sjadlovska@gmail.com,

More information

In the presence of viscous damping, a more generalized form of the Lagrange s equation of motion can be written as

In the presence of viscous damping, a more generalized form of the Lagrange s equation of motion can be written as 2 MODELING Once the control target is identified, which includes the state variable to be controlled (ex. speed, position, temperature, flow rate, etc), and once the system drives are identified (ex. force,

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

ECE-320: Linear Control Systems Homework 8. 1) For one of the rectilinear systems in lab, I found the following state variable representations:

ECE-320: Linear Control Systems Homework 8. 1) For one of the rectilinear systems in lab, I found the following state variable representations: ECE-30: Linear Control Systems Homework 8 Due: Thursday May 6, 00 at the beginning of class ) For one of the rectilinear systems in lab, I found the following state variable representations: 0 0 q q+ 74.805.6469

More information

Rotary Inverted Pendulum

Rotary Inverted Pendulum Rotary Inverted Pendulum Eric Liu 1 Aug 2013 1 1 State Space Derivations 1.1 Electromechanical Derivation Consider the given diagram. We note that the voltage across the motor can be described by: e b

More information

ACKNOWLEDGEMENTS Quanser Inc., All rights reserved.

ACKNOWLEDGEMENTS Quanser Inc., All rights reserved. 2011 Quanser Inc., All rights reserved. Quanser Inc. 119 Spy Court Markham, Ontario L3R 5H6 Canada info@quanser.com Phone: 1-905-940-3575 Fax: 1-905-940-3576 Printed in Markham, Ontario. For more information

More information

Quanser NI-ELVIS Trainer (QNET) Series: QNET Experiment #02: DC Motor Position Control. DC Motor Control Trainer (DCMCT) Student Manual

Quanser NI-ELVIS Trainer (QNET) Series: QNET Experiment #02: DC Motor Position Control. DC Motor Control Trainer (DCMCT) Student Manual Quanser NI-ELVIS Trainer (QNET) Series: QNET Experiment #02: DC Motor Position Control DC Motor Control Trainer (DCMCT) Student Manual Table of Contents 1 Laboratory Objectives1 2 References1 3 DCMCT Plant

More information

THE REACTION WHEEL PENDULUM

THE REACTION WHEEL PENDULUM THE REACTION WHEEL PENDULUM By Ana Navarro Yu-Han Sun Final Report for ECE 486, Control Systems, Fall 2013 TA: Dan Soberal 16 December 2013 Thursday 3-6pm Contents 1. Introduction... 1 1.1 Sensors (Encoders)...

More information

Appendix W. Dynamic Models. W.2 4 Complex Mechanical Systems. Translational and Rotational Systems W.2.1

Appendix W. Dynamic Models. W.2 4 Complex Mechanical Systems. Translational and Rotational Systems W.2.1 Appendix W Dynamic Models W.2 4 Complex Mechanical Systems W.2.1 Translational and Rotational Systems In some cases, mechanical systems contain both translational and rotational portions. The procedure

More information

Inverted Pendulum System

Inverted Pendulum System Introduction Inverted Pendulum System This lab experiment consists of two experimental procedures, each with sub parts. Experiment 1 is used to determine the system parameters needed to implement a controller.

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

ECEN 420 LINEAR CONTROL SYSTEMS. Lecture 6 Mathematical Representation of Physical Systems II 1/67

ECEN 420 LINEAR CONTROL SYSTEMS. Lecture 6 Mathematical Representation of Physical Systems II 1/67 1/67 ECEN 420 LINEAR CONTROL SYSTEMS Lecture 6 Mathematical Representation of Physical Systems II State Variable Models for Dynamic Systems u 1 u 2 u ṙ. Internal Variables x 1, x 2 x n y 1 y 2. y m Figure

More information

Lab 5a: Pole Placement for the Inverted Pendulum

Lab 5a: Pole Placement for the Inverted Pendulum Lab 5a: Pole Placement for the Inverted Pendulum November 1, 2011 1 Purpose The objective of this lab is to achieve simultaneous control of both the angular position of the pendulum and horizontal position

More information

Dynamic Modeling of Rotary Double Inverted Pendulum Using Classical Mechanics

Dynamic Modeling of Rotary Double Inverted Pendulum Using Classical Mechanics ISBN 978-93-84468-- Proceedings of 5 International Conference on Future Computational echnologies (ICFC'5) Singapore, March 9-3, 5, pp. 96-3 Dynamic Modeling of Rotary Double Inverted Pendulum Using Classical

More information

DYNAMICS OF SERIAL ROBOTIC MANIPULATORS

DYNAMICS OF SERIAL ROBOTIC MANIPULATORS DYNAMICS OF SERIAL ROBOTIC MANIPULATORS NOMENCLATURE AND BASIC DEFINITION We consider here a mechanical system composed of r rigid bodies and denote: M i 6x6 inertia dyads of the ith body. Wi 6 x 6 angular-velocity

More information

Rotational Kinetic Energy

Rotational Kinetic Energy Lecture 17, Chapter 10: Rotational Energy and Angular Momentum 1 Rotational Kinetic Energy Consider a rigid body rotating with an angular velocity ω about an axis. Clearly every point in the rigid body

More information

Real-Time Implementation of a LQR-Based Controller for the Stabilization of a Double Inverted Pendulum

Real-Time Implementation of a LQR-Based Controller for the Stabilization of a Double Inverted Pendulum Proceedings of the International MultiConference of Engineers and Computer Scientists 017 Vol I,, March 15-17, 017, Hong Kong Real-Time Implementation of a LQR-Based Controller for the Stabilization of

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

SRV02-Series Rotary Experiment # 7. Rotary Inverted Pendulum. Student Handout

SRV02-Series Rotary Experiment # 7. Rotary Inverted Pendulum. Student Handout SRV02-Series Rotary Experiment # 7 Rotary Inverted Pendulum Student Handout SRV02-Series Rotary Experiment # 7 Rotary Inverted Pendulum Student Handout 1. Objectives The objective in this experiment is

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

Contents. Dynamics and control of mechanical systems. Focus on

Contents. Dynamics and control of mechanical systems. Focus on Dynamics and control of mechanical systems Date Day 1 (01/08) Day 2 (03/08) Day 3 (05/08) Day 4 (07/08) Day 5 (09/08) Day 6 (11/08) Content Review of the basics of mechanics. Kinematics of rigid bodies

More information

Experiment 08: Physical Pendulum. 8.01t Nov 10, 2004

Experiment 08: Physical Pendulum. 8.01t Nov 10, 2004 Experiment 08: Physical Pendulum 8.01t Nov 10, 2004 Goals Investigate the oscillation of a real (physical) pendulum and compare to an ideal (point mass) pendulum. Angular frequency calculation: Practice

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

ECEn 483 / ME 431 Case Studies. Randal W. Beard Brigham Young University

ECEn 483 / ME 431 Case Studies. Randal W. Beard Brigham Young University ECEn 483 / ME 431 Case Studies Randal W. Beard Brigham Young University Updated: December 2, 2014 ii Contents 1 Single Link Robot Arm 1 2 Pendulum on a Cart 9 3 Satellite Attitude Control 17 4 UUV Roll

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

Chapter 14. Oscillations. Oscillations Introductory Terminology Simple Harmonic Motion:

Chapter 14. Oscillations. Oscillations Introductory Terminology Simple Harmonic Motion: Chapter 14 Oscillations Oscillations Introductory Terminology Simple Harmonic Motion: Kinematics Energy Examples of Simple Harmonic Oscillators Damped and Forced Oscillations. Resonance. Periodic Motion

More information

CP1 REVISION LECTURE 3 INTRODUCTION TO CLASSICAL MECHANICS. Prof. N. Harnew University of Oxford TT 2017

CP1 REVISION LECTURE 3 INTRODUCTION TO CLASSICAL MECHANICS. Prof. N. Harnew University of Oxford TT 2017 CP1 REVISION LECTURE 3 INTRODUCTION TO CLASSICAL MECHANICS Prof. N. Harnew University of Oxford TT 2017 1 OUTLINE : CP1 REVISION LECTURE 3 : INTRODUCTION TO CLASSICAL MECHANICS 1. Angular velocity and

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

Physics 8, Fall 2011, equation sheet work in progress

Physics 8, Fall 2011, equation sheet work in progress 1 year 3.16 10 7 s Physics 8, Fall 2011, equation sheet work in progress circumference of earth 40 10 6 m speed of light c = 2.9979 10 8 m/s mass of proton or neutron 1 amu ( atomic mass unit ) = 1 1.66

More information

Controlling the Inverted Pendulum

Controlling the Inverted Pendulum Controlling the Inverted Pendulum Steven A. P. Quintero Department of Electrical and Computer Engineering University of California, Santa Barbara Email: squintero@umail.ucsb.edu Abstract The strategies

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

State Space Representation

State Space Representation ME Homework #6 State Space Representation Last Updated September 6 6. From the homework problems on the following pages 5. 5. 5.6 5.7. 5.6 Chapter 5 Homework Problems 5.6. Simulation of Linear and Nonlinear

More information

Rotational Kinematics

Rotational Kinematics Rotational Kinematics Rotational Coordinates Ridged objects require six numbers to describe their position and orientation: 3 coordinates 3 axes of rotation Rotational Coordinates Use an angle θ to describe

More information

LAST TIME: Simple Pendulum:

LAST TIME: Simple Pendulum: LAST TIME: Simple Pendulum: The displacement from equilibrium, x is the arclength s = L. s / L x / L Accelerating & Restoring Force in the tangential direction, taking cw as positive initial displacement

More information

Classical Mechanics Comprehensive Exam Solution

Classical Mechanics Comprehensive Exam Solution Classical Mechanics Comprehensive Exam Solution January 31, 011, 1:00 pm 5:pm Solve the following six problems. In the following problems, e x, e y, and e z are unit vectors in the x, y, and z directions,

More information

The dynamics of a Mobile Inverted Pendulum (MIP)

The dynamics of a Mobile Inverted Pendulum (MIP) The dynamics of a Mobile Inverted Pendulum (MIP) 1 Introduction Saam Ostovari, Nick Morozovsky, Thomas Bewley UCSD Coordinated Robotics Lab In this document, a Mobile Inverted Pendulum (MIP) is a robotic

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

Swinging-Up and Stabilization Control Based on Natural Frequency for Pendulum Systems

Swinging-Up and Stabilization Control Based on Natural Frequency for Pendulum Systems 9 American Control Conference Hyatt Regency Riverfront, St. Louis, MO, USA June -, 9 FrC. Swinging-Up and Stabilization Control Based on Natural Frequency for Pendulum Systems Noriko Matsuda, Masaki Izutsu,

More information

Lecture 9: Eigenvalues and Eigenvectors in Classical Mechanics (See Section 3.12 in Boas)

Lecture 9: Eigenvalues and Eigenvectors in Classical Mechanics (See Section 3.12 in Boas) Lecture 9: Eigenvalues and Eigenvectors in Classical Mechanics (See Section 3 in Boas) As suggested in Lecture 8 the formalism of eigenvalues/eigenvectors has many applications in physics, especially in

More information

Unit 7: Oscillations

Unit 7: Oscillations Text: Chapter 15 Unit 7: Oscillations NAME: Problems (p. 405-412) #1: 1, 7, 13, 17, 24, 26, 28, 32, 35 (simple harmonic motion, springs) #2: 45, 46, 49, 51, 75 (pendulums) Vocabulary: simple harmonic motion,

More information

28. Pendulum phase portrait Draw the phase portrait for the pendulum (supported by an inextensible rod)

28. Pendulum phase portrait Draw the phase portrait for the pendulum (supported by an inextensible rod) 28. Pendulum phase portrait Draw the phase portrait for the pendulum (supported by an inextensible rod) θ + ω 2 sin θ = 0. Indicate the stable equilibrium points as well as the unstable equilibrium points.

More information

Solution Derivations for Capa #12

Solution Derivations for Capa #12 Solution Derivations for Capa #12 1) A hoop of radius 0.200 m and mass 0.460 kg, is suspended by a point on it s perimeter as shown in the figure. If the hoop is allowed to oscillate side to side as a

More information

Inverted Pendulum. Objectives

Inverted Pendulum. Objectives Inverted Pendulum Objectives The objective of this lab is to experiment with the stabilization of an unstable system. The inverted pendulum problem is taken as an example and the animation program gives

More information

PLANAR KINETIC EQUATIONS OF MOTION (Section 17.2)

PLANAR KINETIC EQUATIONS OF MOTION (Section 17.2) PLANAR KINETIC EQUATIONS OF MOTION (Section 17.2) We will limit our study of planar kinetics to rigid bodies that are symmetric with respect to a fixed reference plane. As discussed in Chapter 16, when

More information

Example: DC Motor Speed Modeling

Example: DC Motor Speed Modeling Page 1 of 5 Example: DC Motor Speed Modeling Physical setup and system equations Design requirements MATLAB representation and open-loop response Physical setup and system equations A common actuator in

More information

Linear Experiment #11: LQR Control. Linear Flexible Joint Cart Plus Single Inverted Pendulum (LFJC+SIP) Student Handout

Linear Experiment #11: LQR Control. Linear Flexible Joint Cart Plus Single Inverted Pendulum (LFJC+SIP) Student Handout Linear Motion Servo Plants: IP01 or IP02 Linear Experiment #11: LQR Control Linear Flexible Joint Cart Plus Single Inverted Pendulum (LFJC+SIP) Student Handout Table of Contents 1. Objectives...1 2. Prerequisites...2

More information

Two-Dimensional Rotational Kinematics

Two-Dimensional Rotational Kinematics Two-Dimensional Rotational Kinematics Rigid Bodies A rigid body is an extended object in which the distance between any two points in the object is constant in time. Springs or human bodies are non-rigid

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

In-Class Problems 30-32: Moment of Inertia, Torque, and Pendulum: Solutions

In-Class Problems 30-32: Moment of Inertia, Torque, and Pendulum: Solutions MASSACHUSETTS INSTITUTE OF TECHNOLOGY Department of Physics Physics 8.01 TEAL Fall Term 004 In-Class Problems 30-3: Moment of Inertia, Torque, and Pendulum: Solutions Problem 30 Moment of Inertia of a

More information

θ + mgl θ = 0 or θ + ω 2 θ = 0 (2) ω 2 = I θ = mgl sinθ (1) + Ml 2 I = I CM mgl Kater s Pendulum The Compound Pendulum

θ + mgl θ = 0 or θ + ω 2 θ = 0 (2) ω 2 = I θ = mgl sinθ (1) + Ml 2 I = I CM mgl Kater s Pendulum The Compound Pendulum Kater s Pendulum The Compound Pendulum A compound pendulum is the term that generally refers to an arbitrary lamina that is allowed to oscillate about a point located some distance from the lamina s center

More information

Chapter 12. Recall that when a spring is stretched a distance x, it will pull back with a force given by: F = -kx

Chapter 12. Recall that when a spring is stretched a distance x, it will pull back with a force given by: F = -kx Chapter 1 Lecture Notes Chapter 1 Oscillatory Motion Recall that when a spring is stretched a distance x, it will pull back with a force given by: F = -kx When the mass is released, the spring will pull

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

Simple Harmonic Motion

Simple Harmonic Motion Simple Harmonic Motion (FIZ 101E - Summer 2018) July 29, 2018 Contents 1 Introduction 2 2 The Spring-Mass System 2 3 The Energy in SHM 5 4 The Simple Pendulum 6 5 The Physical Pendulum 8 6 The Damped Oscillations

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

Lab #2: Digital Simulation of Torsional Disk Systems in LabVIEW

Lab #2: Digital Simulation of Torsional Disk Systems in LabVIEW Lab #2: Digital Simulation of Torsional Disk Systems in LabVIEW Objective The purpose of this lab is to increase your familiarity with LabVIEW, increase your mechanical modeling prowess, and give you simulation

More information

Lab 6d: Self-Erecting Inverted Pendulum (SEIP)

Lab 6d: Self-Erecting Inverted Pendulum (SEIP) Lab 6d: Self-Erecting Inverted Pendulum (SEIP) Arthur Schopen- Life swings like a pendulum backward and forward between pain and boredom. hauer 1 Objectives The goal of this project is to design a controller

More information

The Modeling of Single-dof Mechanical Systems

The Modeling of Single-dof Mechanical Systems The Modeling of Single-dof Mechanical Systems Lagrange equation for a single-dof system: where: q: is the generalized coordinate; T: is the total kinetic energy of the system; V: is the total potential

More information

Example: Modeling DC Motor Position Physical Setup System Equations Design Requirements MATLAB Representation and Open-Loop Response

Example: Modeling DC Motor Position Physical Setup System Equations Design Requirements MATLAB Representation and Open-Loop Response Page 1 of 5 Example: Modeling DC Motor Position Physical Setup System Equations Design Requirements MATLAB Representation and Open-Loop Response Physical Setup A common actuator in control systems is the

More information

Physics 8, Fall 2013, equation sheet work in progress

Physics 8, Fall 2013, equation sheet work in progress (Chapter 1: foundations) 1 year 3.16 10 7 s Physics 8, Fall 2013, equation sheet work in progress circumference of earth 40 10 6 m speed of light c = 2.9979 10 8 m/s mass of proton or neutron 1 amu ( atomic

More information

University of Utah Electrical & Computer Engineering Department ECE 3510 Lab 9 Inverted Pendulum

University of Utah Electrical & Computer Engineering Department ECE 3510 Lab 9 Inverted Pendulum University of Utah Electrical & Computer Engineering Department ECE 3510 Lab 9 Inverted Pendulum p1 ECE 3510 Lab 9, Inverted Pendulum M. Bodson, A. Stolp, 4/2/13 rev, 4/9/13 Objectives The objective of

More information

A Light Weight Rotary Double Pendulum: Maximizing the Domain of Attraction

A Light Weight Rotary Double Pendulum: Maximizing the Domain of Attraction A Light Weight Rotary Double Pendulum: Maximizing the Domain of Attraction R. W. Brockett* and Hongyi Li* Engineering and Applied Sciences Harvard University Cambridge, MA 38, USA {brockett, hongyi}@hrl.harvard.edu

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

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

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

Oscillations Simple Harmonic Motion

Oscillations Simple Harmonic Motion Oscillations Simple Harmonic Motion Lana Sheridan De Anza College Dec 1, 2017 Overview oscillations simple harmonic motion (SHM) spring systems energy in SHM pendula damped oscillations Oscillations and

More information

Linear control of inverted pendulum

Linear control of inverted pendulum Linear control of inverted pendulum Deep Ray, Ritesh Kumar, Praveen. C, Mythily Ramaswamy, J.-P. Raymond IFCAM Summer School on Numerics and Control of PDE 22 July - 2 August 213 IISc, Bangalore http://praveen.cfdlab.net/teaching/control213

More information

Physics Mechanics. Lecture 32 Oscillations II

Physics Mechanics. Lecture 32 Oscillations II Physics 170 - Mechanics Lecture 32 Oscillations II Gravitational Potential Energy A plot of the gravitational potential energy U g looks like this: Energy Conservation Total mechanical energy of an object

More information

Rigid bodies - general theory

Rigid bodies - general theory Rigid bodies - general theory Kinetic Energy: based on FW-26 Consider a system on N particles with all their relative separations fixed: it has 3 translational and 3 rotational degrees of freedom. Motion

More information

Automatic Control 2. Nonlinear systems. Prof. Alberto Bemporad. University of Trento. Academic year

Automatic Control 2. Nonlinear systems. Prof. Alberto Bemporad. University of Trento. Academic year Automatic Control 2 Nonlinear systems Prof. Alberto Bemporad University of Trento Academic year 2010-2011 Prof. Alberto Bemporad (University of Trento) Automatic Control 2 Academic year 2010-2011 1 / 18

More information

Lab 10 - Harmonic Motion and the Pendulum

Lab 10 - Harmonic Motion and the Pendulum Lab 10 Harmonic Motion and the Pendulum L10-1 Name Date Partners Lab 10 - Harmonic Motion and the Pendulum L (measured from the suspension point to the center of mass) Groove marking the center of mass

More information

Torque and Rotation Lecture 7

Torque and Rotation Lecture 7 Torque and Rotation Lecture 7 ˆ In this lecture we finally move beyond a simple particle in our mechanical analysis of motion. ˆ Now we consider the so-called rigid body. Essentially, a particle with extension

More information

Chapter 15+ Revisit Oscillations and Simple Harmonic Motion

Chapter 15+ Revisit Oscillations and Simple Harmonic Motion Chapter 15+ Revisit Oscillations and Simple Harmonic Motion Revisit: Oscillations Simple harmonic motion To-Do: Pendulum oscillations Derive the parallel axis theorem for moments of inertia and apply it

More information

Lab 10: Harmonic Motion and the Pendulum

Lab 10: Harmonic Motion and the Pendulum Lab 10 Harmonic Motion and the Pendulum 119 Name Date Partners Lab 10: Harmonic Motion and the Pendulum OVERVIEW A body is said to be in a position of stable equilibrium if, after displacement in any direction,

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

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

CHAPTER 12 OSCILLATORY MOTION

CHAPTER 12 OSCILLATORY MOTION CHAPTER 1 OSCILLATORY MOTION Before starting the discussion of the chapter s concepts it is worth to define some terms we will use frequently in this chapter: 1. The period of the motion, T, is the time

More information

ECE557 Systems Control

ECE557 Systems Control ECE557 Systems Control Bruce Francis Course notes, Version.0, September 008 Preface This is the second Engineering Science course on control. It assumes ECE56 as a prerequisite. If you didn t take ECE56,

More information

!T = 2# T = 2! " The velocity and acceleration of the object are found by taking the first and second derivative of the position:

!T = 2# T = 2!  The velocity and acceleration of the object are found by taking the first and second derivative of the position: A pendulum swinging back and forth or a mass oscillating on a spring are two examples of (SHM.) SHM occurs any time the position of an object as a function of time can be represented by a sine wave. We

More information

Symmetries 2 - Rotations in Space

Symmetries 2 - Rotations in Space Symmetries 2 - Rotations in Space This symmetry is about the isotropy of space, i.e. space is the same in all orientations. Thus, if we continuously rotated an entire system in space, we expect the system

More information

Simple and Physical Pendulums Challenge Problem Solutions

Simple and Physical Pendulums Challenge Problem Solutions Simple and Physical Pendulums Challenge Problem Solutions Problem 1 Solutions: For this problem, the answers to parts a) through d) will rely on an analysis of the pendulum motion. There are two conventional

More information

Line following of a mobile robot

Line following of a mobile robot Line following of a mobile robot May 18, 004 1 In brief... The project is about controlling a differential steering mobile robot so that it follows a specified track. Steering is achieved by setting different

More information

Lab #2 - Two Degrees-of-Freedom Oscillator

Lab #2 - Two Degrees-of-Freedom Oscillator Lab #2 - Two Degrees-of-Freedom Oscillator Last Updated: March 0, 2007 INTRODUCTION The system illustrated in Figure has two degrees-of-freedom. This means that two is the minimum number of coordinates

More information

For a rigid body that is constrained to rotate about a fixed axis, the gravitational torque about the axis is

For a rigid body that is constrained to rotate about a fixed axis, the gravitational torque about the axis is Experiment 14 The Physical Pendulum The period of oscillation of a physical pendulum is found to a high degree of accuracy by two methods: theory and experiment. The values are then compared. Theory For

More information

Digital Pendulum Control Experiments

Digital Pendulum Control Experiments EE-341L CONTROL SYSTEMS LAB 2013 Digital Pendulum Control Experiments Ahmed Zia Sheikh 2010030 M. Salman Khalid 2010235 Suleman Belal Kazi 2010341 TABLE OF CONTENTS ABSTRACT...2 PENDULUM OVERVIEW...3 EXERCISE

More information

EXPERIMENT 7: ANGULAR KINEMATICS AND TORQUE (V_3)

EXPERIMENT 7: ANGULAR KINEMATICS AND TORQUE (V_3) TA name Lab section Date TA Initials (on completion) Name UW Student ID # Lab Partner(s) EXPERIMENT 7: ANGULAR KINEMATICS AND TORQUE (V_3) 121 Textbook Reference: Knight, Chapter 13.1-3, 6. SYNOPSIS In

More information

EE Homework 3 Due Date: 03 / 30 / Spring 2015

EE Homework 3 Due Date: 03 / 30 / Spring 2015 EE 476 - Homework 3 Due Date: 03 / 30 / 2015 Spring 2015 Exercise 1 (10 points). Consider the problem of two pulleys and a mass discussed in class. We solved a version of the problem where the mass was

More information

Chapter 14 Periodic Motion

Chapter 14 Periodic Motion Chapter 14 Periodic Motion 1 Describing Oscillation First, we want to describe the kinematical and dynamical quantities associated with Simple Harmonic Motion (SHM), for example, x, v x, a x, and F x.

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

Modelling of Ball and Plate System Based on First Principle Model and Optimal Control

Modelling of Ball and Plate System Based on First Principle Model and Optimal Control 2017 21st International Conference on Process Control (PC) June 6 9, 2017, Štrbské Pleso, Slovakia Modelling of Ball and Plate System Based on First Principle Model and Optimal Control František Dušek,

More information

Magnetic pendulum periodically driven by a coil can be in

Magnetic pendulum periodically driven by a coil can be in 2015 Problem 13 : Magnetic Pendulum Experimental Study on The Phase Locking of Magnetic Pendulum Abstract Magnetic pendulum periodically driven by a coil can be in certain conditions phase-locked with

More information