Dynamics and Numerical Integration

Size: px
Start display at page:

Download "Dynamics and Numerical Integration"

Transcription

1 Dynamics and Numerical Integration EECS 398 Intro. to Autonomous Robotics autorob.org ME/EECS 567 ROB 510 Robot Modeling and Control Fall 2018

2

3

4 Administrivia Project 1 ( Path Planning ) due next Monday Sep 24 git pizza extended office hours Friday 5-7pm, Beyster 3725 If you are not on course slack group, me (ocj) Send me point to your git repository (and your picture) Anyone still looking for permission to enroll from waitlist?

5 Example: Motorized Pendulum

6 Example: Motorized Pendulum Pendulum of length l with point mass m

7 Example: Motorized Pendulum Angle expresses pendulum range of motion Pendulum of length l with point mass m

8 Example: Motorized Pendulum Motor produces torque (angular force) Angle expresses pendulum range of motion Pendulum of length l with point mass m

9 Example: Motorized Pendulum Equation of motion (with rotational inertia I) Motor produces torque (angular force) Angle expresses pendulum range of motion Pendulum of length l with point mass m

10 Dynamics Equation of motion (with rotational inertia I) Motorized Pendulum Controls Motor produces torque (angular force) State (or Configuration) Angle expresses pendulum range of motion System Pendulum of length l with point mass m

11 State Defining (or Configuration) State State comprised of degrees-of-freedom (DOFs) DOFs describe translational and rotational axes for joints How many DOFs in the example pendulum? Airplane DOFs? Note: particles vs. rigid bodies, COM, geom, inertia Note: types of joints, global vs. local DOFs

12 Defining State State comprised of degrees-of-freedom (DOFs) DOFs describe translational and rotational axes of system Humanoid DOFs? joint angles global positioning

13 DOFs and Coordinate Spaces Each body has its own coordinate system link frame Joints connect two links (rigid bodies) Hinge (1 rotational DOF) Prismatic (1 translational DOF) Ball-socket (3 DOFs) A motor exerts force along a DOF axis Linear transformations used to relate coordinate systems of bodies and joints Spatial geometry attached to each link, but does not affect the body s coordinate frame

14 DOFs and Coordinate Spaces Each body has its own coordinate system link frame Joints connect two links (rigid bodies) Hinge (1 rotational DOF) Prismatic (1 translational DOF) Ball-socket (3 DOFs) A motor exerts force along a DOF axis Linear transformations used to relate coordinate systems of bodies and joints Spatial geometry attached to each link, but does not affect the body s coordinate frame

15 DOFs and Coordinate Spaces Each body has its own coordinate system link frame Joints connect two links (rigid bodies) Hinge (1 rotational DOF) Prismatic (1 translational DOF) Ball-socket (3 DOFs) A motor exerts force along a DOF axis Linear transformations used to relate coordinate systems of bodies and joints Spatial geometry attached to each link, but does not affect the body s coordinate frame

16 DOFs and Coordinate Spaces Each body has its own coordinate system link frame Joints connect two links (rigid bodies) Hinge (1 rotational DOF) Prismatic (1 translational DOF) Ball-socket (3 DOFs) A motor exerts force along a DOF axis Linear transformations used to relate coordinate systems of bodies and joints Spatial geometry attached to each link, but does not affect the body s coordinate frame

17 DOFs and Coordinate Spaces Each body has its own coordinate system link frame Joints connect two links (rigid bodies) Hinge (1 rotational DOF) Prismatic (1 translational DOF) Ball-socket (3 DOFs) A motor exerts force along a DOF axis Linear transformations used to relate coordinate systems of bodies and joints Spatial geometry attached to each link, but does not affect the body s coordinate frame

18 Robotic machines are comprised of N joints and N+1 links DLR Lightweight arm Joints and links form a tree hierarchy of articulated motion The base is the root link of this hierarchy A link has one parent (inboard) joint and potentially zero, one, or multiple child (outboard) joints A serial chain is a robot where every link has only one child joint Dynamixel robot kit

19 Planar 2-DOF 2-link Arm

20 SCARA Arm Selective Compliance Assembly Robot Arm Tech Museum of Innovation

21 Fetch robot

22 Fetch links Fetch joints

23

24 Atlas robot WPI

25 Physical Simulation (Gazebo) Technion

26 Why simulate robots? Real robots are expensive Improper controllers can physically break robots Inexpensive to experiment and test robot controllers in simulation Predictive model of dynamics Necessary for some types of control (e.g., optimal control)

27 For example, NASA Valkyrie

28 Valkyrie for real -

29 NASA Valkyrie started development in simulation

30 Valkyrie in simulation -

31 Our first robot: Pendularm!

32 Project 2: 1 DOF Pendularm model, simulate, and control 1 DoF robot arm

33 Dynamics Equation of motion (with rotational inertia I) Example: Pendulum Controls Motor produces torque (angular force) State (or Configuration) Angle expresses pendulum range of motion System Pendulum of length l with point mass m

34 Example: Pendulum Equation of motion (with rotational inertia I) Motor produces torque (angular force) motor torque Angle expresses pendulum range of motion Pendulum of length l with point mass m

