SlideShare a Scribd company logo
1 of 44
Robot path planning,
navigation and localization
Robot Motion Planning
Task Plan
Action Plan
Path Plan
Trajectory
Plan
Controller
Sensor
Robot
Tasks
 Path planning
 Geometric path
 Issues: obstacle avoidance, shortest
path
 Trajectory planning,
 “interpolate” or “approximate” the
desired path by a class of polynomial
functions
 Generate a sequence of time-based
“control set points” for the control
of manipulator from the initial
configuration to its destination.
The World is Comprised of…
 Obstacles
 Already occupied spaces of the world
 In other words, robots can’t go there
 Free Space
 Unoccupied space within the world
 Robots “might” be able to go here
 To determine where a robot can go, we need to discuss what a Configuration Space
is
Configuration Space
 Notation:
 A: single rigid object –(the robot)
 W: Euclidean space where A moves;
 B1,…Bm: fixed rigid obstacles distributed in W
Configuration Space is the space of all possible robot configurations.
3
2
R
or
R
W 
• FW – world frame (fixed frame)
• FA – robot frame (moving frame
rigidly associated with the robot)
Configuration q of A is a specification
of the physical state (position and
orientation) of A w.r.t. a fixed
environmental frame FW.
Definitions
 Configuration: Specification of all the variables that
define the system completely
 Example: Configuration of a dof robot is
 Configuration space (C-space): Set of all
configurations
 Free configuration: A configuration that does not
collide with obstacles
 Free space ( F ) : Set of all free configurations
 It is a subset of C
 
1
1
0 ,
, 
 d
q
q
q
q 
d
q
Configuration Space of a 2D
Planer Robot
For a point robot moving in 2-D plane, C-space is
Configuration Space of A is the space (C )of all possible
configurations of A.
qslug
qrobot
C
Cfree
Cobs
2
R
Point robot (free-flying, no constraints)
Configuration Space of a Robot
Moving in 3D
For a point robot moving in 3-D, the C-space is
Z
x
y
qstart
qgoal
C
Cfree
Cobs
3
R
What is the difference between Euclidean space and C-space?
Configuration Space of a
2R Articulated Robot
2R manipulator Configuration space
b
a
b
a
Configuration Space
Two points in the robot’s workspace
b
a
270
360
180
90
0
90 180
135
45
Torus
(wraps horizontally and vertically)
qrobot
qgoal
b
a
Configuration Space
An obstacle in the robot’s workspace
b
a
270
360
180
90
0
90 180
135
45
qslug
qrobot
a “C-space” representation
b
a
If the robot configuration is within the blue area, it will hit the obstacle
What is dimension of the C-space of puma
robot (6R)?
Visualization of high dimension
C-space is difficult
Motion Planning
Find a collision free path from an initial
configuration to goal configuration
while taking into account the constrains
(geometric, physical, temporal)
A separate problem for each robot?
C-space concept
provide a
generalized
framework to
study the motion
planning problem
Expand
obstacle(s)
Reduce
robot
not quite right ...
Robot as a Point Object
C-obstacle
Point robot
Growing Obstacles
This expansion of one planar shape by
another is called the Minkowski sum 
P
R
P  R
Used in robotics to ensure that there are free paths available.
P  R = { p + r | p  P and r  R }
Rectangular robot which can translate only
(Dilation operation)
Minkowski Sums
What would the C-obstacle be if the rectangular
robot (red) can translate and rotate in the plane.
(The blue rectangle is an obstacle.)
x
y
Rectangular robot which can translate and rotate
Additional Dimensions
C-obstacle in 3-D
What would the configuration space of a 3DOF
rectangular robot (red) in this world look like?
(The obstacle is blue.)
x
y
0º
180º
3-D
One Slice of C-obstacle
Taking one slice of the C-obstacle in which the
robot is rotated 45 degrees...
x
y
45 degrees
P
R
P  R
2-D Projection
x
y
Projection problems
qinit
qgoal
Path Planning Methods
The motion planning problem consists of the following:
Input Output
• geometric descriptions of a robot
and its environment (obstacles)
• initial and goal configurations
• a path from start to finish (or
the recognition that none exists)
qgoal
qrobot
Problem Statement
Compute a collision-free path
for a rigid or articulated
moving object among static
obstacles
Path Planning Methods
(1) Roadmap approaches
(2) Cell decomposition
(3) Potential Fields
(4) Bug algorithms
Goal reduce the N-dimensional
configuration space to a set of
one-D paths to search.
Goal account for all of the free space
Goal Create local control strategies that
will be more flexible than those above
Limited knowledge path planning
Roadmap: Visibility Graphs
Visibility graphs: In a polygonal (or polyhedral) configuration space,
construct all of the line segments that connect vertices to one another (and that do
not intersect the obstacles themselves).
From Cfree, a graph is defined
Converts the problem into graph search.
Dijkstra’s algorithm Order(N
^2)
N = the number of vertices in C-space
Formed by connecting all “visible” vertices, the start point and the end
point, to each other.
For two points to be “visible” no obstacle can exist between them
Paths exist on the perimeter of obstacles
Visibility Graph in Action
 First, draw lines of sight from the start and goal to all
