Week 3: Wheeled Kinematics AMR - Autonomous Mobile Robots

Size: px
Start display at page:

Download "Week 3: Wheeled Kinematics AMR - Autonomous Mobile Robots"

Transcription

1 Week 3: Wheeled Kinematics AMR - Paul Furgale Margarita Chli, Marco Hutter, Martin Rufli, Davide Scaramuzza, Roland Siegwart Wheeled Kinematics 1

2 AMRx Flipped Classroom A Matlab exercise is coming later in the class. Download it now! Wheeled Kinematics 2

3 AMRx A review Please register in at edx.org and watch the lecture segments Please try the problem sets online (they don t count for your grade but they are useful) Bring your laptop along for the lectures We may provide short examples or problems for you to work out We may ask for feedback on the worked exercises Flipped Classroom You ask us, we try to help No recording of the lecture, no questions are stupid Feel free to interrupt Wheeled Kinematics 3

4 Why Wheeled Robots? + Requires small control action (in comparison to legs) + Energetically very efficient Wheeled Kinematics 4

5 Why Wheeled Robots? + Requires small control action + Energetically very efficient - Unable to overcome many obstacles Wheeled Kinematics 5

6 AMRx Today s lecture Teacher: Paul Furgale, Deputy Review Practical problems: Intuition about matrices Computing good steering angles Computing wheel odometry Wheeled Kinematics 6

7 Wheeled Kinematics Not all degrees of freedom of a wheel can be actuated or have encoders Wheels can impose differential constraints that complicate the computation of kinematics r φ Y W X W x y = φ r 0 rolling constraint no-sliding constraint Wheeled Locomotion Introduction 7

8 Differential Kinematics Differential forward kinematics Given a set of actuator speeds, determine the corresponding velocity Differential inverse kinematics Given a desired velocity, determine the corresponding actuator speeds Wheeled Locomotion Introduction 8

9 Deriving a general wheel equation S r SW W robot angular velocity steering rate r RS I r IR R v IW = v IR + ω IR r RS + ω IR r SW + ω RS r SW robot velocity steering offset wheel offset Wheeled Locomotion Differential Kinematics 9

10 Example: Standard wheel Rolling constraint Y R sin α + β cos α + β l cos β R θ ξi φ r = 0 Y W Y S X W β X S No-sliding constraint cos α + β sin α + β l sin β R θ ξi = 0 l α X R Wheeled Locomotion Differential Kinematics 10

11 Example: Standard wheel Y R This equation had a mistake in the online lecture. The slides have been updated and we will update the video soon Y W Y S X W β X S No-sliding constraint cos α + β sin α + β l sin β R θ ξi = 0 l α X R Wheeled Locomotion Differential Kinematics 11

12 Differential Kinematics Given a wheeled robot, each wheel imposes n constraints Only fixed and steerable standard wheels impose no-sliding constraints Suppose a robot has n wheels of radius r i, the individual wheel constraints can be concatenated in matrix form: Rolling constraints J 1 β S R θ ξi J 2 φ = 0, J 1 β S = No-sliding constraints C 1 β S R(θ)ξI = 0, C 1 β S = J 1f J 1S β S, J 2 = diag r 1,, r N, φ = C 1f C 1S β S φ 1 φ N Wheeled Locomotion Wheeled Kinematics 12

13 Differential Kinematics Stacking the rolling and no-sliding constraints gives an expression for the differential kinematics J 1 β s C 1 β s R θ ξ I = J 2 0 φ Solving this equation for ξi yields the forward differential kinematics equation needed for computing wheel odometry Solving this equation for φ yields the inverse differential kinematics equation needed for control Wheeled Locomotion Wheeled Kinematics 13

14 Degree of Maneuverability The Degree of Maneuverability, δ M, combines mobility and steerability δ M = δ m + δ s Examples Wheeled Locomotion Wheeled Kinematics 14