35 Example device Control torque of motor as a proportion of current applied Decrease resistance to increase force DC motor Potentiometer irinakl Increase resistance to decrease force

36 Actuator (electric) Servos have: actuators to produce motion proprioception to sense pose controller to regulate current to motor Proprioception (optical encoder) Controller (4 channel H-Bridges)

37

38 Example: Pendulum Equation of motion (with rotational inertia I) Motor produces torque (angular force) angular acceleration (second time derivative) Angle expresses pendulum range of motion Pendulum of length l with point mass m

39 First derivative with approximation after step length h Second derivative Integration inverse operation of differentiation

40 Power rule Time derivatives (velocity, acceleration) or or Product rule Partial derivative Chain rule Total derivative

41 Math.sin(A) Angles A, B, C Lengths a, b, c Math.cos(A) Math.tan(A) Math.atan2(a,b)

42 Example: Pendulum Equation of motion (with rotational inertia I) How was this derived? Motor produces torque (angular force) Angle expresses pendulum range of motion Pendulum of length l with point mass m

43 Example: Pendulum Equation of motion (with rotational inertia I) Lagrangian is kinetic minus potential energy used to generate equation of motion Motor produces torque (angular force) Angle expresses pendulum range of motion Pendulum of length l with point mass m

44 Lagrangian Dynamics for Pendulum Equation of motion (with rotational inertia I) Kinetic Energy Potential Energy Lagrangian Equation of motion

45 Example: Pendulum Equation of motion (with rotational inertia I) Motor produces torque (angular force) with Parallel Axis Theorem (I=ml 2 ) Angle expresses pendulum range of motion Pendulum of length l with point mass m

46 Example: Pendulum Equation of motion (with rotational inertia I) Motor produces torque (angular force) with Parallel Axis Theorem (I=ml 2 ) Angle expresses pendulum range of motion gravity term motor term Pendulum of length l with point mass m

47 Example: Pendulum Equation of motion (with rotational inertia I) Motor produces torque (angular force) with Parallel Axis Theorem (I=ml 2 ) Angle expresses pendulum range of motion Numerical integration over time Pendulum of length l with point mass m

48 Example: Pendulum Equation of motion (with rotational inertia I) with Parallel Axis Theorem (I=ml2) What is this? Numerical integration over time Motor produces torque (angular force) Angle expresses pendulum range of motion Hint Pendulum of length l with point mass m

49 Hidden Figures (2017)

50 Example: Pendulum Equation of motion (with rotational inertia I) Motor produces torque (angular force) with Parallel Axis Theorem (I=ml 2 ) Angle expresses pendulum range of motion Numerical integration over time Euler integration Pendulum of length l with point mass m

51 Let s see what happens

52 Euler integration would kill this man Walter Lewin -

53

54 Given initial condition and

55 Given initial condition and time state

56 Given initial condition differential equation and in the form velocity system dynamics

57 Given initial condition differential equation and in the form how to estimate of future state at simulation iteration n?

58 Given initial condition differential equation and in the form how to estimate of future state at simulation iteration n? numerical integration over timestep iterations next state current state integration over timestep

59 Given initial condition differential equation and in the form how to estimate of future state at simulation iteration n? Euler s method next state current state advance time timestep (dt)

60 Example Euler integration of 2D point over 2 time steps

61 Second-order state State in Newtonian physics has both position ( ) and velocity ( )

62 Euler s method acceleration assumes second order system f(y,y,y ) treats velocity y = f(y) and acceleration y = f (y ) individually

63 Euler s method acceleration Why is the pendulum going unstable?

64 Given initial condition differential equation and in the form how to estimate of future state at time n? integral approximation Euler s method

65 where Euler s method ended up where we should have ended up integral approximation

66 Example Euler integration of 2D point over 4 time steps

67 Example Euler integration of 2D point over 4 time steps Euler integration True evolution of state

68 Example Euler integration of 2D point over 4 time steps Euler integration True evolution of state

69 Initial tangent Euler integration True evolution of state

70 Extend by timestep Euler integration True evolution of state

71 Extend by timestep Euler integration True evolution of state

72 Add to current state Euler integration True evolution of state

73 Euler integration True evolution of state Integration error

74 Euler integration True evolution of state Integration error

75

76 integration error

77 Can we improve this integration over time? integration error

78 Can we improve this integration over time? Option 1: Reduce timestep Option 2: Use a better integrator integration error

79 Can we improve this integration over time? Option 1: Reduce timestep Option 2: Use a better integrator integration error

80 Verlet Integration Initialize Iterate position Iterate velocity (optional) update notation: x is used as state

81 Verlet Integration

82 Verlet Integration

83 Verlet Integration

84 Verlet Integration Initialize Iterate position Iterate velocity (optional) Do not forget to initialize

85 Let s see what happens

86 Verlet Integration Initialize Iterate position Iterate velocity (optional)

87 Velocity Verlet

88 Let s see what happens

89 Runge-Kutta think of f() as callable function for dy/dt

90 Runge-Kutta Butcher tableau describes family of RK methods s : order of RK formula

