Modeling and Control of a Segway

Size: px
Start display at page:

Download "Modeling and Control of a Segway"

Transcription

1 I. Model Modeling and Control of a Segway 4#56&7#68& "9&7#68& % " &#' " # $ " #! " #! "#$% &! '()*+ & & -& % ( # '& ' 3) &,& /& & ' ( #.& ' ( # % ) # & / 3) & $ ( # $ ) #.& Figure : Schematic of Segway The figure above shows a Segway vehicle consisting of a rigid platform B and two rigid wheels C and D. Also included in the schematic is a rigid cylindrical model of a human, H. An intermediate frame, A, exists between the rotation from N to B. The orientation of B in N is determined by first aligning ai with ni (i = x,y,z) and then subjecting A to a right- handed rotation characterized by - θturnnz. Next, bi is aligned with ai (i = x,y,z) and then B is subjected to a rotation characterized by - θtiltbx. The wheels are attached to the platform, B, by frictionless joints. The wheels are assumed to be rolling on N. The human, H, is attached to the platform through a frictionless revolute joint at Bcm. This joint is meant to model the human ankle. To facilitate this analysis, right- handed sets of unit vectors are fixed in N, B, and H respectively, with: nx horizontally- right ny in forward direction nz in upward direction ax parallel to the axis of rotation of C in B and D in B ay in heading direction of Segway az = nz in upward direction bx = ax parallel to the axis of rotation of C in B and D in B bz normal to the top surface of the Segway platform

2 by = bz x bx hx = bx = ax parallel to the axis of rotation of H at Bcm hz directed from Ho to Hcm hy = hz x hx Modeling Assumptions All bodies involved are rigid The revolute joints are frictionless There is no slop or flexibility in the revolute joints The human will be moving slow enough relative to the platform to ignore its dynamics Assume the human can be modeled as a solid cylinder Objectives Find a stable control law using a state space design. Demonstrate stability in response to an initial condition offset and the ability to maneuver in the x- y plane of N. II. Identifiers The following identifiers are useful for analyzing this system. Table : Identifier Table Description Symbol Type Value Distance from B cm to H cm L Constant m Width of wheel base L w Constant.6m b z measure of the length of the platform L Constant.5m b x measure of the length of the platform L Constant.4m b y measure of the length of the platform L 3 Constant.4m Mass of platform m B Constant 4.5kg Radius of the wheels R Constant.38m Thickness of the wheels h Constant.76m Mass of one wheel m W Constant.7kg Mass of human m H Constant 8kg "Radius" of human r H Constant.m Height of human H H Constant.8m Local gravitational constant g Constant 9.8 m/s b x measure of the angle between b z and h z (Lean Angle)! Human Specified b x measure of the control torque applied to wheel C T c Specified b x measure of the control torque applied to wheel D T d Specified n x measure of B cm s position vector from N o x Variable n y measure of B cm s position vector from N o y Variable b x measure of the angle between n z and b z! Tilt Variable n z measure of the angle between n y and a y! Turn Variable a y measure of B cm s velocity in N v Variable Time t Independent Variable

3 III. Physics Control Law Design To design the controller and determine feedback gains, the segway was first analyzed in only one dimension. Motion Genesis was employed to along with Kane s method to find the governing equations for the motion variables θ Tilt and v. Even the one- dimensional equations of motion for the segway are highly nonlinear, coupled, and long. To use a linear control method like state space, one must first linearize the equations of motion about a desired equilibrium point. For this case, the unstable, upright equilibrium is chosen. After linearization the state equations for the one- dimensional segway take the form θ Tilt θ Tilt = A v v θ Tilt θ Tilt + BT control + Fθ Human where θ Tilt, θ Tilt, v are the state variables; A, B, and F are coefficient matrices; Tcontrol is the control torque applied to the wheels, and θ Human is the lean angle of the human. By placing the 3 system poles at desired locations and reiterating, a suitable state feedback gain vector, K, was found to be K = [ ] Controller Implementation The control torque was then integrated into the 3D dynamic model of the seqway in order to test the performance of the controller in the real system. Once again, Kane s method was used to determine the equations of motion for θ Tilt, ωturn, and v. Kinematical differential equations were also found to provide a means to calculate the trajectory variables x and y. The.al file is attached in the appendix for reference. IV. Simplify and Solve Motion Genesis was used to generate MATLAB code for solving the equations of motion. Three different cases were tested:. Initial error in θ Tilt to test the stability and effectiveness of the controller.. Step input for θ Human to see if the system is stable for disturbances 3. Specify a varying θ Human and also command the segway to turn. 3

4 IV. Interpret and Design The results for Case # Stability Test are plotted below..5 State Variables! Tilt dt! Tilt v (m/s) Figure : Response of all three state variables to an initial condition of θ Titlt = deg. If given an initial offset angle and no forcing input, the controller can successfully compensate as shown in Figure. The segway moves forward to counteract the offset angle; notice how the velocity increases slightly in Figure. The state variables eventually come to rest because there is no forcing input. The settling time on the linear velocity state is a slower than the other two. This is not exactly ideal; the user will want to come to rest as soon as possible. The next iteration on the design could attempt to find different gains that accomplish a faster settling time for v. 4

