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

Size: px
Start display at page:

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

Transcription

1 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 for all problems. The exam is closed book. Multiple-Choice 2 marks awarded for each correct answer, 1 mark deducted for each incorrect answer, 0 marks if no answer. 1. Which of the following robots are FULLY autonomous robots: a) Ventana ROV (for Underwater jelly-tracking) b) Minerva c) MARs Rover Spirit 2. Behavior based navigation is better than planning based navigation in some situations because: a) It uses a world model b) Behaviors cannot be fused through competitive coordination schemes c) It navigates by planning a path around obstacles. 3. In general, a locomotion system can possibly have a) Good stability and Good controllability and Good maneuverability b) Good controllability and Good maneuverability c) Good stability and Good controllability 4. A GPS array needs: a) 2 satellites to resolve 3 unknowns b) 4 satellites to resolve 4 unknowns c) 3 satellites to resolve 3 unknowns d) 5 satellites to resolve 5 unknowns 5. Dead reckoning is a good way to navigate because a) It does not require proprioceptive sensors b) Odometry errors are non-deterministic c) Low-resolution encoders have noise

2 6. A robot using control inputs to predict position estimates is moving in the negative y direction in a global coordinate frame. With respect to the variance in its final position estimate, it will have: a) Greatest variance in the y direction b) Equal variance in the x and y directions c) Least variance in the direction orthogonal to its motion 7. In comparing single-query vs. multi-query Probabilistic Road Map (PRM) planning algorithms, which is true a) Single query is faster than multi-query b) The query step of multi-query planning is slow relative to single query planning c) In order to build a trajectory satisfying kinematic constraints, both require postprocessing to smooth the trajectories. d) All of the above 8. In single query planning, clustering occurs when a) Milestones are expanded by considering the dynamics of the vehicle. b) Milestones selected for expansion are randomly picked with probability inverse to the local roadmap milestone density c) Milestones selected for expansion are randomly picked with probability inverse to the number of milestones in the roadmap d) Milestones are expanded by randomly selecting control inputs to the robot 9. Which properties are true about graph searches with branching factor b and depth d a) Depth first searches always have O(bd) time complexity b) Depth first searches always take O(bd) space complexity c) Breadth first searches always take O(bd) time complexity d) Breadth first searches always take O(bd) space complexity 10. For A*, an admissible heuristic is one that a) Always over-estimates the path cost to the start node b) Always under-estimates the path cost to the start node c) Always under-estimates the path cost to the goal node

3 Short Answer Total of 5 marks awarded for each question. 11. Laser range finders (e.g. SICK) are one of the most powerful range sensors on the market. a) Describe how laser range finding sensor works when phase shift measurements are used to obtain the distance to an object. Be sure to use a diagram. b) Explain how ambiguous results might occur and the method for resolving this ambiguity 12. The Mark III mini-sumo robot is equipped with inexpensive range sensors. a) Describe how this technology works. To aid this description, use a diagram and derive (from basic geometry) the equation used to obtain the distance. b) Draw the sensors characteristic curve that maps range to output voltage. c) Using the diagrams in a) and b), discuss limitations of this technology. 13. The landmark method of implementing SLAM Simultaneous Localization and Mapping is based on using stochastic maps. a) Describe how a stochastic map represents the world. b) Consider a situation where a mobile robot moves along a straight path from location 1 to location 2, and then from location 2 to location 3. These motions can be described by the vectors y 12 and y 23 respectively. At location 1, the robot senses object 1 with measurement z 1a. At location 2, the robot senses object 1 with measurement z 1b, and a new object 2 with measurement z 2a. At location 3, the object can only detect object 2 with measurement z 2b. For each location, provide the stochastic map using compound relationship operators. Assume that measurements can be fused with the Kalman filter operator KF. For example the state h could be obtained from fusing two measurements m 1 and m 2 : h = m 1 KF m 2 Step 1: xr=0, x1=z1a Step 2: xr=y+0, x1=y12+z1a K z1b, x2=y12+z2a Step 3: xr=yb+ya, x1=y12+z1a K z1b, x2=y23+y12+z2b KF y12+z2a c) Draw the corresponding confidence ellipses on the diagram below. Use a global coordinate frame attached to the workspace with (0, 0) being location 1. Assume the variance in range to the objects is greater than the variance in relative bearing to the object.

4 Object 2 Location 3 Location 2 Object 1 Location 1 Time step 1 Time step 2 Time step Single-Query Probabilistic Road Maps (PRMs) can be used to search configuration spaces with many degrees of freedom. We wish to set up a single-query PRM for a freefloating robot operating in a bounded, 3D environment. Assume the robot has 6 on/off thrusters (one at the center of each face of a symmetrical robot) with no rotation control. To set this up, address the following issues: a) Define the degrees of freedom of the configuration space to search. C = {x,y,z} b) Roadmap node selection: Describe how to select the nodes in the roadmap for expansion. Discretize and pick from occupied cells, then pick a milestone from the cell. c) Node generation: Given a node has been selected for expansion, describe a method of generating a new node for the roadmap. Include the dynamics of the robot, but don t worry about collision-checking. Note the thrusters can only provide two thrusts: 0 or f max. Pick ux from [-f max, 0, f max ]. Short Math Total of 5 marks awarded for each question. 15. A robot uses a laser range finder to obtain range and bearing estimates of the four legs of a square table. The data set is {r i, α i ; i = 1..4}. The confidence in this data can be characterized by the variance of range and bearing measurements (σ r, σ α ). Assume the robot was at position (0, 0) in global coordinates when it took the measurements. Also assume the table is defined by X = [x y w], where the first two states define the position of the center of the table in global coordinates and the last state is the width of the table. (We neglect orientation to simplify the problem). a) Define an equation of the table X = T(r 1, α 1, r 2, α 2, r 3, α 3, r 4, α 4 ) x = ( r 1 cos α 1 + r 2 cos α 2 + r 3 cos α 3 + r 4 cos α 4 )/4 y = ( r 1 sin α 1 + r 2 sin α 2 + r 3 sin α 3 + r 4 sin α 4 )/4 w = 0.25* [(r 1 cos α 1 - r 2 cos α 2 ) 2 + (r 1 sin α 1 - r 2 sin α 2 ) 2 ] 1/ * [(r 2 cos α 2 - r 3 cos α 3 ) 2 + (r 2 sin α 2 - r 3 sin α 3 ) 2 ] 1/2 +