“visible” vertices and corners of the world.
start
goal
Visibility Graph in Action
 Second, draw lines of sight from every vertex of every
obstacle like before. Remember lines along edges are also
lines of sight.
start
goal
The Visibility Graph
 Repeat until you’re done.
start
goal
Since the map was in C-space, each line potentially represents part of a path
from the start to the goal.
Visibility Graph Drawbacks
Visibility graphs do not preserve their
optimality in higher dimensions:
In addition, the paths they find are “semi-free,” i.e. in contact with obstacles.
shortest path
shortest path within the visibility graph
No clearance
“official” Voronoi diagram
(line segments make up the
Voronoi diagram isolates a
set of points)
Roadmap: Voronoi diagrams
Generalized Voronoi Graph (GVG):
locus of points equidistant from the closest two
or more obstacle boundaries, including the
workspace boundary.
Property: maximizing the
clearance between the points
and obstacles.
Roadmap: Voronoi diagrams
 GVG is formed
by paths
equidistant
from the two
closest objects
 maximizing the
clearance
between the
obstacles.
• This generates a very safe roadmap which avoids
obstacles as much as possible
Voronoi Diagram: Metrics
• Many ways to measure distance; two are:
– L1 metric
• (x,y) : |x| + |y| = const
– L2 metric
• (x,y) : x2 +y2 = const
Voronoi Diagram (L1)
Note the
lack of
curved
edges
Voronoi Diagram (L2)
Note the
curved
edges
Path Planning Methods
Roadmap approaches
• Visibility Graph
• Voronoi Diagram
Cell decomposition
• Exact Cell Decomposition (Trapezoidal)
• Approximate Cell Decomposition (Quadtree)
Exact Cell Decomposition
Decomposition of the free space
into trapezoidal & triangular cells
Connectivity graph representing the
adjacency relation between the cells
(Sweepline algorithm)
Trapezoidal Decomposition:
Exact Cell Decomposition
Search the graph for a path
(sequence of consecutive cells)
Trapezoidal Decomposition:
Exact Cell Decomposition
Transform the sequence of cells into a
free path (e.g., connecting the mid-
points of the intersection of two
consecutive cells)
Trapezoidal Decomposition:
Obtaining the minimum number of convex
cells is NP-complete.
Optimality
15 cells 9 cells
Trapezoidal decomposition is exact
and complete, but not optimal
Trapezoidal Decomposition:
Quadtree Decomposition:
Approximate Cell Decomposition
recursively subdivides each mixed
obstacle/free (sub)region into four quarters...
Quadtree:
Further Decomposition
recursively subdivides each mixed
obstacle/free (sub)region into four quarters...
Quadtree:
Quadtree Decomposition:
Even Further Decomposition
Again, use a graph-search algorithm to
find a path from the start to goal
Quadtree
is this a complete path-planning algorithm?
i.e., does it find a path when one exists ?
Quadtree Decomposition:
• The rectangle cell is recursively
decomposed into smaller rectangles
• At a certain level of resolution, only the
cells whose interiors lie entirely in the free
space are used
• A search in this graph yields a collision
free path
Probablistic Roadmap Methods
 What is a PRM (Probablistic Roadmap Method)
 A probabilistic road map is a discrete representation of a