5 The results for Case # Human Lean Response are plotted below..5 State Variables! Tilt dt! Tilt v (m/s) Figure 3: State variable response to step input in θ Human = deg. As the rider leans forward, his/her center of mass creates a disturbance torque. The controller will respond by increasing the torque to the wheels, thereby increasing linear forward velocity. So long as the rider mass is off center, the velocity will continually increase just as seen in Figure 3 above. Also note that the Tilt Angle is decreasing, which indicates the rider center of mass is moving towards equilibrium once again. The graph indicates the controller is stable when given a step input from the rider. One may wonder, as I did, why the segway can be controlled with a control law that was based upon a one- dimensional model. I started this project by developing a controller based on the 3D model of the segway; however, I came to the realization that force exerted at the base of the pendulum from turning about nz is not significant compared to the control torque as long as the turning is relatively slow (which it should be for safety). Thus, the segway can be steered by slightly lowering the torque on one wheel while slightly raising it on the other. 5

6 The results for Case #3 Full Function are plotted below.! Tilt dt! Tilt State Variables X Y Trajectory of Midpoint.5 v (m/s) 8.5 Y Position (m) Figure 4: Response of state variables X Position (m) Figure 5: Trajectory of platform CM (Bcm) 4 Motor Torques 3 x 4 Energy Check Should be Zero Right Motor Left Motor Torque (n m) dt(ke) Power Figure 6: Time history of control torque for each motor Figure 7: Energy check: dt(ke) Power = Const For Case #3 the human lean angle was specified to be a sinusoid with period sec; therefore, the angle started at zero and ended at zero over the ten second simulation time. The response of the three state variables is given in Figure 4. Similar to what was seen in Case #, the velocity increases with human lean angle and then begins to decrease as human tilt angle decreases. Once more, the system is stable because θtilt in Figure 4 is decreasing towards - degrees, which means the human is almost upright. To show the turning capability of the segway, the trajectory of Bcm is 6

7 plotted in Figure 5. Note that the steering command is less influential at higher linear speeds and more influential when the platform is moving slow. If one were to build a segway, the max torque would need to be known. Figure 6 shows for this run the max torque was - 6Nm. Finally, to double- check the integrator results, a plot of the time derivative of kinetic energy minus power is shown. This energy expression should remain zero throughout the simulation. Figure 7 shows that the expression remains essentially at zero. 7

8 Appendix A MG Code % File: Proj.al % Problem: Dynamics and Control of a Segway % Newtonian, bodies, frames, particles, points NewtonianFrame N % Newtonian reference frame RigidFrame A % Intermediate Frame RigidBody B % Platform and Human RigidBody H % Human Body RigidBody C, D % Wheels Point Cn(C) % Point of contact between C and N Point Dn(D) % Point of contact between D and N % Variables, constants, and specified MotionVariable' qturn'', qtilt'', wc', wd', v' Variable x'', y'' Constant L % distance from Bo to Center of mass of B Constant LW =.6 % Width of wheel base Constant L =.5 % Height of platform Constant L =.4 % width of platform Constant L3 =.4 % depth of platform Constant R =.38 % Radius of wheels Constant h =.76 % Thickness of wheels Constant mw =.7 % Mass of one wheel Constant mh % mass of human Constant rh % radius of human Constant hh % height of human Constant mb = 4.5 % mass of platform Constant g = 9.8 % Gravitational acceleration Constant k{3} % Control gains Specified Turn =.5 % Turning factor Specified qhuman'' % Human Lean Angle disturbance qhuman = Specified Tcont = k*qtilt + k*qtilt' + k3*v Specified Tc = Tcont + Tcont*.*Turn Specified Td = Tcont - Tcont*.*Turn % Mass and inertia Constant ICxx = (/)*mw*r^ Constant ICyy = (/)*mw*(3*r^+h^) Constant ICzz = (/)*mw*(3*r^+h^) Constant IBxx = (/)*mb*(l^ + L3^) Constant IByy = (/)*mb*(l^ + L3^) Constant IBzz = (/)*mb*(l^ + L^) Constant IHxx = (/)*mh*(3*rh^+hh^) Constant IHyy = (/)*mh*(3*rh^+hh^) Constant IHzz = (/)*mh*rh^ B.SetMass(mB) % Mass of platform + Human H.SetMass(mH) % Mass of Human C.SetMass(mW) % mass of wheel D.SetMass(mW) % Mass of wheel B.SetInertia( Bcm, B, IBxx, IByy, IBzz) % Inertia of Platform H.SetInertia( Hcm, H, IHxx, IHyy, IHzz) % Inertia of Human C.SetInertia( Ccm, B, ICxx, ICyy, ICzz) % Inertia of Wheel D.SetInertia( Dcm, B, ICxx, ICyy, ICzz) % Inertia of wheel 8

