Centre for Autonomous Systems

Size: px
Start display at page:

Download "Centre for Autonomous Systems"

Transcription

1 Robot Henrik I Centre for Autonomous Systems Kungl Tekniska Högskolan hic@kth.se 27th April 2005

2 Outline 1 duction 2 Kinematic and Constraints 3 Mobile Robot 4 Mobile Robot 5 Beyond Basic 6 Kinematic 7

3 Motion Requirements Kinematic / dynamic model of the robot Model of ground/wheel interaction Definition of required motion velocity / position control Design of control law to satisfy constriants

4 Mobile Robot Model of mechanical behaviour of robot for design and control can be used both for mobile systems and manipulators Manipulators allow direct estimation of position, which is not always true for mobile systems Position to be derived from integration over time Motion is not free. There are constraints to be considered in the design and control generation.

5 Outline 1 duction 2 Kinematic and Constraints 3 Mobile Robot 4 Mobile Robot 5 Beyond Basic 6 Kinematic 7

6 Reference frames Inertial reference frame (I) Robot references frame (R) Robot pose ξ I = x y θ

7 Transformation between reference frames The relation between the references frame is through the standard orthogonal rotation transformation: cos(θ) sin(θ) 0 R(θ) = sin(θ) cos(θ) Enable handling of motion between frames ξ R = R(θ) ξ I

8 Simple 90 rotation Now with ξ R = R(θ) ξ I ξ R = R( π 2 ) ξ I Implies ξ R = R( π 2 ) ξ I = R( π 2 ) = ẋ ẏ θ = ẏ ẋ θ

9 Kinematic modelling Goal: Determine the robot speed ξ = [ ] T ẋ ẏ θ as a function of wheel speed ϕ, steering angle β, steering speed β and the geometric parameters of the robot. Forward kinematics ξ = ẋ ẏ θ = f ( ϕ 1,..., ϕ n, β 1,..., β m, β 1,..., β m ) Inverse kinematics [ ] ϕ 1... ϕ n β 1... β m β 1... β T m = f (ẋ, ẏ, θ) Why not x y θ = f (ϕ 1,..., ϕ n, β 1,..., β m ) the relation is not straight forward. See later.

10 Forward kinematic model differential drive r Assume a set up with two drive wheels. Wheels have radius r, and a places at a distance l from the center. Wheels rotate at speeds ϕ 1 and ϕ 2 Prediction of the motion of the robot motion in the global frame l P l ξ I = ẋ ẏ θ = f (l, r, θ, ϕ 1, ϕ 2 )

11 Differential drive model Given ξ I = R(θ) 1 ξ R Speed of each wheel is r ϕ i, the translational speed is the average velocity ẋ R = r ϕ 1 + ϕ 2 2 The instantaneous rotation of P for one wheel is The total rotation is then ω 1 = r ϕ 1 2l θ = r 2l ( ϕ 1 ϕ 2 )

12 Differential drive model Given ξ I = R(θ) 1 ξ R The full model is then: ξ I = R(θ) 1 r 2 ϕ 1 + ϕ 2 0 ϕ 1 ϕ 2 l The rotation matrix is trivial to invert cos(θ) sin(θ) 0 R(θ) 1 = sin(θ) cos(θ)

13 Differential motion ICCor ICR The Instantaneous Center of Rotation (ICR) or Instantaneous Center of Curvature is relevant. Characterised by rotation ω and radius R: R = l ϕ 1 + ϕ 2 ϕ 1 ϕ 2 With ϕ 1 = ϕ 2 R =

14 Kinematic constraints Assumptions Plane of wheel is always vertical Single point of contact with surface Motion is purely by rolling (no slippage) Rotation of wheel is around the vertical axis

15 Fixed wheel constraint r The motion of the wheel must be in the plane of the wheel Speed of wheel v = r ϕ The motion must then be (rolling constraint): ˆ sin(α + β) cos(α + β) ( l) cos(β) R(θ) ξ I r ϕ = 0 Motion in the orthogonal plane must be zero (sliding constraint), i.e. beta ˆ cos(α + β) sin(α + β) l sin(β) R(θ) ξi = 0 l alpha v Wheels cannot slide sideways! Similar models can be developed for Swedish and Spherical wheels (see the book!)

16 Steering wheel constraint d r The motion of the wheel must be in the plane of the wheel Speed of wheel v = r ϕ, Rotation speed is β The motion must then be (rolling constraint): ˆ sin(α + β) cos(α + β) ( l) cos(β) R(θ) ξ I r ϕ = 0 Motion in the orthogonal plane must be zero (sliding constraint), i.e. beta ˆ cos(α + β) sin(α + β) (d + l) sin(β) R(θ) ξi + β = 0 l alpha d v Rolling constraint similar to fixed wheel, but the sliding constraint is wrt the wheel-contact point

17 Robot Kinematic Constraints Combination of the wheel constraints imposes the overall constraints for the vehicle Differential between fixed and steerable wheels Assume N wheels divided into N f fixed and N s steerable wheels β f is orientation of fixed wheels β s (t) is the steering angle of the controllable wheels Define motion of wheels as: ϕ(t) = [ ϕf (t) ϕ s (t) ]

18 Kinematic constraints The rolling constraints can be collected: where J 1 (β s )R(θ) ξ I J 2 ϕ = 0 [ J 1 (β s ) = J 1f J 1s (β s ) J 1f is an N f 3 constant matrix and J 1s is an N s 3 matrix of constraints. ] J 2 is a diagonal matrix with wheel radii r i A similar set of constraints can be defined for sliding (C)

19 Differential drive constraints example Fusing rolling and sliding constraints we obtain: [ ] [ ] J1 (β s ) R(θ) C 1 (β s ) ξ J2 ϕ I = 0 Assume robot axis along +X R, then α = π 2, and β = π for right wheel and α = π 2 and β = 0 for left wheel