continuous configuration space generated by randomly
sampling the free configurations of the C-space and
connecting those points into a graph
 Complete path planning in high dimensional C- spaces
is very complex
 PRM methods boost performance by trading
completeness for probabilistic completeness
 Two phase approach: Learning phase, Query phase
Probabilistic Roadmap Methods
 Probabilistic techniques to incrementally build a
roadmap in free space of robot
• Efficiency-driven
• Robots with many dofs (high-dim C-
spaces)
• Static environments
s
g
s
~
g
~
Learning Phase
 Learning phase:
 Construction:
 randomly sample free space and create a list of nodes in free space.
 Connect all the nearest neighbors using a fast local planner.
 Store the graph whose nodes are configurations and edges are paths computed by local
planner
 Expansion step: Find “Difficult” nodes and expand the graph around them using
random walk techniques
Query Phase
 Find a path from the start and goal positions to two nodes of the roadmap
 Search the graph to find a sequence of edges connecting those nodes in the
roadmap
 Concatenating successive segments gives a feasible path for robot.
Thank You
Any Questions?

More Related Content

Similar to Robot path planning, navigation and localization.pptx

A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
CSCJournals
 
RoboticsMotionPlanning
RoboticsMotionPlanningRoboticsMotionPlanning
RoboticsMotionPlanning
Mohamed Wagdy
 
Dynamic Path Planning
Dynamic Path PlanningDynamic Path Planning
Dynamic Path Planning
dare2kreate
 
Robotics: Introduction to Kinematics
Robotics: Introduction to KinematicsRobotics: Introduction to Kinematics
Robotics: Introduction to Kinematics
Damian T. Gordon
 

Similar to Robot path planning, navigation and localization.pptx (20)

A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
 
RoboticsMotionPlanning
RoboticsMotionPlanningRoboticsMotionPlanning
RoboticsMotionPlanning
 
090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdf090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdf
 
Implementation of D* Path Planning Algorithm with NXT LEGO Mindstorms Kit for...
Implementation of D* Path Planning Algorithm with NXT LEGO Mindstorms Kit for...Implementation of D* Path Planning Algorithm with NXT LEGO Mindstorms Kit for...
Implementation of D* Path Planning Algorithm with NXT LEGO Mindstorms Kit for...
 
Dynamic Path Planning
Dynamic Path PlanningDynamic Path Planning
Dynamic Path Planning
 
CAD
CAD CAD
CAD
 
PRM-RL: Long-range Robotics Navigation Tasks by Combining Reinforcement Learn...
PRM-RL: Long-range Robotics Navigation Tasks by Combining Reinforcement Learn...PRM-RL: Long-range Robotics Navigation Tasks by Combining Reinforcement Learn...
PRM-RL: Long-range Robotics Navigation Tasks by Combining Reinforcement Learn...
 
Ultimate Goals In Robotics
Ultimate Goals In RoboticsUltimate Goals In Robotics
Ultimate Goals In Robotics
 
A simulated motion planning algorithm in 2 d
A simulated motion planning algorithm in 2 dA simulated motion planning algorithm in 2 d
A simulated motion planning algorithm in 2 d
 
Mission Planning and Execution for the Unmanned Rotorcraft ARTIS
Mission Planning and Execution for the Unmanned Rotorcraft ARTISMission Planning and Execution for the Unmanned Rotorcraft ARTIS
Mission Planning and Execution for the Unmanned Rotorcraft ARTIS
 