9 % Rotational kinematics A.RotateZ(N, qturn) B.RotateNegativeX(A, qtilt) H.RotateNegativeX(B, qhuman) 9 C.SetAngularVelocityAcceleration( B, -wc*bx> ) D.SetAngularVelocityAcceleration( B, -wd*bx> ) % Translational kinematics Bo.Translate( No, x*nx> + y*ny> ) Bo_Vel> = v*ay> Kin[] = dot(v_bo_n> - Bo_Vel>, Ny>) Kin[] = dot(v_bo_n> - Bo_Vel>, Nx>) Solve(Kin, x', y') % Kinematicall Diff Eqs Bo.SetVelocityAcceleration(N, v*ay>) Bcm.Translate(Bo, >, B) Hcm.Translate(Bo, L*Hz>) % Position of the human CM Ccm.Translate( Bo, (L/)*Bx> ) % wheel CM Cn.Translate(Ccm, -R*Nz>, C) % Contact point Dcm.Translate( Bo, -(L/)*Bx> ) Dn.Translate(Dcm, -R*Nz>, D) % Motion constraints Dependent[] = Dot(V_Cn_N>, Ay>) Dependent[] = Dot(V_Dn_N>, Ay>) Constrain(Dependent[wC,wD]) % Forces System.AddForceGravity( -g*nz> ) C.AddTorque(B, Tc*Bx>) D.AddTorque(B, Td*Bx>) % Equations of motion Zero = System.GetDynamicsKane() solve(zero, qtilt'', qturn'', v') % Energy Check KEdt = dt(system.getkineticenergy()) Power = System.GetPower() EnergyCheck = KEdt - Power % Integration parameters and values for constants and variables Input tfinal=5, integstp=.5, abserror=.e-8, relerror=.e-8 Input k=-89, k=-68.9, k3= -66. Input L =, mh = 8, rh =., hh =.8 Input qtilt= deg, qtilt'= rad/sec, v= m/sec Input qturn = deg, qturn' = Input x = m, y = m % Quantities to be output from CODE Output t sec, x m, y m, v m/s, qhuman deg, qtilt deg, qtilt' deg/s, qturn' deg/s, Tc newtons/m, Td newtons/m, EnergyCheck J % Numerical solution Code ODE() Project.m Save Project_Real.all

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

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

Physics 12. Unit 5 Circular Motion and Gravitation Part 1

Physics 12. Unit 5 Circular Motion and Gravitation Part 1 Physics 12 Unit 5 Circular Motion and Gravitation Part 1 1. Nonlinear motions According to the Newton s first law, an object remains its tendency of motion as long as there is no external force acting

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

AP Physics QUIZ Chapters 10

AP Physics QUIZ Chapters 10 Name: 1. Torque is the rotational analogue of (A) Kinetic Energy (B) Linear Momentum (C) Acceleration (D) Force (E) Mass A 5-kilogram sphere is connected to a 10-kilogram sphere by a rigid rod of negligible

More information

MIPSI: Classic particle pendulum

MIPSI: Classic particle pendulum Chapter 24 MIPSI: Classic particle pendulum The pendulum to the right consists of a small heavy metallic ball tied to a light cable which is connected to the ceiling. This chapter investigates this system

More information

MIPSI: Classic particle pendulum

MIPSI: Classic particle pendulum Chapter 27 MIPSI: Classic particle pendulum (www.motiongenesis.com Textbooks Resources) The pendulum to the right consists of a small heavy metallic ball tied to a light cable which is connected to the

More information

1 MR SAMPLE EXAM 3 FALL 2013

1 MR SAMPLE EXAM 3 FALL 2013 SAMPLE EXAM 3 FALL 013 1. A merry-go-round rotates from rest with an angular acceleration of 1.56 rad/s. How long does it take to rotate through the first rev? A) s B) 4 s C) 6 s D) 8 s E) 10 s. A wheel,

More information

Chapter 8. Rotational Equilibrium and Rotational Dynamics. 1. Torque. 2. Torque and Equilibrium. 3. Center of Mass and Center of Gravity

Chapter 8. Rotational Equilibrium and Rotational Dynamics. 1. Torque. 2. Torque and Equilibrium. 3. Center of Mass and Center of Gravity Chapter 8 Rotational Equilibrium and Rotational Dynamics 1. Torque 2. Torque and Equilibrium 3. Center of Mass and Center of Gravity 4. Torque and angular acceleration 5. Rotational Kinetic energy 6. Angular

More information

Figure 5.16 Compound pendulum: (a) At rest in equilibrium, (b) General position with coordinate θ, Freebody

Figure 5.16 Compound pendulum: (a) At rest in equilibrium, (b) General position with coordinate θ, Freebody Lecture 27. THE COMPOUND PENDULUM Figure 5.16 Compound pendulum: (a) At rest in equilibrium, (b) General position with coordinate θ, Freebody diagram The term compound is used to distinguish the present

More information

Example: Inverted pendulum on cart

Example: Inverted pendulum on cart Chapter 11 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

Chapter 6 Dynamics I: Motion Along a Line

Chapter 6 Dynamics I: Motion Along a Line Chapter 6 Dynamics I: Motion Along a Line Chapter Goal: To learn how to solve linear force-and-motion problems. Slide 6-2 Chapter 6 Preview Slide 6-3 Chapter 6 Preview Slide 6-4 Chapter 6 Preview Slide

More information

Review for 3 rd Midterm

Review for 3 rd Midterm Review for 3 rd Midterm Midterm is on 4/19 at 7:30pm in the same rooms as before You are allowed one double sided sheet of paper with any handwritten notes you like. The moment-of-inertia about the center-of-mass

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

Quadcopter Dynamics 1

Quadcopter Dynamics 1 Quadcopter Dynamics 1 Bréguet Richet Gyroplane No. 1 1907 Brothers Louis Bréguet and Jacques Bréguet Guidance of Professor Charles Richet The first flight demonstration of Gyroplane No. 1 with no control

More information

Physics for Scientists and Engineers 4th Edition, 2017

Physics for Scientists and Engineers 4th Edition, 2017 A Correlation of Physics for Scientists and Engineers 4th Edition, 2017 To the AP Physics C: Mechanics Course Descriptions AP is a trademark registered and/or owned by the College Board, which was not

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

It will be most difficult for the ant to adhere to the wheel as it revolves past which of the four points? A) I B) II C) III D) IV

It will be most difficult for the ant to adhere to the wheel as it revolves past which of the four points? A) I B) II C) III D) IV AP Physics 1 Lesson 16 Homework Newton s First and Second Law of Rotational Motion Outcomes Define rotational inertia, torque, and center of gravity. State and explain Newton s first Law of Motion as it

More information

PHYSICS 221, FALL 2011 EXAM #2 SOLUTIONS WEDNESDAY, NOVEMBER 2, 2011

