SlideShare a Scribd company logo
1 of 27
Download to read offline
Robotics
Chapter 25
Chapter 25 1
Outline
Robots, Effectors, and Sensors
Localization and Mapping
Motion Planning
Motor Control
Chapter 25 2
Mobile Robots
Chapter 25 3
Manipulators
R
RR
P
R R
Configuration of robot specified by 6 numbers
⇒ 6 degrees of freedom (DOF)
6 is the minimum number required to position end-effector arbitrarily.
For dynamical systems, add velocity for each DOF.
Chapter 25 4
Non-holonomic robots
θ
(x, y)
A car has more DOF (3) than controls (2), so is non-holonomic;
cannot generally transition between two infinitesimally close configurations
Chapter 25 5
Sensors
Range finders: sonar (land, underwater), laser range finder, radar (aircraft),
tactile sensors, GPS
Imaging sensors: cameras (visual, infrared)
Proprioceptive sensors: shaft decoders (joints, wheels), inertial sensors,
force sensors, torque sensors
Chapter 25 6
Localization—Where Am I?
Compute current location and orientation (pose) given observations:
Xt+1Xt
At−2 At−1 At
Zt−1
Xt−1
Zt Zt+1
Chapter 25 7
Localization contd.
xi, yi
vt ∆t
t ∆t
t+1
xt+1
h(xt)
xt
θt
θ
ω
Z1 Z2 Z3 Z4
Assume Gaussian noise in motion prediction, sensor range measurements
Chapter 25 8
Localization contd.
Can use particle filtering to produce approximate position estimate
Robot position
Robot position
Robot position
Chapter 25 9
Localization contd.
Can also use extended Kalman filter for simple cases:
robot
landmark
Assumes that landmarks are identifiable—otherwise, posterior is multimodal
Chapter 25 10
Mapping
Localization: given map and observed landmarks, update pose distribution
Mapping: given pose and observed landmarks, update map distribution
SLAM: given observed landmarks, update pose and map distribution
Probabilistic formulation of SLAM:
add landmark locations L1, . . . , Lk to the state vector,
proceed as for localization
Chapter 25 11
Mapping contd.
Chapter 25 12
3D Mapping example
Chapter 25 13
Motion Planning
Idea: plan in configuration space defined by the robot’s DOFs
conf-3
conf-1
conf-2
conf-3
conf-2
conf-1
␸
␸
elb
shou
Solution is a point trajectory in free C-space
Chapter 25 14
Configuration space planning
Basic problem: ∞d
states! Convert to finite state space.
Cell decomposition:
divide up space into simple cells,
each of which can be traversed “easily” (e.g., convex)
Skeletonization:
identify finite number of easily connected points/lines
that form a graph such that any two points are connected
by a path on the graph
Chapter 25 15
Cell decomposition example
start
goal
start
goal
Problem: may be no path in pure freespace cells
Solution: recursive decomposition of mixed (free+obstacle) cells
Chapter 25 16
Skeletonization: Voronoi diagram
Voronoi diagram: locus of points equidistant from obstacles
Problem: doesn’t scale well to higher dimensions
Chapter 25 17
Skeletonization: Probabilistic Roadmap
A probabilistic roadmap is generated by generating random points in C-space
and keeping those in freespace; create graph by joining pairs by straight lines
Problem: need to generate enough points to ensure that every start/goal
pair is connected through the graph
Chapter 25 18
Motor control
Can view the motor control problem as a search problem
in the dynamic rather than kinematic state space:
– state space defined by x1, x2, . . . , ˙x1, ˙x2, . . .
– continuous, high-dimensional (Sarcos humanoid: 162 dimensions)
Deterministic control: many problems are exactly solvable
esp. if linear, low-dimensional, exactly known, observable
Simple regulatory control laws are effective for specified motions
Stochastic optimal control: very few problems exactly solvable
⇒ approximate/adaptive methods
Chapter 25 19
Biological motor control
Motor control systems are characterized by massive redundancy
Infinitely many trajectories achieve any given task
E.g., 3-link arm moving in plane throwing at a target
simple 12-parameter controller, one degree of freedom at target
11-dimensional continuous space of optimal controllers
Idea: if the arm is noisy, only “one” optimal policy minimizes error at target
I.e., noise-tolerance might explain actual motor behaviour
Harris & Wolpert (Nature, 1998): signal-dependent noise
explains eye saccade velocity profile perfectly
Chapter 25 20
Setup
Suppose a controller has “intended” control parameters θ0
which are corrupted by noise, giving θ drawn from Pθ0
Output (e.g., distance from target) y = F(θ);
y
Chapter 25 21
Simple learning algorithm: Stochastic gradient
Minimize Eθ[y2
] by gradient descent:
θ0Eθ[y2
] = θ0 Pθ0(θ)F(θ)2
dθ
=
θ0Pθ0(θ)
Pθ0(θ)
F(θ)2
Pθ0(θ)dθ
= Eθ[
θ0Pθ0(θ)
Pθ0(θ)
y2
]
Given samples (θj, yj), j = 1, . . . , N, we have
ˆθ0Eθ[y2] =
1
N
N
j=1
θ0Pθ0(θj)
Pθ0(θj)
y2
j
For Gaussian noise with covariance Σ, i.e., Pθ0(θ) = N(θ0, Σ), we obtain
ˆθ0Eθ[y2] =
1
N
N
j=1
Σ−1
(θj − θ0)y2
j
Chapter 25 22
What the algorithm is doing
x
x
x
x
x
x
x
x x
x
x
x
x
x x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
x
Chapter 25 23
Results for 2–D controller
4
5
6
7
8
9
10
0.2 0.4 0.6 0.8 1 1.2
Velocityv
Angle phi
Chapter 25 24
Results for 2–D controller
4.51
4.52
4.53
4.54
4.55
4.56
4.57
4.58
4.59
4.6
4.61
0.6 0.61 0.62 0.63 0.64 0.65
Velocityv
Angle phi
Chapter 25 25
Results for 2–D controller
0.0055
0.006
0.0065
0.007
0.0075
0.008
0.0085
0.009
0.0095
0 2000 4000 6000 8000 10000
E(y^2)
Step
Chapter 25 26
Summary
The rubber hits the road
Mobile robots and manipulators
Degrees of freedom to define robot configuration
Localization and mapping as probabilistic inference problems
(require good sensor and motion models)
Motion planning in configuration space
requires some method for finitization
Chapter 25 27