5 0.25* [(r 3 cos α 3 - r 4 cos α 4 ) 2 + (r 3 sin α 3 - r 4 sin α 4 ) 2 ] 1/ * [(r 4 cos α 4 - r 1 cos α 1 ) 2 + (r 4 sin α 4 - r 1 sin α 1 ) 2 ] 1/2 b) What is the associated covariance matrix Σ X. T C X = f r,α C r,α, f r,α C r,α = diagonal(σ r, σ α, σ r,, σ α, σ r,, σ α, σ r,, σ α ) f r,α = dx/dr 1 dx/dα 1 dx/dr 2 dx/dα 2 dx/dr 3 dx/dα 3.. dy/dr 1 dy/dα 1 dy/dr 2 dy/dα 2 dy/dr 3 dy/dα 3.. dw/dr 1 dw/dα 1 dw/dr 2 dw/dα 2 dw/dr 3 dw/dα To measure the forward velocity of a two wheeled motorcycle robot, encoders with resolution g counts per revolution are used along with a cheap micro-processor to measure time (variance σ t ). Assume the robot always moves in a straight line, the wheel radius is r and the encoders on the front and back wheels each have their own variance σ e- front and σ e-back respectively. a) How could you measure the velocity of each wheel i. Provide an equation for both v i and corresponding variance σ i. At each measurement, the robot will measure n encoder counts and t seconds. v i = n/g * 2 π r / t σ i = f n,t C f n,t T C = diagonal(σ e, σ t ) f r,α = [ dv/dn dx/dt ] b) Combine the two wheel velocity measurements to get the velocity and its variance of the robot. v = v front + K v front Kalman covariance 17. In most Markov localization, a key step implements Baye s Rule. a) Derive Baye s rule using the product rule from statistical probability theory. b) Write the equation used for the Observation Prediction step in Markov Localization that is based on Baye s rule and explain how each term is calculated

6 18. A robot stops to take range measurements to a wall. It gains several measurements at different bearings. Assume the wall is to be modeled by a line defined by (r, α), (see diagram below.) a) Set up a weighted least squares problem to solve for the line equation parameters (r, α) that will minimize the perpendicular distance from each measurement point to the line. b) Solve for r. Long Math Total of 10 marks awarded for each question. 19. Consider a differential-drive robot similar to the Mark III. a) Given the robots initial state p = [x y θ], use dead reckoning to estimate the resultant state p after the two robot wheels are controlled to move distances s left and s right respectively. b) Derive the corresponding covariance Σ p. Explain where terms come from. 20. Stereo vision is a powerful tool because the geometry allows for feature position measurements. Assuming an idealized setup (i.e. parallel cameras). a) Draw a typical camera setup, be sure to include the coordinate system origin. Label all relevant distances. b) Derive stereo vision geometry equations. That is, provide the feature position [x y z] as a function of the camera image measurements [ x r y r ] and [ x l y l ] for the right and left cameras respectively. Algorithm Iterations Total of 5 marks awarded for each question. 21. Given below is a 3x3 BW intensity image. Perform the first three steps of the Zlog algorithm. What feature is apparent? /16 19/16 23/16 19/16 51/16 61/16 23/16 61/16 55/16

7 2/16 7/16-6/16 7/16-44/16 /16-6/16 -/16 / The A* algorithm is being used to plan a resolution optimal path through a building hallway system. Given the map below, show the first 5 iterations of the A* algorithm by numbering the cells in the order that they are explored. To get you started, the first iteration will has been done. In your exam booklet, provide details of the iterations (including the first). Details should include the fringe set and their path cost breakdowns ( f(n), g(n), h(n)). Finally, show the final path. 4 *,2 1 *, Fringe Set = {(2,8) f = 1+rt(85) } Pick (2,8) 2. Fringe Set = {(2,7) f = 2+rt(72), (3,8) f = 2+rt(74)} Pick (2,7) 3. Fringe Set = {(3,8) f = 2+rt(74), (2,6) f = 3+rt(61)} Pick (3,8) 4. Fringe Set = {(2,6) f = 3+rt(61), (4,8) f = 3+rt(65)} Pick (2,6) 5. Fringe Set = {(4,8) f = 3+rt(65), (1,6) f = 4+rt(74)} Pick (4,8) Some Equations that might be useful: d = c t / 2 λ = c/f D = f l /x f = 2 ft v cosθ / c