91 Runge-Kutta 1 Euler s Method when s=1 and b 1 =1

92 An RK 2: The Midpoint Method Midpoint Method s=2 b 1 =0 b 2 =1 c 1 c 2 a 21 c 2 =0.5 a 21 =0.5 b 1 b 2

93 2) Evaluate tangent at trial midpoint 3) Step again from start using trial midpoint tangent 1) Take trial step to midpoint

94

95 Euler Midpoint

96 The RK4 : Simpson s Rule a widely used version of fourth order Runge-Kutta (known as RK4 ) implements Simpson s rule: numerical approximation of definite integrals by evaluating integral extents and midpoint

97 RK4 uses s=4 a 21 =1/2, a 32 =1/2, a 43 =1, c 1 =0, c 2 =1/2, c 3 =1/2, c 4 =1 b 1 =1/6, b 2 =1/3, b 3 =1/3, b 4 =1/6

98 Runge-Kutta: RK4 Slope at beginning of interval Slope at trial midpoint hk 1 /2 Slope at trial midpoint hk 2 /2 Slope at trial end of interval

99

100 k (x1) = x t + 0 k (v1) = v t + 0 c 1 =0 remember: 2 nd order ODE can represented as 1 st order

101 integrate position from t to trial midpoint at t+c 2 h using k (v1) (c 2 =1/2) k (x1) = x t + 0 k (v1) = v t + 0 k (x2) = k (x1) + (a 21 * k (v1) * h) a 21 =1/2

102 k (x1) = x t + 0 k (v1) = v t + 0 k (x2) = k (x1) + (a 21 * k (v1) * h) k (v2) = k (v1) + (a 21 * accel(k (x1) ) * h) integrate velocity from t to trial midpoint at t+c 2 h acceleration depends on system state (i.e., position of pendulum)

103 k (x1) = x t + 0 k (v1) = v t + 0 k (x2) = k (x1) + (a 21 * k (v1) * h) k (v2) = k (v1) + (a 21 * accel(k (x1) ) * h) k (x3) = k (x1) + (a 32 * k (v2) * h) a 32 =1/2 integrate position from t to second trial midpoint at t+c 3 h using k (v2) (c 3 =1/2)

104 k (x1) = x t + 0 k (v1) = v t + 0 k (x2) = k (x1) + (a 21 * k (v1) * h) k (v2) = k (v1) + (a 21 * accel(k (x1) ) * h) k (x3) = k (x1) + (a 32 * k (v2) * h) k (v3) = k (v1) + (a 32 * accel(k (x2) ) * h) acceleration depends on system state

105 k (x1) = x t + 0 k (v1) = v t + 0 k (x2) = k (x1) + (a 21 * k (v1) * h) k (v2) = k (v1) + (a 21 * accel(k (x1) ) * h) k (x3) = k (x1) + (a 32 * k (v2) * h) k (v3) = k (v1) + (a 32 * accel(k (x2) ) * h) k (x4) = k (x1) + (a 43 * k (v3) * h) a 43 =1 integrate position from t to trial endpoint at t+c 4 h using k (v3) (c 4 =1)

106 k (x1) = x t + 0 k (v1) = v t + 0 k (x2) = k (x1) + (a 21 * k (v1) * h) k (v2) = k (v1) + (a 21 * accel(k (x1) ) * h) k (x3) = k (x1) + (a 32 * k (v2) * h) k (v3) = k (v1) + (a 32 * accel(k (x2) ) * h) k (x4) = k (x1) + (a 43 * k (v3) * h) k (v4) = k (v1) + (a 43 * accel(k (x3) ) * h)

107 k (x1) = x t + 0 k (v1) = v t + 0 k (x2) = k (x1) + (a 21 * k (v1) * h) k (v2) = k (v1) + (a 21 * accel(k (x1) ) * h) k (x3) = k (x1) + (a 32 * k (v2) * h) k (v3) = k (v1) + (a 32 * accel(k (x2) ) * h) k (x4) = k (x1) + (a 43 * k (v3) * h) k (v4) = k (v1) + (a 43 * accel(k (x3) ) * h) b 1 =1/6, b 2 =1/3, b 3 =1/3, b 4 =1/6 x t+h = x t + h*(b 1 *k (v1) +b 2 *k (v2) +b 3 *k (v3) +b 4 *k (v4) )

108 k (x1) = x t + 0 k (v1) = v t + 0 k (x2) = k (x1) + (a 21 * k (v1) * h) k (v2) = k (v1) + (a 21 * accel(k (x1) ) * h) k (x3) = k (x1) + (a 32 * k (v2) * h) k (v3) = k (v1) + (a 32 * accel(k (x2) ) * h) k (x4) = k (x1) + (a 43 * k (v3) * h) k (v4) = k (v1) + (a 43 * accel(k (x3) ) * h) velocity depends on acceleration a(x) v t+h = v t + h*[b 1 *a(k (x1) )+b 2 *a(k (x2) )+b 3 *a(k (x3) ) +b 4 *a(k (x4) )]

109 Let s see what happens