Robotics for Path Planning
Robotics for Path PlanningRobotics for Path Planning
Robotics for Path Planning
 
Presentation for korea multimedia(in english)
Presentation for korea multimedia(in english)Presentation for korea multimedia(in english)
Presentation for korea multimedia(in english)
 
Robotics: Introduction to Kinematics
Robotics: Introduction to KinematicsRobotics: Introduction to Kinematics
Robotics: Introduction to Kinematics
 
Chapter 7_0.pptx
Chapter 7_0.pptxChapter 7_0.pptx
Chapter 7_0.pptx
 
[Paper research] GOSELO: for Robot navigation using Reactive neural networks
[Paper research] GOSELO: for Robot navigation using Reactive neural networks[Paper research] GOSELO: for Robot navigation using Reactive neural networks
[Paper research] GOSELO: for Robot navigation using Reactive neural networks
 
Task Constrained Motion Planning for Snake Robot
Task Constrained Motion Planning for Snake RobotTask Constrained Motion Planning for Snake Robot
Task Constrained Motion Planning for Snake Robot
 
Trajectory Planning Through Polynomial Equation
Trajectory Planning Through Polynomial EquationTrajectory Planning Through Polynomial Equation
Trajectory Planning Through Polynomial Equation
 
Robotics Localization
Robotics LocalizationRobotics Localization
Robotics Localization
 
Lecture13
Lecture13Lecture13
Lecture13
 
BEV Semantic Segmentation
BEV Semantic SegmentationBEV Semantic Segmentation
BEV Semantic Segmentation
 

More from shohel rana (12)

Single Positron Emission Computed Tomography (SPECT)
Single Positron Emission Computed Tomography (SPECT)Single Positron Emission Computed Tomography (SPECT)
Single Positron Emission Computed Tomography (SPECT)
 
EEG Artifacts & How to Resolve (Lalit Bansal M.D.)
EEG Artifacts & How to Resolve (Lalit Bansal M.D.)EEG Artifacts & How to Resolve (Lalit Bansal M.D.)
EEG Artifacts & How to Resolve (Lalit Bansal M.D.)
 
ECG Rhythm Interpretation (ECG Rhythm Analysis)
ECG Rhythm Interpretation (ECG Rhythm Analysis)ECG Rhythm Interpretation (ECG Rhythm Analysis)
ECG Rhythm Interpretation (ECG Rhythm Analysis)
 
QRS detection is important in all kinds of ECG signal processing
QRS detection is important in all kinds of ECG signal processingQRS detection is important in all kinds of ECG signal processing
QRS detection is important in all kinds of ECG signal processing
 
Power_Electronics_-__Converters__Applications__and_Design-_3rd_edition.pdf
Power_Electronics_-__Converters__Applications__and_Design-_3rd_edition.pdfPower_Electronics_-__Converters__Applications__and_Design-_3rd_edition.pdf
Power_Electronics_-__Converters__Applications__and_Design-_3rd_edition.pdf
 
An angle modulated signal: Different Example
An angle modulated signal: Different ExampleAn angle modulated signal: Different Example
An angle modulated signal: Different Example
 
Calculate the bandwidth of the composite channel
Calculate the bandwidth of the composite channelCalculate the bandwidth of the composite channel
Calculate the bandwidth of the composite channel
 
AC circuits description with different signal
AC circuits description with different signalAC circuits description with different signal
AC circuits description with different signal
 
Machine-Learning-and-Robotics.pptx
Machine-Learning-and-Robotics.pptxMachine-Learning-and-Robotics.pptx
Machine-Learning-and-Robotics.pptx
 
2.-Line-Following-Robot.pptx
2.-Line-Following-Robot.pptx2.-Line-Following-Robot.pptx
2.-Line-Following-Robot.pptx
 
10833762.ppt
10833762.ppt10833762.ppt
10833762.ppt
 
Intro+Imaging.ppt
Intro+Imaging.pptIntro+Imaging.ppt
Intro+Imaging.ppt
 

Recently uploaded

XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
ssuser89054b
 
Verification of thevenin's theorem for BEEE Lab (1).pptx
Verification of thevenin's theorem for BEEE Lab (1).pptxVerification of thevenin's theorem for BEEE Lab (1).pptx
Verification of thevenin's theorem for BEEE Lab (1).pptx
chumtiyababu
 
DeepFakes presentation : brief idea of DeepFakes
DeepFakes presentation : brief idea of DeepFakesDeepFakes presentation : brief idea of DeepFakes
DeepFakes presentation : brief idea of DeepFakes
MayuraD1
 
Kuwait City MTP kit ((+919101817206)) Buy Abortion Pills Kuwait
Kuwait City MTP kit ((+919101817206)) Buy Abortion Pills KuwaitKuwait City MTP kit ((+919101817206)) Buy Abortion Pills Kuwait
Kuwait City MTP kit ((+919101817206)) Buy Abortion Pills Kuwait
jaanualu31
 
Call Girls in South Ex (delhi) call me [🔝9953056974🔝] escort service 24X7
Call Girls in South Ex (delhi) call me [🔝9953056974🔝] escort service 24X7Call Girls in South Ex (delhi) call me [🔝9953056974🔝] escort service 24X7
Call Girls in South Ex (delhi) call me [🔝9953056974🔝] escort service 24X7
9953056974 Low Rate Call Girls In Saket, Delhi NCR
 
Hospital management system project report.pdf
Hospital management system project report.pdfHospital management system project report.pdf
Hospital management system project report.pdf
Kamal Acharya
 
"Lesotho Leaps Forward: A Chronicle of Transformative Developments"
"Lesotho Leaps Forward: A Chronicle of Transformative Developments""Lesotho Leaps Forward: A Chronicle of Transformative Developments"
"Lesotho Leaps Forward: A Chronicle of Transformative Developments"
mphochane1998
 

Recently uploaded (20)

Double Revolving field theory-how the rotor develops torque
Double Revolving field theory-how the rotor develops torqueDouble Revolving field theory-how the rotor develops torque
Double Revolving field theory-how the rotor develops torque
 
Online electricity billing project report..pdf
Online electricity billing project report..pdfOnline electricity billing project report..pdf
Online electricity billing project report..pdf
 
AIRCANVAS[1].pdf mini project for btech students
AIRCANVAS[1].pdf mini project for btech studentsAIRCANVAS[1].pdf mini project for btech students
AIRCANVAS[1].pdf mini project for btech students
 
Navigating Complexity: The Role of Trusted Partners and VIAS3D in Dassault Sy...
Navigating Complexity: The Role of Trusted Partners and VIAS3D in Dassault Sy...Navigating Complexity: The Role of Trusted Partners and VIAS3D in Dassault Sy...
Navigating Complexity: The Role of Trusted Partners and VIAS3D in Dassault Sy...
 
GEAR TRAIN- BASIC CONCEPTS AND WORKING PRINCIPLE
GEAR TRAIN- BASIC CONCEPTS AND WORKING PRINCIPLEGEAR TRAIN- BASIC CONCEPTS AND WORKING PRINCIPLE
GEAR TRAIN- BASIC CONCEPTS AND WORKING PRINCIPLE
 
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
 
Verification of thevenin's theorem for BEEE Lab (1).pptx
Verification of thevenin's theorem for BEEE Lab (1).pptxVerification of thevenin's theorem for BEEE Lab (1).pptx
Verification of thevenin's theorem for BEEE Lab (1).pptx
 
DeepFakes presentation : brief idea of DeepFakes
DeepFakes presentation : brief idea of DeepFakesDeepFakes presentation : brief idea of DeepFakes
DeepFakes presentation : brief idea of DeepFakes
 
Kuwait City MTP kit ((+919101817206)) Buy Abortion Pills Kuwait
Kuwait City MTP kit ((+919101817206)) Buy Abortion Pills KuwaitKuwait City MTP kit ((+919101817206)) Buy Abortion Pills Kuwait
Kuwait City MTP kit ((+919101817206)) Buy Abortion Pills Kuwait
 
