ompl::base::AllValidStateValidityChecker | The simplest state validity checker: all states are valid |
ompl::base::CompoundManifoldStateSampler | Definition of a compound state sampler. This is useful to construct samplers for compound states |
ompl::base::CompoundState | Definition of a compound state |
ompl::base::CompoundStateManifold | A manifold to allow the composition of state manifolds |
ompl::base::DiscreteMotionValidator | A motion validator that only uses the state validity checker. Motions are checked for validity at a specified resolution |
ompl::base::EuclideanProjection | The datatype for state projections. This class contains a real vector |
ompl::base::GaussianValidStateSampler | Generate valid samples using the Gaussian sampling strategy |
ompl::base::Goal | Abstract definition of goals. Will contain solutions, if found |
ompl::base::GoalLazySamples | Definition 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::GoalPtr | A boost shared pointer wrapper for ompl::base::Goal |
ompl::base::GoalRegion | Definition of a goal region |
ompl::base::GoalSampleableRegion | Abstract definition of a goal region that can be sampled |
ompl::base::GoalState | Definition of a goal state |
ompl::base::GoalStates | Definition of a set of goal states |
ompl::base::ManifoldStateSampler | Abstract definition of a manifold state sampler |
ompl::base::ManifoldStateSamplerPtr | A boost shared pointer wrapper for ompl::base::ManifoldStateSampler |
ompl::base::MaximizeClearanceValidStateSampler | Generate valid samples randomly, but with a bias towards higher clearance |
ompl::base::MotionValidator | Abstract 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::MotionValidatorPtr | A boost shared pointer wrapper for ompl::base::MotionValidator |
ompl::base::ObstacleBasedValidStateSampler | Generate valid samples using the Bridge Test |
ompl::base::Path | Abstract definition of a path |
ompl::base::PathPtr | A boost shared pointer wrapper for ompl::base::Path |
ompl::base::Planner | Base class for a planner |
ompl::base::PlannerData | Datatype holding data a planner can expose for debug purposes |
ompl::base::PlannerInputStates | Helper class to extract valid start & goal states. Usually used internally by planners |
ompl::base::PlannerPtr | A boost shared pointer wrapper for ompl::base::Planner |
ompl::base::ProblemDefinition | Definition of a problem to be solved. This includes the start state(s) for the system and a goal specification |
ompl::base::ProblemDefinitionPtr | A boost shared pointer wrapper for ompl::base::ProblemDefinition |
ompl::base::ProjectionEvaluator | Abstract 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::ProjectionEvaluatorPtr | A boost shared pointer wrapper for ompl::base::ProjectionEvaluator |
ompl::base::ProjectionMatrix | A projection matrix -- it allows multiplication of real vectors by a specified matrix. The matrix can also be randomly generated |
ompl::base::RealVectorBounds | The lower and upper bounds for an Rn manifold |
ompl::base::RealVectorIdentityProjectionEvaluator | Define the identity projection |
ompl::base::RealVectorLinearProjectionEvaluator | Definition 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::RealVectorOrthogonalProjectionEvaluator | Definition for a class computing orthogonal projections |
ompl::base::RealVectorRandomLinearProjectionEvaluator | Definition for a class computing a random linear projections |
ompl::base::RealVectorStateManifold | A manifold representing Rn. The distance function is the L2 norm |
ompl::base::RealVectorStateManifold::StateType | The definition of a state in Rn |
ompl::base::RealVectorStateSampler | State 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::SE2StateManifold | A manifold representing SE(2) |
ompl::base::SE2StateManifold::StateType | A state in SE(2): (x, y, yaw) |
ompl::base::SE3StateManifold | A manifold representing SE(3) |
ompl::base::SE3StateManifold::StateType | A state in SE(3): position = (x, y, z), quaternion = (x, y, z, w) |
ompl::base::SO2StateManifold | A manifold representing SO(2). The distance function and interpolation take into account angle wrapping |
ompl::base::SO2StateManifold::StateType | The definition of a state in SO(2) |
ompl::base::SO2StateSampler | Manifold sampler for SO(2) |
ompl::base::SO3StateManifold | A 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::StateType | The definition of a state in SO(3) represented as a unit quaternion |
ompl::base::SO3StateSampler | Manifold sampler for SO(3), using quaternion representation |
ompl::base::SpaceInformation | The 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::SpaceInformationPtr | A boost shared pointer wrapper for ompl::base::SpaceInformation |
ompl::base::State | Definition of an abstract state |
ompl::base::StateManifold | Representation of a space in which planning can be performed. Topology specific sampling, interpolation and distance are defined |
ompl::base::StateManifoldPtr | A 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::StateValidityChecker | Abstract definition for a class checking the validity of states. The implementation of this class must be thread safe |
ompl::base::StateValidityCheckerPtr | A boost shared pointer wrapper for ompl::base::StateValidityChecker |
ompl::base::TimeStateManifold | A 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::StateType | The definition of a time state |
ompl::base::TimeStateSampler | Manifold sampler for time |
ompl::base::UniformValidStateSampler | A state sampler that only samples valid states, uniformly |
ompl::base::ValidStateSampler | Abstract definition of a state sampler |
ompl::base::ValidStateSamplerPtr | A boost shared pointer wrapper for ompl::base::ValidStateSampler |
ompl::Benchmark | Benchmark a set of planners on a problem instance |
ompl::Benchmark::CompleteExperiment | This structure holds experimental data for a set of planners |
ompl::Benchmark::PlannerExperiment | The data collected after running a planner multiple times |
ompl::Benchmark::Status | This 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 >::Element | When 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::CompoundControl | Definition of a compound control |
ompl::control::CompoundControlManifold | A manifold to allow the composition of control manifolds |
ompl::control::CompoundControlSampler | Definition of a compound control sampler. This is useful to construct samplers for compound controls |
ompl::control::Control | Definition of an abstract control |
ompl::control::ControlManifold | A manifold representing the space of applicable controls |
ompl::control::ControlManifoldPtr | A boost shared pointer wrapper for ompl::control::ControlManifold |
ompl::control::ControlSampler | Abstract 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::ControlSamplerPtr | A boost shared pointer wrapper for ompl::control::ControlSampler |
ompl::control::KPIECE1 | Kinodynamic Planning by Interior-Exterior Cell Exploration |
ompl::control::KPIECE1::CellData | The data held by a cell in the grid of motions |
ompl::control::KPIECE1::Motion | Representation of a motion for this algorithm |
ompl::control::KPIECE1::OrderCellsByImportance | Definintion of an operator passed to the Grid structure, to order cells by importance |
ompl::control::KPIECE1::TreeData | The data defining a tree of motions for this algorithm |
ompl::control::ODEControlManifold | Representation of controls applied in ODE environments. This is an array of double values. Only forward propagation is possible |
ompl::control::ODEEnvironment | This class contains the ODE constructs OMPL needs to know about when planning |
ompl::control::ODEEnvironmentPtr | A boost shared pointer wrapper for ompl::control::ODEEnvironment |
ompl::control::ODESimpleSetup | Create the set of classes typically needed to solve a control problem when forward propagation is computed with ODE |
ompl::control::ODEStateManifold | State manifold representing ODE states |
ompl::control::ODEStateManifold::StateType | ODE State. This is a compound state that allows accessing the properties of the bodies the manifold is constructed for |
ompl::control::ODEStateValidityChecker | The simplest state validity checker: all states are valid |
ompl::control::PathControl | Definition of a control path |
ompl::control::RealVectorControlManifold | A manifold representing Rn. The distance function is the L2 norm |
ompl::control::RealVectorControlManifold::ControlType | The definition of a control in Rn |
ompl::control::RealVectorControlUniformSampler | Uniform sampler for the Rn manifold |
ompl::control::RRT | Rapidly-exploring Random Tree |
ompl::control::RRT::Motion | Representation of a motion |
ompl::control::SimpleSetup | Create the set of classes typically needed to solve a control problem |
ompl::control::SpaceInformation | Space information containing necessary information for planning with controls. setup() needs to be called before use |
ompl::control::SpaceInformationPtr | A boost shared pointer wrapper for ompl::control::SpaceInformation |
ompl::Exception | The exception type for ompl |
ompl::geometric::BasicPRM | Probabilistic RoadMap planner |
ompl::geometric::BasicPRM::Milestone | Representation of a milestone |
ompl::geometric::BKPIECE1 | Bi-directional KPIECE with one level of discretization |
ompl::geometric::BKPIECE1::Motion | Representation of a motion for this algorithm |
ompl::geometric::Discretization< Motion > | One-level discretization used for KPIECE |
ompl::geometric::Discretization< Motion >::CellData | The data held by a cell in the grid of motions |
ompl::geometric::Discretization< Motion >::OrderCellsByImportance | Definintion of an operator passed to the Grid structure, to order cells by importance |
ompl::geometric::EST | Expansive Space Trees |
ompl::geometric::EST::Motion | The definition of a motion |
ompl::geometric::EST::TreeData | The data contained by a tree of exploration |
ompl::geometric::GAIK | Inverse Kinematics with Genetic Algorithms |
ompl::geometric::HCIK | Inverse Kinematics with Hill Climbing |
ompl::geometric::KPIECE1 | Kinematic Planning by Interior-Exterior Cell Exploration |
ompl::geometric::KPIECE1::Motion | Representation of a motion for this algorithm |
ompl::geometric::LazyRRT | Lazy RRT |
ompl::geometric::LazyRRT::Motion | Representation of a motion |
ompl::geometric::LBKPIECE1 | Lazy Bi-directional KPIECE with one level of discretization |
ompl::geometric::LBKPIECE1::Motion | Representation of a motion for this algorithm |
ompl::geometric::PathGeometric | Definition of a geometric path |
ompl::geometric::PathSimplifier | This class contains routines that attempt to simplify geometric paths |
ompl::geometric::PathSimplifierPtr | A boost shared pointer wrapper for ompl::geometric::PathSimplifier |
ompl::geometric::pRRT | Parallel RRT |
ompl::geometric::pRRT::Motion | |
ompl::geometric::pRRT::SolutionInfo | |
ompl::geometric::pSBL | Parallel 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::RRT | Rapidly-exploring Random Trees |
ompl::geometric::RRT::Motion | Representation of a motion |
ompl::geometric::RRTConnect | RRT-Connect (RRTConnect) |
ompl::geometric::RRTConnect::Motion | Representation of a motion |
ompl::geometric::RRTConnect::TreeGrowingInfo | Information attached to growing a tree of motions (used internally) |
ompl::geometric::SBL | Single-Query Bi-Directional Probabilistic Roadmap Planner with Lazy Collision Checking |
ompl::geometric::SBL::Motion | Representation of a motion |
ompl::geometric::SBL::TreeData | Representation of a search tree. Two instances will be used. One for start and one for goal |
ompl::geometric::SimpleSetup | Create the set of classes typically needed to solve a geometric problem |
ompl::Grid< _T > | Representation of a simple grid |
ompl::Grid< _T >::Cell | Definition of a cell in this grid |
ompl::Grid< _T >::EqualCoordPtr | Equality operator for coordinate pointers |
ompl::Grid< _T >::HashFunCoordPtr | Hash function for coordinates |
ompl::Grid< _T >::SortComponents | Helper 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 >::LessThanExternalCell | Define order for external cells |
ompl::GridB< _T, LessThanExternal, LessThanInternal >::LessThanInternalCell | Define order for internal cells |
ompl::GridN< _T > | Representation of a grid where cells keep track of how many neighbors they have |
ompl::GridN< _T >::Cell | Definition of a cell in this grid |
ompl::msg::Interface | The 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::OutputHandler | Generic class to handle output from a piece of code |
ompl::msg::OutputHandlerSTD | Default 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::Profiler | This 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::BeginBlock | This instance will call Profiler::begin() when constructed and Profiler::end() when it goes out of scope |
ompl::RNG | Random 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 | |