Spring 2010: Lecture 9. Ashutosh Saxena. Ashutosh Saxena

Similar documents
Motion Planning 2D. Corso di Robotica Prof. Davide Brugali Università degli Studi di Bergamo

Path Planning for Point Robots. NUS CS 5247 David Hsu

Planning in Mobile Robotics

Sung-Eui Yoon ( 윤성의 )

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

Robotics Tasks. CS 188: Artificial Intelligence Spring Manipulator Robots. Mobile Robots. Degrees of Freedom. Sensors and Effectors

ECE276B: Planning & Learning in Robotics Lecture 5: Configuration Space

Lecture 3: Motion Planning 2

Autonomous and Mobile Robotics Prof. Giuseppe Oriolo. Motion Planning 1 Retraction and Cell Decomposition

Lecture 3: Motion Planning (cont.)

Algorithmic Robotics and Motion Planning

Discrete Motion Planning

Computational Geometry csci3250. Laura Toma. Bowdoin College

Road Map Methods. Including material from Howie Choset / G.D. Hager S. Leonard

Geometric Path Planning McGill COMP 765 Oct 12 th, 2017

Robot Motion Planning

MEV 442: Introduction to Robotics - Module 3 INTRODUCTION TO ROBOT PATH PLANNING

Probabilistic Methods for Kinodynamic Path Planning

Trajectory Optimization

Advanced Robotics Path Planning & Navigation

CMU-Q Lecture 4: Path Planning. Teacher: Gianni A. Di Caro

Local Search Methods. CS 188: Artificial Intelligence Fall Announcements. Hill Climbing. Hill Climbing Diagram. Today

Announcements. CS 188: Artificial Intelligence Fall Robot motion planning! Today. Robotics Tasks. Mobile Robots

CS 188: Artificial Intelligence Fall Announcements

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

Introduction to State-of-the-art Motion Planning Algorithms. Presented by Konstantinos Tsianos

Configuration Space of a Robot

Navigation and Metric Path Planning

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

Robot Motion Control Matteo Matteucci

6.141: Robotics systems and science Lecture 9: Configuration Space and Motion Planning

Lesson 1 Introduction to Path Planning Graph Searches: BFS and DFS

Lecture 11 Combinatorial Planning: In the Plane

Principles of Robot Motion

Motion Planning. Howie CHoset

Motion Planning for a Point Robot (2/2) Point Robot on a Grid. Planning requires models. Point Robot on a Grid 1/18/2012.

Visibility Graph. How does a Mobile Robot get from A to B?

A Reduced-Order Analytical Solution to Mobile Robot Trajectory Generation in the Presence of Moving Obstacles

Configuration Space. Ioannis Rekleitis

Visual Navigation for Flying Robots. Motion Planning

SPATIAL GUIDANCE TO RRT PLANNER USING CELL-DECOMPOSITION ALGORITHM

Robot Motion Planning and (a little) Computational Geometry

Lecture Schedule Week Date Lecture (W: 3:05p-4:50, 7-222)

Advanced Robotics Path Planning & Navigation

Robot Motion Planning

for Motion Planning RSS Lecture 10 Prof. Seth Teller

Introduction to Mobile Robotics Path and Motion Planning. Wolfram Burgard, Cyrill Stachniss, Maren Bennewitz, Diego Tipaldi, Luciano Spinello

6.141: Robotics systems and science Lecture 9: Configuration Space and Motion Planning

Can work in a group of at most 3 students.! Can work individually! If you work in a group of 2 or 3 students,!

Motion Planning. Chapter Motion Planning Concepts. by Lydia E. Kavraki and Steven M. LaValle Configuration Space

Planning: Part 1 Classical Planning

Motion Planning of Multiple Mobile Robots for Cooperative Manipulation and Transportation

Approximate path planning. Computational Geometry csci3250 Laura Toma Bowdoin College

Introduction to Information Science and Technology (IST) Part IV: Intelligent Machines and Robotics Planning

