Kinematics for a Three Wheeled Mobile Robot

Size: px
Start display at page:

Download "Kinematics for a Three Wheeled Mobile Robot"

Transcription

1 Kinematics for a Three Wheeled Mobile Robot Randal W. Beard Updated: March 13, Reference Frames and 2D Rotations î 1 y î 2 y w 1 y w w 2 y î 2 x w 2 x w 1 x î 1 x Figure 1: The vector w can be expressed with respect to two different reference frames. Figure 1 shows a vector w and two different coordinate frames with orthogonal axes denoted F 1 = {i 1 x, i 1 y, i 1 z} for Frame 1, and F 2 = {i 2 x, i 2 y, i 2 z} for Frame 2, where i are unit vectors in the direction of the axes. The two frames are centered at the same location, but frame F 2 is rotated with respect to frame F 1 by a right handed rotation about the i 1 z-axis of θ, where i 1 z = i 2 z. Let w be a vector that lies entirely in the x y plane of both reference frames. The vector w is expressed 1

2 with respect to frame F i by a three dimensional vector w i x w i = w y i, wz i where the superscript i denotes that w is expressed with respect to F i, and where w i is the projection of w along the unit vector îi, i.e., w i = w i i. Referring to Figure 1, w can be expressed with respect to F 1 as and with respect to F 2 as w 1 x w 1 = w y 1, w 2 x w 2 = w y 2. To derive a relationship between w 1 and w 2 note that w = w 1 xi 1 x + w 1 yi 1 y = w 2 xi 2 x + w 2 yi 2 y. Taking the inner product of w with i 2 x gives w i 2 x = w 1 xi 1 x i 2 x + w 1 yi 1 y i 2 x = w 2 x where we have used the fact that i 2 x i 2 x = 1 and i 2 y i 2 x =. Similarly, taking the inner product of w with i 2 y we get w i 2 y = w 1 xi 1 x i 2 y + w 1 yi 1 y i 2 y = w 2 y. Expressing these relationships in matrix form, we get wx 2 i 1 w y 2 x i 2 x i 1 y i 2 x w = i 1 x i 2 y i 1 y i 2 x 1 y w 1 y. (1) 1 2

3 From Figure 1 it can be seen that i 1 x i 2 x = cos θ i 1 y i 2 x = sin θ i 1 x i 2 y = sin θ i 1 y i 2 y = cos θ. Therefore Equation (1) can be written as w 2 = R(θ)w 1 where the rotation matrix R(θ) is given by cos θ sin θ R(θ) = sin θ cos θ. 1 2 Kinematics for Three Wheel Mobile Robot The geometry of a three wheeled robot is shown in Figure 2. The vectors r b i = (r b xi, r b yi, ) denote the position of the center of the i th wheel expressed with respect to a reference frame fixed in the body of the robot. The unit vectors ŝ b i = (s b xi, s b yi, ) are unit vectors that point in the direction of spin of the i th wheel. The vector v b = (v b x, v b y, ) denotes the linear velocity of the center of the body fixed reference frame, expressed in F b, and the vector = (,, ) denotes the angular velocity vector of the robot. We will assume that each wheel has radius R, and that the angular speed of the i th wheel is given by Ω i. The objective of this section is to derive the relationship between the velocity v b and and the wheel speeds Ω i. Let v i be the linear velocity vector of the center of the i th wheel. Then v i is related the velocity of the center of the robot, and the angular velocity by the expression v i = v + r i, (2) where denotes the cross product. The linear speed of the i th wheel is the projection of v i along the rolling direction of the wheel. Therefore RΩ i = v i ŝ i. (3) 3

4 ŝ 1 v 1 y r 2 r 1 ŝ 2! x r 3 v ŝ 3 Figure 2: Geometry for a three wheeled mobile robot. If we express all vectors with respect to the body frame, then we have RΩ i = vi b ŝ b i b r = vy b xi b s b + ryi b xi s b yi = s b xi b s b xiriy b + s b yivy b + s b yirxi b = ( s b xi s b yi (s b yirxi b s b xiryi) ) v b b x vy b. Therefore, the forward kinematic relationship between the inertial speeds expressed in the body frame, and the angular speeds of the wheels as Ω 1 v b x Ω 2 = M v b y, Ω 3 4