More Related Content

What's hot

group.D.final.presentation
group.D.final.presentationgroup.D.final.presentation
group.D.final.presentation
jftesser
 
Rational Neural Networks for Approximating Jump Discontinuities of Graph Conv...
Rational Neural Networks for Approximating Jump Discontinuities of Graph Conv...Rational Neural Networks for Approximating Jump Discontinuities of Graph Conv...
Rational Neural Networks for Approximating Jump Discontinuities of Graph Conv...
Zhiqian Chen
 
Lab lect03 arith_control
Lab lect03 arith_controlLab lect03 arith_control
Lab lect03 arith_control
MPDS
 

What's hot (19)

Max flow min cut
Max flow min cutMax flow min cut
Max flow min cut
 
Adauctions
AdauctionsAdauctions
Adauctions
 
Ford Fulkerson Algorithm
Ford Fulkerson AlgorithmFord Fulkerson Algorithm
Ford Fulkerson Algorithm
 
Max Flow Problem
Max Flow ProblemMax Flow Problem
Max Flow Problem
 
Foreground Detection : Combining Background Subspace Learning with Object Smo...
Foreground Detection : Combining Background Subspace Learning with Object Smo...Foreground Detection : Combining Background Subspace Learning with Object Smo...
Foreground Detection : Combining Background Subspace Learning with Object Smo...
 
Gradually Varied Flow in Open Channel
Gradually Varied Flow in Open ChannelGradually Varied Flow in Open Channel
Gradually Varied Flow in Open Channel
 
IROS 2013 talk
IROS 2013 talkIROS 2013 talk
IROS 2013 talk
 
hospital management
hospital managementhospital management
hospital management
 
Network flow problems
Network flow problemsNetwork flow problems
Network flow problems
 
group.D.final.presentation
group.D.final.presentationgroup.D.final.presentation
group.D.final.presentation
 
