All Classes Namespaces Functions Variables Typedefs Enumerations Enumerator
Class List
Here are the classes, structs, unions and interfaces with brief descriptions:
ompl::base::AllValidStateValidityCheckerThe simplest state validity checker: all states are valid
ompl::base::CompoundManifoldStateSamplerDefinition of a compound state sampler. This is useful to construct samplers for compound states
ompl::base::CompoundStateDefinition of a compound state
ompl::base::CompoundStateManifoldA manifold to allow the composition of state manifolds
ompl::base::DiscreteMotionValidatorA motion validator that only uses the state validity checker. Motions are checked for validity at a specified resolution
ompl::base::EuclideanProjectionThe datatype for state projections. This class contains a real vector
ompl::base::GaussianValidStateSamplerGenerate valid samples using the Gaussian sampling strategy
ompl::base::GoalAbstract definition of goals. Will contain solutions, if found
ompl::base::GoalLazySamplesDefinition of a goal region that can be sampled, but the sampling process can be slow. This class allows sampling the happen in a separate thread, and the number of goals may increase, as the planner is running, in a thread-safe manner
ompl::base::GoalPtrA boost shared pointer wrapper for ompl::base::Goal
ompl::base::GoalRegionDefinition of a goal region
ompl::base::GoalSampleableRegionAbstract definition of a goal region that can be sampled
ompl::base::GoalStateDefinition of a goal state
ompl::base::GoalStatesDefinition of a set of goal states
ompl::base::ManifoldStateSamplerAbstract definition of a manifold state sampler
ompl::base::ManifoldStateSamplerPtrA boost shared pointer wrapper for ompl::base::ManifoldStateSampler
ompl::base::MaximizeClearanceValidStateSamplerGenerate valid samples randomly, but with a bias towards higher clearance
ompl::base::MotionValidatorAbstract definition for a class checking the validity of motions -- path segments between states. This is often called a local planner. The implementation of this class must be thread safe
ompl::base::MotionValidatorPtrA boost shared pointer wrapper for ompl::base::MotionValidator
ompl::base::ObstacleBasedValidStateSamplerGenerate valid samples using the Bridge Test
ompl::base::PathAbstract definition of a path
ompl::base::PathPtrA boost shared pointer wrapper for ompl::base::Path
ompl::base::PlannerBase class for a planner
ompl::base::PlannerDataDatatype holding data a planner can expose for debug purposes
ompl::base::PlannerInputStatesHelper class to extract valid start & goal states. Usually used internally by planners
ompl::base::PlannerPtrA boost shared pointer wrapper for ompl::base::Planner
ompl::base::ProblemDefinitionDefinition of a problem to be solved. This includes the start state(s) for the system and a goal specification
ompl::base::ProblemDefinitionPtrA boost shared pointer wrapper for ompl::base::ProblemDefinition
ompl::base::ProjectionEvaluatorAbstract definition for a class computing projections to Rn. Implicit integer grids are imposed on this projection space by setting cell sizes. Before use, the user must supply cell sizes for the integer grid (setCellSizes()). The implementation of this class is thread safe
ompl::base::ProjectionEvaluatorPtrA boost shared pointer wrapper for ompl::base::ProjectionEvaluator
ompl::base::ProjectionMatrixA projection matrix -- it allows multiplication of real vectors by a specified matrix. The matrix can also be randomly generated
ompl::base::RealVectorBoundsThe lower and upper bounds for an Rn manifold
ompl::base::RealVectorIdentityProjectionEvaluatorDefine the identity projection
ompl::base::RealVectorLinearProjectionEvaluatorDefinition for a class computing linear projections (multiplication of a k-by-n matrix to the the Rn vector state to produce an Rk projection. The multiplication matrix needs to be supplied as input
ompl::base::RealVectorOrthogonalProjectionEvaluatorDefinition for a class computing orthogonal projections
ompl::base::RealVectorRandomLinearProjectionEvaluatorDefinition for a class computing a random linear projections
ompl::base::RealVectorStateManifoldA manifold representing Rn. The distance function is the L2 norm
ompl::base::RealVectorStateManifold::StateTypeThe definition of a state in Rn
ompl::base::RealVectorStateSamplerState sampler for the Rn manifold
ompl::base::SamplerSelector< T >Depending on the type of sampler, we have different allocation routines
ompl::base::ScopedState< T >Definition of a scoped state
ompl::base::SE2StateManifoldA manifold representing SE(2)
ompl::base::SE2StateManifold::StateTypeA state in SE(2): (x, y, yaw)
ompl::base::SE3StateManifoldA manifold representing SE(3)
ompl::base::SE3StateManifold::StateTypeA state in SE(3): position = (x, y, z), quaternion = (x, y, z, w)
ompl::base::SO2StateManifoldA manifold representing SO(2). The distance function and interpolation take into account angle wrapping
ompl::base::SO2StateManifold::StateTypeThe definition of a state in SO(2)
ompl::base::SO2StateSamplerManifold sampler for SO(2)
ompl::base::SO3StateManifoldA manifold representing SO(3). The internal representation is done with quaternions. The distance between states is the angle between quaternions and interpolation is done with slerp
ompl::base::SO3StateManifold::StateTypeThe definition of a state in SO(3) represented as a unit quaternion
ompl::base::SO3StateSamplerManifold sampler for SO(3), using quaternion representation
ompl::base::SpaceInformationThe base class for space information. This contains all the information about the space planning is done in. setup() needs to be called as well, before use
ompl::base::SpaceInformationPtrA boost shared pointer wrapper for ompl::base::SpaceInformation
ompl::base::StateDefinition of an abstract state
ompl::base::StateManifoldRepresentation of a space in which planning can be performed. Topology specific sampling, interpolation and distance are defined
ompl::base::StateManifoldPtrA boost shared pointer wrapper for ompl::base::StateManifold
ompl::base::StateSamplerArray< T >Class to ease the creation of a set of samplers. This is especially useful for multi-threaded planners
ompl::base::StateValidityCheckerAbstract definition for a class checking the validity of states. The implementation of this class must be thread safe
ompl::base::StateValidityCheckerPtrA boost shared pointer wrapper for ompl::base::StateValidityChecker
ompl::base::TimeStateManifoldA manifold representing time. The time can be unbounded, in which case enforceBounds() is a no-op, satisfiesBounds() always returns true, sampling uniform time states always produces time 0 and getMaximumExtent() returns 1. If time is bounded (setBounds() has been previously called), the manifold behaves as expected. After construction, the manifold is unbounded. isBounded() can be used to check if the manifold is bounded or not
ompl::base::TimeStateManifold::StateTypeThe definition of a time state
ompl::base::TimeStateSamplerManifold sampler for time
ompl::base::UniformValidStateSamplerA state sampler that only samples valid states, uniformly
ompl::base::ValidStateSamplerAbstract definition of a state sampler
ompl::base::ValidStateSamplerPtrA boost shared pointer wrapper for ompl::base::ValidStateSampler
ompl::BenchmarkBenchmark a set of planners on a problem instance
ompl::Benchmark::CompleteExperimentThis structure holds experimental data for a set of planners
ompl::Benchmark::PlannerExperimentThe data collected after running a planner multiple times
ompl::Benchmark::StatusThis structure contains information about the activity of a benchmark instance. If the instance is running, it is possible to find out information such as which planner is currently being tested or how much
ompl::BinaryHeap< _T, LessThan >This class provides an implementation of an updatable min-heap. Using it is a bit cumbersome, as it requires keeping track of the BinaryHeap::Element* type, however, it should be as fast as it gets with an updatable heap
ompl::BinaryHeap< _T, LessThan >::ElementWhen an element is added to the heap, an instance of Element* is created. This instance contains the data that was added and internal information about the position of the data in the heap's internal storage
ompl::control::CompoundControlDefinition of a compound control
ompl::control::CompoundControlManifoldA manifold to allow the composition of control manifolds
ompl::control::CompoundControlSamplerDefinition of a compound control sampler. This is useful to construct samplers for compound controls
ompl::control::ControlDefinition of an abstract control
ompl::control::ControlManifoldA manifold representing the space of applicable controls
ompl::control::ControlManifoldPtrA boost shared pointer wrapper for ompl::control::ControlManifold
ompl::control::ControlSamplerAbstract definition of a control sampler. Motion planners that need to sample controls will call functions from this class. Planners should call the versions of sample() and sampleNext() with most arguments, whenever this information is available
ompl::control::ControlSamplerPtrA boost shared pointer wrapper for ompl::control::ControlSampler
ompl::control::KPIECE1Kinodynamic Planning by Interior-Exterior Cell Exploration
ompl::control::KPIECE1::CellDataThe data held by a cell in the grid of motions
ompl::control::KPIECE1::MotionRepresentation of a motion for this algorithm
ompl::control::KPIECE1::OrderCellsByImportanceDefinintion of an operator passed to the Grid structure, to order cells by importance
ompl::control::KPIECE1::TreeDataThe data defining a tree of motions for this algorithm
ompl::control::ODEControlManifoldRepresentation of controls applied in ODE environments. This is an array of double values. Only forward propagation is possible
ompl::control::ODEEnvironmentThis class contains the ODE constructs OMPL needs to know about when planning
ompl::control::ODEEnvironmentPtrA boost shared pointer wrapper for ompl::control::ODEEnvironment
ompl::control::ODESimpleSetupCreate the set of classes typically needed to solve a control problem when forward propagation is computed with ODE
ompl::control::ODEStateManifoldState manifold representing ODE states
ompl::control::ODEStateManifold::StateTypeODE State. This is a compound state that allows accessing the properties of the bodies the manifold is constructed for
ompl::control::ODEStateValidityCheckerThe simplest state validity checker: all states are valid
ompl::control::PathControlDefinition of a control path
ompl::control::RealVectorControlManifoldA manifold representing Rn. The distance function is the L2 norm
ompl::control::RealVectorControlManifold::ControlTypeThe definition of a control in Rn
ompl::control::RealVectorControlUniformSamplerUniform sampler for the Rn manifold
ompl::control::RRTRapidly-exploring Random Tree
ompl::control::RRT::MotionRepresentation of a motion
ompl::control::SimpleSetupCreate the set of classes typically needed to solve a control problem
ompl::control::SpaceInformationSpace information containing necessary information for planning with controls. setup() needs to be called before use
ompl::control::SpaceInformationPtrA boost shared pointer wrapper for ompl::control::SpaceInformation
ompl::ExceptionThe exception type for ompl
ompl::geometric::BasicPRMProbabilistic RoadMap planner
ompl::geometric::BasicPRM::MilestoneRepresentation of a milestone
ompl::geometric::BKPIECE1Bi-directional KPIECE with one level of discretization
ompl::geometric::BKPIECE1::MotionRepresentation of a motion for this algorithm
ompl::geometric::Discretization< Motion >One-level discretization used for KPIECE
ompl::geometric::Discretization< Motion >::CellDataThe data held by a cell in the grid of motions
ompl::geometric::Discretization< Motion >::OrderCellsByImportanceDefinintion of an operator passed to the Grid structure, to order cells by importance
ompl::geometric::ESTExpansive Space Trees
ompl::geometric::EST::MotionThe definition of a motion
ompl::geometric::EST::TreeDataThe data contained by a tree of exploration
ompl::geometric::GAIKInverse Kinematics with Genetic Algorithms
ompl::geometric::HCIKInverse Kinematics with Hill Climbing
ompl::geometric::KPIECE1Kinematic Planning by Interior-Exterior Cell Exploration
ompl::geometric::KPIECE1::MotionRepresentation of a motion for this algorithm
ompl::geometric::LazyRRTLazy RRT
ompl::geometric::LazyRRT::MotionRepresentation of a motion
ompl::geometric::LBKPIECE1Lazy Bi-directional KPIECE with one level of discretization
ompl::geometric::LBKPIECE1::MotionRepresentation of a motion for this algorithm
ompl::geometric::PathGeometricDefinition of a geometric path
ompl::geometric::PathSimplifierThis class contains routines that attempt to simplify geometric paths
ompl::geometric::PathSimplifierPtrA boost shared pointer wrapper for ompl::geometric::PathSimplifier
ompl::geometric::pRRTParallel RRT
ompl::geometric::pRRT::Motion
ompl::geometric::pRRT::SolutionInfo
ompl::geometric::pSBLParallel Single-query Bi-directional Lazy collision checking planner
ompl::geometric::pSBL::Motion
ompl::geometric::pSBL::MotionsToBeRemoved
ompl::geometric::pSBL::PendingRemoveMotion
ompl::geometric::pSBL::SolutionInfo
ompl::geometric::pSBL::TreeData
ompl::geometric::RRTRapidly-exploring Random Trees
ompl::geometric::RRT::MotionRepresentation of a motion
ompl::geometric::RRTConnectRRT-Connect (RRTConnect)
ompl::geometric::RRTConnect::MotionRepresentation of a motion
ompl::geometric::RRTConnect::TreeGrowingInfoInformation attached to growing a tree of motions (used internally)
ompl::geometric::SBLSingle-Query Bi-Directional Probabilistic Roadmap Planner with Lazy Collision Checking
ompl::geometric::SBL::MotionRepresentation of a motion
ompl::geometric::SBL::TreeDataRepresentation of a search tree. Two instances will be used. One for start and one for goal
ompl::geometric::SimpleSetupCreate the set of classes typically needed to solve a geometric problem
ompl::Grid< _T >Representation of a simple grid
ompl::Grid< _T >::CellDefinition of a cell in this grid
ompl::Grid< _T >::EqualCoordPtrEquality operator for coordinate pointers
ompl::Grid< _T >::HashFunCoordPtrHash function for coordinates
ompl::Grid< _T >::SortComponentsHelper to sort components by size
ompl::GridB< _T, LessThanExternal, LessThanInternal >This class defines a grid that keeps track of its boundary: it distinguishes between interior and exterior cells
ompl::GridB< _T, LessThanExternal, LessThanInternal >::LessThanExternalCellDefine order for external cells
ompl::GridB< _T, LessThanExternal, LessThanInternal >::LessThanInternalCellDefine order for internal cells
ompl::GridN< _T >Representation of a grid where cells keep track of how many neighbors they have
ompl::GridN< _T >::CellDefinition of a cell in this grid
ompl::msg::InterfaceThe piece of code that desires interaction with an action or an output handler should use an instance of this class. This class connects to the active OutputHandler (if any) and forwards messages
ompl::msg::OutputHandlerGeneric class to handle output from a piece of code
ompl::msg::OutputHandlerSTDDefault implementation of OutputHandler. This sends the information to the console
ompl::NearestNeighbors< _T >Abstract representation of a container that can perform nearest neighbors queries
ompl::NearestNeighborsLinear< _T >A nearest neighbors datastructure that uses linear search
ompl::NearestNeighborsSqrtApprox< _T >A nearest neighbors datastructure that uses linear search. The linear search is done over sqrt(n) elements only. (Every sqrt(n) elements are skipped)
ompl::ProfilerThis is a simple thread-safe tool for counting time spent in various chunks of code. This is different from external profiling tools in that it allows the user to count time spent in various bits of code (sub-function granularity) or count how many times certain pieces of code are executed
ompl::Profiler::BeginBlockThis instance will call Profiler::begin() when constructed and Profiler::end() when it goes out of scope
ompl::RNGRandom number generation. An instance of this class cannot be used by multiple threads at once (member functions are not const). However, the constructor is thread safe and different instances can be used safely in any number of threads. It is also guaranteed that all created instances will have a different random seed
StateSampling::MyValidStateSampler