8 1/f = 1/d + 1/e R = ld/(2e) E(x, y, t) = E (x + u δt, y + v δt, t + δt) p (A B ) = p (A B ) p (B ) E[X 1 X 2 ] = E[X 1 ] E[X 2 ] Var(X 1 +X 2 ) = Var(X 2 ) + Var(X 2 ) ρ i cos (θ i -α) r = d i Y j = f j (X 1 X n ) C Y = f X C X f X T P = G = f(n) = g(n) + h(n) q = q 1 + K ( q 2 q 1 ) K = σ 2 1 / ( σ σ 2 2 ) σ 2 = σ 2 1 σ 2 2 / (σ σ 2 2 ) θ = ( s right - s left ) / b [ sin(α+β) -cos(α+β) lcos(β) ] R(θ) ξ I = rϕ [ cos(α+β) sin(α+β) lsin(β) ] R(θ) ξ I = 0.. x ij x jk = x jk cos θ ij y jk sin θ ij + x ij x jk sin θ ij + y jk cos θ ij + y ij θ ij + θ jk

9 x ij = -x ij cos θ ij - y ij sin θ ij x ij sin θ ij - y ij cos θ ij -θ ij p (x t o t ) = Σ x p ( x t x t-1, o t ) p (x t-1 ) p (x t z t ) = p (z t x t ) p (x t ) p (z t )

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

Mobile Robotics. Mathematics, Models, and Methods. HI Cambridge. Alonzo Kelly. Carnegie Mellon University UNIVERSITY PRESS

Mobile Robotics. Mathematics, Models, and Methods. HI Cambridge. Alonzo Kelly. Carnegie Mellon University UNIVERSITY PRESS Mobile Robotics Mathematics, Models, and Methods Alonzo Kelly Carnegie Mellon University HI Cambridge UNIVERSITY PRESS Contents Preface page xiii 1 Introduction 1 1.1 Applications of Mobile Robots 2 1.2

More information

COS Lecture 13 Autonomous Robot Navigation

COS Lecture 13 Autonomous Robot Navigation COS 495 - Lecture 13 Autonomous Robot Navigation Instructor: Chris Clark Semester: Fall 2011 1 Figures courtesy of Siegwart & Nourbakhsh Control Structure Prior Knowledge Operator Commands Localization

More information

Exam in DD2426 Robotics and Autonomous Systems

Exam in DD2426 Robotics and Autonomous Systems Exam in DD2426 Robotics and Autonomous Systems Lecturer: Patric Jensfelt KTH, March 16, 2010, 9-12 No aids are allowed on the exam, i.e. no notes, no books, no calculators, etc. You need a minimum of 20

More information

Overview. EECS 124, UC Berkeley, Spring 2008 Lecture 23: Localization and Mapping. Statistical Models

Overview. EECS 124, UC Berkeley, Spring 2008 Lecture 23: Localization and Mapping. Statistical Models Introduction ti to Embedded dsystems EECS 124, UC Berkeley, Spring 2008 Lecture 23: Localization and Mapping Gabe Hoffmann Ph.D. Candidate, Aero/Astro Engineering Stanford University Statistical Models

More information

Data Association for SLAM

Data Association for SLAM CALIFORNIA INSTITUTE OF TECHNOLOGY ME/CS 132a, Winter 2011 Lab #2 Due: Mar 10th, 2011 Part I Data Association for SLAM 1 Introduction For this part, you will experiment with a simulation of an EKF SLAM

More information

Centre for Autonomous Systems

Centre for Autonomous Systems Robot Henrik I Centre for Autonomous Systems Kungl Tekniska Högskolan hic@kth.se 27th April 2005 Outline 1 duction 2 Kinematic and Constraints 3 Mobile Robot 4 Mobile Robot 5 Beyond Basic 6 Kinematic 7

More information

Localization and Map Building

Localization and Map Building Localization and Map Building Noise and aliasing; odometric position estimation To localize or not to localize Belief representation Map representation Probabilistic map-based localization Other examples

More information

Robotics. Chapter 25. Chapter 25 1

Robotics. Chapter 25. Chapter 25 1 Robotics Chapter 25 Chapter 25 1 Outline Robots, Effectors, and Sensors Localization and Mapping Motion Planning Chapter 25 2 Mobile Robots Chapter 25 3 Manipulators P R R R R R Configuration of robot

More information

Localization and Map Building

Localization and Map Building Localization and Map Building Noise and aliasing; odometric position estimation To localize or not to localize Belief representation Map representation Probabilistic map-based localization Other examples

More information

MTRX4700: Experimental Robotics

MTRX4700: Experimental Robotics Stefan B. Williams April, 2013 MTR4700: Experimental Robotics Assignment 3 Note: This assignment contributes 10% towards your final mark. This assignment is due on Friday, May 10 th during Week 9 before

More information

Introduction to Autonomous Mobile Robots

Introduction to Autonomous Mobile Robots Introduction to Autonomous Mobile Robots second edition Roland Siegwart, Illah R. Nourbakhsh, and Davide Scaramuzza The MIT Press Cambridge, Massachusetts London, England Contents Acknowledgments xiii

More information

Localization, Where am I?

Localization, Where am I? 5.1 Localization, Where am I?? position Position Update (Estimation?) Encoder Prediction of Position (e.g. odometry) YES matched observations Map data base predicted position Matching Odometry, Dead Reckoning

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