Algorithms for Sensor-Based Robotics: Sampling-Based Motion Planning

Robot Motion Planning in Eight Directions

Sampling-Based Robot Motion Planning. Lydia Kavraki Department of Computer Science Rice University Houston, TX USA

Motion Planning. Jana Kosecka Department of Computer Science

Mobile Robots: An Introduction.

Cognitive Robotics Robot Motion Planning Matteo Matteucci

Manipula0on Algorithms Mo0on Planning. Mo#on Planning I. Katharina Muelling (NREC, Carnegie Mellon University) 1

Autonomous Mobile Robots, Chapter 6 Planning and Navigation Where am I going? How do I get there? Localization. Cognition. Real World Environment

A Simple, but NP-Hard, Motion Planning Problem

Unit 5: Part 1 Planning

Introduction to Robotics

Roadmaps. Vertex Visibility Graph. Reduced visibility graph, i.e., not including segments that extend into obstacles on either side.

Advanced path planning. ROS RoboCup Rescue Summer School 2012

MEAM 620 Part II Introduction to Motion Planning. Peng Cheng. Levine 403,GRASP Lab

6.141: Robotics systems and science Lecture 10: Motion Planning III

Introduction to Mobile Robotics Path Planning and Collision Avoidance. Wolfram Burgard, Maren Bennewitz, Diego Tipaldi, Luciano Spinello

Roadmap Methods vs. Cell Decomposition in Robot Motion Planning

Assignment 1 is out! Due: 9 Sep 23:59! Can work in a group of 2-3 students.! NO cheating!!!! Submit in turnitin! Code + report!

Planning Techniques for Robotics Planning Representations: Skeletonization- and Grid-based Graphs

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

Humanoid Robotics. Inverse Kinematics and Whole-Body Motion Planning. Maren Bennewitz

Shorter, Smaller, Tighter Old and New Challenges

Algorithms for Sensor-Based Robotics: Sampling-Based Motion Planning

6.141: Robotics systems and science Lecture 10: Implementing Motion Planning

Mobile Robots Path Planning using Genetic Algorithms

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

Motion Planning. Howie CHoset

MEM380 Applied Autonomous Robots Fall Depth First Search A* and Dijkstra s Algorithm

Robotics. Chapter 25. Chapter 25 1

Motion Planning for Mobile Robots - A Guide

Introduction to Mobile Robotics Path Planning and Collision Avoidance

PATH PLANNING IMPLEMENTATION USING MATLAB

Lecture Note 2: Configuration Space

University of Nevada, Reno. Dynamic Path Planning and Replanning for Mobile Robot Team Using RRT*

Navigation methods and systems

W4. Perception & Situation Awareness & Decision making

Motion Planning, Part IV Graph Search Part II. Howie Choset

Non-holonomic Planning

Computer Game Programming Basic Path Finding

Robot Motion Planning Using Generalised Voronoi Diagrams

CS 763 F16. Moving objects in space with obstacles/constraints.

Real-time Reach Planning for Animated Characters Using Hardware Acceleration

CS4733 Class Notes. 1 2-D Robot Motion Planning Algorithm Using Grown Obstacles

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

Roadmap-Based Path Planning

This week. CENG 732 Computer Animation. Warping an Object. Warping an Object. 2D Grid Deformation. Warping an Object.

Transcription:

CS 4758/6758: Robot Learning Spring 2010: Lecture 9

Why planning and control? Video

Typical Architecture Planning 0.1 Hz Control 50 Hz Does it apply to all robots and all scenarios?

Previous Lecture: Potential Field

Planning: Articulated Robots

Path Planning

Planning: Goals Compute motion strategies, e.g., Geometric paths Time-parameterized trajectories Sequence of sensor-based motion commands Achieve high-level goals, e.g., Go to the door and do not collide with obstacles Assemble/disassemble the IKEA bookshelf.

Fundamental Question Are two given points connected by a path? Slide 9

