ompl::geometric::RRTstar Class Reference

Optimal Rapidly-exploring Random Trees. More...

#include <RRTstar.h>

Inheritance diagram for ompl::geometric::RRTstar:
Inheritance graph
[legend]

List of all members.

Classes

class  Motion
 Representation of a motion. More...

Public Member Functions

virtual void clear (void)
 Clear all internal datastructures. Planner settings are not affected. Subsequent calls to solve() will ignore all previous work.
double getBallRadiusConstant (void) const
 Get the multiplicative factor used in the computation of the radius whithin which tree rewiring is done.
bool getDelayCC (void) const
 Get the state of the delayed collision checking option.
double getGoalBias (void) const
 Get the goal bias the planner is using.
double getMaxBallRadius (void) const
 Get the maximum radius the planner uses in the tree rewiring step.
virtual void getPlannerData (base::PlannerData &data) const
 Get information about the current run of the motion planner. Repeated calls to this function will update data (only additions are made). This is useful to see what changed in the exploration datastructure, between calls to solve(), for example (without calling clear() in between).
double getRange (void) const
 Get the range the planner is using.
bool getTerminate (void) const
 Get the state of the termination option.
 RRTstar (const base::SpaceInformationPtr &si)
void setBallRadiusConstant (double ballRadiusConstant)
 When the planner attempts to rewire the tree, it does so by looking at some of the neighbors within a computed radius. The computation of that radius depends on the multiplicative factor set here. Set this parameter should be set at least to the side length of the (bounded) state space. E.g., if the state space is a box with side length L, then this parameter should be set to at least L for rapid and efficient convergence in trajectory space.
void setDelayCC (bool delayCC)
 Option that delays collision checking procedures. When it is enabled, all neighbors are sorted by cost. The planner then goes through this list, starting with the lowest cost, checking for collisions in order to find a parent. The planner stops iterating through the list when a collision free parent is found. This prevents the planner from collsion checking each neighbor, reducing computation time in scenarios where collision checking procedures are expensive.
void setGoalBias (double goalBias)
 Set the goal bias.
void setMaxBallRadius (double maxBallRadius)
 When the planner attempts to rewire the tree, it does so by looking at some of the neighbors within a computed radius. That radius is bounded by the value set here. This parameter should ideally be equal longest straight line from the initial state to anywhere in the state space. In other words, this parameter should be "sqrt(d) L", where d is the dimensionality of space and L is the side length of a box containing the obstacle free space.
template<template< typename T > class NN>
void setNearestNeighbors (void)
 Set a different nearest neighbors datastructure.
void setRange (double distance)
 Set the range the planner is supposed to use.
void setTerminate (bool terminate)
 Option that specifies if the planner will terminate upon finding a solution or will continue to refine the solution until the time limit is reached. Set true to terminate when a solution is found.
virtual void setup (void)
 Perform extra configuration steps, if needed. This call will also issue a call to ompl::base::SpaceInformation::setup() if needed. This must be called before solving.
virtual bool solve (const base::PlannerTerminationCondition &ptc)
 Function that can solve the motion planning problem. This function can be called multiple times on the same problem, without calling clear() in between. This allows the planner to continue work more time on an unsolved problem, for example. If this option is used, it is assumed the problem definition is not changed (unpredictable results otherwise). The only change in the problem definition that is accounted for is the addition of starting or goal states (but not changing previously added start/goal states). The function terminates if the call to ptc returns true.
virtual ~RRTstar (void)

Protected Member Functions

double distanceFunction (const Motion *a, const Motion *b) const
 Compute distance between motions (actually distance between contained states).
void freeMemory (void)
 Free the memory allocated by this planner.

Static Protected Member Functions

static bool compareMotion (const Motion *a, const Motion *b)
 Sort the near neighbors by cost.

Protected Attributes

double ballRadiusConst_
 Shrink rate of radius the planner uses to find near neighbors and rewire.
double ballRadiusMax_
 Maximum radius the planner uses to find near neighbors and rewire.
bool delayCC_
 Option to delay and reduce collision checking within iterations.
double goalBias_
 The fraction of time the goal is picked as the state to expand towards (if such a state is available).
double maxDistance_
 The maximum length of a motion to be added to a tree.