110 Can we add another link? Double pendulum

111 Locations of pendulum bobs Lagrangian of pendulum bob positions

112 Lagrangian in generalized coordinates (joint angles)

113 Lagrangian equations of motion Lagrangian EOM for i=1

114 Lagrangian equations of motion Lagrangian EOM for i=2

115 The 2 equations of motion for double pendulum Substitute equations into each other to solve for and What happened to the torques?

116 Pendularm2 by oharib

117 Project 2: Pendularm function init() {... pendulum = { // pendulum object length:2.0, mass:2.0, angle:math.pi/2, angle_dot:0.0}; gravity = 9.81; // Earth gravity t = 0; dt = 0.05; // init time pendulum.control = 0; // motor kineval-stencil-f16/master/ project_pendularm/pendularm1.html // next lecture: PID control pendulum.desired = -Math.PI/2.5; pendulum.desired_dot = 0; pendulum.servo = {kp:0, kd:0, ki:0};...}

118 function animate() {... if (numerical_integrator === "euler") { // STENCIL: Euler integrator } else if (numerical_integrator === "verlet") { // STENCIL: basic Verlet integration } else if (numerical_integrator === "velocity verlet") { // STENCIL: velocity Verlet } else if (numerical_integrator === "runge-kutta") { // STENCIL: Runge-Kutta 4 integrator } else { } // set the angle of the pendulum pendulum.geom.rotation.y = pendulum.angle; t = t + dt; // advance time...} function pendulum_acceleration(p,g) { // STENCIL: return acceleration from equations of motion }

119 Next up: Control (although no Janet Jackson)

Game Physics. Game and Media Technology Master Program - Utrecht University. Dr. Nicolas Pronost

Game Physics. Game and Media Technology Master Program - Utrecht University. Dr. Nicolas Pronost Game and Media Technology Master Program - Utrecht University Dr. Nicolas Pronost Rigid body physics Particle system Most simple instance of a physics system Each object (body) is a particle Each particle

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

Solution: (a) Before opening the parachute, the differential equation is given by: dv dt. = v. v(0) = 0

Solution: (a) Before opening the parachute, the differential equation is given by: dv dt. = v. v(0) = 0 Math 2250 Lab 4 Name/Unid: 1. (25 points) A man bails out of an airplane at the altitute of 12,000 ft, falls freely for 20 s, then opens his parachute. Assuming linear air resistance ρv ft/s 2, taking

More information

Multibody simulation

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

More information

Multibody simulation

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

More information

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

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

More information

Video 3.1 Vijay Kumar and Ani Hsieh

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

More information

Lecture Schedule Week Date Lecture (M: 2:05p-3:50, 50-N202)

Lecture Schedule Week Date Lecture (M: 2:05p-3:50, 50-N202) J = x θ τ = J T F 2018 School of Information Technology and Electrical Engineering at the University of Queensland Lecture Schedule Week Date Lecture (M: 2:05p-3:50, 50-N202) 1 23-Jul Introduction + Representing

More information

Rotational & Rigid-Body Mechanics. Lectures 3+4

Rotational & Rigid-Body Mechanics. Lectures 3+4 Rotational & Rigid-Body Mechanics Lectures 3+4 Rotational Motion So far: point objects moving through a trajectory. Next: moving actual dimensional objects and rotating them. 2 Circular Motion - Definitions

More information

Video 2.1a Vijay Kumar and Ani Hsieh

Video 2.1a Vijay Kumar and Ani Hsieh Video 2.1a Vijay Kumar and Ani Hsieh Robo3x-1.3 1 Introduction to Lagrangian Mechanics Vijay Kumar and Ani Hsieh University of Pennsylvania Robo3x-1.3 2 Analytical Mechanics Aristotle Galileo Bernoulli

More information

Lecture Note 12: Dynamics of Open Chains: Lagrangian Formulation

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

More information

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

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

Lecture IV: Time Discretization

Lecture IV: Time Discretization Lecture IV: Time Discretization Motivation Kinematics: continuous motion in continuous time Computer simulation: Discrete time steps t Discrete Space (mesh particles) Updating Position Force induces acceleration.

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

Lecture «Robot Dynamics»: Dynamics and Control

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

More information

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

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

More information

1.053J/2.003J Dynamics and Control I Fall Final Exam 18 th December, 2007

1.053J/2.003J Dynamics and Control I Fall Final Exam 18 th December, 2007 1.053J/2.003J Dynamics and Control I Fall 2007 Final Exam 18 th December, 2007 Important Notes: 1. You are allowed to use three letter-size sheets (two-sides each) of notes. 2. There are five (5) problems

More information

ODE Runge-Kutta methods

ODE Runge-Kutta methods ODE Runge-Kutta methods The theory (very short excerpts from lectures) First-order initial value problem We want to approximate the solution Y(x) of a system of first-order ordinary differential equations

More information

Lecture V: The game-engine loop & Time Integration

Lecture V: The game-engine loop & Time Integration Lecture V: The game-engine loop & Time Integration The Basic Game-Engine Loop Previous state: " #, %(#) ( #, )(#) Forces -(#) Integrate velocities and positions Resolve Interpenetrations Per-body change

More information

Università degli Studi di Bari. mechanics 1. Load system determination. Joint load. Stress-strain distribution. Biological response 2/45 3/45

Università degli Studi di Bari. mechanics 1. Load system determination. Joint load. Stress-strain distribution. Biological response 2/45 3/45 Università degli Studi di Bari mechanics 1 Load system determination Joint load Stress-strain distribution Biological response 2/45 3/45 ? 4/45 The human body machine Energy transformation Work development

More information

Lecture «Robot Dynamics»: Dynamics 2

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

More information

Automatic Control Systems. -Lecture Note 15-

Automatic Control Systems. -Lecture Note 15- -Lecture Note 15- Modeling of Physical Systems 5 1/52 AC Motors AC Motors Classification i) Induction Motor (Asynchronous Motor) ii) Synchronous Motor 2/52 Advantages of AC Motors i) Cost-effective ii)