Call Girls in South Ex (delhi) call me [🔝9953056974🔝] escort service 24X7
Call Girls in South Ex (delhi) call me [🔝9953056974🔝] escort service 24X7Call Girls in South Ex (delhi) call me [🔝9953056974🔝] escort service 24X7
Call Girls in South Ex (delhi) call me [🔝9953056974🔝] escort service 24X7
 
PE 459 LECTURE 2- natural gas basic concepts and properties
PE 459 LECTURE 2- natural gas basic concepts and propertiesPE 459 LECTURE 2- natural gas basic concepts and properties
PE 459 LECTURE 2- natural gas basic concepts and properties
 
Computer Lecture 01.pptxIntroduction to Computers
Computer Lecture 01.pptxIntroduction to ComputersComputer Lecture 01.pptxIntroduction to Computers
Computer Lecture 01.pptxIntroduction to Computers
 
Hospital management system project report.pdf
Hospital management system project report.pdfHospital management system project report.pdf
Hospital management system project report.pdf
 
"Lesotho Leaps Forward: A Chronicle of Transformative Developments"
"Lesotho Leaps Forward: A Chronicle of Transformative Developments""Lesotho Leaps Forward: A Chronicle of Transformative Developments"
"Lesotho Leaps Forward: A Chronicle of Transformative Developments"
 
Wadi Rum luxhotel lodge Analysis case study.pptx
Wadi Rum luxhotel lodge Analysis case study.pptxWadi Rum luxhotel lodge Analysis case study.pptx
Wadi Rum luxhotel lodge Analysis case study.pptx
 
Unit 4_Part 1 CSE2001 Exception Handling and Function Template and Class Temp...
Unit 4_Part 1 CSE2001 Exception Handling and Function Template and Class Temp...Unit 4_Part 1 CSE2001 Exception Handling and Function Template and Class Temp...
Unit 4_Part 1 CSE2001 Exception Handling and Function Template and Class Temp...
 
data_management_and _data_science_cheat_sheet.pdf
data_management_and _data_science_cheat_sheet.pdfdata_management_and _data_science_cheat_sheet.pdf
data_management_and _data_science_cheat_sheet.pdf
 
Work-Permit-Receiver-in-Saudi-Aramco.pptx
Work-Permit-Receiver-in-Saudi-Aramco.pptxWork-Permit-Receiver-in-Saudi-Aramco.pptx
Work-Permit-Receiver-in-Saudi-Aramco.pptx
 
Hostel management system project report..pdf
Hostel management system project report..pdfHostel management system project report..pdf
Hostel management system project report..pdf
 
Moment Distribution Method For Btech Civil
Moment Distribution Method For Btech CivilMoment Distribution Method For Btech Civil
Moment Distribution Method For Btech Civil
 