Zürich. Roland Siegwart Margarita Chli Martin Rufli Davide Scaramuzza. ETH Master Course: L Autonomous Mobile Robots Summary

Zürich. Roland Siegwart Margarita Chli Martin Rufli Davide Scaramuzza. ETH Master Course: L Autonomous Mobile Robots Summary Roland Siegwart Margarita Chli Martin Rufli Davide Scaramuzza ETH Master Course: 151-0854-00L Autonomous Mobile Robots Summary 2 Lecture Overview Mobile Robot Control Scheme knowledge, data base mission

More information

EE565:Mobile Robotics Lecture 3

EE565:Mobile Robotics Lecture 3 EE565:Mobile Robotics Lecture 3 Welcome Dr. Ahmad Kamal Nasir Today s Objectives Motion Models Velocity based model (Dead-Reckoning) Odometry based model (Wheel Encoders) Sensor Models Beam model of range

More information

Autonomous Mobile Robot Design

Autonomous Mobile Robot Design Autonomous Mobile Robot Design Topic: EKF-based SLAM Dr. Kostas Alexis (CSE) These slides have partially relied on the course of C. Stachniss, Robot Mapping - WS 2013/14 Autonomous Robot Challenges Where

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

Navigation methods and systems

Navigation methods and systems Navigation methods and systems Navigare necesse est Content: Navigation of mobile robots a short overview Maps Motion Planning SLAM (Simultaneous Localization and Mapping) Navigation of mobile robots a

More information

Probabilistic Robotics