20 Differential drive contraint Resulting in 2» l 4 ˆ 1 0 l 5 R(θ) ξ I = Inverting the equation results in:» J2 ϕ 0 2 ξ I = R(θ) l 3 2 3» 1 0 l 5 1 J2 ϕ = » R(θ) J2 ϕ 1 l l

21 Outline 1 duction 2 Kinematic and Constraints 3 Mobile Robot 4 Mobile Robot 5 Beyond Basic 6 Kinematic 7

22 Degree of mobility The sliding constraints can be separated between fixed and steerable wheels: C 1f R(θ) ξ I = 0 C 1s (β s )R(θ) ξ I = 0 Motion of the robot must belong to the null space of C 1, i.e. C 1 (β s ) m = 0, m null(c 1 ) Constraint is also shown by the instantaneous centre of rotation (ICR) mentioned earlier

23 Instantaneous centre of rotation ICR ICR Ackermann steering Bicycle

24 Mobility constraints The rank(c 1 ) defines the number of independent constraints The degree of mobility is defined by the dimensionality of the null space of C 1 which for a mobile platform is equal to: δ m = dim(null(c 1 )) = 3 rank(c 1 ) Examples: Robot δ m Differential drive 2 Bicycle 1

25 Degree of steerability Steerability is the number of independent DOF that can be controlled δ s = rank(c 1s ) Similarly the degree of maneuverability is defined as δ M = δ m + δ s

26 examples

27 Outline 1 duction 2 Kinematic and Constraints 3 Mobile Robot 4 Mobile Robot 5 Beyond Basic 6 Kinematic 7

28 The / Degree of Freedom :controllable degree of freedom The workspace: the space of possible configurations The velocity space: independent degree of motion that can be controlled. Sometimes referred to as the Differentiable degree of freedom (DDOF). DDOF = δ m. DDOF δ M DOF

29 Holonomic Systems Holonomy is frequently used in robotics Holonomic kinematic constraints: defined by position / pose variables Non-holonomic kinematic constraints: defined by differential variables. The pose cannot be recovered by integration. Non-holonomic systems are also referred to as non-integrable systems.

30 Holonomic systems Example, fixed wheel sliding constraint: [ cos(α + β) sin(α + β) l sin(β) ] R(θ) ξ I = 0 the constraint is in terms of ξ rather the ξ as it constraint the motion not the final configuration. A systems is only holonomic iff DDOF = DOF.

31 Path/trajectory considerations The constraints only define what can be achieved and the limitations. For systems there is a a need to consider how to achieve different configuration. Trajectory planning: partly covered in final lecture Trajectory control/tracking: given a specification how can the robot be moved to achieve the specified trajectory

32 Example of trajectory control

33 Outline 1 duction 2 Kinematic and Constraints 3 Mobile Robot 4 Mobile Robot 5 Beyond Basic 6 Kinematic 7

34 Beyond Basic The above analysis has been performed under a strong set of assumptions: only rolling motion with no sliding Tanks, rigid vehicles, etc use skid steering in which sliding motion is utilized to ensure control of the vehicle. Requires consideration of dynamic models beyond pure kinematics The friction model for interaction between surface and wheel must be considered. High speed motion also requires explicit modelling of system dynamics for the control. Dynamics is a separate field of research in robotics. Beyond the scope of this course.

35 Outline 1 duction 2 Kinematic and Constraints 3 Mobile Robot 4 Mobile Robot 5 Beyond Basic 6 Kinematic 7

36 Kinematic Start Goal

37 Trajectory following Kinematic control is following of a pre-specified trajectory described in terms of positions and velocities Often the trajectory is divided into trajectory segments Simple controllers use a combination of arcs and line segments (as done on American roads). Others use clothoids in which the curvature changes linearly with time, as done on European roads An entire field of robotics is devoted to path planning See for comprehensive / free book on the topic.

38 Feedback control A more appropriate strategy is a trajectory feedback controller that uses the path specification as control points to drive the robot system

39 Problem statement In the robot reference frame the error is e = [x, y, θ] T R The task is now to design a control matrix K [ ] k11 k K = 12 k 13 k k 21 k 22 k ij = k(t, e) 23 Such that [ v(t) ω(t) ] = Ke = K drives the error to zero lim t e(t) = 0 x y θ R

40 The basic setup for control β ρ α θ x

41 Kinematic model Consider a differential drive robot in the inertial frame ẋ cos(θ) 0 [ ] ẏ = sin(θ) 0 v ω θ 0 1 In polar coordinates the error is now ρ = x 2 + y 2 α = θ + atan2( y, x) β = θ α

42 Kinematic control Rephrased in polar coordinates: ρ cos(α) 0 α sin(α) = ρ 1 β sin(α) ρ 0 [ v ω ]

43 The control law the linear control law: v = k ρ ρ ω = k α α + k β β Which generates a closed loop system of: ρ k ρ ρ cos(α) α = k ρ sin(α) k α α k β β β k ρ sin(α)

44 Stability requirement It can be shown that the system is exponentially stable if: k ρ > 0 k β < 0 k α k ρ > 0 Sketch of proof (cos x = 1, sin x = x): ρ α β = k ρ (k α k ρ ) k β 0 k ρ 0 ρ α β

45 Sketch of stability requirement if A has all eigenvalues where the real part is negative it is exponentially stable Characteristic polynomial: (λ + k ρ )(λ 2 + λ(k α k ρ ) k ρ k β )

46 examples

47 Outline 1 duction 2 Kinematic and Constraints 3 Mobile Robot 4 Mobile Robot 5 Beyond Basic 6 Kinematic 7

48 WRAP-UP Brief introduction to kinematic modelling of mobile systems Presentation of constraints and its use in models Example models for robots Brief example of kinematic control

CMPUT 412 Motion Control Wheeled robots. Csaba Szepesvári University of Alberta

CMPUT 412 Motion Control Wheeled robots. Csaba Szepesvári University of Alberta CMPUT 412 Motion Control Wheeled robots Csaba Szepesvári University of Alberta 1 Motion Control (wheeled robots) Requirements Kinematic/dynamic model of the robot Model of the interaction between the wheel