5 where M = 1 s b x1 s b y1 (s b y1rx1 b s b x1ry1) b s b x2 s b y2 (s b R y2rx2 b s b x2ry2) b. s b x3 s b y3 (s b y3rx3 b s b x3ry3) b Similarly, the reverse kinematic relationship is given by b Ω 1 vy b = M 1 Ω 2. Ω 3 However, we typically would like to command velocities in the world frame rather than the inertial frame. Note that since i b z = i w z, and the angular speed is the projection of on i z, that we can express the relationship between world frame velocities and body frames velocities as b v vy b x w = R(θ) vy w, where θ is the heading angle of the robot, or in other words, the angle between i w x and i b x. Therefore, the forward kinematic relationship between speeds in the world frame and wheel speeds is given by Ω 1 w Ω 2 = MR(θ) v w y, Ω 3 and the inverse kinematic relationship is given by w Ω 1 vy w = R (θ)m 1 Ω 2, Ω 3 where we have used the fact that R 1 (θ) = R (θ). 3 Velocity Control for Three Wheel Mobile Robot The velocity control scheme for a three wheel mobile robot is shown in Figure 3, where the commanded speeds expressed in the world frame are given by wc, vy wc, and c. 5

6 c 1 PID Motor 1 wc vy wc! c 1 A MR( ) c 2 PID Motor 2 2 c 3 3 PID Motor 3 Figure 3: Velocity control scheme for a three wheeled mobile robot. 6

Robotics I. Test November 29, 2013

Robotics I. Test November 29, 2013 Exercise 1 [6 points] Robotics I Test November 9, 013 A DC motor is used to actuate a single robot link that rotates in the horizontal plane around a joint axis passing through its base. The motor is connected

More information

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

Physics 121, March 25, Rotational Motion and Angular Momentum. Department of Physics and Astronomy, University of Rochester

Physics 121, March 25, Rotational Motion and Angular Momentum. Department of Physics and Astronomy, University of Rochester Physics 121, March 25, 2008. Rotational Motion and Angular Momentum. Physics 121. March 25, 2008. Course Information Topics to be discussed today: Review of Rotational Motion Rolling Motion Angular Momentum

More information

12. Rigid Body Dynamics I

12. Rigid Body Dynamics I University of Rhode Island DigitalCommons@URI Classical Dynamics Physics Course Materials 015 1. Rigid Body Dynamics I Gerhard Müller University of Rhode Island, gmuller@uri.edu Creative Commons License

More information

Week 3: Wheeled Kinematics AMR - Autonomous Mobile Robots

Week 3: Wheeled Kinematics AMR - Autonomous Mobile Robots Week 3: Wheeled Kinematics AMR - Paul Furgale Margarita Chli, Marco Hutter, Martin Rufli, Davide Scaramuzza, Roland Siegwart Wheeled Kinematics 1 AMRx Flipped Classroom A Matlab exercise is coming later

More information

Circular Motion, Pt 2: Angular Dynamics. Mr. Velazquez AP/Honors Physics

Circular Motion, Pt 2: Angular Dynamics. Mr. Velazquez AP/Honors Physics Circular Motion, Pt 2: Angular Dynamics Mr. Velazquez AP/Honors Physics Formulas: Angular Kinematics (θ must be in radians): s = rθ Arc Length 360 = 2π rads = 1 rev ω = θ t = v t r Angular Velocity α av

More information

Chapters 10 & 11: Rotational Dynamics Thursday March 8 th

Chapters 10 & 11: Rotational Dynamics Thursday March 8 th Chapters 10 & 11: Rotational Dynamics Thursday March 8 th Review of rotational kinematics equations Review and more on rotational inertia Rolling motion as rotation and translation Rotational kinetic energy

More information

1/30. Rigid Body Rotations. Dave Frank

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

More information

Project 1: Application of s = rθ and v = rω in Two Pulley Systems

Project 1: Application of s = rθ and v = rω in Two Pulley Systems Project 1: Application of s = rθ and v = rω in Two Pulley Systems Pulley systems provide an ideal environment for using the formulas s = rθ and v = rω. Most of these problems can be solved more quickly

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

KINEMATICS OF PARTICLES RESPECT TO TRANSLATING AXES

KINEMATICS OF PARTICLES RESPECT TO TRANSLATING AXES KINEMATICS OF PARTICLES RELATIVE MOTION WITH RESPECT TO TRANSLATING AXES In the previous articles, we have described particle motion using coordinates with respect to fixed reference axes. The displacements,

More information

Karlstads University Faculty of Technology and Science Physics. Rolling constraints. Author: Henrik Jackman. Classical mechanics

Karlstads University Faculty of Technology and Science Physics. Rolling constraints. Author: Henrik Jackman. Classical mechanics Karlstads University Faculty of Technology and Science Physics Rolling constraints Author: Henrik Jackman Classical mechanics 008-01-08 Introduction Rolling constraints are so called non-holonomic constraints.

More information

Robotics I. Figure 1: Initial placement of a rigid thin rod of length L in an absolute reference frame.

Robotics I. Figure 1: Initial placement of a rigid thin rod of length L in an absolute reference frame. Robotics I September, 7 Exercise Consider the rigid body in Fig., a thin rod of length L. The rod will be rotated by an angle α around the z axis, then by an angle β around the resulting x axis, and finally