More information

Lecture 19: Calculus of Variations II - Lagrangian

Lecture 19: Calculus of Variations II - Lagrangian Lecture 19: Calculus of Variations II - Lagrangian 1. Key points Lagrangian Euler-Lagrange equation Canonical momentum Variable transformation Maple VariationalCalculus package EulerLagrange 2. Newton's

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

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

6. 3D Kinematics DE2-EA 2.1: M4DE. Dr Connor Myant

6. 3D Kinematics DE2-EA 2.1: M4DE. Dr Connor Myant DE2-EA 2.1: M4DE Dr Connor Myant 6. 3D Kinematics Comments and corrections to connor.myant@imperial.ac.uk Lecture resources may be found on Blackboard and at http://connormyant.com Contents Three-Dimensional

More information

Robot Dynamics II: Trajectories & Motion

Robot Dynamics II: Trajectories & Motion Robot Dynamics II: Trajectories & Motion Are We There Yet? METR 4202: Advanced Control & Robotics Dr Surya Singh Lecture # 5 August 23, 2013 metr4202@itee.uq.edu.au http://itee.uq.edu.au/~metr4202/ 2013

More information

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

WEEK 1 Dynamics of Machinery

WEEK 1 Dynamics of Machinery WEEK 1 Dynamics of Machinery References Theory of Machines and Mechanisms, J.J. Uicker, G.R.Pennock ve J.E. Shigley, 2003 Makine Dinamiği, Prof. Dr. Eres SÖYLEMEZ, 2013 Uygulamalı Makine Dinamiği, Jeremy

More information

Objectives. Fundamentals of Dynamics: Module 9 : Robot Dynamics & controls. Lecture 31 : Robot dynamics equation (LE & NE methods) and examples

Objectives. Fundamentals of Dynamics: Module 9 : Robot Dynamics & controls. Lecture 31 : Robot dynamics equation (LE & NE methods) and examples \ Module 9 : Robot Dynamics & controls Lecture 31 : Robot dynamics equation (LE & NE methods) and examples Objectives In this course you will learn the following Fundamentals of Dynamics Coriolis component

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

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

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

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

More information

PowerPoints organized by Dr. Michael R. Gustafson II, Duke University

PowerPoints organized by Dr. Michael R. Gustafson II, Duke University Part 6 Chapter 20 Initial-Value Problems PowerPoints organized by Dr. Michael R. Gustafson II, Duke University All images copyright The McGraw-Hill Companies, Inc. Permission required for reproduction

More information

MEAM 520. More Velocity Kinematics

MEAM 520. More Velocity Kinematics MEAM 520 More Velocity Kinematics Katherine J. Kuchenbecker, Ph.D. General Robotics, Automation, Sensing, and Perception Lab (GRASP) MEAM Department, SEAS, University of Pennsylvania Lecture 12: October

More information

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

1 Introduction. 2 Process description

1 Introduction. 2 Process description 1 Introduction This document describes the backround and theory of the Rotary Inverted Pendulum laboratory excercise. The purpose of this laboratory excercise is to familiarize the participants with state

More information

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

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

More information

Physics 8 Friday, October 20, 2017

Physics 8 Friday, October 20, 2017 Physics 8 Friday, October 20, 2017 HW06 is due Monday (instead of today), since we still have some rotation ideas to cover in class. Pick up the HW07 handout (due next Friday). It is mainly rotation, plus

More information

Solution: (a) Before opening the parachute, the differential equation is given by: dv dt. = v. v(0) = 0

Solution: (a) Before opening the parachute, the differential equation is given by: dv dt. = v. v(0) = 0 Math 2250 Lab 4 Name/Unid: 1. (35 points) Leslie Leroy Irvin bails out of an airplane at the altitude of 16,000 ft, falls freely for 20 s, then opens his parachute. Assuming linear air resistance ρv ft/s

More information

Computational and mathematical modeling of an industrialautomobile robot: a multi-purpose case of study

Computational and mathematical modeling of an industrialautomobile robot: a multi-purpose case of study Issue 2, Volume 5, 2011 91 Computational and mathematical modeling of an industrialautomobile robot: a multi-purpose case of study J. Alejandro Betancur Abstract Nowadays, in automobile industry are found