More information

Motion Control (wheeled robots)

Motion Control (wheeled robots) Motion Control (wheeled robots) Requirements for Motion Control Kinematic / dynamic model of the robot Model of the interaction between the wheel and the ground Definition of required motion -> speed control,

More information

10/11/07 1. Motion Control (wheeled robots) Representing Robot Position ( ) ( ) [ ] T

10/11/07 1. Motion Control (wheeled robots) Representing Robot Position ( ) ( ) [ ] T 3 3 Motion Control (wheeled robots) Introduction: Mobile Robot Kinematics Requirements for Motion Control Kinematic / dynamic model of the robot Model of the interaction between the wheel and the ground

More information

BEST2015 Autonomous Mobile Robots Lecture 2: Mobile Robot Kinematics and Control

BEST2015 Autonomous Mobile Robots Lecture 2: Mobile Robot Kinematics and Control BEST2015 Autonomous Mobile Robots Lecture 2: Mobile Robot Kinematics and Control Renaud Ronsse renaud.ronsse@uclouvain.be École polytechnique de Louvain, UCLouvain July 2015 1 Introduction Mobile robot

More information

Mobile Robot Kinematics

Mobile Robot Kinematics Mobile Robot Kinematics Dr. Kurtuluş Erinç Akdoğan kurtuluserinc@cankaya.edu.tr INTRODUCTION Kinematics is the most basic study of how mechanical systems behave required to design to control Manipulator

More information

Robotics (Kinematics) Winter 1393 Bonab University

Robotics (Kinematics) Winter 1393 Bonab University Robotics () Winter 1393 Bonab University : most basic study of how mechanical systems behave Introduction Need to understand the mechanical behavior for: Design Control Both: Manipulators, Mobile Robots

More information

Unit 2: Locomotion Kinematics of Wheeled Robots: Part 3

Unit 2: Locomotion Kinematics of Wheeled Robots: Part 3 Unit 2: Locomotion Kinematics of Wheeled Robots: Part 3 Computer Science 4766/6778 Department of Computer Science Memorial University of Newfoundland January 28, 2014 COMP 4766/6778 (MUN) Kinematics of

More information

Motion Control (wheeled robots)

Motion Control (wheeled robots) 3 Motion Control (wheeled robot) Requirement for Motion Control Kinematic / dynamic model of the robot Model of the interaction between the wheel and the ground Definition of required motion -> peed control,

More information

Fundamental problems in mobile robotics

Fundamental problems in mobile robotics ROBOTICS 01PEEQW Basilio Bona DAUIN Politecnico di Torino Mobile & Service Robotics Kinematics Fundamental problems in mobile robotics Locomotion: how the robot moves in the environment Perception: how

More information

Mobile Robotics. Marcello Restelli. Dipartimento di Elettronica e Informazione Politecnico di Milano tel:

Mobile Robotics. Marcello Restelli. Dipartimento di Elettronica e Informazione Politecnico di Milano   tel: Marcello Restelli Dipartimento di Elettronica e Informazione Politecnico di Milano email: restelli@elet.polimi.it tel: 02-2399-3470 Mobile Robotics Robotica for Computer Engineering students A.A. 2006/2007

More information

Kinematics, Kinematics Chains CS 685

Kinematics, Kinematics Chains CS 685 Kinematics, Kinematics Chains CS 685 Previously Representation of rigid body motion Two different interpretations - as transformations between different coord. frames - as operators acting on a rigid body

More information

17. Wheeled Robots Overview. Part B 17. Guy Campion, Woojin Chung

17. Wheeled Robots Overview. Part B 17. Guy Campion, Woojin Chung 391 17. Wheeled Robots Guy Campion, Woojin Chung The purpose of this chapter is to introduce, analyze, and compare the models of wheeled mobile robots (WMR) and to present several realizations and commonly

More information

EE565:Mobile Robotics Lecture 2

EE565:Mobile Robotics Lecture 2 EE565:Mobile Robotics Lecture 2 Welcome Dr. Ing. Ahmad Kamal Nasir Organization Lab Course Lab grading policy (40%) Attendance = 10 % In-Lab tasks = 30 % Lab assignment + viva = 60 % Make a group Either

More information

Introduction to Robotics

Introduction to Robotics Introduction to Robotics Ph.D. Antonio Marin-Hernandez Artificial Intelligence Department Universidad Veracruzana Sebastian Camacho # 5 Xalapa, Veracruz Robotics Action and Perception LAAS-CNRS 7, av du

More information