15 Worked Exercise A Differential Drive Robot Two fixed standard wheels The robot frame (R) in between the wheels Stack the wheel equations for this configuration b r φ l Y R X R r φ r Wheeled Kinematics 15

16 A Differential Drive Robot Summary Degree of Maneuverability δ m = 2, δ s = 0, δ M = 2 r φ l Forward differential kinematics x r/2 r/2 φ r y = 0 0 φ l θ r/2b r/2b b Y R Inverse differential kinematics φ r φ l = 1/r 0 b/r 1/r 0 b/r x y θ X R r φ r Wheeled Kinematics 16

17 An Omnidirectional Robot This robot was the example in the online problem set. Were there any questions about the example? Y R X R Wheeled Kinematics 17

18 Simple Robots r φ l Y R b Y R X R X R r φ r Wheeled Kinematics 18

19 Practical Problems Head over to MATLAB and get into groups Wheeled Kinematics 19

20 Computing the steering angle X W Y S v v x β v y To compute the steering angle, we must transform the velocity of the vehicle into the steering frame S, then determine the angle, β, that brings the velocity into the negative y direction in the wheel frame. β π 2 X S Y W β = π 2 + atan( v y/v x ) Wheeled Kinematics 20

21 Computing Wheel Odometry Given sensed wheel speeds at time t, we know how to generate a predicted platform velocity: Recall that ξr(t) = F φ (t) ξr = R θ ξi In the inertial frame, the velocity equation is: ξi(t) = R( θ(t))f φ (t) Wheeled Kinematics 21

22 Computing Wheel Odometry Assumptions: Timesteps of size T Constant acceleration ξr(t) = ξ R t 0 + t t 0 T ξr t 1 ξr t 0, t 0 t < t 1 The velocity integration equation: ξ I t k = ξ I t k 1 + t k ξi t k 1 t dt Wheeled Kinematics 22

23 Computing Wheel Odometry Assumptions: Timesteps of size T Constant acceleration ξr(t) = ξ R t 0 + t t 0 T ξr t 1 ξr t 0, t 0 t < t 1 The velocity integration equation: ξ I t k ξ I t k 1 + T 2 R( θ t k 1 )(ξr t k 1 + ξr(t k )) Wheeled Kinematics 23

24 Computing Wheel Odometry Assumptions: Timesteps of size T Constant acceleration ξr(t) = ξ R t 0 + t t 0 T ξr t 1 ξr t 0, t 0 t < t 1 The velocity integration equation: ξ I t k ξ I t k 1 + T 2 R( θ t k 1 )(F t k 1 φ (t k 1 ) + F(t k )φ (t k )) Wheeled Kinematics 24

25 Computing Wheel Odometry The velocity integration equation: ξ I t k ξ I t k 1 + T 2 R( θ t k 1 )(F t k 1 φ (t k 1 ) + F(t k )φ (t k )) Wheeled Kinematics 25

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

Kinematics for a Three Wheeled Mobile Robot

Kinematics for a Three Wheeled Mobile Robot Kinematics for a Three Wheeled Mobile Robot Randal W. Beard Updated: March 13, 214 1 Reference Frames and 2D Rotations î 1 y î 2 y w 1 y w w 2 y î 2 x w 2 x w 1 x î 1 x Figure 1: The vector w can be expressed

More information

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

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

More information

Robot Dynamics Instantaneous Kinematiccs and Jacobians

Robot Dynamics Instantaneous Kinematiccs and Jacobians Robot Dynamics Instantaneous Kinematiccs and Jacobians 151-0851-00 V Lecture: Tuesday 10:15 12:00 CAB G11 Exercise: Tuesday 14:15 16:00 every 2nd week Marco Hutter, Michael Blösch, Roland Siegwart, Konrad

More information

Lecture «Robot Dynamics»: Kinematics 2

Lecture «Robot Dynamics»: Kinematics 2 Lecture «Robot Dynamics»: Kinematics 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) Marco Hutter,

More information

Mobile Robots Localization