More information

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

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

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

Chapter 8. Rotational Kinematics

Chapter 8. Rotational Kinematics Chapter 8 Rotational Kinematics 8.1 Rotational Motion and Angular Displacement In the simplest kind of rotation, points on a rigid object move on circular paths around an axis of rotation. 8.1 Rotational

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

CEE 271: Applied Mechanics II, Dynamics Lecture 33: Ch.19, Sec.1 2

CEE 271: Applied Mechanics II, Dynamics Lecture 33: Ch.19, Sec.1 2 1 / 36 CEE 271: Applied Mechanics II, Dynamics Lecture 33: Ch.19, Sec.1 2 Prof. Albert S. Kim Civil and Environmental Engineering, University of Hawaii at Manoa Thursday, December 6, 2012 2 / 36 LINEAR

More information

1. This is a CLOSED BOOK, CLOSED NOTES exam. A list of equations for your reference is provided below.

1. This is a CLOSED BOOK, CLOSED NOTES exam. A list of equations for your reference is provided below. _ Instructions 1. This is a CLOSED BOOK, CLOSED NOTES exam. A list of equations for your reference is provided below. 2. Begin each problem on the printed sheet and continue on the lined paper provided.

More information

Oscillatory Motion. Solutions of Selected Problems

Oscillatory Motion. Solutions of Selected Problems Chapter 15 Oscillatory Motion. Solutions of Selected Problems 15.1 Problem 15.18 (In the text book) A block-spring system oscillates with an amplitude of 3.50 cm. If the spring constant is 250 N/m and

More information

Chapter 8- Rotational Kinematics Angular Variables Kinematic Equations

Chapter 8- Rotational Kinematics Angular Variables Kinematic Equations Chapter 8- Rotational Kinematics Angular Variables Kinematic Equations Chapter 9- Rotational Dynamics Torque Center of Gravity Newton s 2 nd Law- Angular Rotational Work & Energy Angular Momentum Angular

More information

Motion Models (cont) 1 2/15/2012