Linear algebra deals with matrixes: two-dimensional arrays of values. Here s a matrix: [ x + 5y + 7z 9x + 3y + 11z

Linear algebra deals with matrixes: two-dimensional arrays of values. Here s a matrix: [ x + 5y + 7z 9x + 3y + 11z Basic Linear Algebra Linear algebra deals with matrixes: two-dimensional arrays of values. Here s a matrix: [ 1 5 ] 7 9 3 11 Often matrices are used to describe in a simpler way a series of linear equations.

More information

MEM380 Applied Autonomous Robots Winter Robot Kinematics

MEM380 Applied Autonomous Robots Winter Robot Kinematics MEM38 Applied Autonomous obots Winter obot Kinematics Coordinate Transformations Motivation Ultimatel, we are interested in the motion of the robot with respect to a global or inertial navigation frame

More information

Mobile Robots Locomotion

Mobile Robots Locomotion Mobile Robots Locomotion Institute for Software Technology 1 Course Outline 1. Introduction to Mobile Robots 2. Locomotion 3. Sensors 4. Localization 5. Environment Modelling 6. Reactive Navigation 2 Today

More information

Chapter 4 Dynamics. Part Constrained Kinematics and Dynamics. Mobile Robotics - Prof Alonzo Kelly, CMU RI

Chapter 4 Dynamics. Part Constrained Kinematics and Dynamics. Mobile Robotics - Prof Alonzo Kelly, CMU RI Chapter 4 Dynamics Part 2 4.3 Constrained Kinematics and Dynamics 1 Outline 4.3 Constrained Kinematics and Dynamics 4.3.1 Constraints of Disallowed Direction 4.3.2 Constraints of Rolling without Slipping

More information

Kinematics of Wheeled Robots

Kinematics of Wheeled Robots CSE 390/MEAM 40 Kinematics of Wheeled Robots Professor Vijay Kumar Department of Mechanical Engineering and Applied Mechanics University of Pennsylvania September 16, 006 1 Introduction In this chapter,

More information

Kinematics Modeling of the Amigobot Robot

Kinematics Modeling of the Amigobot Robot Mechanics and Mechanical Engineering Vol. 4, No. (2) 57 64 c Technical University of Lodz Kinematics Modeling of the Amigobot Robot Tomasz Buratowski Department of Robotics and Mechatronics, AGH University

More information

CHAPTER 3 MATHEMATICAL MODEL

CHAPTER 3 MATHEMATICAL MODEL 38 CHAPTER 3 MATHEMATICAL MODEL 3.1 KINEMATIC MODEL 3.1.1 Introduction The kinematic model of a mobile robot, represented by a set of equations, allows estimation of the robot s evolution on its trajectory,

More information

CALCULATING TRANSFORMATIONS OF KINEMATIC CHAINS USING HOMOGENEOUS COORDINATES

CALCULATING TRANSFORMATIONS OF KINEMATIC CHAINS USING HOMOGENEOUS COORDINATES CALCULATING TRANSFORMATIONS OF KINEMATIC CHAINS USING HOMOGENEOUS COORDINATES YINGYING REN Abstract. In this paper, the applications of homogeneous coordinates are discussed to obtain an efficient model

More information

Bearing only visual servo control of a non-holonomic mobile robot. Robert Mahony

Bearing only visual servo control of a non-holonomic mobile robot. Robert Mahony Bearing only visual servo control of a non-holonomic mobile robot. Robert Mahony Department of Engineering, Australian National University, Australia. email: Robert.Mahony@anu.edu.au url: http://engnet.anu.edu.au/depeople/robert.mahony/

More information

Industrial Robots : Manipulators, Kinematics, Dynamics

Industrial Robots : Manipulators, Kinematics, Dynamics Industrial Robots : Manipulators, Kinematics, Dynamics z z y x z y x z y y x x In Industrial terms Robot Manipulators The study of robot manipulators involves dealing with the positions and orientations

More information

Visual Recognition: Image Formation

Visual Recognition: Image Formation Visual Recognition: Image Formation Raquel Urtasun TTI Chicago Jan 5, 2012 Raquel Urtasun (TTI-C) Visual Recognition Jan 5, 2012 1 / 61 Today s lecture... Fundamentals of image formation You should know

More information

1 Differential Drive Kinematics

1 Differential Drive Kinematics CS W4733 NOTES - Differential Drive Robots Note: these notes were compiled from Dudek and Jenkin, Computational Principles of Mobile Robotics. 1 Differential Drive Kinematics Many mobile robots use a drive

More information

Mobile Robotics. Competitions and Opportunities

Mobile Robotics. Competitions and Opportunities Mobile Robotics Administrivia Course web page: http://palantir.swarthmore.edu Syllabus, readings, homework, textbooks, handouts Textbooks: Probabilistic Robotics and Autonomous Mobile Robots Homework:

More information

CS612 - Algorithms in Bioinformatics

CS612 - Algorithms in Bioinformatics Fall 2017 Structural Manipulation November 22, 2017 Rapid Structural Analysis Methods Emergence of large structural databases which do not allow manual (visual) analysis and require efficient 3-D search

More information

Jacobian: Velocities and Static Forces 1/4

Jacobian: Velocities and Static Forces 1/4 Jacobian: Velocities and Static Forces /4 Models of Robot Manipulation - EE 54 - Department of Electrical Engineering - University of Washington Kinematics Relations - Joint & Cartesian Spaces A robot

More information

9. Representing constraint

9. Representing constraint 9. Representing constraint Mechanics of Manipulation Matt Mason matt.mason@cs.cmu.edu http://www.cs.cmu.edu/~mason Carnegie Mellon Lecture 9. Mechanics of Manipulation p.1 Lecture 9. Representing constraint.

More information

Lecture 18 Kinematic Chains

Lecture 18 Kinematic Chains CS 598: Topics in AI - Adv. Computational Foundations of Robotics Spring 2017, Rutgers University Lecture 18 Kinematic Chains Instructor: Jingjin Yu Outline What are kinematic chains? C-space for kinematic

More information

Final Exam Practice Fall Semester, 2012

Final Exam Practice Fall Semester, 2012 COS 495 - Autonomous Robot Navigation Final Exam Practice Fall Semester, 2012 Duration: Total Marks: 70 Closed Book 2 hours Start Time: End Time: By signing this exam, I agree to the honor code Name: Signature:

More information

Graphics and Interaction Transformation geometry and homogeneous coordinates

Graphics and Interaction Transformation geometry and homogeneous coordinates 433-324 Graphics and Interaction Transformation geometry and homogeneous coordinates Department of Computer Science and Software Engineering The Lecture outline Introduction Vectors and matrices Translation

More information

Practical Robotics (PRAC)

Practical Robotics (PRAC) Practical Robotics (PRAC) A Mobile Robot Navigation System (1) - Sensor and Kinematic Modelling Nick Pears University of York, Department of Computer Science December 17, 2014 nep (UoY CS) PRAC Practical

More information

COMP30019 Graphics and Interaction Transformation geometry and homogeneous coordinates

COMP30019 Graphics and Interaction Transformation geometry and homogeneous coordinates COMP30019 Graphics and Interaction Transformation geometry and homogeneous coordinates Department of Computer Science and Software Engineering The Lecture outline Introduction Vectors and matrices Translation

More information

EE Kinematics & Inverse Kinematics

EE Kinematics & Inverse Kinematics Electric Electronic Engineering Bogazici University October 15, 2017 Problem Statement Kinematics: Given c C, find a map f : C W s.t. w = f(c) where w W : Given w W, find a map f 1 : W C s.t. c = f 1

More information

CSC418 / CSCD18 / CSC2504

CSC418 / CSCD18 / CSC2504 5 5.1 Surface Representations As with 2D objects, we can represent 3D objects in parametric and implicit forms. (There are also explicit forms for 3D surfaces sometimes called height fields but we will

More information

Lecture 1 Wheeled Mobile Robots (WMRs)

Lecture 1 Wheeled Mobile Robots (WMRs) Lecture 1 Wheeled Mobile Robots (WMRs) Course Chair: Prof. M. De Cecco Teaching: A. Cesarini Mechatronics Department, University of Trento Email: andrea.cesarini@unitn.it http://www.miro.ing.unitn.it/

More information

MTRX4700 Experimental Robotics

MTRX4700 Experimental Robotics MTRX 4700 : Experimental Robotics Lecture 2 Stefan B. Williams Slide 1 Course Outline Week Date Content Labs Due Dates 1 5 Mar Introduction, history & philosophy of robotics 2 12 Mar Robot kinematics &

More information

Lecture Note 3: Rotational Motion

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

More information

ME 597/747 Autonomous Mobile Robots. Mid Term Exam. Duration: 2 hour Total Marks: 100

ME 597/747 Autonomous Mobile Robots. Mid Term Exam. Duration: 2 hour Total Marks: 100 ME 597/747 Autonomous Mobile Robots Mid Term Exam Duration: 2 hour Total Marks: 100 Instructions: Read the exam carefully before starting. Equations are at the back, but they are NOT necessarily valid

More information

Planning in Mobile Robotics

Planning in Mobile Robotics Planning in Mobile Robotics Part I. Miroslav Kulich Intelligent and Mobile Robotics Group Gerstner Laboratory for Intelligent Decision Making and Control Czech Technical University in Prague Tuesday 26/07/2011

More information

Planar Robot Kinematics

Planar Robot Kinematics V. Kumar lanar Robot Kinematics The mathematical modeling of spatial linkages is quite involved. t is useful to start with planar robots because the kinematics of planar mechanisms is generally much simpler

More information

Computer Animation II

Computer Animation II Computer Animation II Orientation interpolation Dynamics Some slides courtesy of Leonard McMillan and Jovan Popovic Lecture 13 6.837 Fall 2002 Interpolation Review from Thursday Splines Articulated bodies

More information

Non-holonomic Planning

Non-holonomic Planning Non-holonomic Planning Jane Li Assistant Professor Mechanical Engineering & Robotics Engineering http://users.wpi.edu/~zli11 Recap We have learned about RRTs. q new q init q near q rand But the standard

More information

Forward kinematics and Denavit Hartenburg convention

Forward kinematics and Denavit Hartenburg convention Forward kinematics and Denavit Hartenburg convention Prof. Enver Tatlicioglu Department of Electrical & Electronics Engineering Izmir Institute of Technology Chapter 5 Dr. Tatlicioglu (EEE@IYTE) EE463

More information

Kinematic Model of Robot Manipulators

Kinematic Model of Robot Manipulators Kinematic Model of Robot Manipulators Claudio Melchiorri Dipartimento di Ingegneria dell Energia Elettrica e dell Informazione (DEI) Università di Bologna email: claudio.melchiorri@unibo.it C. Melchiorri

More information

MEAM 520. Mobile Robots

MEAM 520. Mobile Robots MEAM 520 Mobile Robots Katherine J. Kuchenbecker, Ph.D. General Robotics, Automation, Sensing, and Perception Lab (GRASP) MEAM Department, SEAS, Universit of Pennslvania Lecture 22: December 6, 2012 T

More information

Robotics I. March 27, 2018

Robotics I. March 27, 2018 Robotics I March 27, 28 Exercise Consider the 5-dof spatial robot in Fig., having the third and fifth joints of the prismatic type while the others are revolute. z O x Figure : A 5-dof robot, with a RRPRP

More information

CS545 Contents IX. Inverse Kinematics. Reading Assignment for Next Class. Analytical Methods Iterative (Differential) Methods

CS545 Contents IX. Inverse Kinematics. Reading Assignment for Next Class. Analytical Methods Iterative (Differential) Methods CS545 Contents IX Inverse Kinematics Analytical Methods Iterative (Differential) Methods Geometric and Analytical Jacobian Jacobian Transpose Method Pseudo-Inverse Pseudo-Inverse with Optimization Extended

More information

Homography-Based Multi-Robot Control with a Flying Camera

Homography-Based Multi-Robot Control with a Flying Camera Citation: G. López-Nicolás, Y. Mezouar, and C. Sagüés. Homography-based multi-robot control with a flying camera. In IEEE International Conference on Robotics and Automation, pp. 4492-4497, Shangai, China,

More information

Torque Distribution and Slip Minimization in an Omnidirectional Mobile Base

Torque Distribution and Slip Minimization in an Omnidirectional Mobile Base Torque Distribution and Slip Minimization in an Omnidirectional Mobile Base Yuan Ping Li, Denny Oetomo, Marcelo H. Ang Jr.* National University of Singapore 1 ent Ridge Crescent, Singapore 1196 *mpeangh@nus.edu.sg

More information

4.1 Radian and Degree Measure

4.1 Radian and Degree Measure 4.1 Radian and Degree Measure Accelerated Pre-Calculus Mr. Niedert Accelerated Pre-Calculus 4.1 Radian and Degree Measure Mr. Niedert 1 / 27 4.1 Radian and Degree Measure 1 Angles Accelerated Pre-Calculus

More information

METR 4202: Advanced Control & Robotics

METR 4202: Advanced Control & Robotics Position & Orientation & State t home with Homogenous Transformations METR 4202: dvanced Control & Robotics Drs Surya Singh, Paul Pounds, and Hanna Kurniawati Lecture # 2 July 30, 2012 metr4202@itee.uq.edu.au

More information

1498. End-effector vibrations reduction in trajectory tracking for mobile manipulator

1498. End-effector vibrations reduction in trajectory tracking for mobile manipulator 1498. End-effector vibrations reduction in trajectory tracking for mobile manipulator G. Pajak University of Zielona Gora, Faculty of Mechanical Engineering, Zielona Góra, Poland E-mail: g.pajak@iizp.uz.zgora.pl

More information

10. Cartesian Trajectory Planning for Robot Manipulators

10. Cartesian Trajectory Planning for Robot Manipulators V. Kumar 0. Cartesian rajectory Planning for obot Manipulators 0.. Introduction Given a starting end effector position and orientation and a goal position and orientation we want to generate a smooth trajectory

More information

ROBOTICS: ADVANCED CONCEPTS & ANALYSIS

ROBOTICS: ADVANCED CONCEPTS & ANALYSIS ROBOTICS: ADVANCED CONCEPTS & ANALYSIS MODULE 9 MODELING AND ANALYSIS OF WHEELED MOBILE ROBOTS Ashitava Ghosal 1 1 Department of Mechanical Engineering & Centre for Product Design and Manufacture Indian

More information

EEE 187: Robotics Summary 2

EEE 187: Robotics Summary 2 1 EEE 187: Robotics Summary 2 09/05/2017 Robotic system components A robotic system has three major components: Actuators: the muscles of the robot Sensors: provide information about the environment and

More information

WORKSPACE AGILITY FOR ROBOTIC ARM Karna Patel

WORKSPACE AGILITY FOR ROBOTIC ARM Karna Patel ISSN 30-9135 1 International Journal of Advance Research, IJOAR.org Volume 4, Issue 1, January 016, Online: ISSN 30-9135 WORKSPACE AGILITY FOR ROBOTIC ARM Karna Patel Karna Patel is currently pursuing

More information

Configuration Space. Chapter 2

Configuration Space. Chapter 2 Chapter 2 Configuration Space A typical robot is mechanically constructed from several bodies, or links, that are connected by various types of joints. The robot moves when certain joints are driven by

More information

Introduction to Robotics

Introduction to Robotics Université de Strasbourg Introduction to Robotics Bernard BAYLE, 2013 http://eavr.u-strasbg.fr/ bernard Modelling of a SCARA-type robotic manipulator SCARA-type robotic manipulators: introduction SCARA-type

More information

Generalizing the Dubins and Reeds-Shepp cars: fastest paths for bounded-velocity mobile robots

Generalizing the Dubins and Reeds-Shepp cars: fastest paths for bounded-velocity mobile robots Generalizing the Dubins and Reeds-Shepp cars: fastest paths for bounded-velocity mobile robots Andrei A. Furtuna, Devin J. Balkcom Hamidreza Chitsaz, Paritosh Kavathekar Abstract What is the shortest or

More information

DETC THREE-DIMENSIONAL KINEMATIC ANALYSIS OF THE ACTUATED SPOKE WHEEL ROBOT. September 10-13, 2006, Philadelphia, Pennsylvania, USA

DETC THREE-DIMENSIONAL KINEMATIC ANALYSIS OF THE ACTUATED SPOKE WHEEL ROBOT. September 10-13, 2006, Philadelphia, Pennsylvania, USA Proceedings Proceedings of IDETC/CIE of IDETC 06 2006 ASME 2006 ASME International International Design Design Engineering Engineering Technical Technical Conferences Conferences & September Computers

More information

E80. Experimental Engineering. Lecture 9 Inertial Measurement

E80. Experimental Engineering. Lecture 9 Inertial Measurement Lecture 9 Inertial Measurement http://www.volker-doormann.org/physics.htm Feb. 19, 2013 Christopher M. Clark Where is the rocket? Outline Sensors People Accelerometers Gyroscopes Representations State

More information

Cobots

Cobots Cobots http://cobot.com Michael Peshkin J. Edward Colgate Witaya Wannasuphoprasit ( Wit ) Intelligent Assist Devices IADs use computer control of motion to create functionality greater than that of conventional

More information

CS283: Robotics Fall 2016: Sensors

CS283: Robotics Fall 2016: Sensors CS283: Robotics Fall 2016: Sensors Sören Schwertfeger / 师泽仁 ShanghaiTech University Robotics ShanghaiTech University - SIST - 23.09.2016 2 REVIEW TRANSFORMS Robotics ShanghaiTech University - SIST - 23.09.2016

More information

The Path-of-Probability Algorithm for Steering and Feedback Control of Flexible Needles. Wooram Park, Yunfeng Wang, and Gregory S.

The Path-of-Probability Algorithm for Steering and Feedback Control of Flexible Needles. Wooram Park, Yunfeng Wang, and Gregory S. The Path-of-Probability Algorithm for Steering and Feedback Control of Flexible Needles Wooram Park, Yunfeng Wang, and Gregory S. Chirikjian Abstract In this paper we develop a new framework for path planning

More information

Kinematics of Closed Chains

Kinematics of Closed Chains Chapter 7 Kinematics of Closed Chains Any kinematic chain that contains one or more loops is called a closed chain. Several examples of closed chains were encountered in Chapter 2, from the planar four-bar

More information

Waypoint Navigation with Position and Heading Control using Complex Vector Fields for an Ackermann Steering Autonomous Vehicle

Waypoint Navigation with Position and Heading Control using Complex Vector Fields for an Ackermann Steering Autonomous Vehicle Waypoint Navigation with Position and Heading Control using Complex Vector Fields for an Ackermann Steering Autonomous Vehicle Tommie J. Liddy and Tien-Fu Lu School of Mechanical Engineering; The University

More information

Fall 2016 Semester METR 3113 Atmospheric Dynamics I: Introduction to Atmospheric Kinematics and Dynamics

Fall 2016 Semester METR 3113 Atmospheric Dynamics I: Introduction to Atmospheric Kinematics and Dynamics Fall 2016 Semester METR 3113 Atmospheric Dynamics I: Introduction to Atmospheric Kinematics and Dynamics Lecture 5 August 31 2016 Topics: Polar coordinate system Conversion of polar coordinates to 2-D

More information

ME 115(b): Final Exam, Spring

ME 115(b): Final Exam, Spring ME 115(b): Final Exam, Spring 2011-12 Instructions 1. Limit your total time to 5 hours. That is, it is okay to take a break in the middle of the exam if you need to ask me a question, or go to dinner,

More information

3D Computer Vision II. Reminder Projective Geometry, Transformations. Nassir Navab. October 27, 2009

3D Computer Vision II. Reminder Projective Geometry, Transformations. Nassir Navab. October 27, 2009 3D Computer Vision II Reminder Projective Geometr, Transformations Nassir Navab based on a course given at UNC b Marc Pollefes & the book Multiple View Geometr b Hartle & Zisserman October 27, 29 2D Transformations

More information

Session #5 2D Mechanisms: Mobility, Kinematic Analysis & Synthesis

Session #5 2D Mechanisms: Mobility, Kinematic Analysis & Synthesis Session #5 2D Mechanisms: Mobility, Kinematic Analysis & Synthesis Courtesy of Design Simulation Technologies, Inc. Used with permission. Dan Frey Today s Agenda Collect assignment #2 Begin mechanisms

More information

Robot Inverse Kinematics Asanga Ratnaweera Department of Mechanical Engieering

Robot Inverse Kinematics Asanga Ratnaweera Department of Mechanical Engieering PR 5 Robot Dynamics & Control /8/7 PR 5: Robot Dynamics & Control Robot Inverse Kinematics Asanga Ratnaweera Department of Mechanical Engieering The Inverse Kinematics The determination of all possible

More information

3-D D Euclidean Space - Vectors

3-D D Euclidean Space - Vectors 3-D D Euclidean Space - Vectors Rigid Body Motion and Image Formation A free vector is defined by a pair of points : Jana Kosecka http://cs.gmu.edu/~kosecka/cs682.html Coordinates of the vector : 3D Rotation

More information

MCE/EEC 647/747: Robot Dynamics and Control. Lecture 3: Forward and Inverse Kinematics

MCE/EEC 647/747: Robot Dynamics and Control. Lecture 3: Forward and Inverse Kinematics MCE/EEC 647/747: Robot Dynamics and Control Lecture 3: Forward and Inverse Kinematics Denavit-Hartenberg Convention Reading: SHV Chapter 3 Mechanical Engineering Hanz Richter, PhD MCE503 p.1/12 Aims of

More information

Kinematics. Kinematics analyzes the geometry of a manipulator, robot or machine motion. The essential concept is a position.

Kinematics. Kinematics analyzes the geometry of a manipulator, robot or machine motion. The essential concept is a position. Kinematics Kinematics analyzes the geometry of a manipulator, robot or machine motion. The essential concept is a position. 1/31 Statics deals with the forces and moments which are aplied on the mechanism

More information

NMT EE 589 & UNM ME 482/582 ROBOT ENGINEERING. Dr. Stephen Bruder NMT EE 589 & UNM ME 482/582

NMT EE 589 & UNM ME 482/582 ROBOT ENGINEERING. Dr. Stephen Bruder NMT EE 589 & UNM ME 482/582 ROBOT ENGINEERING Dr. Stephen Bruder Course Information Robot Engineering Classroom UNM: Woodward Hall room 147 NMT: Cramer 123 Schedule Tue/Thur 8:00 9:15am Office Hours UNM: After class 10am Email bruder@aptec.com

More information

Ch. 7.4, 7.6, 7.7: Complex Numbers, Polar Coordinates, ParametricFall equations / 17

Ch. 7.4, 7.6, 7.7: Complex Numbers, Polar Coordinates, ParametricFall equations / 17 Ch. 7.4, 7.6, 7.7: Complex Numbers, Polar Coordinates, Parametric equations Johns Hopkins University Fall 2014 Ch. 7.4, 7.6, 7.7: Complex Numbers, Polar Coordinates, ParametricFall equations 2014 1 / 17

More information

Motion Planning for a Reversing Full-Scale Truck and Trailer System

Motion Planning for a Reversing Full-Scale Truck and Trailer System Master of Science Thesis in Department of Electrical Engineering, Linköping University, 216 Motion Planning for a Reversing Full-Scale Truck and Trailer System Olov Holmer Master of Science Thesis in Motion

More information

Formation Control of Nonholonomic Mobile Robots with Omnidirectional Visual Servoing and Motion Segmentation

Formation Control of Nonholonomic Mobile Robots with Omnidirectional Visual Servoing and Motion Segmentation Formation Control of Nonholonomic Mobile Robots with Omnidirectional Visual Servoing and Motion Segmentation René Vidal Omid Shakernia Shankar Sastry Department of Electrical Engineering & Computer Sciences

More information

ECE569 Fall 2015 Solution to Problem Set 2

ECE569 Fall 2015 Solution to Problem Set 2 ECE569 Fall 2015 Solution to Problem Set 2 These problems are from the textbook by Spong et al. 1, which is the textbook for the ECE580 this Fall 2015 semester. As such, many of the problem statements

More information

Jane Li. Assistant Professor Mechanical Engineering Department, Robotic Engineering Program Worcester Polytechnic Institute

Jane Li. Assistant Professor Mechanical Engineering Department, Robotic Engineering Program Worcester Polytechnic Institute Jane Li Assistant Professor Mechanical Engineering Department, Robotic Engineering Program Worcester Polytechnic Institute We know how to describe the transformation of a single rigid object w.r.t. a single

More information

Singularity Handling on Puma in Operational Space Formulation

Singularity Handling on Puma in Operational Space Formulation Singularity Handling on Puma in Operational Space Formulation Denny Oetomo, Marcelo Ang Jr. National University of Singapore Singapore d oetomo@yahoo.com mpeangh@nus.edu.sg Ser Yong Lim Gintic Institute

More information

Exercise 1: Kinematics of the ABB IRB 120

Exercise 1: Kinematics of the ABB IRB 120 Exercise 1: Kinematics of the ABB IRB 120 Marco Hutter, Michael Blösch, Dario Bellicoso, Samuel Bachmann October 2, 2015 Abstract In this exercise you learn how to calculate the forward and inverse kinematics

More information

COMP30019 Graphics and Interaction Three-dimensional transformation geometry and perspective

COMP30019 Graphics and Interaction Three-dimensional transformation geometry and perspective COMP30019 Graphics and Interaction Three-dimensional transformation geometry and perspective Department of Computing and Information Systems The Lecture outline Introduction Rotation about artibrary axis

More information

Singularity Loci of Planar Parallel Manipulators with Revolute Joints

Singularity Loci of Planar Parallel Manipulators with Revolute Joints Singularity Loci of Planar Parallel Manipulators with Revolute Joints ILIAN A. BONEV AND CLÉMENT M. GOSSELIN Département de Génie Mécanique Université Laval Québec, Québec, Canada, G1K 7P4 Tel: (418) 656-3474,

More information

Chapter 3: Kinematics Locomotion. Ross Hatton and Howie Choset

Chapter 3: Kinematics Locomotion. Ross Hatton and Howie Choset Chapter 3: Kinematics Locomotion Ross Hatton and Howie Choset 1 (Fully/Under)Actuated Fully Actuated Control all of the DOFs of the system Controlling the joint angles completely specifies the configuration

More information

Transformations. Ed Angel Professor of Computer Science, Electrical and Computer Engineering, and Media Arts University of New Mexico

Transformations. Ed Angel Professor of Computer Science, Electrical and Computer Engineering, and Media Arts University of New Mexico Transformations Ed Angel Professor of Computer Science, Electrical and Computer Engineering, and Media Arts University of New Mexico Angel: Interactive Computer Graphics 4E Addison-Wesley 25 1 Objectives

More information

θ x Week Date Lecture (M: 2:05p-3:50, 50-N202) 1 23-Jul Introduction + Representing Position & Orientation & State 2 30-Jul

θ x Week Date Lecture (M: 2:05p-3:50, 50-N202) 1 23-Jul Introduction + Representing Position & Orientation & State 2 30-Jul θ x 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 Position

More information

11. Kinematic models of contact Mechanics of Manipulation

11. Kinematic models of contact Mechanics of Manipulation 11. Kinematic models of contact Mechanics of Manipulation Matt Mason matt.mason@cs.cmu.edu http://www.cs.cmu.edu/~mason Carnegie Mellon Lecture 11. Mechanics of Manipulation p.1 Lecture 11. Kinematic models

More information

An approach for generic detection of conic equation from images

An approach for generic detection of conic equation from images An approach for generic detection of conic equation from images Maysa Macedo and Aura Conci Universidade Federal Fluminense (UFF) mmacedo@ic.uff.br - aconci@ic.uff.br Hough Transform Hough transform is

More information

A Simple Introduction to Omni Roller Robots (3rd April 2015)

A Simple Introduction to Omni Roller Robots (3rd April 2015) A Simple Introduction to Omni Roller Robots (3rd April 2015) Omni wheels have rollers all the way round the tread so they can slip laterally as well as drive in the direction of a regular wheel. The three-wheeled

More information

Jacobian: Velocities and Static Forces 1/4

Jacobian: Velocities and Static Forces 1/4 Jacobian: Velocities and Static Forces /4 Advanced Robotic - MAE 6D - Department of Mechanical & Aerospace Engineering - UCLA Kinematics Relations - Joint & Cartesian Spaces A robot is often used to manipulate

More information

PPGEE Robot Dynamics I

PPGEE Robot Dynamics I PPGEE Electrical Engineering Graduate Program UFMG April 2014 1 Introduction to Robotics 2 3 4 5 What is a Robot? According to RIA Robot Institute of America A Robot is a reprogrammable multifunctional

More information

Mathematics for Computer Graphics. Trigonometry

Mathematics for Computer Graphics. Trigonometry Mathematics for Computer Graphics Trigonometry Trigonometry...????? The word trigonometry is derived from the ancient Greek language and means measurement of triangles. trigonon triangle + metron measure

More information

To graph the point (r, θ), simply go out r units along the initial ray, then rotate through the angle θ. The point (1, 5π 6. ) is graphed below:

To graph the point (r, θ), simply go out r units along the initial ray, then rotate through the angle θ. The point (1, 5π 6. ) is graphed below: Polar Coordinates Any point in the plane can be described by the Cartesian coordinates (x, y), where x and y are measured along the corresponding axes. However, this is not the only way to represent points

More information

Inverse Kinematics Analysis for Manipulator Robot With Wrist Offset Based On the Closed-Form Algorithm

Inverse Kinematics Analysis for Manipulator Robot With Wrist Offset Based On the Closed-Form Algorithm Inverse Kinematics Analysis for Manipulator Robot With Wrist Offset Based On the Closed-Form Algorithm Mohammed Z. Al-Faiz,MIEEE Computer Engineering Dept. Nahrain University Baghdad, Iraq Mohammed S.Saleh

More information

Cecilia Laschi The BioRobotics Institute Scuola Superiore Sant Anna, Pisa

Cecilia Laschi The BioRobotics Institute Scuola Superiore Sant Anna, Pisa University of Pisa Master of Science in Computer Science Course of Robotics (ROB) A.Y. 2016/17 cecilia.laschi@santannapisa.it http://didawiki.cli.di.unipi.it/doku.php/magistraleinformatica/rob/start Robot

More information

Lecture «Robot Dynamics»: Kinematic Control

Lecture «Robot Dynamics»: Kinematic Control Lecture «Robot Dynamics»: Kinematic 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 Hutter,

More information