Mobile Robots Localization Mobile Robots Localization Institute for Software Technology 1 Today s Agenda Motivation for Localization Odometry Odometry Calibration Error Model 2 Robotics is Easy control behavior perception modelling

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

Team-Exercises for DGC 100 Modelica Course

Team-Exercises for DGC 100 Modelica Course Team-Exercises for DGC 100 Modelica Course Hubertus Tummescheit United Technologies Research Center, East Hartford, CT 06108. November 4, 2003 Abstract This document is a preliminary version and is going

More information

Robot Control Basics CS 685

Robot Control Basics CS 685 Robot Control Basics CS 685 Control basics Use some concepts from control theory to understand and learn how to control robots Control Theory general field studies control and understanding of behavior

More information

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

Locomotion. Amir Degani. Intro to Robotics CS - Technion Winter Guest Lecture. Locomotion and Manipulation. Locomotion and. Manipulation Duality

Locomotion. Amir Degani. Intro to Robotics CS - Technion Winter Guest Lecture. Locomotion and Manipulation. Locomotion and. Manipulation Duality Locomotion Amir Degani Intro to Robotics CS - Technion Winter 2012 Duality Parts of slides taken from Howie Choset and Matt Mason 1 Today s outline Duality Duality 2 - Duality Locomotion cars, trains,

More information

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

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

More information

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

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

Motion Models (cont) 1 2/15/2012

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

More information

NONLINEAR PATH CONTROL FOR A DIFFERENTIAL DRIVE MOBILE ROBOT

NONLINEAR PATH CONTROL FOR A DIFFERENTIAL DRIVE MOBILE ROBOT NONLINEAR PATH CONTROL FOR A DIFFERENTIAL DRIVE MOBILE ROBOT Plamen PETROV Lubomir DIMITROV Technical University of Sofia Bulgaria Abstract. A nonlinear feedback path controller for a differential drive

More information

ELEC4631 s Lecture 2: Dynamic Control Systems 7 March Overview of dynamic control systems

ELEC4631 s Lecture 2: Dynamic Control Systems 7 March Overview of dynamic control systems ELEC4631 s Lecture 2: Dynamic Control Systems 7 March 2011 Overview of dynamic control systems Goals of Controller design Autonomous dynamic systems Linear Multi-input multi-output (MIMO) systems Bat flight

More information

Control of Mobile Robots Prof. Luca Bascetta

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

More information

Mecanum-Wheeled Vehicle Base

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

More information

EE565:Mobile Robotics Lecture 6

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

More information

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

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

More information

Line following of a mobile robot

Line following of a mobile robot Line following of a mobile robot May 18, 004 1 In brief... The project is about controlling a differential steering mobile robot so that it follows a specified track. Steering is achieved by setting different

More information

Physics 2D Lecture Slides Sep 26. Vivek Sharma UCSD Physics

Physics 2D Lecture Slides Sep 26. Vivek Sharma UCSD Physics Physics 2D Lecture Slides Sep 26 Vivek Sharma UCSD Physics Modern Physics (PHYS 2D) Exploration of physical ideas and phenomena related to High velocities and acceleration ( Einstein s Theory of Relativity)

More information

ARW Lecture 04 Point Tracking

ARW Lecture 04 Point Tracking ARW Lecture 04 Point Tracking Instructor: Chris Clark Semester: Summer 2016 1 Figures courtesy of Siegwart & Nourbakhsh Planning Based Control Prior Knowledge Operator Commands Localization Path Planning

More information

CONTROL OF THE NONHOLONOMIC INTEGRATOR

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

More information

1 Kalman Filter Introduction

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

More information

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

Vehicle Dynamics of Redundant Mobile Robots with Powered Caster Wheels

Vehicle Dynamics of Redundant Mobile Robots with Powered Caster Wheels Vehicle Dynamics of Redundant Mobile Robots with Powered Caster Wheels Yuan Ping Li * and Teresa Zielinska and Marcelo H. Ang Jr.* and Wei Lin * National University of Singapore, Faculty of Engineering,