Motion Models (cont) 1 2/15/2012 Motion Models (cont 1 Odometry Motion Model the key to computing p( xt ut, xt 1 for the odometry motion model is to remember that the robot has an internal estimate of its pose θ x t 1 x y θ θ true poses

More information

EQUATIONS OF MOTION: CYLINDRICAL COORDINATES (Section 13.6)

EQUATIONS OF MOTION: CYLINDRICAL COORDINATES (Section 13.6) EQUATIONS OF MOTION: CYLINDRICAL COORDINATES (Section 13.6) Today s Objectives: Students will be able to analyze the kinetics of a particle using cylindrical coordinates. APPLICATIONS The forces acting

More information

1 Kalman Filter Introduction

1 Kalman Filter Introduction 1 Kalman Filter Introduction You should first read Chapter 1 of Stochastic models, estimation, and control: Volume 1 by Peter S. Maybec (available here). 1.1 Explanation of Equations (1-3) and (1-4) Equation

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

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

Localización Dinámica de Robots Móviles Basada en Filtrado de Kalman y Triangulación

Localización Dinámica de Robots Móviles Basada en Filtrado de Kalman y Triangulación Universidad Pública de Navarra 13 de Noviembre de 2008 Departamento de Ingeniería Mecánica, Energética y de Materiales Localización Dinámica de Robots Móviles Basada en Filtrado de Kalman y Triangulación

More information

2-D Motion of Rigid Bodies - Kinematics

2-D Motion of Rigid Bodies - Kinematics 1 2.003J/1.053J Dynamics and Control I, Spring 2007 Professor Thomas Peacock 2/28/2007 Lecture 7 2-D Motion of Rigid Bodies - Kinematics Kinematics of Rigid Bodies Williams 3-3 (No method of instant centers)

More information

Precalculus Lesson 6.1: Angles and Their Measure Lesson 6.2: A Unit Circle Approach Part 2

Precalculus Lesson 6.1: Angles and Their Measure Lesson 6.2: A Unit Circle Approach Part 2 Precalculus Lesson 6.1: Angles and Their Measure Lesson 6.2: A Unit Circle Approach Part 2 Lesson 6.2 Before we look at the unit circle with respect to the trigonometric functions, we need to get some

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

Consistent Triangulation for Mobile Robot Localization Using Discontinuous Angular Measurements

Consistent Triangulation for Mobile Robot Localization Using Discontinuous Angular Measurements Seminar on Mechanical Robotic Systems Centre for Intelligent Machines McGill University Consistent Triangulation for Mobile Robot Localization Using Discontinuous Angular Measurements Josep M. Font Llagunes

More information

14. Rotational Kinematics and Moment of Inertia

14. Rotational Kinematics and Moment of Inertia 14. Rotational Kinematics and Moment of nertia A) Overview n this unit we will introduce rotational motion. n particular, we will introduce the angular kinematic variables that are used to describe the

More information

Physics 111. Lecture 23 (Walker: 10.6, 11.1) Conservation of Energy in Rotation Torque March 30, Kinetic Energy of Rolling Object

Physics 111. Lecture 23 (Walker: 10.6, 11.1) Conservation of Energy in Rotation Torque March 30, Kinetic Energy of Rolling Object Physics 111 Lecture 3 (Walker: 10.6, 11.1) Conservation of Energy in Rotation Torque March 30, 009 Lecture 3 1/4 Kinetic Energy of Rolling Object Total kinetic energy of a rolling object is the sum of

More information

Kinematics, Dynamics, and Vibrations FE Review Session. Dr. David Herrin March 27, 2012

Kinematics, Dynamics, and Vibrations FE Review Session. Dr. David Herrin March 27, 2012 Kinematics, Dynamics, and Vibrations FE Review Session Dr. David Herrin March 7, 0 Example A 0 g ball is released vertically from a height of 0 m. The ball strikes a horizontal surface and bounces back.

More information

Lecture 19. ROLLING WITHOUT SLIPPING. Figure 4.8 Gear rolling in geared horizontal guides. Figure 4.9 Wheel rolling on a horizontal surface.

Lecture 19. ROLLING WITHOUT SLIPPING. Figure 4.8 Gear rolling in geared horizontal guides. Figure 4.9 Wheel rolling on a horizontal surface. Lecture 19. ROLLING WITHOUT SLIPPING Figure 4.8 Gear rolling in geared horizontal guides. Figure 4.9 Wheel rolling on a horizontal surface. The derivation and understanding of velocity and acceleration

More information

Robotics I. Classroom Test November 21, 2014

Robotics I. Classroom Test November 21, 2014 Robotics I Classroom Test November 21, 2014 Exercise 1 [6 points] In the Unimation Puma 560 robot, the DC motor that drives joint 2 is mounted in the body of link 2 upper arm and is connected to the joint

More information

UAV Coordinate Frames and Rigid Body Dynamics

UAV Coordinate Frames and Rigid Body Dynamics Brigham Young University BYU ScholarsArchive All Faculty Publications 24-- UAV oordinate Frames and Rigid Body Dynamics Randal Beard beard@byu.edu Follow this and additional works at: https://scholarsarchive.byu.edu/facpub

More information

RELATIVE MOTION ANALYSIS: VELOCITY (Section 16.5)

RELATIVE MOTION ANALYSIS: VELOCITY (Section 16.5) RELATIVE MOTION ANALYSIS: VELOCITY (Section 16.5) Today s Objectives: Students will be able to: a) Describe the velocity of a rigid body in terms of translation and rotation components. b) Perform a relative-motion

More information

Cinematica dei Robot Mobili su Ruote. Corso di Robotica Prof. Davide Brugali Università degli Studi di Bergamo

Cinematica dei Robot Mobili su Ruote. Corso di Robotica Prof. Davide Brugali Università degli Studi di Bergamo Cinematica dei Robot Mobili su Ruote Corso di Robotica Prof. Davide Brugali Università degli Studi di Bergamo Riferimenti bibliografici Roland SIEGWART, Illah R. NOURBAKHSH Introduction to Autonomous Mobile

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

Physics 141. Lecture 18. Frank L. H. Wolfs Department of Physics and Astronomy, University of Rochester, Lecture 18, Page 1

Physics 141. Lecture 18. Frank L. H. Wolfs Department of Physics and Astronomy, University of Rochester, Lecture 18, Page 1 Physics 141. Lecture 18. Frank L. H. Wolfs Department of Physics and Astronomy, University of Rochester, Lecture 18, Page 1 Physics 141. Lecture 18. Course Information. Topics to be discussed today: A

More information

Physics 201. Professor P. Q. Hung. 311B, Physics Building. Physics 201 p. 1/1

Physics 201. Professor P. Q. Hung. 311B, Physics Building. Physics 201 p. 1/1 Physics 201 p. 1/1 Physics 201 Professor P. Q. Hung 311B, Physics Building Physics 201 p. 2/1 Rotational Kinematics and Energy Rotational Kinetic Energy, Moment of Inertia All elements inside the rigid

More information

University of Huddersfield Repository

University of Huddersfield Repository University of Huddersfield Repository Pislaru, Crinela Modelling and Simulation of the Dynamic Behaviour of Wheel-Rail Interface Original Citation Pislaru, Crinela (2012) Modelling and Simulation of the

More information

CEE 271: Applied Mechanics II, Dynamics Lecture 25: Ch.17, Sec.4-5

