Robot Arm Transformations, Path Planning, and Trajectories!

Size: px
Start display at page:

Download "Robot Arm Transformations, Path Planning, and Trajectories!"

Transcription

1 Robot Arm Transformations, Path Planning, and Trajectories Robert Stengel Robotics and Intelligent Systems MAE 345, Princeton University, 217 Forward and inverse kinematics Path planning Voronoi diagrams and Delaunay triangulation Probabilistic Road Map Rapidly Exploring Random Tree Closed-form trajectories; connecting the dots Polynomials and splines Acceleration profiles Copyright 217 by Robert Stengel. All rights reserved. For educational use only. 1 Manipulator Maneuvering Spaces Joint space: Vector of joint variables, e.g., r J = waist shoulder elbow wrist bend flange wrist twist End-effecter space: Vector of end-effecter positions, e.g., r E = x tool y tool z tool tool tool tool Task space: Vector of task-dependent positions, e.g., locating a symmetric grinding tool above a horizontal surface: r T = x tool y tool z tool tool tool T T T 2

2 Forward and Inverse Transformations of a Robotic Assembly Forward Transformation Transforms homogeneous coordinates from tool frame to reference frame coordinates s base = A base tool s tool = A waist A shoulder A elbow A wristbend A flange A wristtwist s tool Inverse Transformation Transform homogeneous coordinate from reference frame to tool frame coordinates s tool = A tool base s base = A 1 wristtwista 1 flangea 1 wristbenda 1 elbowa 1 shouldera 1 waists base 3 Forward and Inverse Kinematics Between Joints, Tool Position, and Tool Orientation Forward Kinematic Problem: Compute the position of the tool in the reference frame that corresponds to a given joint vector (i.e., vector of link variables) s base = A waist A shoulder A elbow A wristbend A flange A wristtwist s tool = A base tool s tool To Be Determined Given Inverse Kinematic Problem: Find the vector of link variables that corresponds to a desired task-dependent position A waist A shoulder A elbow A wristbend A flange A wristtwist s tool = A base tool s = s base To Be Determined Given 4