More information

Classical Mechanics III (8.09) Fall 2014 Assignment 3

Classical Mechanics III (8.09) Fall 2014 Assignment 3 Classical Mechanics III (8.09) Fall 2014 Assignment 3 Massachusetts Institute of Technology Physics Department Due September 29, 2014 September 22, 2014 6:00pm Announcements This week we continue our discussion

More information

Robotics & Automation. Lecture 25. Dynamics of Constrained Systems, Dynamic Control. John T. Wen. April 26, 2007

Robotics & Automation. Lecture 25. Dynamics of Constrained Systems, Dynamic Control. John T. Wen. April 26, 2007 Robotics & Automation Lecture 25 Dynamics of Constrained Systems, Dynamic Control John T. Wen April 26, 2007 Last Time Order N Forward Dynamics (3-sweep algorithm) Factorization perspective: causal-anticausal

More information

The dynamics of a Mobile Inverted Pendulum (MIP)

The dynamics of a Mobile Inverted Pendulum (MIP) The dynamics of a Mobile Inverted Pendulum (MIP) 1 Introduction Saam Ostovari, Nick Morozovsky, Thomas Bewley UCSD Coordinated Robotics Lab In this document, a Mobile Inverted Pendulum (MIP) is a robotic

More information

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

Welcome back to Physics 211

Welcome back to Physics 211 Welcome back to Physics 211 The room is very full please move toward the center and help others find a seat. Be patient. The registration database is only updated twice per week. Get to know the people

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 Newmark Integration Formula [not in the textbook] December 9, 2014 Dan Negrut ME451, Fall 2014 University of Wisconsin-Madison

More information

2.003SC Engineering Dynamics

2.003SC Engineering Dynamics 2.003SC Engineering Dynamics Problem Set 1 1. This is a review problem on the topic of projectile motion. A football player kicks a ball, giving it an initial speed of 80 ft/s with an initial angle relative

More information

Lecture Notes Multibody Dynamics B, wb1413

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

More information

Inertial Odometry using AR Drone s IMU and calculating measurement s covariance

Inertial Odometry using AR Drone s IMU and calculating measurement s covariance Inertial Odometry using AR Drone s IMU and calculating measurement s covariance Welcome Lab 6 Dr. Ahmad Kamal Nasir 25.02.2015 Dr. Ahmad Kamal Nasir 1 Today s Objectives Introduction to AR-Drone On-board

More information

Welcome back to Physics 211

Welcome back to Physics 211 Welcome back to Physics 211 Today s agenda: Rotations What s on the exam? Relative motion Physics 211 Fall 2012 Lecture 04-1 1 Assignments due this week: Prelecture 4-2: Ch 5.1-5.7 Complete short quiz

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

Flipping Physics Lecture Notes: Demonstrating Rotational Inertia (or Moment of Inertia)

Flipping Physics Lecture Notes: Demonstrating Rotational Inertia (or Moment of Inertia) Flipping Physics Lecture Notes: Demonstrating Rotational Inertia (or Moment of Inertia) Have you ever struggled to describe Rotational Inertia to your students? Even worse, have you ever struggled to understand

More information

WELCOME TO 1103 PERIOD 6

WELCOME TO 1103 PERIOD 6 WELCOE TO 1103 PERIOD 6 Homework Exercise #5 is due today. Please watch video 2, America Revealed: Electric Nation, for class discussion one week from today. PHYSICS 1103 PERIOD 6 Where is the center of

More information

Physics 2D Lecture Slides Lecture 1: Jan