CEE 271: Applied Mechanics II, Dynamics Lecture 25: Ch.17, Sec.4-5 1 / 36 CEE 271: Applied Mechanics II, Dynamics Lecture 25: Ch.17, Sec.4-5 Prof. Albert S. Kim Civil and Environmental Engineering, University of Hawaii at Manoa Date: 2 / 36 EQUATIONS OF MOTION: ROTATION

More information

EQUATIONS OF MOTION: ROTATION ABOUT A FIXED AXIS (Section 17.4) Today s Objectives: Students will be able to analyze the planar kinetics of a rigid

EQUATIONS OF MOTION: ROTATION ABOUT A FIXED AXIS (Section 17.4) Today s Objectives: Students will be able to analyze the planar kinetics of a rigid EQUATIONS OF MOTION: ROTATION ABOUT A FIXED AXIS (Section 17.4) Today s Objectives: Students will be able to analyze the planar kinetics of a rigid body undergoing rotational motion. APPLICATIONS The crank

More information

Lab #4 - Gyroscopic Motion of a Rigid Body

Lab #4 - Gyroscopic Motion of a Rigid Body Lab #4 - Gyroscopic Motion of a Rigid Body Last Updated: April 6, 2007 INTRODUCTION Gyroscope is a word used to describe a rigid body, usually with symmetry about an axis, that has a comparatively large

More information

ME 230: Kinematics and Dynamics Spring 2014 Section AD. Final Exam Review: Rigid Body Dynamics Practice Problem

ME 230: Kinematics and Dynamics Spring 2014 Section AD. Final Exam Review: Rigid Body Dynamics Practice Problem ME 230: Kinematics and Dynamics Spring 2014 Section AD Final Exam Review: Rigid Body Dynamics Practice Problem 1. A rigid uniform flat disk of mass m, and radius R is moving in the plane towards a wall

More information

PLANAR KINETICS OF A RIGID BODY FORCE AND ACCELERATION

PLANAR KINETICS OF A RIGID BODY FORCE AND ACCELERATION PLANAR KINETICS OF A RIGID BODY FORCE AND ACCELERATION I. Moment of Inertia: Since a body has a definite size and shape, an applied nonconcurrent force system may cause the body to both translate and rotate.

More information

Exam 1 September 11, 2013

Exam 1 September 11, 2013 Exam 1 Instructions: You have 60 minutes to complete this exam. This is a closed-book, closed-notes exam. You are allowed to use an approved calculator during the exam. Usage of mobile phones and other

More information

11.1 Introduction Galilean Coordinate Transformations

11.1 Introduction Galilean Coordinate Transformations 11.1 Introduction In order to describe physical events that occur in space and time such as the motion of bodies, we introduced a coordinate system. Its spatial and temporal coordinates can now specify

More information

1.1. Rotational Kinematics Description Of Motion Of A Rotating Body

1.1. Rotational Kinematics Description Of Motion Of A Rotating Body PHY 19- PHYSICS III 1. Moment Of Inertia 1.1. Rotational Kinematics Description Of Motion Of A Rotating Body 1.1.1. Linear Kinematics Consider the case of linear kinematics; it concerns the description

More information

Rigid Body Motion. Greg Hager Simon Leonard

Rigid Body Motion. Greg Hager Simon Leonard Rigid ody Motion Greg Hager Simon Leonard Overview Different spaces used in robotics and why we need to get from one space to the other Focus on Cartesian space Transformation between two Cartesian coordinate

More information

Chapter 10.A. Rotation of Rigid Bodies

Chapter 10.A. Rotation of Rigid Bodies Chapter 10.A Rotation of Rigid Bodies P. Lam 7_23_2018 Learning Goals for Chapter 10.1 Understand the equations govern rotational kinematics, and know how to apply them. Understand the physical meanings

More information

Dynamics 12e. Copyright 2010 Pearson Education South Asia Pte Ltd. Chapter 20 3D Kinematics of a Rigid Body

Dynamics 12e. Copyright 2010 Pearson Education South Asia Pte Ltd. Chapter 20 3D Kinematics of a Rigid Body Engineering Mechanics: Dynamics 12e Chapter 20 3D Kinematics of a Rigid Body Chapter Objectives Kinematics of a body subjected to rotation about a fixed axis and general plane motion. Relative-motion analysis

More information

EE Mobile Robots

EE Mobile Robots Electric Electronic Engineering Bogazici University December 27, 2017 Introduction Motion Sensing Absolute position measurement Environmental Sensing Introduction Motion Sensing Environmental Sensing Robot

More information

Lagrangian Dynamics: Generalized Coordinates and Forces