PHYSICS 221, FALL 2011 EXAM #2 SOLUTIONS WEDNESDAY, NOVEMBER 2, 2011 PHYSICS 1, FALL 011 EXAM SOLUTIONS WEDNESDAY, NOVEMBER, 011 Note: The unit vectors in the +x, +y, and +z directions of a right-handed Cartesian coordinate system are î, ĵ, and ˆk, respectively. In this

More information

Chapter 8: Momentum, Impulse, & Collisions. Newton s second law in terms of momentum:

Chapter 8: Momentum, Impulse, & Collisions. Newton s second law in terms of momentum: linear momentum: Chapter 8: Momentum, Impulse, & Collisions Newton s second law in terms of momentum: impulse: Under what SPECIFIC condition is linear momentum conserved? (The answer does not involve collisions.)

More information

CHAPTER 8: ROTATIONAL OF RIGID BODY PHYSICS. 1. Define Torque

CHAPTER 8: ROTATIONAL OF RIGID BODY PHYSICS. 1. Define Torque 7 1. Define Torque 2. State the conditions for equilibrium of rigid body (Hint: 2 conditions) 3. Define angular displacement 4. Define average angular velocity 5. Define instantaneous angular velocity

More information

Physics for Scientist and Engineers third edition Rotational Motion About a Fixed Axis Problems

Physics for Scientist and Engineers third edition Rotational Motion About a Fixed Axis Problems A particular bird s eye can just distinguish objects that subtend an angle no smaller than about 3 E -4 rad, A) How many degrees is this B) How small an object can the bird just distinguish when flying

More information

Essentially, the amount of work accomplished can be determined two ways:

Essentially, the amount of work accomplished can be determined two ways: 1 Work and Energy Work is done on an object that can exert a resisting force and is only accomplished if that object will move. In particular, we can describe work done by a specific object (where a force

More information

III. Angular Momentum Conservation (Chap. 10) Rotation. We repeat Chap. 2-8 with rotatiing objects. Eqs. of motion. Energy.

III. Angular Momentum Conservation (Chap. 10) Rotation. We repeat Chap. 2-8 with rotatiing objects. Eqs. of motion. Energy. Chap. 10: Rotational Motion I. Rotational Kinematics II. Rotational Dynamics - Newton s Law for Rotation III. Angular Momentum Conservation (Chap. 10) 1 Toward Exam 3 Eqs. of motion o To study angular

More information

Flat disk Hollow disk Solid sphere. Flat plate Hollow plate Solid block. n y n O O O

Flat disk Hollow disk Solid sphere. Flat plate Hollow plate Solid block. n y n O O O NAME ME161 Midterm. Icertify that Iupheld the Stanford Honor code during this exam Tuesday October 29, 22 1:15-2:45 p.m. ffl Print your name and sign the honor code statement ffl You may use your course

More information

Lecture 13 REVIEW. Physics 106 Spring What should we know? What should we know? Newton s Laws

Lecture 13 REVIEW. Physics 106 Spring What should we know? What should we know? Newton s Laws Lecture 13 REVIEW Physics 106 Spring 2006 http://web.njit.edu/~sirenko/ What should we know? Vectors addition, subtraction, scalar and vector multiplication Trigonometric functions sinθ, cos θ, tan θ,

More information

Chapter 8 Rotational Motion

Chapter 8 Rotational Motion Chapter 8 Rotational Motion Chapter 8 Rotational Motion In this chapter you will: Learn how to describe and measure rotational motion. Learn how torque changes rotational velocity. Explore factors that

More information

Chapter 11 Vibrations and Waves

Chapter 11 Vibrations and Waves Chapter 11 Vibrations and Waves If an object vibrates or oscillates back and forth over the same path, each cycle taking the same amount of time, the motion is called periodic. The mass and spring system

More information

8.012 Physics I: Classical Mechanics Fall 2008

8.012 Physics I: Classical Mechanics Fall 2008 IT OpenCourseWare http://ocw.mit.edu 8.012 Physics I: Classical echanics Fall 2008 For information about citing these materials or our Terms of Use, visit: http://ocw.mit.edu/terms. ASSACHUSETTS INSTITUTE

More information

Chapter 8 Rotational Motion and Equilibrium. 1. Give explanation of torque in own words after doing balance-the-torques lab as an inquiry introduction

Chapter 8 Rotational Motion and Equilibrium. 1. Give explanation of torque in own words after doing balance-the-torques lab as an inquiry introduction Chapter 8 Rotational Motion and Equilibrium Name 1. Give explanation of torque in own words after doing balance-the-torques lab as an inquiry introduction 1. The distance between a turning axis and the

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

Rotation Quiz II, review part A

Rotation Quiz II, review part A Rotation Quiz II, review part A 1. A solid disk with a radius R rotates at a constant rate ω. Which of the following points has the greater angular velocity? A. A B. B C. C D. D E. All points have the

More information

Chapter 1: Units, Physical Quantities, and Vectors. scalar: vector: What is the main difference between a scalar quantity and a vector quantity?

Chapter 1: Units, Physical Quantities, and Vectors. scalar: vector: What is the main difference between a scalar quantity and a vector quantity? Chapter 1: Units, Physical Quantities, and Vectors scalar: vector: What is the main difference between a scalar quantity and a vector quantity? List all of the scalar and vector quantities you know in

More information

Use a BLOCK letter to answer each question: A, B, C, or D (not lower case such a b or script such as D)

Use a BLOCK letter to answer each question: A, B, C, or D (not lower case such a b or script such as D) Physics 23 Spring 212 Answer Sheet Print LAST Name: Rec Sec Letter EM Mini-Test First Name: Recitation Instructor & Final Exam Student ID: Gently remove this page from your exam when you begin. Write clearly

More information

Chapter 15 Periodic Motion

Chapter 15 Periodic Motion Chapter 15 Periodic Motion Slide 1-1 Chapter 15 Periodic Motion Concepts Slide 1-2 Section 15.1: Periodic motion and energy Section Goals You will learn to Define the concepts of periodic motion, vibration,

More information

1 x(k +1)=(Φ LH) x(k) = T 1 x 2 (k) x1 (0) 1 T x 2(0) T x 1 (0) x 2 (0) x(1) = x(2) = x(3) =

1 x(k +1)=(Φ LH) x(k) = T 1 x 2 (k) x1 (0) 1 T x 2(0) T x 1 (0) x 2 (0) x(1) = x(2) = x(3) = 567 This is often referred to as Þnite settling time or deadbeat design because the dynamics will settle in a Þnite number of sample periods. This estimator always drives the error to zero in time 2T or

More information

PHYSICS 220. Lecture 15. Textbook Sections Lecture 15 Purdue University, Physics 220 1

PHYSICS 220. Lecture 15. Textbook Sections Lecture 15 Purdue University, Physics 220 1 PHYSICS 220 Lecture 15 Angular Momentum Textbook Sections 9.3 9.6 Lecture 15 Purdue University, Physics 220 1 Last Lecture Overview Torque = Force that causes rotation τ = F r sin θ Work done by torque

More information

Exam 3 Practice Solutions

Exam 3 Practice Solutions Exam 3 Practice Solutions Multiple Choice 1. A thin hoop, a solid disk, and a solid sphere, each with the same mass and radius, are at rest at the top of an inclined plane. If all three are released at

More information

AP Physics Free Response Practice Dynamics

AP Physics Free Response Practice Dynamics AP Physics Free Response Practice Dynamics 14) In the system shown above, the block of mass M 1 is on a rough horizontal table. The string that attaches it to the block of mass M 2 passes over a frictionless