More information

CS 480/680: GAME ENGINE PROGRAMMING

CS 480/680: GAME ENGINE PROGRAMMING CS 480/680: GAME ENGINE PROGRAMMING PHYSICS 2/14/2013 Santiago Ontañón santi@cs.drexel.edu https://www.cs.drexel.edu/~santi/teaching/2013/cs480-680/intro.html Outline Student Presentations Basics on Rigid

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

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

Screw Theory and its Applications in Robotics

Screw Theory and its Applications in Robotics Screw Theory and its Applications in Robotics Marco Carricato Group of Robotics, Automation and Biomechanics University of Bologna Italy IFAC 2017 World Congress, Toulouse, France Table of Contents 1.

More information

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

The Dynamics of Fixed Base and Free-Floating Robotic Manipulator

The Dynamics of Fixed Base and Free-Floating Robotic Manipulator The Dynamics of Fixed Base and Free-Floating Robotic Manipulator Ravindra Biradar 1, M.B.Kiran 1 M.Tech (CIM) Student, Department of Mechanical Engineering, Dayananda Sagar College of Engineering, Bangalore-560078

More information

Phys101 Lectures 19, 20 Rotational Motion

Phys101 Lectures 19, 20 Rotational Motion Phys101 Lectures 19, 20 Rotational Motion Key points: Angular and Linear Quantities Rotational Dynamics; Torque and Moment of Inertia Rotational Kinetic Energy Ref: 10-1,2,3,4,5,6,8,9. Page 1 Angular Quantities

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

3- DOF Scara type Robot Manipulator using Mamdani Based Fuzzy Controller