Lagrangian Dynamics: Generalized Coordinates and Forces Lecture Outline 1 2.003J/1.053J Dynamics and Control I, Spring 2007 Professor Sanjay Sarma 4/2/2007 Lecture 13 Lagrangian Dynamics: Generalized Coordinates and Forces Lecture Outline Solve one problem

More information

Classical Mechanics Lecture 15

Classical Mechanics Lecture 15 Classical Mechanics Lecture 5 Today s Concepts: a) Parallel Axis Theorem b) Torque & Angular Acceleration Mechanics Lecture 5, Slide Unit 4 Main Points Mechanics Lecture 4, Slide Unit 4 Main Points Mechanics

More information

PLANAR KINETICS OF A RIGID BODY: WORK AND ENERGY Today s Objectives: Students will be able to: 1. Define the various ways a force and couple do work.

PLANAR KINETICS OF A RIGID BODY: WORK AND ENERGY Today s Objectives: Students will be able to: 1. Define the various ways a force and couple do work. PLANAR KINETICS OF A RIGID BODY: WORK AND ENERGY Today s Objectives: Students will be able to: 1. Define the various ways a force and couple do work. In-Class Activities: 2. Apply the principle of work

More information

Angular Displacement (θ)

Angular Displacement (θ) Rotational Motion Angular Displacement, Velocity, Acceleration Rotation w/constant angular acceleration Linear vs. Angular Kinematics Rotational Energy Parallel Axis Thm. Angular Displacement (θ) Angular

More information

Exam 1 January 31, 2012

Exam 1 January 31, 2012 Exam 1 Instructions: You have 60 minutes to complete this exam. This is a closed-book, closed-notes exam. You are allowed to use a calculator during the exam. Usage of mobile phones and other electronic

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 Notes Multibody Dynamics B, wb1413

Lecture Notes Multibody Dynamics B, wb1413 Lecture Notes Multibody Dynamics B, wb1413 A. L. Schwab & Guido M.J. Delhaes Laboratory for Engineering Mechanics Mechanical Engineering Delft University of Technolgy The Netherlands June 9, 29 Contents

More information

Connection between angular and linear speed

Connection between angular and linear speed Connection between angular and linear speed If a point-like object is in motion on a circular path of radius R at an instantaneous speed v, then its instantaneous angular speed ω is v = ω R Example: A

More information

Plane Motion of Rigid Bodies: Forces and Accelerations

Plane Motion of Rigid Bodies: Forces and Accelerations Plane Motion of Rigid Bodies: Forces and Accelerations Reference: Beer, Ferdinand P. et al, Vector Mechanics for Engineers : Dynamics, 8 th Edition, Mc GrawHill Hibbeler R.C., Engineering Mechanics: Dynamics,

More information

2.003SC Recitation 3 Notes:V and A of a Point in a Moving Frame

2.003SC Recitation 3 Notes:V and A of a Point in a Moving Frame 2.003SC Recitation 3 Notes:V and A of a Point in a Moving Frame Velocity and Acceleration of a Point in a Moving Frame The figure below shows a point B in a coordinate system Axyz which is translating

More information

Rotational Motion, Torque, Angular Acceleration, and Moment of Inertia. 8.01t Nov 3, 2004

Rotational Motion, Torque, Angular Acceleration, and Moment of Inertia. 8.01t Nov 3, 2004 Rotational Motion, Torque, Angular Acceleration, and Moment of Inertia 8.01t Nov 3, 2004 Rotation and Translation of Rigid Body Motion of a thrown object Translational Motion of the Center of Mass Total

More information

, respectively to the inverse and the inverse differential problem. Check the correctness of the obtained results. Exercise 2 y P 2 P 1.

, respectively to the inverse and the inverse differential problem. Check the correctness of the obtained results. Exercise 2 y P 2 P 1. Robotics I July 8 Exercise Define the orientation of a rigid body in the 3D space through three rotations by the angles α β and γ around three fixed axes in the sequence Y X and Z and determine the associated

More information

UAVBook Supplement Full State Direct and Indirect EKF

UAVBook Supplement Full State Direct and Indirect EKF UAVBook Supplement Full State Direct and Indirect EKF Randal W. Beard March 14, 217 This supplement will explore alternatives to the state estimation scheme presented in the book. In particular, we will

More information

Control of Mobile Robots Prof. Luca Bascetta

Control of Mobile Robots Prof. Luca Bascetta Control of Mobile Robots Prof. Luca Bascetta EXERCISE 1 1. Consider a wheel rolling without slipping on the horizontal plane, keeping the sagittal plane in the vertical direction. Write the expression

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

KINEMATICS OF PARTICLES PROBLEMS ON RELATIVE MOTION WITH RESPECT TO TRANSLATING AXES