More information

General Definition of Torque, final. Lever Arm. General Definition of Torque 7/29/2010. Units of Chapter 10

General Definition of Torque, final. Lever Arm. General Definition of Torque 7/29/2010. Units of Chapter 10 Units of Chapter 10 Determining Moments of Inertia Rotational Kinetic Energy Rotational Plus Translational Motion; Rolling Why Does a Rolling Sphere Slow Down? General Definition of Torque, final Taking

More information

8.012 Physics I: Classical Mechanics Fall 2008

8.012 Physics I: Classical Mechanics Fall 2008 MIT OpenCourseWare http://ocw.mit.edu 8.012 Physics I: Classical Mechanics Fall 2008 For information about citing these materials or our Terms of Use, visit: http://ocw.mit.edu/terms. MASSACHUSETTS INSTITUTE

More information

Chapter 14 Oscillations. Copyright 2009 Pearson Education, Inc.

Chapter 14 Oscillations. Copyright 2009 Pearson Education, Inc. Chapter 14 Oscillations 14-1 Oscillations of a Spring If an object vibrates or oscillates back and forth over the same path, each cycle taking the same amount of time, the motion is called periodic. The

More information

A uniform rod of length L and Mass M is attached at one end to a frictionless pivot. If the rod is released from rest from the horizontal position,

A uniform rod of length L and Mass M is attached at one end to a frictionless pivot. If the rod is released from rest from the horizontal position, A dentist s drill starts from rest. After 3.20 s of constant angular acceleration, it turns at a rate of 2.51 10 4 rev/min. (a) Find the drill s angular acceleration. (b) Determine the angle (in radians)

More information

AP Physics 1. April 11, Simple Harmonic Motion. Table of Contents. Period. SHM and Circular Motion

AP Physics 1. April 11, Simple Harmonic Motion. Table of Contents. Period. SHM and Circular Motion AP Physics 1 2016-07-20 www.njctl.org Table of Contents Click on the topic to go to that section Period and Frequency SHM and UCM Spring Pendulum Simple Pendulum Sinusoidal Nature of SHM Period and Frequency

More information

Stability of rotating objects

Stability of rotating objects PHY131H1F - Hour 28 Today: We finish up Chapter 9! 9.5 Rotational Kinetic Energy (skip 9.6 on Tides and Earth s day) Stability of rotating objects If the rider's balance shifts a bit, the bike + rider

More information

Unit 8 Notetaking Guide Torque and Rotational Motion

Unit 8 Notetaking Guide Torque and Rotational Motion Unit 8 Notetaking Guide Torque and Rotational Motion Rotational Motion Until now, we have been concerned mainly with translational motion. We discussed the kinematics and dynamics of translational motion

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

8.012 Physics I: Classical Mechanics Fall 2008

8.012 Physics I: Classical Mechanics Fall 2008 MIT OpenCourseWare http://ocw.mit.edu 8.012 Physics I: Classical Mechanics Fall 2008 For information about citing these materials or our Terms of Use, visit: http://ocw.mit.edu/terms. MASSACHUSETTS INSTITUTE

More information

Chapter 14 Oscillations

Chapter 14 Oscillations Chapter 14 Oscillations If an object vibrates or oscillates back and forth over the same path, each cycle taking the same amount of time, the motion is called periodic. The mass and spring system is a

More information

Newton s Laws.

Newton s Laws. Newton s Laws http://mathsforeurope.digibel.be/images Forces and Equilibrium If the net force on a body is zero, it is in equilibrium. dynamic equilibrium: moving relative to us static equilibrium: appears

More information

CONTROL OF THE NONHOLONOMIC INTEGRATOR