Rational Neural Networks for Approximating Jump Discontinuities of Graph Conv...
Rational Neural Networks for Approximating Jump Discontinuities of Graph Conv...Rational Neural Networks for Approximating Jump Discontinuities of Graph Conv...
Rational Neural Networks for Approximating Jump Discontinuities of Graph Conv...
 
Single sourceshortestpath by emad
Single sourceshortestpath by emadSingle sourceshortestpath by emad
Single sourceshortestpath by emad
 
Introduction to Turing Machine
Introduction to Turing MachineIntroduction to Turing Machine
Introduction to Turing Machine
 
09 bsc-17 dsp lab 10-1
09 bsc-17 dsp lab 10-109 bsc-17 dsp lab 10-1
09 bsc-17 dsp lab 10-1
 
Geometry Shader
Geometry ShaderGeometry Shader
Geometry Shader
 
5.MLP(Multi-Layer Perceptron)
5.MLP(Multi-Layer Perceptron) 5.MLP(Multi-Layer Perceptron)
5.MLP(Multi-Layer Perceptron)
 
Lab lect03 arith_control
Lab lect03 arith_controlLab lect03 arith_control
Lab lect03 arith_control
 
Vlsi presentation final
Vlsi presentation finalVlsi presentation final
Vlsi presentation final
 
Model-counting Approaches For Nonlinear Numerical Constraints
Model-counting Approaches For Nonlinear Numerical ConstraintsModel-counting Approaches For Nonlinear Numerical Constraints
Model-counting Approaches For Nonlinear Numerical Constraints
 

Similar to robotics basics

15_robotics-intro.pdf in ai machine learning
15_robotics-intro.pdf in ai machine learning15_robotics-intro.pdf in ai machine learning
15_robotics-intro.pdf in ai machine learning
McSwathi
 
VTC-location based channel estimation for massive full-dimensional MIMO systems
VTC-location based channel estimation for massive full-dimensional MIMO systemsVTC-location based channel estimation for massive full-dimensional MIMO systems
VTC-location based channel estimation for massive full-dimensional MIMO systems
Qian Han
 
Lesson_11_Low-level_Flight_Control hexa copt best ppt.pdf
Lesson_11_Low-level_Flight_Control hexa copt best ppt.pdfLesson_11_Low-level_Flight_Control hexa copt best ppt.pdf
Lesson_11_Low-level_Flight_Control hexa copt best ppt.pdf
BorchalaDareje
 

Similar to robotics basics (20)

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
 
Relay Vehicle Formations for Optimizing Communication Quality in Robot Networks
Relay Vehicle Formations for Optimizing Communication Quality in Robot NetworksRelay Vehicle Formations for Optimizing Communication Quality in Robot Networks
Relay Vehicle Formations for Optimizing Communication Quality in Robot Networks
 
Применение машинного обучения для навигации и управления роботами
Применение машинного обучения для навигации и управления роботамиПрименение машинного обучения для навигации и управления роботами
Применение машинного обучения для навигации и управления роботами
 
ITS World Congress :: Vienna, Oct 2012
ITS World Congress :: Vienna, Oct 2012ITS World Congress :: Vienna, Oct 2012
ITS World Congress :: Vienna, Oct 2012
 
Actuator Constrained Optimal Control of Formations Near the Libration Points
Actuator Constrained Optimal Control of Formations Near the Libration PointsActuator Constrained Optimal Control of Formations Near the Libration Points
Actuator Constrained Optimal Control of Formations Near the Libration Points
 
Vector Distance Transform Maps for Autonomous Mobile Robot Navigation
Vector Distance Transform Maps for Autonomous Mobile Robot NavigationVector Distance Transform Maps for Autonomous Mobile Robot Navigation
Vector Distance Transform Maps for Autonomous Mobile Robot Navigation
 
15_robotics-intro.pdf in ai machine learning
15_robotics-intro.pdf in ai machine learning15_robotics-intro.pdf in ai machine learning
15_robotics-intro.pdf in ai machine learning
 
DiamondH1_EN
DiamondH1_ENDiamondH1_EN
DiamondH1_EN
 
VTC-location based channel estimation for massive full-dimensional MIMO systems
VTC-location based channel estimation for massive full-dimensional MIMO systemsVTC-location based channel estimation for massive full-dimensional MIMO systems
VTC-location based channel estimation for massive full-dimensional MIMO systems
 