boost::shared_ptr
< NearestNeighbors< Motion * > > 
nn_
 A nearest-neighbors datastructure containing the tree of motions.
RNG rng_
 The random number generator.
base::StateSamplerPtr sampler_
 State sampler.
bool terminate_
 Option to terminate planning when a solution is found.

Detailed Description

Optimal Rapidly-exploring Random Trees.

Short description
RRT* (optimal RRT) is an asymptotically-optimal incremental sampling-based motion planning algorithm. RRT* algorithm is guaranteed to converge to an optimal solution, while its running time is guaranteed to be a constant factor of the running time of the RRT. The notion of optimality is with respect to the distance function defined on the manifold we are operating on. See ompl::base::Goal::setMaximumPathLength() for how to set the maximally allowed path length to reach the goal. If a solution path that is shorter than ompl::base::Goal::getMaximumPathLength() is found, the algorithm terminates before the elapsed time.
External documentation
S. Karaman and E. Frazzoli, Sampling-based Algorithms for Optimal Motion Planning, International Journal of Robotics Research (to appear), 2011. http://arxiv.org/abs/1105.1186

Definition at line 77 of file RRTstar.h.


Constructor & Destructor Documentation

ompl::geometric::RRTstar::RRTstar ( const base::SpaceInformationPtr si  )  [inline]

Definition at line 81 of file RRTstar.h.

virtual ompl::geometric::RRTstar::~RRTstar ( void   )  [inline, virtual]

Definition at line 95 of file RRTstar.h.


Member Function Documentation

virtual void ompl::geometric::RRTstar::clear ( void   )  [virtual]

Clear all internal datastructures. Planner settings are not affected. Subsequent calls to solve() will ignore all previous work.

Reimplemented from ompl::base::Planner.

static bool ompl::geometric::RRTstar::compareMotion ( const Motion a,
const Motion b 
) [inline, static, protected]

Sort the near neighbors by cost.

Definition at line 261 of file RRTstar.h.

double ompl::geometric::RRTstar::distanceFunction ( const Motion a,
const Motion b 
) const [inline, protected]

Compute distance between motions (actually distance between contained states).

Definition at line 267 of file RRTstar.h.

void ompl::geometric::RRTstar::freeMemory ( void   )  [protected]

Free the memory allocated by this planner.

double ompl::geometric::RRTstar::getBallRadiusConstant ( void   )  const [inline]

Get the multiplicative factor used in the computation of the radius whithin which tree rewiring is done.

Definition at line 159 of file RRTstar.h.

bool ompl::geometric::RRTstar::getDelayCC ( void   )  const [inline]

Get the state of the delayed collision checking option.

Definition at line 204 of file RRTstar.h.

double ompl::geometric::RRTstar::getGoalBias ( void   )  const [inline]

Get the goal bias the planner is using.

Definition at line 121 of file RRTstar.h.

double ompl::geometric::RRTstar::getMaxBallRadius ( void   )  const [inline]

Get the maximum radius the planner uses in the tree rewiring step.

Definition at line 179 of file RRTstar.h.

virtual void ompl::geometric::RRTstar::getPlannerData ( base::PlannerData data  )  const [virtual]

Get information about the current run of the motion planner. Repeated calls to this function will update data (only additions are made). This is useful to see what changed in the exploration datastructure, between calls to solve(), for example (without calling clear() in between).

Reimplemented from ompl::base::Planner.

double ompl::geometric::RRTstar::getRange ( void   )  const [inline]

Get the range the planner is using.

Definition at line 137 of file RRTstar.h.

bool ompl::geometric::RRTstar::getTerminate ( void   )  const [inline]

Get the state of the termination option.

Definition at line 219 of file RRTstar.h.

void ompl::geometric::RRTstar::setBallRadiusConstant ( double  ballRadiusConstant  )  [inline]

When the planner attempts to rewire the tree, it does so by looking at some of the neighbors within a computed radius. The computation of that radius depends on the multiplicative factor set here. Set this parameter should be set at least to the side length of the (bounded) state space. E.g., if the state space is a box with side length L, then this parameter should be set to at least L for rapid and efficient convergence in trajectory space.

Definition at line 151 of file RRTstar.h.