CONTROL OF THE NONHOLONOMIC INTEGRATOR June 6, 25 CONTROL OF THE NONHOLONOMIC INTEGRATOR R. N. Banavar (Work done with V. Sankaranarayanan) Systems & Control Engg. Indian Institute of Technology, Bombay Mumbai -INDIA. banavar@iitb.ac.in Outline

More information

Lecture 3. Rotational motion and Oscillation 06 September 2018

Lecture 3. Rotational motion and Oscillation 06 September 2018 Lecture 3. Rotational motion and Oscillation 06 September 2018 Wannapong Triampo, Ph.D. Angular Position, Velocity and Acceleration: Life Science applications Recall last t ime. Rigid Body - An object

More information

MECH 3140 Final Project

MECH 3140 Final Project MECH 3140 Final Project Final presentation will be held December 7-8. The presentation will be the only deliverable for the final project and should be approximately 20-25 minutes with an additional 10

More information

2.003 Engineering Dynamics Problem Set 4 (Solutions)

2.003 Engineering Dynamics Problem Set 4 (Solutions) .003 Engineering Dynamics Problem Set 4 (Solutions) Problem 1: 1. Determine the velocity of point A on the outer rim of the spool at the instant shown when the cable is pulled to the right with a velocity

More information

第 1 頁, 共 7 頁 Chap10 1. Test Bank, Question 3 One revolution per minute is about: 0.0524 rad/s 0.105 rad/s 0.95 rad/s 1.57 rad/s 6.28 rad/s 2. *Chapter 10, Problem 8 The angular acceleration of a wheel

More information

Q2. A machine carries a 4.0 kg package from an initial position of d ˆ. = (2.0 m)j at t = 0 to a final position of d ˆ ˆ

Q2. A machine carries a 4.0 kg package from an initial position of d ˆ. = (2.0 m)j at t = 0 to a final position of d ˆ ˆ Coordinator: Dr. S. Kunwar Monday, March 25, 2019 Page: 1 Q1. An object moves in a horizontal circle at constant speed. The work done by the centripetal force is zero because: A) the centripetal force

More information

Today. Why idealized? Idealized physical models of robotic vehicles. Noise. Idealized physical models of robotic vehicles

Today. Why idealized? Idealized physical models of robotic vehicles. Noise. Idealized physical models of robotic vehicles PID controller COMP417 Introduction to Robotics and Intelligent Systems Kinematics and Dynamics Perhaps the most widely used controller in industry and robotics. Perhaps the easiest to code. You will also

More information

is acting on a body of mass m = 3.0 kg and changes its velocity from an initial

is acting on a body of mass m = 3.0 kg and changes its velocity from an initial PHYS 101 second major Exam Term 102 (Zero Version) Q1. A 15.0-kg block is pulled over a rough, horizontal surface by a constant force of 70.0 N acting at an angle of 20.0 above the horizontal. The block

More information

Name:. Set:. Don: Physics: Pre-U Revision Toytime Rotational and Circular Motion

Name:. Set:. Don: Physics: Pre-U Revision Toytime Rotational and Circular Motion Name:. Set:. Don: Physics: Pre-U Revision Toytime 2015-16 Rotational and Circular Motion 1 19 (ii) Place ticks in the table below to identify the effect on waves of light as they refract from diamond into

More information

AP Physics C: Mechanics Practice (Newton s Laws including friction, resistive forces, and centripetal force).

AP Physics C: Mechanics Practice (Newton s Laws including friction, resistive forces, and centripetal force). AP Physics C: Mechanics Practice (Newton s Laws including friction, resistive forces, and centripetal force). 1981M1. A block of mass m, acted on by a force of magnitude F directed horizontally to the

More information

9 Kinetics of 3D rigid bodies - rotating frames

9 Kinetics of 3D rigid bodies - rotating frames 9 Kinetics of 3D rigid bodies - rotating frames 9. Consider the two gears depicted in the figure. The gear B of radius R B is fixed to the ground, while the gear A of mass m A and radius R A turns freely

More information

Engineering Mechanics

Engineering Mechanics 2019 MPROVEMENT Mechanical Engineering Engineering Mechanics Answer Key of Objective & Conventional Questions 1 System of forces, Centoriod, MOI 1. (c) 2. (b) 3. (a) 4. (c) 5. (b) 6. (c) 7. (b) 8. (b)

More information

Multi Rotor Scalability

Multi Rotor Scalability Multi Rotor Scalability With the rapid growth in popularity of quad copters and drones in general, there has been a small group of enthusiasts who propose full scale quad copter designs (usable payload

More information

r r Sample Final questions for PS 150

r r Sample Final questions for PS 150 Sample Final questions for PS 150 1) Which of the following is an accurate statement? A) Rotating a vector about an axis passing through the tip of the vector does not change the vector. B) The magnitude

More information

Dynamics Final Report

Dynamics Final Report Dynamics Final Report Sophie Li and Hannah Wilk 1 Abstract We set out to develop a n-rigid body solver in MatLab. We wanted a user to define how many rigid bodies there are, and our system creates the

More information

CEE 271: Applied Mechanics II, Dynamics Lecture 27: Ch.18, Sec.1 5

CEE 271: Applied Mechanics II, Dynamics Lecture 27: Ch.18, Sec.1 5 1 / 42 CEE 271: Applied Mechanics II, Dynamics Lecture 27: Ch.18, Sec.1 5 Prof. Albert S. Kim Civil and Environmental Engineering, University of Hawaii at Manoa Tuesday, November 27, 2012 2 / 42 KINETIC

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

SCHOOL OF COMPUTING, ENGINEERING AND MATHEMATICS SEMESTER 1 EXAMINATIONS 2012/2013 XE121. ENGINEERING CONCEPTS (Test)