Platoon Control of Nonholonomic Robots using Quintic Bezier Splines
Platoon Control of Nonholonomic Robots using Quintic Bezier SplinesPlatoon Control of Nonholonomic Robots using Quintic Bezier Splines
Platoon Control of Nonholonomic Robots using Quintic Bezier Splines
 
Combinational logic circuit by umakant bhaskar gohatre
Combinational logic circuit by umakant bhaskar gohatreCombinational logic circuit by umakant bhaskar gohatre
Combinational logic circuit by umakant bhaskar gohatre
 
Super-twisting sliding mode based nonlinear control for planar dual arm robots
Super-twisting sliding mode based nonlinear control for planar dual arm robotsSuper-twisting sliding mode based nonlinear control for planar dual arm robots
Super-twisting sliding mode based nonlinear control for planar dual arm robots
 
Lecture13 controls
Lecture13  controls Lecture13  controls
Lecture13 controls
 
Back-Stepping Control of Free-Floating Space Robot based on Adaptive Neural N...
Back-Stepping Control of Free-Floating Space Robot based on Adaptive Neural N...Back-Stepping Control of Free-Floating Space Robot based on Adaptive Neural N...
Back-Stepping Control of Free-Floating Space Robot based on Adaptive Neural N...
 
Fpw chapter 4 - digital ctrl of dynamic systems
Fpw chapter 4 - digital ctrl of dynamic systemsFpw chapter 4 - digital ctrl of dynamic systems
Fpw chapter 4 - digital ctrl of dynamic systems
 
Lesson_11_Low-level_Flight_Control hexa copt best ppt.pdf
Lesson_11_Low-level_Flight_Control hexa copt best ppt.pdfLesson_11_Low-level_Flight_Control hexa copt best ppt.pdf
Lesson_11_Low-level_Flight_Control hexa copt best ppt.pdf
 
Cycle’s topological optimizations and the iterative decoding problem on gener...
Cycle’s topological optimizations and the iterative decoding problem on gener...Cycle’s topological optimizations and the iterative decoding problem on gener...
Cycle’s topological optimizations and the iterative decoding problem on gener...
 
090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdf090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdf
 
E043036045
E043036045E043036045
E043036045
 
E043036045
E043036045E043036045
E043036045
 

Recently uploaded

+97470301568>> buy weed in qatar,buy thc oil qatar,buy weed and vape oil in d...
+97470301568>> buy weed in qatar,buy thc oil qatar,buy weed and vape oil in d...+97470301568>> buy weed in qatar,buy thc oil qatar,buy weed and vape oil in d...
+97470301568>> buy weed in qatar,buy thc oil qatar,buy weed and vape oil in d...
Health
 
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
 
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
 
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
ssuser89054b
 
"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)

+97470301568>> buy weed in qatar,buy thc oil qatar,buy weed and vape oil in d...
+97470301568>> buy weed in qatar,buy thc oil qatar,buy weed and vape oil in d...+97470301568>> buy weed in qatar,buy thc oil qatar,buy weed and vape oil in d...
+97470301568>> buy weed in qatar,buy thc oil qatar,buy weed and vape oil in d...
 
COST-EFFETIVE and Energy Efficient BUILDINGS ptx
COST-EFFETIVE  and Energy Efficient BUILDINGS ptxCOST-EFFETIVE  and Energy Efficient BUILDINGS ptx
COST-EFFETIVE and Energy Efficient BUILDINGS ptx
 
Learn the concepts of Thermodynamics on Magic Marks
Learn the concepts of Thermodynamics on Magic MarksLearn the concepts of Thermodynamics on Magic Marks
Learn the concepts of Thermodynamics on Magic Marks
 
Unleashing the Power of the SORA AI lastest leap
Unleashing the Power of the SORA AI lastest leapUnleashing the Power of the SORA AI lastest leap
Unleashing the Power of the SORA AI lastest leap
 
DC MACHINE-Motoring and generation, Armature circuit equation
DC MACHINE-Motoring and generation, Armature circuit equationDC MACHINE-Motoring and generation, Armature circuit equation
DC MACHINE-Motoring and generation, Armature circuit equation
 