Motion Planning: Basic Problem Problem statement: Compute a collision-free path for a rigid or articulated moving object among static obstacles. Input Geometry of a moving object, robot, and obstacles How does the robot move? Kinematics of the robot (degrees of freedom) Initial and goal robot configurations (positions & orientations) Output Continuous sequence of collision-free robot configurations connecting the initial and goal configurations Slide 10

Example: Rigid Objects

Example: Articulated Robot Slide 12

Tool: Configuration Space Difficulty Number of degrees of freedom (dimension of configuration space) Geometric complexity Slide 13

Extensions of the Basic Problem More complex robots Multiple robots Movable objects Nonholonomic & dynamic constraints Physical models and deformable objects Sensorless motions (exploiting task mechanics) Uncertainty in control Slide 14

Extensions of the Basic Problem More complex environments Moving obstacles Uncertainty in sensing More complex objectives Integration of planning and control Sensing the environment Model/map building Target finding, tracking

Practical Algorithms A complete motion planner always returns a solution when one exists and indicates that no such solution exists otherwise. Most motion planning problems are hard, meaning that complete planners take exponential time in the number of degrees of freedom, moving objects, etc. Slide 16

Practical Algorithms Theoretical algorithms strive for completeness and low worst-case complexity Difficult to implement Not robust Heuristic algorithms strive for efficiency in commonly encountered situations. No performance guarantee Practical algorithms with performance guarantees Weaker forms of completeness Simplifying assumptions on the space: exponential time algorithms that work in practice

Problem Formulation for Point Robot Input Robot represented as a point in the plane Obstacles represented as polygons Initial and goal positions Output A collision-free path between the initial and goal positions

Framework

Discretization Methods Full Grid Visibility Graph Voronoi Diagram Cell Decomposition Probabilistic Roadmaps

Full Grid

Full Grid

Visibility Graph Method Observation: If there is a collision-free path between two points, then there is a polygonal path that bends only at the obstacles vertices. Why? Any collision-free path can be transformed into a polygonal path that bends only at the obstacle vertices. A polygonal path is a piecewise linear curve.

Visibility Graph A visibility graph is a graph such that Nodes: q init, q goal, or an obstacle vertex. Edges: An edge exists between nodes u and v if the line segment between u and v is an obstacle edge or it does not intersect the obstacles.

A Simple Algorithm for Building Visibility Graphs

Computational Efficiency Simple algorithm O(n 3 ) time More efficient algorithms Rotational sweep O(n 2 log n) time Optimal algorithm O(n 2 ) time Output sensitive algorithms O(n 2 ) space Slide 26

Voronoi Diagram

Cell Decomposition

Approximate Cell Decomposition

Problem Formulation for General Robot What is the state space? Does it include other objects E.g., when interacting with other objects Full Grid discretization is huge (consider 7-dof arm, 100^7 possibilities) How should I discretize?

Discretization Methods Full Grid Visibility Graph Voronoi Diagram Cell Decomposition Probabilistic Roadmaps

Framework Slide 36

Summary Discretize the space by constructing visibility graph Search the visibility graph with breadth-first search

Search: Overview Breadth-first search Depth-first search A* star search Dijkstra

Breadth-First Search Slide 39

Breadth-First Search Slide 40

Breadth-First Search Slide 41

Breadth-First Search Slide 42

Breadth-First Search Slide 43

Breadth-First Search Slide 44

Breadth-First Search Slide 45

Breadth-First Search Slide 46

Breadth-First Search Slide 47

Breadth-First Search Slide 48

Breadth-first Search

Depth-First Search

A* Search

Given perfect sensing and map, one can do: 1. Planning 1. Discretize 2. Search 2. Control 1. Kinematics 2. PID control Example video

RRT

RRT: Car like robot

Hovercraft

RRT Reckless Driver

Driver s perspective

Planning packages in ROS OpenRave planar_patch_map (to convert point- cloud to polygonal structures)