3- DOF Scara type Robot Manipulator using Mamdani Based Fuzzy Controller 659 3- DOF Scara type Robot Manipulator using Mamdani Based Fuzzy Controller Nitesh Kumar Jaiswal *, Vijay Kumar ** *(Department of Electronics and Communication Engineering, Indian Institute of Technology,

More information

Ch. 5: Jacobian. 5.1 Introduction

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

More information

Adaptive Fuzzy PID For The Control Of Ball And Beam System

Adaptive Fuzzy PID For The Control Of Ball And Beam System Adaptive Fuzzy PID For The Control Of Ball And Beam System Shabeer Ali K P₁, Dr. Vijay Kumar₂ ₁ Student, E & CE Department, IIT Roorkee,Roorkee, India ₂ Professor, E & CE Department, IIT Roorkee,Roorkee,

More information

112 Dynamics. Example 5-3

112 Dynamics. Example 5-3 112 Dynamics Gravity Joint 1 Figure 6-7: Remotely driven two d.o.r. planar manipulator. Note that, since no external force acts on the endpoint, the generalized forces coincide with the joint torques,

More information

Instructor (Oussama Khatib):All right. So today, we re going to the Alps. [Video Playing]

Instructor (Oussama Khatib):All right. So today, we re going to the Alps. [Video Playing] IntroductionToRobotics-Lecture12 Instructor (Oussama Khatib):All right. So today, we re going to the Alps. [Video Playing] An innovative Space Rover with extended climbing abilities. Switzerland. Autonomous

More information

Dynamic Model of a Badminton Stroke

Dynamic Model of a Badminton Stroke ISEA 28 CONFERENCE Dynamic Model of a Badminton Stroke M. Kwan* and J. Rasmussen Department of Mechanical Engineering, Aalborg University, 922 Aalborg East, Denmark Phone: +45 994 9317 / Fax: +45 9815

More information

AB-267 DYNAMICS & CONTROL OF FLEXIBLE AIRCRAFT

AB-267 DYNAMICS & CONTROL OF FLEXIBLE AIRCRAFT FLÁIO SILESTRE DYNAMICS & CONTROL OF FLEXIBLE AIRCRAFT LECTURE NOTES LAGRANGIAN MECHANICS APPLIED TO RIGID-BODY DYNAMICS IMAGE CREDITS: BOEING FLÁIO SILESTRE Introduction Lagrangian Mechanics shall be

More information

Contents. Objectives Torque on an Object Rotational Kinetic Energy Yo yo Rolling on an Incline Physical Pendulum Angular Momentum and Torque Recap

Contents. Objectives Torque on an Object Rotational Kinetic Energy Yo yo Rolling on an Incline Physical Pendulum Angular Momentum and Torque Recap Physics 121 for Majors Class 21 Rotating Objects Last Class We learned to find angular momentum and torques of point masses and objects. We learned how to use torques and forces to solve problems with

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

Control of Robotic Manipulators

Control of Robotic Manipulators Control of Robotic Manipulators Set Point Control Technique 1: Joint PD Control Joint torque Joint position error Joint velocity error Why 0? Equivalent to adding a virtual spring and damper to the joints

More information

ME451 Kinematics and Dynamics of Machine Systems

ME451 Kinematics and Dynamics of Machine Systems ME451 Kinematics and Dynamics of Machine Systems Introduction to Dynamics 6.3.4, 6.6 November 25, 2014 Dan Negrut ME451, Fall 2014 University of Wisconsin-Madison Quote of the day: Marge, don't discourage

More information

Chapter 3 Numerical Methods

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

More information

The Jacobian. Jesse van den Kieboom

The Jacobian. Jesse van den Kieboom The Jacobian Jesse van den Kieboom jesse.vandenkieboom@epfl.ch 1 Introduction 1 1 Introduction The Jacobian is an important concept in robotics. Although the general concept of the Jacobian in robotics

More information

Euler-Lagrange's equations in several variables

Euler-Lagrange's equations in several variables Euler-Lagrange's equations in several variables So far we have studied one variable and its derivative Let us now consider L2:1 More:1 Taylor: 226-227 (This proof is slightly more general than Taylor's.)

More information

Multibody dynamics of mechanism with secondary system

Multibody dynamics of mechanism with secondary system University of Iowa Iowa Research Online Theses and Dissertations Spring 212 Multibody dynamics of mechanism with secondary system Jun Hyeak Choi University of Iowa Copyright 212 Jun Choi This thesis is

More information

MA 102 Mathematics II Lecture Feb, 2015

MA 102 Mathematics II Lecture Feb, 2015 MA 102 Mathematics II Lecture 1 20 Feb, 2015 Differential Equations An equation containing derivatives is called a differential equation. The origin of differential equations Many of the laws of nature

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

Ordinary Differential Equations II

Ordinary Differential Equations II Ordinary Differential Equations II CS 205A: Mathematical Methods for Robotics, Vision, and Graphics Justin Solomon CS 205A: Mathematical Methods Ordinary Differential Equations II 1 / 33 Almost Done! Last

More information

Trajectory Planning from Multibody System Dynamics

Trajectory Planning from Multibody System Dynamics Trajectory Planning from Multibody System Dynamics Pierangelo Masarati Politecnico di Milano Dipartimento di Ingegneria Aerospaziale Manipulators 2 Manipulator: chain of

More information

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

Ordinary Differential Equations II

Ordinary Differential Equations II Ordinary Differential Equations II CS 205A: Mathematical Methods for Robotics, Vision, and Graphics Justin Solomon CS 205A: Mathematical Methods Ordinary Differential Equations II 1 / 29 Almost Done! No

More information

Physics 8 Friday, October 25, 2013

Physics 8 Friday, October 25, 2013 Physics 8 Friday, October 25, 2013 Hold on to your HW8 paper. Don t turn it in yet! What we covered in class this week went much more slowly than I had expected. We spent a lot of time discussing the ideas

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

PowerPoints organized by Dr. Michael R. Gustafson II, Duke University

PowerPoints organized by Dr. Michael R. Gustafson II, Duke University Part 6 Chapter 20 Initial-Value Problems PowerPoints organized by Dr. Michael R. Gustafson II, Duke University All images copyright The McGraw-Hill Companies, Inc. Permission required for reproduction

More information

Chapter 8. Rotational Motion

Chapter 8. Rotational Motion Chapter 8 Rotational Motion The Action of Forces and Torques on Rigid Objects In pure translational motion, all points on an object travel on parallel paths. The most general motion is a combination of

More information

3. A bicycle tire of radius 0.33 m and a mass 1.5 kg is rotating at 98.7 rad/s. What torque is necessary to stop the tire in 2.0 s?

3. A bicycle tire of radius 0.33 m and a mass 1.5 kg is rotating at 98.7 rad/s. What torque is necessary to stop the tire in 2.0 s? Practice 8A Torque 1. Find the torque produced by a 3.0 N force applied at an angle of 60.0 to a door 0.25 m from the hinge. What is the maximum torque this force could exert? 2. If the torque required

More information

8 Velocity Kinematics

8 Velocity Kinematics 8 Velocity Kinematics Velocity analysis of a robot is divided into forward and inverse velocity kinematics. Having the time rate of joint variables and determination of the Cartesian velocity of end-effector

More information

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

Lecture 38: Equations of Rigid-Body Motion

Lecture 38: Equations of Rigid-Body Motion Lecture 38: Equations of Rigid-Body Motion It s going to be easiest to find the equations of motion for the object in the body frame i.e., the frame where the axes are principal axes In general, we can

More information

Logistic Map, Euler & Runge-Kutta Method and Lotka-Volterra Equations

Logistic Map, Euler & Runge-Kutta Method and Lotka-Volterra Equations Logistic Map, Euler & Runge-Kutta Method and Lotka-Volterra Equations S. Y. Ha and J. Park Department of Mathematical Sciences Seoul National University Sep 23, 2013 Contents 1 Logistic Map 2 Euler and

More information

Introduction MEAM 535. What is MEAM 535? Audience. Advanced topics in dynamics

Introduction MEAM 535. What is MEAM 535? Audience. Advanced topics in dynamics What is MEAM 535? Advanced topics in dynamics Audience Review of Newtonian mechanics MEAM 535 Introduction Analytical mechanics: Lagrangian and Hamiltonian Special topics: Stability of dynamical systems,

More information

Lecture 14. Rotational dynamics Torque. Give me a lever long enough and a fulcrum on which to place it, and I shall move the world.

Lecture 14. Rotational dynamics Torque. Give me a lever long enough and a fulcrum on which to place it, and I shall move the world. Lecture 14 Rotational dynamics Torque Give me a lever long enough and a fulcrum on which to place it, and I shall move the world. Archimedes, 87 1 BC EXAM Tuesday March 6, 018 8:15 PM 9:45 PM Today s Topics:

More information

Robotics I Kinematics, Dynamics and Control of Robotic Manipulators. Velocity Kinematics

Robotics I Kinematics, Dynamics and Control of Robotic Manipulators. Velocity Kinematics Robotics I Kinematics, Dynamics and Control of Robotic Manipulators Velocity Kinematics Dr. Christopher Kitts Director Robotic Systems Laboratory Santa Clara University Velocity Kinematics So far, we ve

More information

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

Three-Dimensional Biomechanical Analysis of Human Movement

Three-Dimensional Biomechanical Analysis of Human Movement Three-Dimensional Biomechanical Analysis of Human Movement Anthropometric Measurements Motion Data Acquisition Force Platform Body Mass & Height Biomechanical Model Moments of Inertia and Locations of

More information

Physical Simulation. October 19, 2005

Physical Simulation. October 19, 2005 Physical Simulation October 19, 2005 Objects So now that we have objects, lets make them behave like real objects Want to simulate properties of matter Physical properties (dynamics, kinematics) [today

More information

ME751 Advanced Computational Multibody Dynamics

ME751 Advanced Computational Multibody Dynamics ME751 Advanced Computational Multibody Dynamics Inverse Dynamics Equilibrium Analysis Various Odd Ends March 18, 2010 Dan Negrut, 2010 ME751, UW-Madison Action speaks louder than words but not nearly as

More information

SIMULATION OF OPEN-LOOP MULTIBODY SYSTEMS WITH TIME-VARYING TOPOLOGY:

SIMULATION OF OPEN-LOOP MULTIBODY SYSTEMS WITH TIME-VARYING TOPOLOGY: Proceedings of MUSME 2005, the International Symposium on Multibody Systems and Mechatronics Uberlandia (Brazil), 6-9 March 2005 Paper n.xx-musme05 SIMULATION OF OPEN-LOOP MULTIBODY SYSTEMS WITH TIME-VARYING

More information

Exercise 1b: Differential Kinematics of the ABB IRB 120

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

More information

Chapter 5. The Laws of Motion

Chapter 5. The Laws of Motion Chapter 5 The Laws of Motion The Laws of Motion The description of an object in motion included its position, velocity, and acceleration. There was no consideration of what might influence that motion.

More information

Quantitative Skills and Advanced Calculus Topics in AP Physics C: Mechanics

Quantitative Skills and Advanced Calculus Topics in AP Physics C: Mechanics in AP Physics C: This chapter focuses on some of the quantitative skills that are important in your AP Physics C: course. These are not all of the skills that you will learn, practice, and apply during

More information

Balancing of an Inverted Pendulum with a SCARA Robot

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

More information

Quadrotor Modeling and Control

Quadrotor Modeling and Control 16-311 Introduction to Robotics Guest Lecture on Aerial Robotics Quadrotor Modeling and Control Nathan Michael February 05, 2014 Lecture Outline Modeling: Dynamic model from first principles Propeller

More information

Robotics I Midterm classroom test November 24, 2017

Robotics I Midterm classroom test November 24, 2017 xercise [8 points] Robotics I Midterm classroom test November, 7 Consider the -dof (RPR) planar robot in ig., where the joint coordinates r = ( r r r have been defined in a free, arbitrary way, with reference

More information

Lecture 9 - Rotational Dynamics

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

More information

Dynamics. Dynamics of mechanical particle and particle systems (many body systems)

Dynamics. Dynamics of mechanical particle and particle systems (many body systems) Dynamics Dynamics of mechanical particle and particle systems (many body systems) Newton`s first law: If no net force acts on a body, it will move on a straight line at constant velocity or will stay at

More information

DYNAMICS OF PARALLEL MANIPULATOR

DYNAMICS OF PARALLEL MANIPULATOR DYNAMICS OF PARALLEL MANIPULATOR The 6nx6n matrices of manipulator mass M and manipulator angular velocity W are introduced below: M = diag M 1, M 2,, M n W = diag (W 1, W 2,, W n ) From this definitions

More information

Autonomous Mobile Robot Design

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

More information

Circular Motion. Conceptual Physics 11 th Edition. Circular Motion Tangential Speed

Circular Motion. Conceptual Physics 11 th Edition. Circular Motion Tangential Speed Conceptual Physics 11 th Edition Circular Motion Rotational Inertia Torque Center of Mass and Center of Gravity Centripetal Force Centrifugal Force Chapter 8: ROTATION Rotating Reference Frames Simulated

More information

Articulated body dynamics

Articulated body dynamics Articulated rigid bodies Articulated body dynamics Beyond human models How would you represent a pose? Quadraped animals Wavy hair Animal fur Plants Maximal vs. reduced coordinates How are things connected?

More information