KINEMATICS OF PARTICLES PROBLEMS ON RELATIVE MOTION WITH RESPECT TO TRANSLATING AXES KINEMATICS OF PARTICLES PROBLEMS ON RELATIVE MOTION WITH RESPECT TO TRANSLATING AXES 1. The car A has a forward speed of 18 km/h and is accelerating at 3 m/s2. Determine the elocity and acceleration of

More information

Moving Reference Frame Kinematics Homework

Moving Reference Frame Kinematics Homework Chapter 3 Moving Reference Frame Kinematics Homework Freeform c 2016 3-1 3-2 Freeform c 2016 Homework 3. Given: n L-shaped telescoping arm is pinned to ground at point. The arm is rotating counterclockwise

More information

Fundamentals of Mathematics (MATH 1510)

Fundamentals of Mathematics (MATH 1510) Fundamentals of Mathematics () Instructor: Email: shenlili@yorku.ca Department of Mathematics and Statistics York University March 14-18, 2016 Outline 1 2 s An angle AOB consists of two rays R 1 and R

More information

Robotics & Automation. Lecture 06. Serial Kinematic Chain, Forward Kinematics. John T. Wen. September 11, 2008

Robotics & Automation. Lecture 06. Serial Kinematic Chain, Forward Kinematics. John T. Wen. September 11, 2008 Robotics & Automation Lecture 06 Serial Kinematic Chain, Forward Kinematics John T. Wen September 11, 2008 So Far... We have covered rigid body rotational kinematics: representations of SO(3), change of

More information

Angular Displacement. θ i. 1rev = 360 = 2π rads. = "angular displacement" Δθ = θ f. π = circumference. diameter

Angular Displacement. θ i. 1rev = 360 = 2π rads. = angular displacement Δθ = θ f. π = circumference. diameter Rotational Motion Angular Displacement π = circumference diameter π = circumference 2 radius circumference = 2πr Arc length s = rθ, (where θ in radians) θ 1rev = 360 = 2π rads Δθ = θ f θ i = "angular displacement"

More information

Video 1.1 Vijay Kumar and Ani Hsieh

Video 1.1 Vijay Kumar and Ani Hsieh Video 1.1 Vijay Kumar and Ani Hsieh 1 Robotics: Dynamics and Control Vijay Kumar and Ani Hsieh University of Pennsylvania 2 Why? Robots live in a physical world The physical world is governed by the laws

More information

Inelastic Collisions. Experiment Number 8 Physics 109 Fall 2017

Inelastic Collisions. Experiment Number 8 Physics 109 Fall 2017 Inelastic Collisions Experiment Number 8 Physics 109 Fall 2017 Midterm Exam Scores 6 5 4 Number 3 2 1 0 0-49 50-59 60-69 70-79 Score Range 80-89 90-100 Outline Ballistic Pendulum Physics of Rotation Angular

More information

Angular Momentum. Physics 1425 Lecture 21. Michael Fowler, UVa

Angular Momentum. Physics 1425 Lecture 21. Michael Fowler, UVa Angular Momentum Physics 1425 Lecture 21 Michael Fowler, UVa A New Look for τ = Iα We ve seen how τ = Iα works for a body rotating about a fixed axis. τ = Iα is not true in general if the axis of rotation

More information

AS3010: Introduction to Space Technology

AS3010: Introduction to Space Technology AS3010: Introduction to Space Technology L E C T U R E 22 Part B, Lecture 22 19 April, 2017 C O N T E N T S Attitude stabilization passive and active. Actuators for three axis or active stabilization.

More information

Physics 1A. Lecture 10B

Physics 1A. Lecture 10B Physics 1A Lecture 10B Review of Last Lecture Rotational motion is independent of translational motion A free object rotates around its center of mass Objects can rotate around different axes Natural unit

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

UNIT 15 ROTATION KINEMATICS. Objectives

UNIT 15 ROTATION KINEMATICS. Objectives UNIT 5 ROTATION KINEMATICS Objectives to understand the concept of angular speed to understand the concept of angular acceleration to understand and be able to use kinematics equations to describe the

More information

Physics of Rotation. Physics 109, Introduction To Physics Fall 2017

Physics of Rotation. Physics 109, Introduction To Physics Fall 2017 Physics of Rotation Physics 109, Introduction To Physics Fall 017 Outline Next two lab periods Rolling without slipping Angular Momentum Comparison with Translation New Rotational Terms Rotational and

More information

Two-Dimensional Rotational Dynamics

Two-Dimensional Rotational Dynamics Two-Dimensional Rotational Dynamics 8.01 W09D2 W09D2 Reading Assignment: MIT 8.01 Course Notes: Chapter 17 Two Dimensional Rotational Dynamics Sections 17.1-17.5 Chapter 18 Static Equilibrium Sections

More information

Physics 218 Lecture 21