A Study of Urban Area Plan for Pabna Municipality
A Study of Urban Area Plan for Pabna MunicipalityA Study of Urban Area Plan for Pabna Municipality
A Study of Urban Area Plan for Pabna Municipality
 
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...
 
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
 
Generative AI or GenAI technology based PPT
Generative AI or GenAI technology based PPTGenerative AI or GenAI technology based PPT
Generative AI or GenAI technology based PPT
 
Thermal Engineering-R & A / C - unit - V
Thermal Engineering-R & A / C - unit - VThermal Engineering-R & A / C - unit - V
Thermal Engineering-R & A / C - unit - V
 
Tamil Call Girls Bhayandar WhatsApp +91-9930687706, Best Service
Tamil Call Girls Bhayandar WhatsApp +91-9930687706, Best ServiceTamil Call Girls Bhayandar WhatsApp +91-9930687706, Best Service
Tamil Call Girls Bhayandar WhatsApp +91-9930687706, Best Service
 
Hazard Identification (HAZID) vs. Hazard and Operability (HAZOP): A Comparati...
Hazard Identification (HAZID) vs. Hazard and Operability (HAZOP): A Comparati...Hazard Identification (HAZID) vs. Hazard and Operability (HAZOP): A Comparati...
Hazard Identification (HAZID) vs. Hazard and Operability (HAZOP): A Comparati...
 
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
 
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
 
Air Compressor reciprocating single stage
Air Compressor reciprocating single stageAir Compressor reciprocating single stage
Air Compressor reciprocating single stage
 
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
 
Design For Accessibility: Getting it right from the start
Design For Accessibility: Getting it right from the startDesign For Accessibility: Getting it right from the start
Design For Accessibility: Getting it right from the start
 
"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"
 
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
 
HOA1&2 - Module 3 - PREHISTORCI ARCHITECTURE OF KERALA.pptx
HOA1&2 - Module 3 - PREHISTORCI ARCHITECTURE OF KERALA.pptxHOA1&2 - Module 3 - PREHISTORCI ARCHITECTURE OF KERALA.pptx
HOA1&2 - Module 3 - PREHISTORCI ARCHITECTURE OF KERALA.pptx
 