SCHOOL OF COMPUTING, ENGINEERING AND MATHEMATICS SEMESTER 1 EXAMINATIONS 2012/2013 XE121. ENGINEERING CONCEPTS (Test) s SCHOOL OF COMPUTING, ENGINEERING AND MATHEMATICS SEMESTER EXAMINATIONS 202/203 XE2 ENGINEERING CONCEPTS (Test) Time allowed: TWO hours Answer: Attempt FOUR questions only, a maximum of TWO questions

More information

A B Ax Bx Ay By Az Bz

A B Ax Bx Ay By Az Bz Lecture 5.1 Dynamics of Rotation For some time now we have been discussing the laws of classical dynamics. However, for the most part, we only talked about examples of translational motion. On the other

More information

1 A car moves around a circular path of a constant radius at a constant speed. Which of the following statements is true?

1 A car moves around a circular path of a constant radius at a constant speed. Which of the following statements is true? Slide 1 / 30 1 car moves around a circular path of a constant radius at a constant speed. Which of the following statements is true? The car s velocity is constant The car s acceleration is constant The

More information

MODEL PAPER CLASS XI PHYSICS (GROUP 1) BLUEPRINT Name of chapter (1)

MODEL PAPER CLASS XI PHYSICS (GROUP 1) BLUEPRINT Name of chapter (1) sr. no. MODEL PAPER CLASS XI PHYSICS (GROUP ) BLUEPRINT Name of chapter VSAQ () SA-I (2) SA-II (3) Value based (4) LA(5) Total 70 Physical world and measurement 3 2 Kinematics 2 3,3 5 3 Laws of motion

More information

557. Radial correction controllers of gyroscopic stabilizer

557. Radial correction controllers of gyroscopic stabilizer 557. Radial correction controllers of gyroscopic stabilizer M. Sivčák 1, J. Škoda, Technical University in Liberec, Studentská, Liberec, Czech Republic e-mail: 1 michal.sivcak@tul.cz; jan.skoda@pevnosti.cz

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

PHYSICS 1 Simple Harmonic Motion

PHYSICS 1 Simple Harmonic Motion Advanced Placement PHYSICS 1 Simple Harmonic Motion Student 014-015 What I Absolutely Have to Know to Survive the AP* Exam Whenever the acceleration of an object is proportional to its displacement and

More information

Kinetic Energy of Rolling

Kinetic Energy of Rolling Kinetic Energy of Rolling A solid disk and a hoop (with the same mass and radius) are released from rest and roll down a ramp from a height h. Which one is moving faster at the bottom of the ramp? A. they

More information

Chapter 11. Angular Momentum

Chapter 11. Angular Momentum Chapter 11 Angular Momentum Angular Momentum Angular momentum plays a key role in rotational dynamics. There is a principle of conservation of angular momentum. In analogy to the principle of conservation

More information

CHAPTER 10 ROTATION OF A RIGID OBJECT ABOUT A FIXED AXIS WEN-BIN JIAN ( 簡紋濱 ) DEPARTMENT OF ELECTROPHYSICS NATIONAL CHIAO TUNG UNIVERSITY

CHAPTER 10 ROTATION OF A RIGID OBJECT ABOUT A FIXED AXIS WEN-BIN JIAN ( 簡紋濱 ) DEPARTMENT OF ELECTROPHYSICS NATIONAL CHIAO TUNG UNIVERSITY CHAPTER 10 ROTATION OF A RIGID OBJECT ABOUT A FIXED AXIS WEN-BIN JIAN ( 簡紋濱 ) DEPARTMENT OF ELECTROPHYSICS NATIONAL CHIAO TUNG UNIVERSITY OUTLINE 1. Angular Position, Velocity, and Acceleration 2. Rotational

More information

Force Questions. Ground

Force Questions. Ground Force Questions 8. The London Eye is a large wheel which rotates at a slow steady speed in a vertical plane about a fixed horizontal axis. A total of 800 passengers can ride in 32 capsules equally spaced

More information

PHYSICS 1. Section I 40 Questions Time 90 minutes. g = 10 m s in all problems.

PHYSICS 1. Section I 40 Questions Time 90 minutes. g = 10 m s in all problems. Note: To simplify calculations, you may use PHYSICS 1 Section I 40 Questions Time 90 minutes 2 g = 10 m s in all problems. Directions: Each of the questions or incomplete statements below is followed by

More information

Oscillations. Phys101 Lectures 28, 29. Key points: Simple Harmonic Motion (SHM) SHM Related to Uniform Circular Motion The Simple Pendulum

Oscillations. Phys101 Lectures 28, 29. Key points: Simple Harmonic Motion (SHM) SHM Related to Uniform Circular Motion The Simple Pendulum Phys101 Lectures 8, 9 Oscillations Key points: Simple Harmonic Motion (SHM) SHM Related to Uniform Circular Motion The Simple Pendulum Ref: 11-1,,3,4. Page 1 Oscillations of a Spring If an object oscillates

More information

Oscillations. Oscillations and Simple Harmonic Motion

Oscillations. Oscillations and Simple Harmonic Motion Oscillations AP Physics C Oscillations and Simple Harmonic Motion 1 Equilibrium and Oscillations A marble that is free to roll inside a spherical bowl has an equilibrium position at the bottom of the bowl

More information

Rotational Dynamics, Moment of Inertia and Angular Momentum

Rotational Dynamics, Moment of Inertia and Angular Momentum Rotational Dynamics, Moment of Inertia and Angular Momentum Now that we have examined rotational kinematics and torque we will look at applying the concepts of angular motion to Newton s first and second

More information

Big Idea 4: Interactions between systems can result in changes in those systems. Essential Knowledge 4.D.1: Torque, angular velocity, angular