Probabilistic Robotics Probabilistic Robotics Bayes Filter Implementations Discrete filters, Particle filters Piecewise Constant Representation of belief 2 Discrete Bayes Filter Algorithm 1. Algorithm Discrete_Bayes_filter(

More information

Last update: May 6, Robotics. CMSC 421: Chapter 25. CMSC 421: Chapter 25 1

Last update: May 6, Robotics. CMSC 421: Chapter 25. CMSC 421: Chapter 25 1 Last update: May 6, 2010 Robotics CMSC 421: Chapter 25 CMSC 421: Chapter 25 1 A machine to perform tasks What is a robot? Some level of autonomy and flexibility, in some type of environment Sensory-motor

More information

Mobile Robotics. Mathematics, Models, and Methods

Mobile Robotics. Mathematics, Models, and Methods Mobile Robotics Mathematics, Models, and Methods Mobile Robotics offers comprehensive coverage of the essentials of the field suitable for both students and practitioners. Adapted from the author's graduate

More information

Robotics. Haslum COMP3620/6320

Robotics. Haslum COMP3620/6320 Robotics P@trik Haslum COMP3620/6320 Introduction Robotics Industrial Automation * Repetitive manipulation tasks (assembly, etc). * Well-known, controlled environment. * High-power, high-precision, very

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

Basics of Localization, Mapping and SLAM. Jari Saarinen Aalto University Department of Automation and systems Technology

Basics of Localization, Mapping and SLAM. Jari Saarinen Aalto University Department of Automation and systems Technology Basics of Localization, Mapping and SLAM Jari Saarinen Aalto University Department of Automation and systems Technology Content Introduction to Problem (s) Localization A few basic equations Dead Reckoning

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

From Personal Computers to Personal Robots

From Personal Computers to Personal Robots From Personal Computers to Personal Robots Challenges in Computer Science Education Nikolaus Correll Department of Computer Science University of Colorado at Boulder Mechanism vs. Computer Unimate (1961)

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

Implementation of Odometry with EKF for Localization of Hector SLAM Method

Implementation of Odometry with EKF for Localization of Hector SLAM Method Implementation of Odometry with EKF for Localization of Hector SLAM Method Kao-Shing Hwang 1 Wei-Cheng Jiang 2 Zuo-Syuan Wang 3 Department of Electrical Engineering, National Sun Yat-sen University, Kaohsiung,

More information

Introduction to Mobile Robotics

Introduction to Mobile Robotics Introduction to Mobile Robotics Olivier Aycard Associate Professor University of Grenoble Laboratoire d Informatique de Grenoble http://membres-liglab.imag.fr/aycard 1/29 Some examples of mobile robots

More information

Sensor Modalities. Sensor modality: Different modalities:

Sensor Modalities. Sensor modality: Different modalities: Sensor Modalities Sensor modality: Sensors which measure same form of energy and process it in similar ways Modality refers to the raw input used by the sensors Different modalities: Sound Pressure Temperature

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

Laser sensors. Transmitter. Receiver. Basilio Bona ROBOTICA 03CFIOR

Laser sensors. Transmitter. Receiver. Basilio Bona ROBOTICA 03CFIOR Mobile & Service Robotics Sensors for Robotics 3 Laser sensors Rays are transmitted and received coaxially The target is illuminated by collimated rays The receiver measures the time of flight (back and

More information

Robotics/Perception II

Robotics/Perception II Robotics/Perception II Artificial Intelligence and Integrated Computer Systems Division (AIICS) Outline Sensors - summary Computer systems Robotic architectures Mapping and Localization Motion planning

More information

Robot Mapping. A Short Introduction to the Bayes Filter and Related Models. Gian Diego Tipaldi, Wolfram Burgard

Robot Mapping. A Short Introduction to the Bayes Filter and Related Models. Gian Diego Tipaldi, Wolfram Burgard Robot Mapping A Short Introduction to the Bayes Filter and Related Models Gian Diego Tipaldi, Wolfram Burgard 1 State Estimation Estimate the state of a system given observations and controls Goal: 2 Recursive

More information

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

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

Introduction to robot algorithms CSE 410/510

Introduction to robot algorithms CSE 410/510 Introduction to robot algorithms CSE 410/510 Rob Platt robplatt@buffalo.edu Times: MWF, 10-10:50 Location: Clemens 322 Course web page: http://people.csail.mit.edu/rplatt/cse510.html Office Hours: 11-12

More information

EKF Localization and EKF SLAM incorporating prior information

EKF Localization and EKF SLAM incorporating prior information EKF Localization and EKF SLAM incorporating prior information Final Report ME- Samuel Castaneda ID: 113155 1. Abstract In the context of mobile robotics, before any motion planning or navigation algorithm

More information

High Accuracy Navigation Using Laser Range Sensors in Outdoor Applications

High Accuracy Navigation Using Laser Range Sensors in Outdoor Applications Proceedings of the 2000 IEEE International Conference on Robotics & Automation San Francisco, CA April 2000 High Accuracy Navigation Using Laser Range Sensors in Outdoor Applications Jose Guivant, Eduardo

More information

Mobile Robots Summery. Autonomous Mobile Robots

Mobile Robots Summery. Autonomous Mobile Robots Mobile Robots Summery Roland Siegwart Mike Bosse, Marco Hutter, Martin Rufli, Davide Scaramuzza, (Margarita Chli, Paul Furgale) Mobile Robots Summery 1 Introduction probabilistic map-based localization

More information

Motion Planning. Howie CHoset

Motion Planning. Howie CHoset Motion Planning Howie CHoset Questions Where are we? Where do we go? Which is more important? Encoders Encoders Incremental Photodetector Encoder disk LED Photoemitter Encoders - Incremental Encoders -

More information

W4. Perception & Situation Awareness & Decision making

W4. Perception & Situation Awareness & Decision making W4. Perception & Situation Awareness & Decision making Robot Perception for Dynamic environments: Outline & DP-Grids concept Dynamic Probabilistic Grids Bayesian Occupancy Filter concept Dynamic Probabilistic

More information

Theory of Robotics and Mechatronics

Theory of Robotics and Mechatronics Theory of Robotics and Mechatronics Final Exam 19.12.2016 Question: 1 2 3 Total Points: 18 32 10 60 Score: Name: Legi-Nr: Department: Semester: Duration: 120 min 1 A4-sheet (double sided) of notes allowed

More information

Navigation and Metric Path Planning

Navigation and Metric Path Planning Navigation and Metric Path Planning October 4, 2011 Minerva tour guide robot (CMU): Gave tours in Smithsonian s National Museum of History Example of Minerva s occupancy map used for navigation Objectives

More information

Motion estimation of unmanned marine vehicles Massimo Caccia

Motion estimation of unmanned marine vehicles Massimo Caccia Motion estimation of unmanned marine vehicles Massimo Caccia Consiglio Nazionale delle Ricerche Istituto di Studi sui Sistemi Intelligenti per l Automazione Via Amendola 122 D/O, 70126, Bari, Italy massimo.caccia@ge.issia.cnr.it

More information

Turning an Automated System into an Autonomous system using Model-Based Design Autonomous Tech Conference 2018

Turning an Automated System into an Autonomous system using Model-Based Design Autonomous Tech Conference 2018 Turning an Automated System into an Autonomous system using Model-Based Design Autonomous Tech Conference 2018 Asaf Moses Systematics Ltd., Technical Product Manager aviasafm@systematics.co.il 1 Autonomous

More information

Segway RMP Experiments at Georgia Tech

Segway RMP Experiments at Georgia Tech Segway RMP Experiments at Georgia Tech DARPA MARS Segway Workshop September 23, 2003 Tom Collins Major activities Interface to MissionLab Teleoperation experiments Use of laser range finder for terrain

More information

Rigid Body Transformations

Rigid Body Transformations F1/10 th Racing Rigid Body Transformations (Or How Different sensors see the same world) By, Paritosh Kelkar Mapping the surroundings Specify destination and generate path to goal The colored cells represent

More information

Robotic Perception and Action: Vehicle SLAM Assignment

Robotic Perception and Action: Vehicle SLAM Assignment Robotic Perception and Action: Vehicle SLAM Assignment Mariolino De Cecco Mariolino De Cecco, Mattia Tavernini 1 CONTENTS Vehicle SLAM Assignment Contents Assignment Scenario 3 Odometry Localization...........................................

More information

Configuration Space of a Robot

Configuration Space of a Robot Robot Path Planning Overview: 1. Visibility Graphs 2. Voronoi Graphs 3. Potential Fields 4. Sampling-Based Planners PRM: Probabilistic Roadmap Methods RRTs: Rapidly-exploring Random Trees Configuration

More information

Nonlinear State Estimation for Robotics and Computer Vision Applications: An Overview

Nonlinear State Estimation for Robotics and Computer Vision Applications: An Overview Nonlinear State Estimation for Robotics and Computer Vision Applications: An Overview Arun Das 05/09/2017 Arun Das Waterloo Autonomous Vehicles Lab Introduction What s in a name? Arun Das Waterloo Autonomous

More information

Advanced Robotics Path Planning & Navigation

Advanced Robotics Path Planning & Navigation Advanced Robotics Path Planning & Navigation 1 Agenda Motivation Basic Definitions Configuration Space Global Planning Local Planning Obstacle Avoidance ROS Navigation Stack 2 Literature Choset, Lynch,

More information

Robot Mapping. SLAM Front-Ends. Cyrill Stachniss. Partial image courtesy: Edwin Olson 1

Robot Mapping. SLAM Front-Ends. Cyrill Stachniss. Partial image courtesy: Edwin Olson 1 Robot Mapping SLAM Front-Ends Cyrill Stachniss Partial image courtesy: Edwin Olson 1 Graph-Based SLAM Constraints connect the nodes through odometry and observations Robot pose Constraint 2 Graph-Based

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

Simultaneous Localization and Mapping (SLAM)

Simultaneous Localization and Mapping (SLAM) Simultaneous Localization and Mapping (SLAM) RSS Lecture 16 April 8, 2013 Prof. Teller Text: Siegwart and Nourbakhsh S. 5.8 SLAM Problem Statement Inputs: No external coordinate reference Time series of

More information

Mobile Robots: An Introduction.

Mobile Robots: An Introduction. Mobile Robots: An Introduction Amirkabir University of Technology Computer Engineering & Information Technology Department http://ce.aut.ac.ir/~shiry/lecture/robotics-2004/robotics04.html Introduction

More information

Introduction to Multi-Agent Programming

Introduction to Multi-Agent Programming Introduction to Multi-Agent Programming 6. Cooperative Sensing Modeling Sensors, Kalman Filter, Markov Localization, Potential Fields Alexander Kleiner, Bernhard Nebel Contents Introduction Modeling and

More information

CSE 527: Introduction to Computer Vision

CSE 527: Introduction to Computer Vision CSE 527: Introduction to Computer Vision Week 10 Class 2: Visual Odometry November 2nd, 2017 Today Visual Odometry Intro Algorithm SLAM Visual Odometry Input Output Images, Video Camera trajectory, motion

More information

Humanoid Robotics. Monte Carlo Localization. Maren Bennewitz

Humanoid Robotics. Monte Carlo Localization. Maren Bennewitz Humanoid Robotics Monte Carlo Localization Maren Bennewitz 1 Basis Probability Rules (1) If x and y are independent: Bayes rule: Often written as: The denominator is a normalizing constant that ensures

More information

Final Exam : Introduction to Robotics. Last Updated: 9 May You will have 1 hour and 15 minutes to complete this exam

Final Exam : Introduction to Robotics. Last Updated: 9 May You will have 1 hour and 15 minutes to complete this exam Final Exam 16-311: Introduction to Robotics Last Updated: 9 May 2017 Name: Andrew ID: Team Number: You will have 1 hour and 15 minutes to complete this exam There are 6 sections on 20 pages. Make sure

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

CV: 3D to 2D mathematics. Perspective transformation; camera calibration; stereo computation; and more

CV: 3D to 2D mathematics. Perspective transformation; camera calibration; stereo computation; and more CV: 3D to 2D mathematics Perspective transformation; camera calibration; stereo computation; and more Roadmap of topics n Review perspective transformation n Camera calibration n Stereo methods n Structured

More information

Automated Parameterization of the Joint Space Dynamics of a Robotic Arm. Josh Petersen

Automated Parameterization of the Joint Space Dynamics of a Robotic Arm. Josh Petersen Automated Parameterization of the Joint Space Dynamics of a Robotic Arm Josh Petersen Introduction The goal of my project was to use machine learning to fully automate the parameterization of the joint

More information

Uncertainties: Representation and Propagation & Line Extraction from Range data

Uncertainties: Representation and Propagation & Line Extraction from Range data 41 Uncertainties: Representation and Propagation & Line Extraction from Range data 42 Uncertainty Representation Section 4.1.3 of the book Sensing in the real world is always uncertain How can uncertainty

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

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

UAV Autonomous Navigation in a GPS-limited Urban Environment

UAV Autonomous Navigation in a GPS-limited Urban Environment UAV Autonomous Navigation in a GPS-limited Urban Environment Yoko Watanabe DCSD/CDIN JSO-Aerial Robotics 2014/10/02-03 Introduction 2 Global objective Development of a UAV onboard system to maintain flight

More information

Introduction to Mobile Robotics

Introduction to Mobile Robotics Introduction to Mobile Robotics Olivier Aycard Associate Professor University of Grenoble Laboratoire d Informatique de Grenoble http://membres-liglab.imag.fr/aycard olivier. 1/22 What is a robot? Robot

More information

Practical Course WS12/13 Introduction to Monte Carlo Localization

Practical Course WS12/13 Introduction to Monte Carlo Localization Practical Course WS12/13 Introduction to Monte Carlo Localization Cyrill Stachniss and Luciano Spinello 1 State Estimation Estimate the state of a system given observations and controls Goal: 2 Bayes Filter

More information

Robotics. Lecture 5: Monte Carlo Localisation. See course website for up to date information.

Robotics. Lecture 5: Monte Carlo Localisation. See course website  for up to date information. Robotics Lecture 5: Monte Carlo Localisation See course website http://www.doc.ic.ac.uk/~ajd/robotics/ for up to date information. Andrew Davison Department of Computing Imperial College London Review:

More information

State Estimation for Continuous-Time Systems with Perspective Outputs from Discrete Noisy Time-Delayed Measurements

State Estimation for Continuous-Time Systems with Perspective Outputs from Discrete Noisy Time-Delayed Measurements State Estimation for Continuous-Time Systems with Perspective Outputs from Discrete Noisy Time-Delayed Measurements António Pedro Aguiar aguiar@ece.ucsb.edu João Pedro Hespanha hespanha@ece.ucsb.edu Dept.

More information

Simultaneous Localization

Simultaneous Localization Simultaneous Localization and Mapping (SLAM) RSS Technical Lecture 16 April 9, 2012 Prof. Teller Text: Siegwart and Nourbakhsh S. 5.8 Navigation Overview Where am I? Where am I going? Localization Assumed

More information

Probabilistic Robotics

Probabilistic Robotics Probabilistic Robotics Sebastian Thrun Wolfram Burgard Dieter Fox The MIT Press Cambridge, Massachusetts London, England Preface xvii Acknowledgments xix I Basics 1 1 Introduction 3 1.1 Uncertainty in

More information

High-precision, consistent EKF-based visual-inertial odometry

High-precision, consistent EKF-based visual-inertial odometry High-precision, consistent EKF-based visual-inertial odometry Mingyang Li and Anastasios I. Mourikis, IJRR 2013 Ao Li Introduction What is visual-inertial odometry (VIO)? The problem of motion tracking

More information

DYNAMIC POSITIONING OF A MOBILE ROBOT USING A LASER-BASED GONIOMETER. Joaquim A. Batlle*, Josep Maria Font*, Josep Escoda**

DYNAMIC POSITIONING OF A MOBILE ROBOT USING A LASER-BASED GONIOMETER. Joaquim A. Batlle*, Josep Maria Font*, Josep Escoda** DYNAMIC POSITIONING OF A MOBILE ROBOT USING A LASER-BASED GONIOMETER Joaquim A. Batlle*, Josep Maria Font*, Josep Escoda** * Department of Mechanical Engineering Technical University of Catalonia (UPC)

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

Robot Motion Planning

Robot Motion Planning Robot Motion Planning James Bruce Computer Science Department Carnegie Mellon University April 7, 2004 Agent Planning An agent is a situated entity which can choose and execute actions within in an environment.

More information

Robot Localization based on Geo-referenced Images and G raphic Methods

Robot Localization based on Geo-referenced Images and G raphic Methods Robot Localization based on Geo-referenced Images and G raphic Methods Sid Ahmed Berrabah Mechanical Department, Royal Military School, Belgium, sidahmed.berrabah@rma.ac.be Janusz Bedkowski, Łukasz Lubasiński,

More information

Robotics Project. Final Report. Computer Science University of Minnesota. December 17, 2007

Robotics Project. Final Report. Computer Science University of Minnesota. December 17, 2007 Robotics Project Final Report Computer Science 5551 University of Minnesota December 17, 2007 Peter Bailey, Matt Beckler, Thomas Bishop, and John Saxton Abstract: A solution of the parallel-parking problem

More information

Motion Planning, Part III Graph Search, Part I. Howie Choset

Motion Planning, Part III Graph Search, Part I. Howie Choset Motion Planning, Part III Graph Search, Part I Howie Choset Happy President s Day The Configuration Space What it is A set of reachable areas constructed from knowledge of both the robot and the world

More information

Range Imaging Through Triangulation. Range Imaging Through Triangulation. Range Imaging Through Triangulation. Range Imaging Through Triangulation

Range Imaging Through Triangulation. Range Imaging Through Triangulation. Range Imaging Through Triangulation. Range Imaging Through Triangulation Obviously, this is a very slow process and not suitable for dynamic scenes. To speed things up, we can use a laser that projects a vertical line of light onto the scene. This laser rotates around its vertical

More information

NAVIGATION SYSTEM OF AN OUTDOOR SERVICE ROBOT WITH HYBRID LOCOMOTION SYSTEM

NAVIGATION SYSTEM OF AN OUTDOOR SERVICE ROBOT WITH HYBRID LOCOMOTION SYSTEM NAVIGATION SYSTEM OF AN OUTDOOR SERVICE ROBOT WITH HYBRID LOCOMOTION SYSTEM Jorma Selkäinaho, Aarne Halme and Janne Paanajärvi Automation Technology Laboratory, Helsinki University of Technology, Espoo,

More information

10-701/15-781, Fall 2006, Final

10-701/15-781, Fall 2006, Final -7/-78, Fall 6, Final Dec, :pm-8:pm There are 9 questions in this exam ( pages including this cover sheet). If you need more room to work out your answer to a question, use the back of the page and clearly

More information

Major project components: Sensors Robot hardware/software integration Kinematic model generation High-level control

Major project components: Sensors Robot hardware/software integration Kinematic model generation High-level control Status update: Path planning/following for a snake Major project components: Sensors Robot hardware/software integration Kinematic model generation High-level control 2. Optical mouse Optical mouse technology

More information

Path Planning. Jacky Baltes Dept. of Computer Science University of Manitoba 11/21/10

Path Planning. Jacky Baltes Dept. of Computer Science University of Manitoba   11/21/10 Path Planning Jacky Baltes Autonomous Agents Lab Department of Computer Science University of Manitoba Email: jacky@cs.umanitoba.ca http://www.cs.umanitoba.ca/~jacky Path Planning Jacky Baltes Dept. of

More information

Advanced Robotics Path Planning & Navigation

Advanced Robotics Path Planning & Navigation Advanced Robotics Path Planning & Navigation 1 Agenda Motivation Basic Definitions Configuration Space Global Planning Local Planning Obstacle Avoidance ROS Navigation Stack 2 Literature Choset, Lynch,

More information

Outline Sensors. EE Sensors. H.I. Bozma. Electric Electronic Engineering Bogazici University. December 13, 2017

Outline Sensors. EE Sensors. H.I. Bozma. Electric Electronic Engineering Bogazici University. December 13, 2017 Electric Electronic Engineering Bogazici University December 13, 2017 Absolute position measurement Outline Motion Odometry Inertial systems Environmental Tactile Proximity Sensing Ground-Based RF Beacons

More information

Introduction to Mobile Robotics Path Planning and Collision Avoidance

Introduction to Mobile Robotics Path Planning and Collision Avoidance Introduction to Mobile Robotics Path Planning and Collision Avoidance Wolfram Burgard, Cyrill Stachniss, Maren Bennewitz, Giorgio Grisetti, Kai Arras 1 Motion Planning Latombe (1991): eminently necessary

More information

Sung-Eui Yoon ( 윤성의 )

Sung-Eui Yoon ( 윤성의 ) Path Planning for Point Robots Sung-Eui Yoon ( 윤성의 ) Course URL: http://sglab.kaist.ac.kr/~sungeui/mpa Class Objectives Motion planning framework Classic motion planning approaches 2 3 Configuration Space:

More information

Revising Stereo Vision Maps in Particle Filter Based SLAM using Localisation Confidence and Sample History

Revising Stereo Vision Maps in Particle Filter Based SLAM using Localisation Confidence and Sample History Revising Stereo Vision Maps in Particle Filter Based SLAM using Localisation Confidence and Sample History Simon Thompson and Satoshi Kagami Digital Human Research Center National Institute of Advanced

More information

ROBUST LOCALISATION OF AUTOMATED GUIDED VEHICLES FOR COMPUTER-INTEGRATED MANUFACTURING ENVIRONMENTS. R.C. Dixon 1 *, G.Bright 2 & R.

ROBUST LOCALISATION OF AUTOMATED GUIDED VEHICLES FOR COMPUTER-INTEGRATED MANUFACTURING ENVIRONMENTS. R.C. Dixon 1 *, G.Bright 2 & R. ROBUST LOCALISATION OF AUTOMATED GUIDED VEHICLES FOR COMPUTER-INTEGRATED MANUFACTURING ENVIRONMENTS R.C. Dixon 1 *, G.Bright 2 & R. Harley 3 1.2 Department of Mechanical Engineering University of KwaZulu-Natal,

More information

Artificial Intelligence for Robotics: A Brief Summary

Artificial Intelligence for Robotics: A Brief Summary Artificial Intelligence for Robotics: A Brief Summary This document provides a summary of the course, Artificial Intelligence for Robotics, and highlights main concepts. Lesson 1: Localization (using Histogram

More information

Robot Motion Planning

Robot Motion Planning Robot Motion Planning slides by Jan Faigl Department of Computer Science and Engineering Faculty of Electrical Engineering, Czech Technical University in Prague lecture A4M36PAH - Planning and Games Dpt.

More information

Encoder applications. I Most common use case: Combination with motors

Encoder applications. I Most common use case: Combination with motors 3.5 Rotation / Motion - Encoder applications 64-424 Intelligent Robotics Encoder applications I Most common use case: Combination with motors I Used to measure relative rotation angle, rotational direction

More information

BBR Progress Report 006: Autonomous 2-D Mapping of a Building Floor

BBR Progress Report 006: Autonomous 2-D Mapping of a Building Floor BBR Progress Report 006: Autonomous 2-D Mapping of a Building Floor Andy Sayler & Constantin Berzan November 30, 2010 Abstract In the past two weeks, we implemented and tested landmark extraction based

More information

Path Planning. Marcello Restelli. Dipartimento di Elettronica e Informazione Politecnico di Milano tel:

Path Planning. 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 Path Planning Robotica for Computer Engineering students A.A. 2006/2007

More information

Vision-based Mobile Robot Localization and Mapping using Scale-Invariant Features

Vision-based Mobile Robot Localization and Mapping using Scale-Invariant Features Vision-based Mobile Robot Localization and Mapping using Scale-Invariant Features Stephen Se, David Lowe, Jim Little Department of Computer Science University of British Columbia Presented by Adam Bickett

More information

Spring Localization II. Roland Siegwart, Margarita Chli, Martin Rufli. ASL Autonomous Systems Lab. Autonomous Mobile Robots

Spring Localization II. Roland Siegwart, Margarita Chli, Martin Rufli. ASL Autonomous Systems Lab. Autonomous Mobile Robots Spring 2016 Localization II Localization I 25.04.2016 1 knowledge, data base mission commands Localization Map Building environment model local map position global map Cognition Path Planning path Perception

More information

Principles of Robot Motion

Principles of Robot Motion Principles of Robot Motion Theory, Algorithms, and Implementation Howie Choset, Kevin Lynch, Seth Hutchinson, George Kantor, Wolfram Burgard, Lydia Kavraki, and Sebastian Thrun A Bradford Book The MIT

More information