Physics 2D Lecture Slides Lecture 1: Jan Physics 2D Lecture Slides Lecture 1: Jan 3 2005 Vivek Sharma UCSD Physics 1 Modern Physics (PHYS 2D) Exploration of physical ideas and phenomena related to High velocities and acceleration ( Einstein s

More information

Sensors Fusion for Mobile Robotics localization. M. De Cecco - Robotics Perception and Action

Sensors Fusion for Mobile Robotics localization. M. De Cecco - Robotics Perception and Action Sensors Fusion for Mobile Robotics localization 1 Until now we ve presented the main principles and features of incremental and absolute (environment referred localization systems) could you summarize

More information

Miscellaneous. Regarding reading materials. Again, ask questions (if you have) and ask them earlier

Miscellaneous. Regarding reading materials. Again, ask questions (if you have) and ask them earlier Miscellaneous Regarding reading materials Reading materials will be provided as needed If no assigned reading, it means I think the material from class is sufficient Should be enough for you to do your

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

A trajectory tracking control design for a skid-steering mobile robot by adapting its desired instantaneous center of rotation

A trajectory tracking control design for a skid-steering mobile robot by adapting its desired instantaneous center of rotation A trajectory tracking control design for a skid-steering mobile robot by adapting its desired instantaneous center of rotation Jae-Yun Jun, Minh-Duc Hua, Faïz Benamar Abstract A skid-steering mobile robot

More information

Lab #8: The Unbalanced Wheel

Lab #8: The Unbalanced Wheel Lab #8: The Unbalanced Wheel OBJECTIVE Use observations to calculate the radius of gyration of a wheel. Apply energy models to the dynamics of an unbalanced rotating wheel. Learn new computing skills.

More information

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

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

More information

RELATIVE MOTION ANALYSIS: VELOCITY (Section 16.5)

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

More information

Physics 218 Lecture 21

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

More information

ME 597: AUTONOMOUS MOBILE ROBOTICS SECTION 3 MOTION MODELING. Prof. Steven Waslander

ME 597: AUTONOMOUS MOBILE ROBOTICS SECTION 3 MOTION MODELING. Prof. Steven Waslander ME 597: AUTONOMOUS MOBILE ROBOTICS SECTION 3 MOTION MODELING Prof. Steven Waslander COMPONENTS Mission Planning Mission Mapping Mission Autonomy Path Planning Mapping Environmental Autonomy Control Estimation

More information

Probability: Review. Pieter Abbeel UC Berkeley EECS. Many slides adapted from Thrun, Burgard and Fox, Probabilistic Robotics

Probability: Review. Pieter Abbeel UC Berkeley EECS. Many slides adapted from Thrun, Burgard and Fox, Probabilistic Robotics robabilit: Review ieter Abbeel UC Berkele EECS Man slides adapted from Thrun Burgard and Fo robabilistic Robotics Wh probabilit in robotics? Often state of robot and state of its environment are unknown

More information

EEE 187: Take Home Test #2

EEE 187: Take Home Test #2 EEE 187: Take Home Test #2 Date: 11/30/2017 Due : 12/06/2017 at 5pm 1 Please read. Two versions of the exam are proposed. You need to solve one only. Version A: Four problems, Python is required for some

More information

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

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

More information

EE Mobile Robots

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

More information

Rolling with slipping experiment Virtual Laboratory Guide

Rolling with slipping experiment Virtual Laboratory Guide Rolling with slipping experiment Virtual Laboratory Guide Nora L. Maidana, Monaliza da Fonseca, Suelen F. Barros and Vito R. Vanin April 10, 2015 We recorded the motion of a ring rolling and slipping in

More information

2. Relative and Circular Motion

2. Relative and Circular Motion 2. Relative and Circular Motion A) Overview We will begin with a discussion of relative motion in one dimension. We will describe this motion in terms of displacement and velocity vectors which will allow

More information

Cross-Coupling Control for Slippage Minimization of a Four-Wheel-Steering Mobile Robot

Cross-Coupling Control for Slippage Minimization of a Four-Wheel-Steering Mobile Robot Cross-Coupling Control for Slippage Minimization of a Four-Wheel-Steering Mobile Robot Maxim Makatchev Dept. of Manufacturing Engineering and Engineering Management City University of Hong Kong Hong Kong

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