Physics 218 Lecture 21 Physics 218 Lecture 21 Dr. David Toback Physics 218, Lecture XXI 1 Checklist for Today Things due Yesterday Chapters 12 & 13 in WebCT Things that are due for today Read Chapters 14-16 Things that are due

More information

Rotational Motion and Torque

Rotational Motion and Torque Rotational Motion and Torque Introduction to Angular Quantities Sections 8- to 8-2 Introduction Rotational motion deals with spinning objects, or objects rotating around some point. Rotational motion is

More information

Chapter 8. Rotational Kinematics

Chapter 8. Rotational Kinematics Chapter 8 Rotational Kinematics 8.3 The Equations of Rotational Kinematics 8.4 Angular Variables and Tangential Variables The relationship between the (tangential) arc length, s, at some radius, r, and

More information

EE565:Mobile Robotics Lecture 6

EE565:Mobile Robotics Lecture 6 EE565:Mobile Robotics Lecture 6 Welcome Dr. Ahmad Kamal Nasir Announcement Mid-Term Examination # 1 (25%) Understand basic wheel robot kinematics, common mobile robot sensors and actuators knowledge. Understand

More information

Circular Motion Kinematics 8.01 W03D1

Circular Motion Kinematics 8.01 W03D1 Circular Motion Kinematics 8.01 W03D1 Announcements Open up the Daily Concept Questions page on the MITx 8.01x Webpage. Problem Set 2 due Tue Week 3 at 9 pm Week 3 Prepset due Friday Week 3 at 8:30 am

More information

Trajectory tracking & Path-following control

Trajectory tracking & Path-following control Cooperative Control of Multiple Robotic Vehicles: Theory and Practice Trajectory tracking & Path-following control EECI Graduate School on Control Supélec, Feb. 21-25, 2011 A word about T Tracking and

More information

1 Problems 1-3 A disc rotates about an axis through its center according to the relation θ (t) = t 4 /4 2t

1 Problems 1-3 A disc rotates about an axis through its center according to the relation θ (t) = t 4 /4 2t Slide 1 / 30 1 Problems 1-3 disc rotates about an axis through its center according to the relation θ (t) = t 4 /4 2t etermine the angular velocity of the disc at t= 2 s 2 rad/s 4 rad/s 6 rad/s 8 rad/s

More information

Slide 1 / 30. Slide 2 / 30. Slide 3 / m/s -1 m/s

Slide 1 / 30. Slide 2 / 30. Slide 3 / m/s -1 m/s 1 Problems 1-3 disc rotates about an axis through its center according to the relation θ (t) = t 4 /4 2t Slide 1 / 30 etermine the angular velocity of the disc at t= 2 s 2 rad/s 4 rad/s 6 rad/s 8 rad/s

More information

Notes on Torque. We ve seen that if we define torque as rfsinθ, and the N 2. i i

Notes on Torque. We ve seen that if we define torque as rfsinθ, and the N 2. i i Notes on Torque We ve seen that if we define torque as rfsinθ, and the moment of inertia as N, we end up with an equation mr i= 1 that looks just like Newton s Second Law There is a crucial difference,

More information

Chapter 8. Rotational Motion

Chapter 8. Rotational Motion Chapter 8 Rotational Motion Rotational Work and Energy W = Fs = s = rθ Frθ Consider the work done in rotating a wheel with a tangential force, F, by an angle θ. τ = Fr W =τθ Rotational Work and Energy

More information

Mecanum-Wheeled Vehicle Base

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

More information

Chapter 8 Lecture Notes

Chapter 8 Lecture Notes Chapter 8 Lecture Notes Physics 2414 - Strauss Formulas: v = l / t = r θ / t = rω a T = v / t = r ω / t =rα a C = v 2 /r = ω 2 r ω = ω 0 + αt θ = ω 0 t +(1/2)αt 2 θ = (1/2)(ω 0 +ω)t ω 2 = ω 0 2 +2αθ τ

More information

Central Angles and Arcs

Central Angles and Arcs Advance Algebra & Trigonometry Angles & Circular Functions Central Angles and Arcs Arc Length 1. A central angle an angle whose vertex lies at the center of the circle: A B ABC is a central angle C 2.

More information

RECURSIVE INVERSE DYNAMICS

RECURSIVE INVERSE DYNAMICS We assume at the outset that the manipulator under study is of the serial type with n+1 links including the base link and n joints of either the revolute or the prismatic type. The underlying algorithm

More information

Problem 1 Problem 2 Problem 3 Problem 4 Total

Problem 1 Problem 2 Problem 3 Problem 4 Total Name Section THE PENNSYLVANIA STATE UNIVERSITY Department of Engineering Science and Mechanics Engineering Mechanics 12 Final Exam May 5, 2003 8:00 9:50 am (110 minutes) Problem 1 Problem 2 Problem 3 Problem

More information