void ompl::geometric::RRTstar::setDelayCC ( bool  delayCC  )  [inline]

Option that delays collision checking procedures. When it is enabled, all neighbors are sorted by cost. The planner then goes through this list, starting with the lowest cost, checking for collisions in order to find a parent. The planner stops iterating through the list when a collision free parent is found. This prevents the planner from collsion checking each neighbor, reducing computation time in scenarios where collision checking procedures are expensive.

Definition at line 198 of file RRTstar.h.

void ompl::geometric::RRTstar::setGoalBias ( double  goalBias  )  [inline]

Set the goal bias.

In the process of randomly selecting states in the state space to attempt to go towards, the algorithm may in fact choose the actual goal state, if it knows it, with some probability. This probability is a real number between 0.0 and 1.0; its value should usually be around 0.05 and should not be too large. It is probably a good idea to use the default value.

Definition at line 115 of file RRTstar.h.

void ompl::geometric::RRTstar::setMaxBallRadius ( double  maxBallRadius  )  [inline]

When the planner attempts to rewire the tree, it does so by looking at some of the neighbors within a computed radius. That radius is bounded by the value set here. This parameter should ideally be equal longest straight line from the initial state to anywhere in the state space. In other words, this parameter should be "sqrt(d) L", where d is the dimensionality of space and L is the side length of a box containing the obstacle free space.

Definition at line 172 of file RRTstar.h.

template<template< typename T > class NN>
void ompl::geometric::RRTstar::setNearestNeighbors ( void   )  [inline]

Set a different nearest neighbors datastructure.

Definition at line 186 of file RRTstar.h.

void ompl::geometric::RRTstar::setRange ( double  distance  )  [inline]

Set the range the planner is supposed to use.

This parameter greatly influences the runtime of the algorithm. It represents the maximum length of a motion to be added in the tree of motions.

Definition at line 131 of file RRTstar.h.

void ompl::geometric::RRTstar::setTerminate ( bool  terminate  )  [inline]

Option that specifies if the planner will terminate upon finding a solution or will continue to refine the solution until the time limit is reached. Set true to terminate when a solution is found.

Definition at line 213 of file RRTstar.h.

virtual void ompl::geometric::RRTstar::setup ( void   )  [virtual]

Perform extra configuration steps, if needed. This call will also issue a call to ompl::base::SpaceInformation::setup() if needed. This must be called before solving.

Reimplemented from ompl::base::Planner.

virtual bool ompl::geometric::RRTstar::solve ( const base::PlannerTerminationCondition ptc  )  [virtual]

Function that can solve the motion planning problem. This function can be called multiple times on the same problem, without calling clear() in between. This allows the planner to continue work more time on an unsolved problem, for example. If this option is used, it is assumed the problem definition is not changed (unpredictable results otherwise). The only change in the problem definition that is accounted for is the addition of starting or goal states (but not changing previously added start/goal states). The function terminates if the call to ptc returns true.

Implements ompl::base::Planner.


Member Data Documentation

Shrink rate of radius the planner uses to find near neighbors and rewire.

Definition at line 288 of file RRTstar.h.

Maximum radius the planner uses to find near neighbors and rewire.

Definition at line 291 of file RRTstar.h.

Option to delay and reduce collision checking within iterations.

Definition at line 294 of file RRTstar.h.

The fraction of time the goal is picked as the state to expand towards (if such a state is available).

Definition at line 279 of file RRTstar.h.

The maximum length of a motion to be added to a tree.

Definition at line 282 of file RRTstar.h.

boost::shared_ptr< NearestNeighbors<Motion*> > ompl::geometric::RRTstar::nn_ [protected]

A nearest-neighbors datastructure containing the tree of motions.

Definition at line 276 of file RRTstar.h.

The random number generator.

Definition at line 285 of file RRTstar.h.

State sampler.

Definition at line 273 of file RRTstar.h.

Option to terminate planning when a solution is found.

Definition at line 297 of file RRTstar.h.


The documentation for this class was generated from the following file:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Friends Defines


ompl
Author(s): Ioan Sucan/isucan@rice.edu, Mark Moll/mmoll@rice.edu, Lydia Kavraki/kavraki@rice.edu
autogenerated on Fri Jan 11 11:37:49 2013