1 Introduction. Control 2:

1 Introduction. Control 2: Introduction Kinematics of Wheeled Mobile Robots (No legs here. They ork like arms. We e seen arms already) For control purposes, the kinematics of heeled mobile robots (WMRs) that e care about are the

More information

(Refer Slide Time: 00:01:30 min)

(Refer Slide Time: 00:01:30 min) Control Engineering Prof. M. Gopal Department of Electrical Engineering Indian Institute of Technology, Delhi Lecture - 3 Introduction to Control Problem (Contd.) Well friends, I have been giving you various

More information

Nonholonomic Constraints Examples

Nonholonomic Constraints Examples Nonholonomic Constraints Examples Basilio Bona DAUIN Politecnico di Torino July 2009 B. Bona (DAUIN) Examples July 2009 1 / 34 Example 1 Given q T = [ x y ] T check that the constraint φ(q) = (2x + siny

More information

Physics 8 Friday, November 4, 2011

Physics 8 Friday, November 4, 2011 Physics 8 Friday, November 4, 2011 Please turn in Homework 7. I will hand out solutions once everyone is here. The handout also includes HW8 and a page or two of updates to the equation sheet needed to

More information

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

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

More information

Physics 2D Lecture Slides Lecture 1: Jan

Physics 2D Lecture Slides Lecture 1: Jan Physics 2D Lecture Slides Lecture 1: Jan 5 2004 Vivek Sharma UCSD Physics Modern Physics (PHYS 2D) Exploration of physical ideas and phenomena related to High velocities and acceleration ( Einstein s Theory

More information

CS-184: Computer Graphics

CS-184: Computer Graphics CS-184: Computer Graphics Lecture #25: Rigid Body Simulations Tobias Pfaff 537 Soda (Visual Computing Lab) tpfaff@berkeley.edu Reminder Final project presentations next week! Game Physics Types of Materials

More information

The Principle of Virtual Power Slide companion notes

The Principle of Virtual Power Slide companion notes The Principle of Virtual Power Slide companion notes Slide 2 In Modules 2 and 3 we have seen concepts of Statics and Kinematics in a separate way. In this module we shall see how the static and the kinematic

More information

Distributed Intelligent Systems W4 An Introduction to Localization Methods for Mobile Robots

Distributed Intelligent Systems W4 An Introduction to Localization Methods for Mobile Robots Distributed Intelligent Systems W4 An Introduction to Localization Methods for Mobile Robots 1 Outline Positioning systems Indoor Outdoor Robot localization using proprioceptive sensors without uncertainties

More information

(Refer Slide Time: 0:16)

(Refer Slide Time: 0:16) Engineering Mechanics Professor Manoj K Harbola Department of Physics Indian Institute of Technology Kanpur Module 1 Lecture No 01 Introduction to vectors (Refer Slide Time: 0:16) This is a course on engineering

More information

Vlad Estivill-Castro. Robots for People --- A project for intelligent integrated systems

Vlad Estivill-Castro. Robots for People --- A project for intelligent integrated systems 1 Vlad Estivill-Castro Robots for People --- A project for intelligent integrated systems V. Estivill-Castro 2 Probabilistic Map-based Localization (Kalman Filter) Chapter 5 (textbook) Based on textbook

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

Planar Rigid Body Kinematics Homework

Planar Rigid Body Kinematics Homework Chapter 2 Planar Rigid ody Kinematics Homework Freeform c 2016 2-1 2-2 Freeform c 2016 Homework 2. Given: The pulley shown below freely rotates about point C and interacts with two rubber belts (one horizontal,

More information

Quaternion-Based Tracking Control Law Design For Tracking Mode

Quaternion-Based Tracking Control Law Design For Tracking Mode A. M. Elbeltagy Egyptian Armed forces Conference on small satellites. 2016 Logan, Utah, USA Paper objectives Introduction Presentation Agenda Spacecraft combined nonlinear model Proposed RW nonlinear attitude

More information

(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

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

Physics 121, March 27, Angular Momentum, Torque, and Precession. Department of Physics and Astronomy, University of Rochester

Physics 121, March 27, Angular Momentum, Torque, and Precession. Department of Physics and Astronomy, University of Rochester Physics 121, March 27, 2008. Angular Momentum, Torque, and Precession. Physics 121. March 27, 2008. Course Information Quiz Topics to be discussed today: Review of Angular Momentum Conservation of Angular

More information

EQUATIONS OF MOTION: GENERAL PLANE MOTION (Section 17.5) Today s Objectives: Students will be able to analyze the planar kinetics of a rigid body

EQUATIONS OF MOTION: GENERAL PLANE MOTION (Section 17.5) Today s Objectives: Students will be able to analyze the planar kinetics of a rigid body EQUATIONS OF MOTION: GENERAL PLANE MOTION (Section 17.5) Today s Objectives: Students will be able to analyze the planar kinetics of a rigid body undergoing general plane motion. APPLICATIONS As the soil

More information

Physics 351 Wednesday, January 10, 2018

Physics 351 Wednesday, January 10, 2018 Physics 351 Wednesday, January 10, 2018 Chapers 1 5 mostly review freshman physics, so we ll go through them very quickly in the first few days of class. Read Chapters 1+2 for Friday. Read Chapter 3 (momentum

More information

Non-holonomic constraint example A unicycle

Non-holonomic constraint example A unicycle Non-holonomic constraint example A unicycle A unicycle (in gray) moves on a plane; its motion is given by three coordinates: position x, y and orientation θ. The instantaneous velocity v = [ ẋ ẏ ] is along

More information

PLANAR KINETIC EQUATIONS OF MOTION (Section 17.2)

PLANAR KINETIC EQUATIONS OF MOTION (Section 17.2) PLANAR KINETIC EQUATIONS OF MOTION (Section 17.2) We will limit our study of planar kinetics to rigid bodies that are symmetric with respect to a fixed reference plane. As discussed in Chapter 16, when

More information

Lab #4 - Gyroscopic Motion of a Rigid Body

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

More information

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

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

More information

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

arxiv: v2 [math.oc] 18 Sep 2014

arxiv: v2 [math.oc] 18 Sep 2014 A robust trajectory tracking controller for four-wheel skid-steering mobile robots Jae-Yun Jun Minh-Duc Hua Faïz Benamar arxiv:1404.4839v [math.oc] 18 Sep 014 Abstract A novel dynamic model-based trajectory

More information

Localization. Howie Choset Adapted from slides by Humphrey Hu, Trevor Decker, and Brad Neuman

Localization. Howie Choset Adapted from slides by Humphrey Hu, Trevor Decker, and Brad Neuman Localization Howie Choset Adapted from slides by Humphrey Hu, Trevor Decker, and Brad Neuman Localization General robotic task Where am I? Techniques generalize to many estimation tasks System parameter

More information

MATH1014. Semester 1 Administrative Overview. Neil Montgomery calculus

MATH1014. Semester 1 Administrative Overview. Neil Montgomery calculus MATH1014 Semester 1 Administrative Overview Lecturers: Scott Morrison linear algebra scott.morrison@anu.edu.au Neil Montgomery calculus neil.montgomery@anu.edu.au Dr Scott Morrison (ANU) MATH1014 Notes

More information

Physics 351 Wednesday, January 14, 2015

Physics 351 Wednesday, January 14, 2015 Physics 351 Wednesday, January 14, 2015 Read Chapter 1 for today. Two-thirds of you answered the Chapter 1 questions so far. Read Chapters 2+3 for Friday. Skim Chapter 4 for next Wednesday (1/21). Homework

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

Designing Information Devices and Systems II Spring 2018 J. Roychowdhury and M. Maharbiz Homework 7

Designing Information Devices and Systems II Spring 2018 J. Roychowdhury and M. Maharbiz Homework 7 EECS 6B Designing Information Devices and Systems II Spring 28 J. Roychowdhury and M. Maharbiz Homework 7 This homework is due on Thursday, March 22, 28, at :59AM (NOON). Self-grades are due on Monday,

More information

Robot Localisation. Henrik I. Christensen. January 12, 2007

Robot Localisation. Henrik I. Christensen. January 12, 2007 Robot Henrik I. Robotics and Intelligent Machines @ GT College of Computing Georgia Institute of Technology Atlanta, GA hic@cc.gatech.edu January 12, 2007 The Robot Structure Outline 1 2 3 4 Sum of 5 6

More information

ME751 Advanced Computational Multibody Dynamics. September 14, 2016

ME751 Advanced Computational Multibody Dynamics. September 14, 2016 ME751 Advanced Computational Multibody Dynamics September 14, 2016 Quote of the Day My own business always bores me to death; I prefer other people's. -- Oscar Wilde 2 Looking Ahead, Friday Need to wrap

More information

Recap. The bigger the exhaust speed, ve, the higher the gain in velocity of the rocket.

Recap. The bigger the exhaust speed, ve, the higher the gain in velocity of the rocket. Recap Classical rocket propulsion works because of momentum conservation. Exhaust gas ejected from a rocket pushes the rocket forwards, i.e. accelerates it. The bigger the exhaust speed, ve, the higher

More information

Control of a Car-Like Vehicle with a Reference Model and Particularization

Control of a Car-Like Vehicle with a Reference Model and Particularization Control of a Car-Like Vehicle with a Reference Model and Particularization Luis Gracia Josep Tornero Department of Systems and Control Engineering Polytechnic University of Valencia Camino de Vera s/n,

More information

Displacement, Velocity, and Acceleration

Displacement, Velocity, and Acceleration Displacement, Velocity, and Acceleration (WHERE and WHEN?) I m not going to teach you anything today that you don t already know! (basically) Practice: 7.1, 7.5, 7.7, 7.9, 7.11, 7.13 Do you guys remember

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

Robot Dynamics Lecture Notes. Robotic Systems Lab, ETH Zurich

Robot Dynamics Lecture Notes. Robotic Systems Lab, ETH Zurich Robot Dynamics Lecture Notes Robotic Systems Lab, ETH Zurich HS 217 Contents 1 Introduction 1 1.1 Nomenclature.............................. 2 1.2 Operators................................ 3 2 Kinematics

More information

L03. PROBABILITY REVIEW II COVARIANCE PROJECTION. NA568 Mobile Robotics: Methods & Algorithms

L03. PROBABILITY REVIEW II COVARIANCE PROJECTION. NA568 Mobile Robotics: Methods & Algorithms L03. PROBABILITY REVIEW II COVARIANCE PROJECTION NA568 Mobile Robotics: Methods & Algorithms Today s Agenda State Representation and Uncertainty Multivariate Gaussian Covariance Projection Probabilistic

More information

ME751 Advanced Computational Multibody Dynamics

ME751 Advanced Computational Multibody Dynamics ME751 Advanced Computational Multibody Dynamics Section 9.2 September 16, 2016 Dan Negrut University of Wisconsin-Madison Quote of the day I only believe in statistics that I doctored myself. -- Sir Winston

More information

Robotics. Islam S. M. Khalil. September 19, German University in Cairo

Robotics. Islam S. M. Khalil. September 19, German University in Cairo Robotics German University in Cairo September 19, 2016 Angular Velocity Let b l, b 2, and b 3 form a right-handed set of mutually perpendicular unit vectors fixed in a rigid body B moving in a reference

More information

MEAM 520. Homogenous Transformations

MEAM 520. Homogenous Transformations MEAM 520 Homogenous Transformations Katherine J. Kuchenbecker, Ph.D. General Robotics, Automation, Sensing, and Perception Lab (GRASP) MEAM Department, SEAS, University of Pennsylvania Lecture 3: September

More information