Big Idea 4: Interactions between systems can result in changes in those systems. Essential Knowledge 4.D.1: Torque, angular velocity, angular Unit 7: Rotational Motion (angular kinematics, dynamics, momentum & energy) Name: Big Idea 3: The interactions of an object with other objects can be described by forces. Essential Knowledge 3.F.1: Only

More information

PS 11 GeneralPhysics I for the Life Sciences

PS 11 GeneralPhysics I for the Life Sciences PS 11 GeneralPhysics I for the Life Sciences ROTATIONAL MOTION D R. B E N J A M I N C H A N A S S O C I A T E P R O F E S S O R P H Y S I C S D E P A R T M E N T F E B R U A R Y 0 1 4 Questions and Problems

More information

The acceleration due to gravity g, which varies with latitude and height, will be approximated to 101m1s 2, unless otherwise specified.

The acceleration due to gravity g, which varies with latitude and height, will be approximated to 101m1s 2, unless otherwise specified. The acceleration due to gravity g, which varies with latitude and height, will be approximated to 101m1s 2, unless otherwise specified. F1 (a) The fulcrum in this case is the horizontal axis, perpendicular

More information

Rotation. PHYS 101 Previous Exam Problems CHAPTER

Rotation. PHYS 101 Previous Exam Problems CHAPTER PHYS 101 Previous Exam Problems CHAPTER 10 Rotation Rotational kinematics Rotational inertia (moment of inertia) Kinetic energy Torque Newton s 2 nd law Work, power & energy conservation 1. Assume that

More information

Webreview Torque and Rotation Practice Test

Webreview Torque and Rotation Practice Test Please do not write on test. ID A Webreview - 8.2 Torque and Rotation Practice Test Multiple Choice Identify the choice that best completes the statement or answers the question. 1. A 0.30-m-radius automobile

More information

= o + t = ot + ½ t 2 = o + 2

= o + t = ot + ½ t 2 = o + 2 Chapters 8-9 Rotational Kinematics and Dynamics Rotational motion Rotational motion refers to the motion of an object or system that spins about an axis. The axis of rotation is the line about which the

More information

Kinematics (special case) Dynamics gravity, tension, elastic, normal, friction. Energy: kinetic, potential gravity, spring + work (friction)

Kinematics (special case) Dynamics gravity, tension, elastic, normal, friction. Energy: kinetic, potential gravity, spring + work (friction) Kinematics (special case) a = constant 1D motion 2D projectile Uniform circular Dynamics gravity, tension, elastic, normal, friction Motion with a = constant Newton s Laws F = m a F 12 = F 21 Time & Position

More information

C7047. PART A Answer all questions, each carries 5 marks.

C7047. PART A Answer all questions, each carries 5 marks. 7047 Reg No.: Total Pages: 3 Name: Max. Marks: 100 PJ DUL KLM TEHNOLOGIL UNIVERSITY FIRST SEMESTER.TEH DEGREE EXMINTION, DEEMER 2017 ourse ode: E100 ourse Name: ENGINEERING MEHNIS PRT nswer all questions,

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

AP Physics C Summer Homework. Questions labeled in [brackets] are required only for students who have completed AP Calculus AB

AP Physics C Summer Homework. Questions labeled in [brackets] are required only for students who have completed AP Calculus AB 1. AP Physics C Summer Homework NAME: Questions labeled in [brackets] are required only for students who have completed AP Calculus AB 2. Fill in the radian conversion of each angle and the trigonometric

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

Two Dimensional Rotational Kinematics Challenge Problem Solutions

Two Dimensional Rotational Kinematics Challenge Problem Solutions Two Dimensional Rotational Kinematics Challenge Problem Solutions Problem 1: Moment of Inertia: Uniform Disc A thin uniform disc of mass M and radius R is mounted on an axis passing through the center

More information

Chapter 14 Oscillations. Copyright 2009 Pearson Education, Inc.

Chapter 14 Oscillations. Copyright 2009 Pearson Education, Inc. Chapter 14 Oscillations Oscillations of a Spring Simple Harmonic Motion Energy in the Simple Harmonic Oscillator Simple Harmonic Motion Related to Uniform Circular Motion The Simple Pendulum The Physical

More information

Quantitative Skills in AP Physics 1

Quantitative Skills in AP Physics 1 This chapter focuses on some of the quantitative skills that are important in your AP Physics 1 course. These are not all of the skills that you will learn, practice, and apply during the year, but these

More information

PHYSICS 221 SPRING 2014

PHYSICS 221 SPRING 2014 PHYSICS 221 SPRING 2014 EXAM 2: April 3, 2014 8:15-10:15pm Name (printed): Recitation Instructor: Section # INSTRUCTIONS: This exam contains 25 multiple-choice questions plus 2 extra credit questions,

More information

A Ferris wheel in Japan has a radius of 50m and a mass of 1.2 x 10 6 kg. If a torque of 1 x 10 9 Nm is needed to turn the wheel when it starts at

A Ferris wheel in Japan has a radius of 50m and a mass of 1.2 x 10 6 kg. If a torque of 1 x 10 9 Nm is needed to turn the wheel when it starts at Option B Quiz 1. A Ferris wheel in Japan has a radius of 50m and a mass of 1. x 10 6 kg. If a torque of 1 x 10 9 Nm is needed to turn the wheel when it starts at rest, what is the wheel s angular acceleration?

More information

Use the following to answer question 1:

Use the following to answer question 1: Use the following to answer question 1: On an amusement park ride, passengers are seated in a horizontal circle of radius 7.5 m. The seats begin from rest and are uniformly accelerated for 21 seconds to

More information