Robot path planning, navigation and localization.pptx

  • 2. Robot Motion Planning Task Plan Action Plan Path Plan Trajectory Plan Controller Sensor Robot Tasks  Path planning  Geometric path  Issues: obstacle avoidance, shortest path  Trajectory planning,  “interpolate” or “approximate” the desired path by a class of polynomial functions  Generate a sequence of time-based “control set points” for the control of manipulator from the initial configuration to its destination.
  • 3. The World is Comprised of…  Obstacles  Already occupied spaces of the world  In other words, robots can’t go there  Free Space  Unoccupied space within the world  Robots “might” be able to go here  To determine where a robot can go, we need to discuss what a Configuration Space is
  • 4. Configuration Space  Notation:  A: single rigid object –(the robot)  W: Euclidean space where A moves;  B1,…Bm: fixed rigid obstacles distributed in W Configuration Space is the space of all possible robot configurations. 3 2 R or R W  • FW – world frame (fixed frame) • FA – robot frame (moving frame rigidly associated with the robot) Configuration q of A is a specification of the physical state (position and orientation) of A w.r.t. a fixed environmental frame FW.
  • 5. Definitions  Configuration: Specification of all the variables that define the system completely  Example: Configuration of a dof robot is  Configuration space (C-space): Set of all configurations  Free configuration: A configuration that does not collide with obstacles  Free space ( F ) : Set of all free configurations  It is a subset of C   1 1 0 , ,   d q q q q  d q
  • 6. Configuration Space of a 2D Planer Robot For a point robot moving in 2-D plane, C-space is Configuration Space of A is the space (C )of all possible configurations of A. qslug qrobot C Cfree Cobs 2 R Point robot (free-flying, no constraints)
  • 7. Configuration Space of a Robot Moving in 3D For a point robot moving in 3-D, the C-space is Z x y qstart qgoal C Cfree Cobs 3 R What is the difference between Euclidean space and C-space?
  • 8. Configuration Space of a 2R Articulated Robot 2R manipulator Configuration space b a b a
  • 9. Configuration Space Two points in the robot’s workspace b a 270 360 180 90 0 90 180 135 45 Torus (wraps horizontally and vertically) qrobot qgoal b a
  • 10. Configuration Space An obstacle in the robot’s workspace b a 270 360 180 90 0 90 180 135 45 qslug qrobot a “C-space” representation b a If the robot configuration is within the blue area, it will hit the obstacle What is dimension of the C-space of puma robot (6R)? Visualization of high dimension C-space is difficult
  • 11. Motion Planning Find a collision free path from an initial configuration to goal configuration while taking into account the constrains (geometric, physical, temporal) A separate problem for each robot? C-space concept provide a generalized framework to study the motion planning problem
  • 12. Expand obstacle(s) Reduce robot not quite right ... Robot as a Point Object
  • 14. This expansion of one planar shape by another is called the Minkowski sum  P R P  R Used in robotics to ensure that there are free paths available. P  R = { p + r | p  P and r  R } Rectangular robot which can translate only (Dilation operation) Minkowski Sums
  • 15. What would the C-obstacle be if the rectangular robot (red) can translate and rotate in the plane. (The blue rectangle is an obstacle.) x y Rectangular robot which can translate and rotate Additional Dimensions
  • 16. C-obstacle in 3-D What would the configuration space of a 3DOF rectangular robot (red) in this world look like? (The obstacle is blue.) x y 0º 180º 3-D
  • 17. One Slice of C-obstacle Taking one slice of the C-obstacle in which the robot is rotated 45 degrees... x y 45 degrees P R P  R
  • 20. Path Planning Methods The motion planning problem consists of the following: Input Output • geometric descriptions of a robot and its environment (obstacles) • initial and goal configurations • a path from start to finish (or the recognition that none exists) qgoal qrobot Problem Statement Compute a collision-free path for a rigid or articulated moving object among static obstacles
  • 21. Path Planning Methods (1) Roadmap approaches (2) Cell decomposition (3) Potential Fields (4) Bug algorithms Goal reduce the N-dimensional configuration space to a set of one-D paths to search. Goal account for all of the free space Goal Create local control strategies that will be more flexible than those above Limited knowledge path planning
  • 22. Roadmap: Visibility Graphs Visibility graphs: In a polygonal (or polyhedral) configuration space, construct all of the line segments that connect vertices to one another (and that do not intersect the obstacles themselves). From Cfree, a graph is defined Converts the problem into graph search. Dijkstra’s algorithm Order(N ^2) N = the number of vertices in C-space Formed by connecting all “visible” vertices, the start point and the end point, to each other. For two points to be “visible” no obstacle can exist between them Paths exist on the perimeter of obstacles
  • 23. Visibility Graph in Action  First, draw lines of sight from the start and goal to all “visible” vertices and corners of the world. start goal
  • 24. Visibility Graph in Action  Second, draw lines of sight from every vertex of every obstacle like before. Remember lines along edges are also lines of sight. start goal
  • 25. The Visibility Graph  Repeat until you’re done. start goal Since the map was in C-space, each line potentially represents part of a path from the start to the goal.
  • 26. Visibility Graph Drawbacks Visibility graphs do not preserve their optimality in higher dimensions: In addition, the paths they find are “semi-free,” i.e. in contact with obstacles. shortest path shortest path within the visibility graph No clearance
  • 27. “official” Voronoi diagram (line segments make up the Voronoi diagram isolates a set of points) Roadmap: Voronoi diagrams Generalized Voronoi Graph (GVG): locus of points equidistant from the closest two or more obstacle boundaries, including the workspace boundary. Property: maximizing the clearance between the points and obstacles.
  • 28. Roadmap: Voronoi diagrams  GVG is formed by paths equidistant from the two closest objects  maximizing the clearance between the obstacles. • This generates a very safe roadmap which avoids obstacles as much as possible
  • 29. Voronoi Diagram: Metrics • Many ways to measure distance; two are: – L1 metric • (x,y) : |x| + |y| = const – L2 metric • (x,y) : x2 +y2 = const
  • 30. Voronoi Diagram (L1) Note the lack of curved edges
  • 31. Voronoi Diagram (L2) Note the curved edges
  • 32. Path Planning Methods Roadmap approaches • Visibility Graph • Voronoi Diagram Cell decomposition • Exact Cell Decomposition (Trapezoidal) • Approximate Cell Decomposition (Quadtree)
  • 33. Exact Cell Decomposition Decomposition of the free space into trapezoidal & triangular cells Connectivity graph representing the adjacency relation between the cells (Sweepline algorithm) Trapezoidal Decomposition:
  • 34. Exact Cell Decomposition Search the graph for a path (sequence of consecutive cells) Trapezoidal Decomposition:
  • 35. Exact Cell Decomposition Transform the sequence of cells into a free path (e.g., connecting the mid- points of the intersection of two consecutive cells) Trapezoidal Decomposition:
  • 36. Obtaining the minimum number of convex cells is NP-complete. Optimality 15 cells 9 cells Trapezoidal decomposition is exact and complete, but not optimal Trapezoidal Decomposition:
  • 37. Quadtree Decomposition: Approximate Cell Decomposition recursively subdivides each mixed obstacle/free (sub)region into four quarters... Quadtree:
  • 38. Further Decomposition recursively subdivides each mixed obstacle/free (sub)region into four quarters... Quadtree: Quadtree Decomposition:
  • 39. Even Further Decomposition Again, use a graph-search algorithm to find a path from the start to goal Quadtree is this a complete path-planning algorithm? i.e., does it find a path when one exists ? Quadtree Decomposition: • The rectangle cell is recursively decomposed into smaller rectangles • At a certain level of resolution, only the cells whose interiors lie entirely in the free space are used • A search in this graph yields a collision free path
  • 40. Probablistic Roadmap Methods  What is a PRM (Probablistic Roadmap Method)  A probabilistic road map is a discrete representation of a continuous configuration space generated by randomly sampling the free configurations of the C-space and connecting those points into a graph  Complete path planning in high dimensional C- spaces is very complex  PRM methods boost performance by trading completeness for probabilistic completeness  Two phase approach: Learning phase, Query phase
  • 41. Probabilistic Roadmap Methods  Probabilistic techniques to incrementally build a roadmap in free space of robot • Efficiency-driven • Robots with many dofs (high-dim C- spaces) • Static environments s g s ~ g ~
  • 42. Learning Phase  Learning phase:  Construction:  randomly sample free space and create a list of nodes in free space.  Connect all the nearest neighbors using a fast local planner.  Store the graph whose nodes are configurations and edges are paths computed by local planner  Expansion step: Find “Difficult” nodes and expand the graph around them using random walk techniques
  • 43. Query Phase  Find a path from the start and goal positions to two nodes of the roadmap  Search the graph to find a sequence of edges connecting those nodes in the roadmap  Concatenating successive segments gives a feasible path for robot.