3 Forward and Inverse Kinematics Single-Link Example Forward Kinematic Problem: Specify task-dependent position that corresponds to a given joint variable ( = n ) s n1 = A( z n1, n )A( z n1,d n )A( x n1,l n )A( x n1, n ) s n = cos n sin n cos n sin n sin n l n cos n sin n cos n cos n cos n sin n l n sin n sin n cos n d n 1 ) ) ) ) () s n Red: Known Blue: Unknown 5 Forward and Inverse Kinematics Single-Link Example Inverse Problem: Find the joint variable,, that corresponds to a desired task-dependent position s n1 = A( z n1, n )A( z n1,)a( x n1,l n )A( x n1,9 ) s n = cos n sin n l n cos n sin n cos n l n sin n 1 1 ( ( ( ( s n Red: Known Blue: Unknown x n1 = x n cos n + z n sin n + l n cos n y n1 = x n sin n z n cos n + l n sin n In this simple case, check by elimination and inverse trig functions 6

4 Manipulator Redundancy and Degeneracy More than one link configuration may provide a given end point Redundancy: Finite number of joint vectors provide the same task-dependent vector Degeneracy: Infinite number of joint vectors provide the same task-dependent vector Co-linear joint axes are degenerate 7 Why? Space Robot Arms are Highly Redundant 8

5 Transformations for a Two-Link Manipulator cos 1 sin 1 H 1 = sin 1 cos 1 1 ( ( ( ; r = l 1 ( ( ( Example: Type 1 Two-Link Manipulator, neglecting offset (e.g., Puma geometry without waist and wrist) A 1 = 1 H r ( ) 1 = cos 1 sin 1 (l 1 (sin 1 cos A 2 1 = 2 H 1 r 1 ( ) 1 = cos 2 sin 2 (l 2 (sin 2 cos Position of Distal Joint Relative to the Base (2-link manipulator) B = s base = = x y z 1 base cos B (sin B l 1 cos 1 + l 2 cos B = A 1 A 1 sin 2 s distal = B cos B l 1 sin 1 + l 2 sin B 1 1 l 1 cos 1 + l 2 cos B l 1 sin 1 + l 2 sin B 1 1 distal 1

6 Path Planning Baxter Path Planning (UNC, 214) 11 Path Planning Environment idealization and nominal path Trajectory decomposition and segmentation Well-defined Start and Goal Waypoints Path primitives (line, circle, etc.) Timing and coordination Obstacle detection and avoidance Feasibility and regulation Optimization and constraint 12

7 Path Planning with Waypoints Define Start, Goal, and Waypoints by position and time Connect the dots Various interpolation methods Straight lines Polynomials Splines Generate associated velocity and acceleration Satisfy trajectory constraints 13 Path Planning with Obstacles and Destinations Given set of points, e.g., obstacles, destinations, or centroids of multiple points Chart best path from start to goal Tessellation (tiling) of decision space 2-D Voronoi diagram Polygons with sides equidistant to two nearest points (black dots) Voronoi diagram 14

8 Delaunay Triangulation Constructs the Voronoi Diagram Threats/obstacles are black points Edges (black) connect all triplets of black points lying on circumferences of empty circles, i.e., circles containing no other black points Circumcircle centers are red points Voronoi segment boundaries (red) connect centers and are perpendicular to each edge Delaunay_triangulation 15 Voronoi Diagrams in Path Planning Threat/obstacle avoidance Choose path with farthest distance from obstacles 16

9 Path Planning with Potential Fields Map features attract or repel path from Start to Goal, e.g., +/ gravity fields 17 Path Planning on Occupancy Grid Admissible and Inadmissible Blocks Identify feasible paths from Start to Goal Chose path that best satisfies criteria, e.g., Simplicity of calculation Lowest cost Highest performance 18

10 Bug Path Planning 1) Identify shortest unconstrained path from Start to Goal, i.e., green path 2) Chose path that navigates the boundary 1) Stays as close as to possible to unconstrained path (dashed line) 2) Satisfies constraint 3) Follows simple rule, e.g., stay to the left 19 D* or A* Path Planning (TBD) Determine occupancy cost of each block Chose path from Start to Goal that Reduce occupancy cost with each step 2

11 Probabilistic Road Map (PRM) Construct random configuration of admissible points Connect admissible points to nearest neighbors Assess incremental cost of traveling along each edge between points Query to find all feasible paths from Start to Goal Select lowest cost path 21 Rapidly Exploring Random Tree (RRT*) Space-filling tree evolves from Start Open-loop trajectories with state constraints Initially feasible solution converges to optimal solution through searching Committed trajectories Branch-and-bound tree adaptation 22

12 Trajectories 23 One-Dimensional Trajectory Constant Velocity, v Velocity, v(t) vs. t, is constant v( t) = x ( t) = v( ) Position, x(t) vs. t, is a straight line x( t) = x( ) + v( )t 24

13 One-Dimensional Trajectory Constant Velocity, v Position specified at and t x t = 1 1 t Velocity at to be determined = 1 1 t 1 x t = 1 1 t 1 t x t 25 One-Dimensional Trajectory Constant Acceleration, a Velocity, v(t) vs. t, is a straight line v( t) = x ( t) = v( ) + at Position, x(t) vs. t, is a parabola x( t) = x( ) + v( t) + at

14 One-Dimensional Trajectory Constant Acceleration, a Position specified at and t; velocity specified at x t = 1 1 t t a Acceleration at to be determined a 1 = 1 t t x t = t 2 2 t 2 2 t x t 27 One-Dimensional Trajectory Constant Jerk, j, = Derivative of Acceleration, a Acceleration, a(t) vs. t, is a straight line a( t) = v ( t) = x ( t) = a( ) + jt Velocity, v(t) vs. t, is a parabola v( t) = x ( t) = v( ) + a( )t + jt 2 2 Position, x(t) vs. t, is cubic x( t) = x( ) + v( )t + a( )t jt

15 One-Dimensional Trajectory Constant Jerk, j Position and velocity specified at and t; acceleration and jerk at to be determined x t v t = 1 1 t t 2 2 t t t 2 2 a j 29 One-Dimensional Trajectory Constant Jerk, j Find a() and j to produce desired position and velocity a j = Start Finish Start Finish x t v t 1 1 t t 2 2 t t t 2 2 = t t 2 2 t t t 2 2 x t v t = a j Start Start TBD TBD Inverse of (4 x 4) relationship defines required a() and j t 2 6 t 2 4 t 2 t 12 t 3 12 t 3 6 t 2 6 t 2 x t v t 3

16 Further Derivatives Snap, s, = Derivative of Jerk, j Crackle, c, = Derivative of Snap, s What is the derivative of Crackle? Pop 31 One-Dimensional Trajectory Constant Crackle, c Snap, s(t) vs. t, is linear in time = d j( t) s t dt = +s + ct Jerk, j(t) vs. t, is quadratic j( t) = a ( t) = j( ) + s( )t + ct 2 2 Acceleration, a(t) vs. t, is cubic a( t) = v ( t) = x ( t) = a( ) + j( )t + s( )t ct

17 One-Dimensional Trajectory with Constant Crackle, c Velocity, v(t) vs. t, is quartic v( t) = x ( t) = v( ) + a( )t + jt s( )t ct 4 24 Position, x(t) vs. t, is quintic x( t) = x( ) + v( )t + a( )t j( )t s( )t ct One-Dimensional Trajectory with Constant Crackle, c Position, velocity, and acceleration specified at and t x t v t a a t = 1 1 t t 2 2 t 3 6 t 4 24 t t t 2 2 t 3 6 t t t 2 2 t 3 6 a j s c 34

18 One-Dimensional Trajectory Inverse of (6 x 6) relationship defines controls a j s c = 1 1 t t 2 2 t 3 6 t 4 24 t t t 2 2 t 3 6 t t t 2 2 t x t v t a a t a j s c = t 3 6 t 3 36 t 2 24 t 2 9 t 3 t 36 t 4 36 t t t 3 36 t 2 24 t 2 72 t 5 72 t 5 36 t 4 36 t 4 6 t 3 6 t 3 x t v t a a t 35 One-Dimensional Trajectory Eliminate unnecessary equations and define acceleration constants j s c 6 t 3 6 t 3 36 t 2 24 t 2 9 t 3 t = 36 t 4 36 t t t 3 36 t 2 24 t 2 72 t 5 72 t 5 36 t 4 36 t 4 6 t 3 6 t 3 x t v t a a t Corresponding acceleration and force are specified by a( t) = a( ) + j( )t + s( )t ct 3 6 = a control ( t) + a gravity ( t) + a disturbance ( t) = f control t + f gravity ( t) + f disturbance ( t) m t 36

19 One-Dimensional Trajectory Calculate trajectory components, given acceleration constants x t v t a t = 1 t t 2 2 t 3 6 t 4 24 t t t 2 2 t 3 6 t t t 2 2 t 3 6 a j s c Example Calculate constants for x() =, x(1) = = Calculate trajectory, given constants for t f = 1 1 x t v t a t = 1 t t 2 2 t 3 6 t 4 24 t t t 2 2 t 3 6 t t t 2 2 t

20 1-D Example a net ( t) = ( ) +.6t.36t t Examples with Different End Conditions v(1) = 1 v(1) = 1, a(1) = 2 4

21 Sensitivity to Errors 1 error in Crackle 41 Constrained 1-D Trajectories v( t) v max a net ( t) a max What are the alternatives for achieving desired end conditions? 42

22 Alternatives for Reaching End Position Increase end time Lower max/min values of velocity and acceleration Fatten velocity and acceleration profiles Multi-segment trajectory Unconstrained arcs Constrained arcs (velocity and/or acceleration held constant 43 Connect the Dots Interpolation Piecewise polynomials (linear -> quintic) End-point discontinuities End-point constraints Parabolic blend Single polynomial through all points Polynomial degree = of points Sensitivity to high-degree terms (e.g., ct 6 ) Possibility of large excursions between points Polynomials through adjacent points e.g., cubic B splines Kriging 44

23 Next Time: Time Response of Dynamic Systems 45 Supplemental Material 46

24 Joint Variables for Different Link Types Joint Variable = n Joint Variable = n Joint Variable = n Joint Variable = n Joint Variable = d n Joint Variable = n Joint Variable = n Joint Variable = d n 47 Position of Distal Joint Relative to the Base (2-link manipulator) Tool Plate Suppose a tool plate is fixed to the distal joint at (x y z) distalt ; then s base = x y z 1 base cos B (sin B l 1 cos 1 + l 2 cos B = A 1 A 1 sin 2 s distal = B cos B l 1 sin 1 + l 2 sin B 1 1 x cos B ( ysin B + l 1 cos 1 + l 2 cos B xsin = B + ycos B + l 1 sin 1 + l 2 sin B z 1 Alternatively, straightforward trigonometry could be used in this example x y z 1 distal 48

25 Tool Plates and Jaws Tool Changer v=g8zqooledhyfeature=related Four-Bar Linkage and 2 nd Set of Jaws Another Tool Changer v=lkpnt_nudlcfeature=related 49 Robot Arms for Space Dextre Manipulator, ISS Canadarm2, ISS Curiosity Robot Arm Kibo Arm, ISS 5

26 Snake-Like Manipulator Multi-Jointed Arms Octopus Arms OctArm Tentacle Arm 51 DNA Microarray- Spotting Robot DNA strands representing different genes are spotted on a microscope slide Finished slide is used to analyze DNA from tissue samples 52

27 American Android Multi-Arm UGV (David Handelman, *89) Voronoi Diagrams in Data Processing Computer graphics textures (2-D and 3-D meshes) Density characterization (3-D mesh) Vector quantization in data compression 54

28 One-Dimensional Trajectory with Constant Kix, k Position, velocity, acceleration, and jerk specified at and t 1 v( ) 1 1 a( ) 1 j( ) = 18 /( 19t 4 ) 18 / ( 19t 4 ) 168 / ( 19t 3 ) 12 / ( 19t 3 ) 36 / ( t 2 ) 96 / ( 19t 2 ) 156 / 19t s( ) 144 / ( 19t 5 ) 144 / ( 19t 5 ) 1116 / ( 19t 4 ) 324 / ( 19t 4 ) 192 / ( t 3 ) 312 / ( 19t 3 ) 564 / 19t 2 c( ) 54 / 19t p( ) ( 6 ) 54 / ( 19t 6 ) 288 / ( 19t 5 ) 216 / ( 19t 5 ) 36 / ( t 4 ) 324 / ( 19t 4 ) 72 / 19t 3 k( ) 72 / ( 19t 7 ) 72 / ( 19t 7 ) 216 / ( 19t 6 ) 54 / ( 19t 6 ) 144 / ( 19t 5 ) 6 / 19t 4 12 / ( 19t) 96 / ( 19t 2 ) 12 / ( 19t 3 ) 18 / ( 19t 4 ) x( t) v( ) v( t) a( ) a( t) j( ) j( t ) Snap, crackle, pop, and kix computed One-Dimensional Trajectory Inverse of (8 x 8) relationship defines controls x t v t a a t j j t = 1 1 t t 2 2 t 3 6 t 4 24 t 5 12 t 6 6 t t t 2 2 t 3 6 t 4 24 t 5 12 t t t 2 2 t 3 6 t 6 6 t t t 2 2 t 3 6 t 4 24 a j s c p k

13 Path Planning Cubic Path P 2 P 1. θ 2

13 Path Planning Cubic Path P 2 P 1. θ 2 13 Path Planning Path planning includes three tasks: 1 Defining a geometric curve for the end-effector between two points. 2 Defining a rotational motion between two orientations. 3 Defining a time function

More information

Lecture 8: Kinematics: Path and Trajectory Planning

Lecture 8: Kinematics: Path and Trajectory Planning Lecture 8: Kinematics: Path and Trajectory Planning Concept of Configuration Space c Anton Shiriaev. 5EL158: Lecture 8 p. 1/20 Lecture 8: Kinematics: Path and Trajectory Planning Concept of Configuration

More information

Inverse differential kinematics Statics and force transformations

Inverse differential kinematics Statics and force transformations Robotics 1 Inverse differential kinematics Statics and force transformations Prof Alessandro De Luca Robotics 1 1 Inversion of differential kinematics! find the joint velocity vector that realizes a desired

More information

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

Time Response of Dynamic Systems! Multi-Dimensional Trajectories Position, velocity, and acceleration are vectors

Time Response of Dynamic Systems! Multi-Dimensional Trajectories Position, velocity, and acceleration are vectors Time Response of Dynamic Systems Robert Stengel Robotics and Intelligent Systems MAE 345, Princeton University, 217 Multi-dimensional trajectories Numerical integration Linear and nonlinear systems Linearization

More information

Introduction to Optimization!

Introduction to Optimization! Introduction to Optimization! Robert Stengel! Robotics and Intelligent Systems, MAE 345, Princeton University, 2017 Optimization problems and criteria Cost functions Static optimality conditions Examples

More information

Robotics I. February 6, 2014

Robotics I. February 6, 2014 Robotics I February 6, 214 Exercise 1 A pan-tilt 1 camera sensor, such as the commercial webcams in Fig. 1, is mounted on the fixed base of a robot manipulator and is used for pointing at a (point-wise)

More information

Programming Robots in ROS Slides adapted from CMU, Harvard and TU Stuttgart

Programming Robots in ROS Slides adapted from CMU, Harvard and TU Stuttgart Programming Robots in ROS Slides adapted from CMU, Harvard and TU Stuttgart Path Planning Problem Given an initial configuration q_start and a goal configuration q_goal,, we must generate the best continuous

More information

GENG2140, S2, 2012 Week 7: Curve fitting

GENG2140, S2, 2012 Week 7: Curve fitting GENG2140, S2, 2012 Week 7: Curve fitting Curve fitting is the process of constructing a curve, or mathematical function, f(x) that has the best fit to a series of data points Involves fitting lines and

More information

Vectors and Coordinate Systems

Vectors and Coordinate Systems Vectors and Coordinate Systems In Newtonian mechanics, we want to understand how material bodies interact with each other and how this affects their motion through space. In order to be able to make quantitative

More information

Robotics I. April 1, the motion starts and ends with zero Cartesian velocity and acceleration;

Robotics I. April 1, the motion starts and ends with zero Cartesian velocity and acceleration; Robotics I April, 6 Consider a planar R robot with links of length l = and l =.5. he end-effector should move smoothly from an initial point p in to a final point p fin in the robot workspace so that the

More information

MA 323 Geometric Modelling Course Notes: Day 07 Parabolic Arcs

MA 323 Geometric Modelling Course Notes: Day 07 Parabolic Arcs MA 323 Geometric Modelling Course Notes: Day 07 Parabolic Arcs David L. Finn December 9th, 2004 We now start considering the basic curve elements to be used throughout this course; polynomial curves and

More information

Robotics 1 Inverse kinematics

Robotics 1 Inverse kinematics Robotics 1 Inverse kinematics Prof. Alessandro De Luca Robotics 1 1 Inverse kinematics what are we looking for? direct kinematics is always unique; how about inverse kinematics for this 6R robot? Robotics

More information

Figure 2.1 The Inclined Plane

Figure 2.1 The Inclined Plane PHYS-101 LAB-02 One and Two Dimensional Motion 1. Objectives The objectives of this experiment are: to measure the acceleration due to gravity using one-dimensional motion, i.e. the motion of an object

More information

Math Review for AP Calculus

Math Review for AP Calculus Math Review for AP Calculus This course covers the topics shown below. Students navigate learning paths based on their level of readiness. Institutional users may customize the scope and sequence to meet

More information

Math Prep for Statics

Math Prep for Statics Math Prep for Statics This course covers the topics shown below. Students navigate learning paths based on their level of readiness. Institutional users may customize the scope and sequence to meet curricular

More information

MATH 32A: MIDTERM 1 REVIEW. 1. Vectors. v v = 1 22

MATH 32A: MIDTERM 1 REVIEW. 1. Vectors. v v = 1 22 MATH 3A: MIDTERM 1 REVIEW JOE HUGHES 1. Let v = 3,, 3. a. Find e v. Solution: v = 9 + 4 + 9 =, so 1. Vectors e v = 1 v v = 1 3,, 3 b. Find the vectors parallel to v which lie on the sphere of radius two

More information

AS and A level Further mathematics contents lists

AS and A level Further mathematics contents lists AS and A level Further mathematics contents lists Contents Core Pure Mathematics Book 1/AS... 2 Core Pure Mathematics Book 2... 4 Further Pure Mathematics 1... 6 Further Pure Mathematics 2... 8 Further

More information

Arsène Pérard-Gayot (Slides by Piotr Danilewski)

Arsène Pérard-Gayot (Slides by Piotr Danilewski) Computer Graphics - Splines - Arsène Pérard-Gayot (Slides by Piotr Danilewski) CURVES Curves Explicit y = f x f: R R γ = x, f x y = 1 x 2 Implicit F x, y = 0 F: R 2 R γ = x, y : F x, y = 0 x 2 + y 2 =

More information

Path Planning based on Bézier Curve for Autonomous Ground Vehicles

Path Planning based on Bézier Curve for Autonomous Ground Vehicles Path Planning based on Bézier Curve for Autonomous Ground Vehicles Ji-wung Choi Computer Engineering Department University of California Santa Cruz Santa Cruz, CA95064, US jwchoi@soe.ucsc.edu Renwick Curry

More information

2009 Assessment Report. Mathematics Level 2

2009 Assessment Report. Mathematics Level 2 National Certificate of Educational Achievement 2009 Assessment Report Mathematics Level 2 90284 Manipulate algebraic expressions and solve equations 90285 Draw straightforward non linear graphs 90286

More information

1 Trajectory Generation

1 Trajectory Generation CS 685 notes, J. Košecká 1 Trajectory Generation The material for these notes has been adopted from: John J. Craig: Robotics: Mechanics and Control. This example assumes that we have a starting position

More information

PreCalculus. Curriculum (447 topics additional topics)

PreCalculus. Curriculum (447 topics additional topics) PreCalculus This course covers the topics shown below. Students navigate learning paths based on their level of readiness. Institutional users may customize the scope and sequence to meet curricular needs.

More information

Copyright 2018 UC Regents and ALEKS Corporation. ALEKS is a registered trademark of ALEKS Corporation. 2/10

Copyright 2018 UC Regents and ALEKS Corporation. ALEKS is a registered trademark of ALEKS Corporation. 2/10 Prep for Calculus This course covers the topics outlined below. You can customize the scope and sequence of this course to meet your curricular needs. Curriculum (281 topics + 125 additional topics) Real

More information

Robotics I. June 6, 2017

Robotics I. June 6, 2017 Robotics I June 6, 217 Exercise 1 Consider the planar PRPR manipulator in Fig. 1. The joint variables defined therein are those used by the manufacturer and do not correspond necessarily to a Denavit-Hartenberg

More information

Robotics. Path Planning. Marc Toussaint U Stuttgart

Robotics. Path Planning. Marc Toussaint U Stuttgart Robotics Path Planning Path finding vs. trajectory optimization, local vs. global, Dijkstra, Probabilistic Roadmaps, Rapidly Exploring Random Trees, non-holonomic systems, car system equation, path-finding

More information

Smooth Path Generation Based on Bézier Curves for Autonomous Vehicles

Smooth Path Generation Based on Bézier Curves for Autonomous Vehicles Smooth Path Generation Based on Bézier Curves for Autonomous Vehicles Ji-wung Choi, Renwick E. Curry, Gabriel Hugh Elkaim Abstract In this paper we present two path planning algorithms based on Bézier

More information

Prep for College Algebra with Trigonometry

Prep for College Algebra with Trigonometry Prep for College Algebra with Trigonometry This course covers the topics outlined below. You can customize the scope and sequence of this course to meet your curricular needs. Curriculum (246 topics +

More information

Robotics 1 Inverse kinematics

Robotics 1 Inverse kinematics Robotics 1 Inverse kinematics Prof. Alessandro De Luca Robotics 1 1 Inverse kinematics what are we looking for? direct kinematics is always unique; how about inverse kinematics for this 6R robot? Robotics

More information

Trigonometry I. Pythagorean theorem: WEST VIRGINIA UNIVERSITY Physics

Trigonometry I. Pythagorean theorem: WEST VIRGINIA UNIVERSITY Physics Trigonometry I Pythagorean theorem: Trigonometry II 90 180 270 360 450 540 630 720 sin(x) and cos(x) are mathematical functions that describe oscillations. This will be important later, when we talk about

More information

Robotics. Path Planning. University of Stuttgart Winter 2018/19

Robotics. Path Planning. University of Stuttgart Winter 2018/19 Robotics Path Planning Path finding vs. trajectory optimization, local vs. global, Dijkstra, Probabilistic Roadmaps, Rapidly Exploring Random Trees, non-holonomic systems, car system equation, path-finding

More information

Robotics 1 Inverse kinematics

Robotics 1 Inverse kinematics Robotics 1 Inverse kinematics Prof. Alessandro De Luca Robotics 1 1 Inverse kinematics what are we looking for? direct kinematics is always unique; how about inverse kinematics for this 6R robot? Robotics

More information

Particle Motion. Typically, if a particle is moving along the x-axis at any time, t, x()

Particle Motion. Typically, if a particle is moving along the x-axis at any time, t, x() Typically, if a particle is moving along the x-axis at any time, t, x() t represents the position of the particle; along the y-axis, yt () is often used; along another straight line, st () is often used.

More information

MATHEMATICAL MODELLING, MECHANICS AND MOD- ELLING MTHA4004Y

MATHEMATICAL MODELLING, MECHANICS AND MOD- ELLING MTHA4004Y UNIVERSITY OF EAST ANGLIA School of Mathematics Main Series UG Examination 2017 18 MATHEMATICAL MODELLING, MECHANICS AND MOD- ELLING MTHA4004Y Time allowed: 2 Hours Attempt QUESTIONS 1 and 2, and ONE other

More information

From The Picture Book of Quantum Mechanics, S. Brandt and H.D. Dahmen, 4th ed., c 2012 by Springer-Verlag New York.

From The Picture Book of Quantum Mechanics, S. Brandt and H.D. Dahmen, 4th ed., c 2012 by Springer-Verlag New York. 1 Fig. 6.1. Bound states in an infinitely deep square well. The long-dash line indicates the potential energy V (x). It vanishes for d/2 < x < d/2 and is infinite elsewhere. Points x = ±d/2 are indicated

More information

Translational and Rotational Dynamics!

Translational and Rotational Dynamics! Translational and Rotational Dynamics Robert Stengel Robotics and Intelligent Systems MAE 345, Princeton University, 217 Copyright 217 by Robert Stengel. All rights reserved. For educational use only.

More information

CS545 Contents XIII. Trajectory Planning. Reading Assignment for Next Class

CS545 Contents XIII. Trajectory Planning. Reading Assignment for Next Class CS545 Contents XIII Trajectory Planning Control Policies Desired Trajectories Optimization Methods Dynamical Systems Reading Assignment for Next Class See http://www-clmc.usc.edu/~cs545 Learning Policies

More information

Time-Invariant Linear Quadratic Regulators Robert Stengel Optimal Control and Estimation MAE 546 Princeton University, 2015

Time-Invariant Linear Quadratic Regulators Robert Stengel Optimal Control and Estimation MAE 546 Princeton University, 2015 Time-Invariant Linear Quadratic Regulators Robert Stengel Optimal Control and Estimation MAE 546 Princeton University, 15 Asymptotic approach from time-varying to constant gains Elimination of cross weighting

More information

Lecture Note 8: Inverse Kinematics

Lecture Note 8: Inverse Kinematics ECE5463: Introduction to Robotics Lecture Note 8: Inverse Kinematics Prof. Wei Zhang Department of Electrical and Computer Engineering Ohio State University Columbus, Ohio, USA Spring 2018 Lecture 8 (ECE5463

More information

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

SERVOMOTOR SIZING AND APPLICATION. Gary Kirckof, P.E.

SERVOMOTOR SIZING AND APPLICATION. Gary Kirckof, P.E. SERVOMOTOR SIZING AND APPLICATION by Gary Kirckof, P.E. Basic Contents About the Author xvii Introduction xix 1 Kinematics 1 Introduction 1 Rectilinear Motion 2 Position and Distance 2 Velocity and Speed

More information

Mechanics Lecture Notes

Mechanics Lecture Notes Mechanics Lecture Notes Lectures 0 and : Motion in a circle. Introduction The important result in this lecture concerns the force required to keep a particle moving on a circular path: if the radius of

More information

14 F Time Optimal Control

14 F Time Optimal Control 14 F Time Optimal Control The main job of an industrial robot is to move an object on a pre-specified path, rest to rest, repeatedly. To increase productivity, the robot should do its job in minimum time.

More information

Lecture Note 8: Inverse Kinematics

Lecture Note 8: Inverse Kinematics ECE5463: Introduction to Robotics Lecture Note 8: Inverse Kinematics Prof. Wei Zhang Department of Electrical and Computer Engineering Ohio State University Columbus, Ohio, USA Spring 2018 Lecture 8 (ECE5463

More information

VISUAL PHYSICS ONLINE

VISUAL PHYSICS ONLINE VISUAL PHYSICS ONLINE EXCEL SIMULATION MOTION OF SATELLITES DOWNLOAD the MS EXCEL program PA50satellite.xlsx and view the worksheet Display as shown in the figure below. One of the most important questions

More information

Control of Mobile Robots

Control of Mobile Robots Control of Mobile Robots Regulation and trajectory tracking Prof. Luca Bascetta (luca.bascetta@polimi.it) Politecnico di Milano Dipartimento di Elettronica, Informazione e Bioingegneria Organization and

More information

Kinematics in Two Dimensions; Vectors

Kinematics in Two Dimensions; Vectors Kinematics in Two Dimensions; Vectors Vectors & Scalars!! Scalars They are specified only by a number and units and have no direction associated with them, such as time, mass, and temperature.!! Vectors

More information

MECHANICS OF MATERIALS. Prepared by Engr. John Paul Timola

MECHANICS OF MATERIALS. Prepared by Engr. John Paul Timola MECHANICS OF MATERIALS Prepared by Engr. John Paul Timola Mechanics of materials branch of mechanics that studies the internal effects of stress and strain in a solid body. stress is associated with the

More information

Chapter 4. Motion in Two Dimensions

Chapter 4. Motion in Two Dimensions Chapter 4 Motion in Two Dimensions Kinematics in Two Dimensions Will study the vector nature of position, velocity and acceleration in greater detail Will treat projectile motion and uniform circular motion

More information

Squigonometry (doing trig on a squircle)

Squigonometry (doing trig on a squircle) (doing trig on a squircle) http://www.southernct.edu/~fields/ abstract outline The point of radian measure (although this probably isn t apparent when we first learn it) is to give a parameterization of

More information

Aircraft Flight Dynamics!

Aircraft Flight Dynamics! Aircraft Flight Dynamics Robert Stengel MAE 331, Princeton University, 2016 Course Overview Introduction to Flight Dynamics Math Preliminaries Copyright 2016 by Robert Stengel. All rights reserved. For

More information

Chapter 2 One-Dimensional Kinematics. Copyright 2010 Pearson Education, Inc.

Chapter 2 One-Dimensional Kinematics. Copyright 2010 Pearson Education, Inc. Chapter 2 One-Dimensional Kinematics Units of Chapter 2 Position, Distance, and Displacement Average Speed and Velocity Instantaneous Velocity Acceleration Motion with Constant Acceleration Applications

More information

Prep for College Algebra

Prep for College Algebra Prep for College Algebra This course covers the topics outlined below. You can customize the scope and sequence of this course to meet your curricular needs. Curriculum (219 topics + 85 additional topics)

More information

CAMBRIDGE IGCSE MATHS EXAMINATION BOARD COVERAGE

CAMBRIDGE IGCSE MATHS EXAMINATION BOARD COVERAGE CAMBRIDGE IGCSE MATHS EXAMINATION BOARD COVERAGE TIER TOPIC HEADING SUB HEADING Both Number Integers Ordering numbers Both Number Integers Rounding numbers Both Number Integers Adding and subtracting whole

More information

Interpolated Rigid-Body Motions and Robotics

Interpolated Rigid-Body Motions and Robotics Interpolated Rigid-Body Motions and Robotics J.M. Selig London South Bank University and Yuanqing Wu Shanghai Jiaotong University. IROS Beijing 2006 p.1/22 Introduction Interpolation of rigid motions important

More information

AP* Circular & Gravitation Free Response Questions

AP* Circular & Gravitation Free Response Questions 1992 Q1 AP* Circular & Gravitation Free Response Questions A 0.10-kilogram solid rubber ball is attached to the end of a 0.80-meter length of light thread. The ball is swung in a vertical circle, as shown

More information

DYNAMICS OF PARALLEL MANIPULATOR

DYNAMICS OF PARALLEL MANIPULATOR DYNAMICS OF PARALLEL MANIPULATOR PARALLEL MANIPULATORS 6-degree of Freedom Flight Simulator BACKGROUND Platform-type parallel mechanisms 6-DOF MANIPULATORS INTRODUCTION Under alternative robotic mechanical

More information

AP PHYSICS 1 UNIT 4 / FINAL 1 PRACTICE TEST

AP PHYSICS 1 UNIT 4 / FINAL 1 PRACTICE TEST AP PHYSICS 1 UNIT 4 / FINAL 1 PRACTICE TEST NAME FREE RESPONSE PROBLEMS Put all answers on this test. Show your work for partial credit. Circle or box your answers. Include the correct units and the correct

More information

Trajectory Planning of Planar Tracked Vehicles

Trajectory Planning of Planar Tracked Vehicles Trajectory Planning of Planar Tracked Vehicles Zvi Shiller and William Serate Department of Mechanical, Aerospace and Nuclear Engineering University of California Los Angeles Los Angeles, California 924

More information

Uniform Circular Motion

Uniform Circular Motion Slide 1 / 112 Uniform Circular Motion 2009 by Goodman & Zavorotniy Slide 2 / 112 Topics of Uniform Circular Motion (UCM) Kinematics of UCM Click on the topic to go to that section Period, Frequency, and

More information

MECH 314 Dynamics of Mechanisms February 17, 2011 Offset Slider Crank Analysis and Some Other Slider Systems

MECH 314 Dynamics of Mechanisms February 17, 2011 Offset Slider Crank Analysis and Some Other Slider Systems MCH 314 ynamics of Mechanisms February 17, 011 ffset Slider Crank nalysis and Some ther Slider Systems 1 ffset Slider Crank Position nalysis Position and velocity analysis for the common slider-crank has

More information

Further Pure Mathematics FP1 (AS) Unit FP1

Further Pure Mathematics FP1 (AS) Unit FP1 Further Pure Mathematics FP1 (AS) Unit FP1 3 Coordinate systems Cartesian equations for the parabola and rectangular hyperbola. Students should be familiar with the equations: y 2 = 4ax or x = at 2, y

More information

Automatic Control Motion planning

Automatic Control Motion planning Automatic Control Motion planning (luca.bascetta@polimi.it) Politecnico di Milano Dipartimento di Elettronica, Informazione e Bioingegneria Motivations 2 Electric motors are used in many different applications,

More information

Research Article Simplified Robotics Joint-Space Trajectory Generation with a via Point Using a Single Polynomial

Research Article Simplified Robotics Joint-Space Trajectory Generation with a via Point Using a Single Polynomial Robotics Volume, Article ID 75958, 6 pages http://dx.doi.org/.55//75958 Research Article Simplified Robotics Joint-Space Trajectory Generation with a via Point Using a Single Polynomial Robert L. Williams

More information

The Grade Descriptors below are used to assess work and student progress in Mathematics from Year 7 to

The Grade Descriptors below are used to assess work and student progress in Mathematics from Year 7 to Jersey College for Girls Assessment criteria for KS3 and KS4 Mathematics In Mathematics, students are required to become familiar, confident and competent with a range of content and procedures described

More information

CHAPTER 11:PART 1 THE DESCRIPTION OF HUMAN MOTION

CHAPTER 11:PART 1 THE DESCRIPTION OF HUMAN MOTION CHAPTER 11:PART 1 THE DESCRIPTION OF HUMAN MOTION KINESIOLOGY Scientific Basis of Human Motion, 12 th edition Hamilton, Weimar & Luttgens Presentation Created by TK Koesterer, Ph.D., ATC Humboldt State

More information

Computational Geometry

Computational Geometry Voronoi diagrams Voronoi diagram Given some trees, seen from above, which region will they occupy? Voronoi diagram Given some trees, seen from above, which region will they occupy? Voronoi diagram Given

More information

AP Physics C Mechanics Objectives

AP Physics C Mechanics Objectives AP Physics C Mechanics Objectives I. KINEMATICS A. Motion in One Dimension 1. The relationships among position, velocity and acceleration a. Given a graph of position vs. time, identify or sketch a graph

More information

Chapter 1- Polynomial Functions

Chapter 1- Polynomial Functions Chapter 1- Polynomial Functions Lesson Package MHF4U Chapter 1 Outline Unit Goal: By the end of this unit, you will be able to identify and describe some key features of polynomial functions, and make

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

Chapter 3 Acceleration

Chapter 3 Acceleration Chapter 3 Acceleration Slide 3-1 Chapter 3: Acceleration Chapter Goal: To extend the description of motion in one dimension to include changes in velocity. This type of motion is called acceleration. Slide

More information

Kinematics in Two Dimensions; 2D- Vectors

Kinematics in Two Dimensions; 2D- Vectors Kinematics in Two Dimensions; 2D- Vectors Addition of Vectors Graphical Methods Below are two example vector additions of 1-D displacement vectors. For vectors in one dimension, simple addition and subtraction

More information

Time-Invariant Linear Quadratic Regulators!

Time-Invariant Linear Quadratic Regulators! Time-Invariant Linear Quadratic Regulators Robert Stengel Optimal Control and Estimation MAE 546 Princeton University, 17 Asymptotic approach from time-varying to constant gains Elimination of cross weighting

More information

1 Introduction. 2 Successive Convexification Algorithm

1 Introduction. 2 Successive Convexification Algorithm 1 Introduction There has been growing interest in cooperative group robotics [], with potential applications in construction and assembly. Most of this research focuses on grounded or mobile manipulator

More information

Chapter 4. Motion in Two Dimensions. Professor Wa el Salah

Chapter 4. Motion in Two Dimensions. Professor Wa el Salah Chapter 4 Motion in Two Dimensions Kinematics in Two Dimensions Will study the vector nature of position, velocity and acceleration in greater detail. Will treat projectile motion and uniform circular

More information

Advanced Robotic Manipulation

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

More information

Lab: Vectors. You are required to finish this section before coming to the lab. It will be checked by one of the lab instructors when the lab begins.

Lab: Vectors. You are required to finish this section before coming to the lab. It will be checked by one of the lab instructors when the lab begins. Lab: Vectors Lab Section (circle): Day: Monday Tuesday Time: 8:00 9:30 1:10 2:40 Name Partners Pre-Lab You are required to finish this section before coming to the lab. It will be checked by one of the

More information

Maths for Map Makers

Maths for Map Makers SUB Gottingen 7 210 050 861 99 A 2003 Maths for Map Makers by Arthur Allan Whittles Publishing Contents /v Chapter 1 Numbers and Calculation 1.1 1.2 1.3 1.4 1.5 1.6 1.7 1.8 1.9 1.10 1.11 1.12 1.13 1.14

More information

Review of Lectures 1, 2 and 3

Review of Lectures 1, 2 and 3 Physics 22000 General Physics Lecture 4 Applying Newton s Laws Fall 2016 Semester Prof. Matthew Jones 1 Review of Lectures 1, 2 and 3 Algebraic description of linear motion with constant acceleration:

More information

Lecture «Robot Dynamics» : Kinematics 3

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

More information

ALGEBRA 2. Background Knowledge/Prior Skills Knows what operation properties hold for operations with matrices

ALGEBRA 2. Background Knowledge/Prior Skills Knows what operation properties hold for operations with matrices ALGEBRA 2 Numbers and Operations Standard: 1 Understands and applies concepts of numbers and operations Power 1: Understands numbers, ways of representing numbers, relationships among numbers, and number

More information

Core Mathematics C1 (AS) Unit C1

Core Mathematics C1 (AS) Unit C1 Core Mathematics C1 (AS) Unit C1 Algebraic manipulation of polynomials, including expanding brackets and collecting like terms, factorisation. Graphs of functions; sketching curves defined by simple equations.

More information

Faculty of Engineering and Department of Physics Engineering Physics 131 Midterm Examination Monday February 24, 2014; 7:00 pm 8:30 pm

Faculty of Engineering and Department of Physics Engineering Physics 131 Midterm Examination Monday February 24, 2014; 7:00 pm 8:30 pm Faculty of Engineering and Department of Physics Engineering Physics 131 Midterm Examination Monday February 4, 014; 7:00 pm 8:30 pm 1. No notes or textbooks allowed.. Formula sheets are included (may

More information

Pythagorean-hodograph curves

Pythagorean-hodograph curves 1 / 24 Pythagorean-hodograph curves V. Vitrih Raziskovalni matematični seminar 20. 2. 2012 2 / 24 1 2 3 4 5 3 / 24 Let r : [a, b] R 2 be a planar polynomial parametric curve ( ) x(t) r(t) =, y(t) where

More information

Algebra and Trigonometry

Algebra and Trigonometry Algebra and Trigonometry 978-1-63545-098-9 To learn more about all our offerings Visit Knewtonalta.com Source Author(s) (Text or Video) Title(s) Link (where applicable) OpenStax Jay Abramson, Arizona State

More information

Return Difference Function and Closed-Loop Roots Single-Input/Single-Output Control Systems

Return Difference Function and Closed-Loop Roots Single-Input/Single-Output Control Systems Spectral Properties of Linear- Quadratic Regulators Robert Stengel Optimal Control and Estimation MAE 546 Princeton University, 2018! Stability margins of single-input/singleoutput (SISO) systems! Characterizations

More information

Robotics, Geometry and Control - A Preview

Robotics, Geometry and Control - A Preview Robotics, Geometry and Control - A Preview Ravi Banavar 1 1 Systems and Control Engineering IIT Bombay HYCON-EECI Graduate School - Spring 2008 Broad areas Types of manipulators - articulated mechanisms,

More information

Algebra 2. Curriculum (384 topics additional topics)

Algebra 2. Curriculum (384 topics additional topics) Algebra 2 This course covers the topics shown below. Students navigate learning paths based on their level of readiness. Institutional users may customize the scope and sequence to meet curricular needs.

More information

Alternative Expressions for the Velocity Vector Velocity restricted to the vertical plane. Longitudinal Equations of Motion

Alternative Expressions for the Velocity Vector Velocity restricted to the vertical plane. Longitudinal Equations of Motion Linearized Longitudinal Equations of Motion Robert Stengel, Aircraft Flig Dynamics MAE 33, 008 Separate solutions for nominal and perturbation flig paths Assume that nominal path is steady and in the vertical

More information

Trajectory planning and feedforward design for electromechanical motion systems version 2

Trajectory planning and feedforward design for electromechanical motion systems version 2 2 Trajectory planning and feedforward design for electromechanical motion systems version 2 Report nr. DCT 2003-8 Paul Lambrechts Email: P.F.Lambrechts@tue.nl April, 2003 Abstract This report considers

More information

Curriculum Area: Mathematics A Level - 2 year course (AQA) Year: 12. Aspire Learn Achieve

Curriculum Area: Mathematics A Level - 2 year course (AQA) Year: 12. Aspire Learn Achieve Topics Core 1 - Algebra Core 1 - Coordinate Geometry Core 1 - Differentiation Core 1 - Integration Year Curriculum - Use and manipulate surds - Quadratic functions and their graphs - The discriminant of

More information

INERTIALIZATION: HIGH-PERFORMANCE ANIMATION TRANSITIONS IN GEARS OF WAR DAVID BOLLO PRINCIPAL SOFTWARE ENGINEER THE COALITION (MICROSOFT STUDIOS)

INERTIALIZATION: HIGH-PERFORMANCE ANIMATION TRANSITIONS IN GEARS OF WAR DAVID BOLLO PRINCIPAL SOFTWARE ENGINEER THE COALITION (MICROSOFT STUDIOS) INERTIALIZATION: HIGH-PERFORMANCE ANIMATION TRANSITIONS IN GEARS OF WAR DAVID BOLLO PRINCIPAL SOFTWARE ENGINEER THE COALITION (MICROSOFT STUDIOS) ANIMATION TRANSITIONS ANIMATION TRANSITIONS Transition

More information

AH Mechanics Checklist (Unit 1) AH Mechanics Checklist (Unit 1) Rectilinear Motion

AH Mechanics Checklist (Unit 1) AH Mechanics Checklist (Unit 1) Rectilinear Motion Rectilinear Motion No. kill Done 1 Know that rectilinear motion means motion in 1D (i.e. along a straight line) Know that a body is a physical object 3 Know that a particle is an idealised body that has

More information

Review 1D motion. Other 1D equations (in table 2-1) are restatements of these

Review 1D motion. Other 1D equations (in table 2-1) are restatements of these Review 1D motion Constant acceleration Position (x) and velocity (v) as a function of time Note when clock starts (t= ), the position and velocity are x and v v = v + at 1 x = x + vt + at Other 1D equations

More information

MAKING MEASUREMENTS. I walk at a rate of paces per...or...my pace =

MAKING MEASUREMENTS. I walk at a rate of paces per...or...my pace = MAKING MEASUREMENTS TIME: The times that are required to work out the problems can be measured using a digital watch with a stopwatch mode or a watch with a second hand. When measuring the period of a

More information

Spiral spline interpolation to a planar spiral

Spiral spline interpolation to a planar spiral Spiral spline interpolation to a planar spiral Zulfiqar Habib Department of Mathematics and Computer Science, Graduate School of Science and Engineering, Kagoshima University Manabu Sakai Department of

More information

Companion. Jeffrey E. Jones

Companion. Jeffrey E. Jones MATLAB7 Companion 1O11OO1O1O1OOOO1O1OO1111O1O1OO 1O1O1OO1OO1O11OOO1O111O1O1O1O1 O11O1O1O11O1O1O1O1OO1O11O1O1O1 O1O1O1111O11O1O1OO1O1O1O1OOOOO O1111O1O1O1O1O1O1OO1OO1OO1OOO1 O1O11111O1O1O1O1O Jeffrey E.

More information

Chapter 4. Motion in Two Dimensions

Chapter 4. Motion in Two Dimensions Chapter 4 Motion in Two Dimensions Kinematics in Two Dimensions Will study the vector nature of position, velocity and acceleration in greater detail Will treat projectile motion and uniform circular motion

More information

EXPLORE Score 9 th Grade. English College Algebra Mathematics Social Sciences Reading

EXPLORE Score 9 th Grade. English College Algebra Mathematics Social Sciences Reading Working with Your Curriculum in Mathematics and the ACT College & Career Readiness Standards T h i s d o c u m e n t p r o v i d e s y o u a n e x a m p l e o f h o w y o u r c u r r i c u l u m i n m

More information

Introduction to Computer Graphics. Modeling (1) April 13, 2017 Kenshi Takayama

Introduction to Computer Graphics. Modeling (1) April 13, 2017 Kenshi Takayama Introduction to Computer Graphics Modeling (1) April 13, 2017 Kenshi Takayama Parametric curves X & Y coordinates defined by parameter t ( time) Example: Cycloid x t = t sin t y t = 1 cos t Tangent (aka.

More information