robotics basics

  • 2. Outline Robots, Effectors, and Sensors Localization and Mapping Motion Planning Motor Control Chapter 25 2
  • 4. Manipulators R RR P R R Configuration of robot specified by 6 numbers ⇒ 6 degrees of freedom (DOF) 6 is the minimum number required to position end-effector arbitrarily. For dynamical systems, add velocity for each DOF. Chapter 25 4
  • 5. Non-holonomic robots θ (x, y) A car has more DOF (3) than controls (2), so is non-holonomic; cannot generally transition between two infinitesimally close configurations Chapter 25 5
  • 6. Sensors Range finders: sonar (land, underwater), laser range finder, radar (aircraft), tactile sensors, GPS Imaging sensors: cameras (visual, infrared) Proprioceptive sensors: shaft decoders (joints, wheels), inertial sensors, force sensors, torque sensors Chapter 25 6
  • 7. Localization—Where Am I? Compute current location and orientation (pose) given observations: Xt+1Xt At−2 At−1 At Zt−1 Xt−1 Zt Zt+1 Chapter 25 7
  • 8. Localization contd. xi, yi vt ∆t t ∆t t+1 xt+1 h(xt) xt θt θ ω Z1 Z2 Z3 Z4 Assume Gaussian noise in motion prediction, sensor range measurements Chapter 25 8
  • 9. Localization contd. Can use particle filtering to produce approximate position estimate Robot position Robot position Robot position Chapter 25 9
  • 10. Localization contd. Can also use extended Kalman filter for simple cases: robot landmark Assumes that landmarks are identifiable—otherwise, posterior is multimodal Chapter 25 10
  • 11. Mapping Localization: given map and observed landmarks, update pose distribution Mapping: given pose and observed landmarks, update map distribution SLAM: given observed landmarks, update pose and map distribution Probabilistic formulation of SLAM: add landmark locations L1, . . . , Lk to the state vector, proceed as for localization Chapter 25 11
  • 14. Motion Planning Idea: plan in configuration space defined by the robot’s DOFs conf-3 conf-1 conf-2 conf-3 conf-2 conf-1 ␸ ␸ elb shou Solution is a point trajectory in free C-space Chapter 25 14
  • 15. Configuration space planning Basic problem: ∞d states! Convert to finite state space. Cell decomposition: divide up space into simple cells, each of which can be traversed “easily” (e.g., convex) Skeletonization: identify finite number of easily connected points/lines that form a graph such that any two points are connected by a path on the graph Chapter 25 15
  • 16. Cell decomposition example start goal start goal Problem: may be no path in pure freespace cells Solution: recursive decomposition of mixed (free+obstacle) cells Chapter 25 16
  • 17. Skeletonization: Voronoi diagram Voronoi diagram: locus of points equidistant from obstacles Problem: doesn’t scale well to higher dimensions Chapter 25 17
  • 18. Skeletonization: Probabilistic Roadmap A probabilistic roadmap is generated by generating random points in C-space and keeping those in freespace; create graph by joining pairs by straight lines Problem: need to generate enough points to ensure that every start/goal pair is connected through the graph Chapter 25 18
  • 19. Motor control Can view the motor control problem as a search problem in the dynamic rather than kinematic state space: – state space defined by x1, x2, . . . , ˙x1, ˙x2, . . . – continuous, high-dimensional (Sarcos humanoid: 162 dimensions) Deterministic control: many problems are exactly solvable esp. if linear, low-dimensional, exactly known, observable Simple regulatory control laws are effective for specified motions Stochastic optimal control: very few problems exactly solvable ⇒ approximate/adaptive methods Chapter 25 19
  • 20. Biological motor control Motor control systems are characterized by massive redundancy Infinitely many trajectories achieve any given task E.g., 3-link arm moving in plane throwing at a target simple 12-parameter controller, one degree of freedom at target 11-dimensional continuous space of optimal controllers Idea: if the arm is noisy, only “one” optimal policy minimizes error at target I.e., noise-tolerance might explain actual motor behaviour Harris & Wolpert (Nature, 1998): signal-dependent noise explains eye saccade velocity profile perfectly Chapter 25 20
  • 21. Setup Suppose a controller has “intended” control parameters θ0 which are corrupted by noise, giving θ drawn from Pθ0 Output (e.g., distance from target) y = F(θ); y Chapter 25 21
  • 22. Simple learning algorithm: Stochastic gradient Minimize Eθ[y2 ] by gradient descent: θ0Eθ[y2 ] = θ0 Pθ0(θ)F(θ)2 dθ = θ0Pθ0(θ) Pθ0(θ) F(θ)2 Pθ0(θ)dθ = Eθ[ θ0Pθ0(θ) Pθ0(θ) y2 ] Given samples (θj, yj), j = 1, . . . , N, we have ˆθ0Eθ[y2] = 1 N N j=1 θ0Pθ0(θj) Pθ0(θj) y2 j For Gaussian noise with covariance Σ, i.e., Pθ0(θ) = N(θ0, Σ), we obtain ˆθ0Eθ[y2] = 1 N N j=1 Σ−1 (θj − θ0)y2 j Chapter 25 22
  • 23. What the algorithm is doing x x x x x x x x x x x x x x x x x x x x x x x x x x x x x x x x x x x x x x x x x x x Chapter 25 23
  • 24. Results for 2–D controller 4 5 6 7 8 9 10 0.2 0.4 0.6 0.8 1 1.2 Velocityv Angle phi Chapter 25 24
  • 25. Results for 2–D controller 4.51 4.52 4.53 4.54 4.55 4.56 4.57 4.58 4.59 4.6 4.61 0.6 0.61 0.62 0.63 0.64 0.65 Velocityv Angle phi Chapter 25 25
  • 26. Results for 2–D controller 0.0055 0.006 0.0065 0.007 0.0075 0.008 0.0085 0.009 0.0095 0 2000 4000 6000 8000 10000 E(y^2) Step Chapter 25 26
  • 27. Summary The rubber hits the road Mobile robots and manipulators Degrees of freedom to define robot configuration Localization and mapping as probabilistic inference problems (require good sensor and motion models) Motion planning in configuration space requires some method for finitization Chapter 25 27