Compl::BinaryHeap< CellX *, LessThanExternalCell > | |
Compl::BinaryHeap< CellX *, LessThanInternalCell > | |
Compl::BinaryHeap< ompl::control::PDST::Motion *, ompl::control::PDST::MotionCompare > | |
Compl::BinaryHeap< ompl::geometric::PDST::Motion *, ompl::geometric::PDST::MotionCompare > | |
►Cnoncopyable | |
►Compl::base::Goal | Abstract definition of goals |
►Compl::base::GoalRegion | Definition of a goal region |
►Compl::base::GoalSampleableRegion | Abstract definition of a goal region that can be sampled |
CKoulesGoal | |
Compl::base::GoalState | Definition of a goal state |
►Compl::base::GoalStates | Definition of a set of goal states |
Compl::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 |
Compl::base::MorseGoal | This is a goal class that is more amenable to Python |
►Compl::base::OptimizationObjective | Abstract definition of optimization objectives |
Compl::base::MechanicalWorkOptimizationObjective | An optimization objective which defines path cost using the idea of mechanical work. To be used in conjunction with TRRT |
►Compl::base::MinimaxObjective | The cost of a path is defined as the worst state cost over the entire path. This objective attempts to find the path with the "best worst cost" over all paths |
Compl::base::MaximizeMinClearanceObjective | Objective for attempting to maximize the minimum clearance along a path |
Compl::base::MultiOptimizationObjective | This class allows for the definition of multiobjective optimal planning problems. Objectives are added to this compound object, and motion costs are computed by taking a weighted sum of the individual objective costs |
Compl::base::PathLengthOptimizationObjective | An optimization objective which corresponds to optimizing path length |
Compl::base::StateCostIntegralObjective | Defines optimization objectives where path cost can be represented as a path integral over a cost function defined over the state space. This cost function is specified by implementing the stateCost() method |
►Compl::base::Path | Abstract definition of a path |
Compl::control::PathControl | Definition of a control path |
Compl::geometric::PathGeometric | Definition of a geometric path |
►Compl::base::Planner | Base class for a planner |
Compl::control::EST | Expansive Space Trees |
Compl::control::KPIECE1 | Kinodynamic Planning by Interior-Exterior Cell Exploration |
Compl::control::PDST | Path-Directed Subdivision Tree |
Compl::control::RRT | Rapidly-exploring Random Tree |
►Compl::control::Syclop | Synergistic Combination of Layers of Planning |
Compl::control::SyclopEST | SyclopEST is Syclop with EST as its low-level tree planner |
Compl::control::SyclopRRT | SyclopRRT is Syclop with RRT as its low-level tree planner |
Compl::geometric::BKPIECE1 | Bi-directional KPIECE with one level of discretization |
Compl::geometric::EST | Expansive Space Trees |
Compl::geometric::KPIECE1 | Kinematic Planning by Interior-Exterior Cell Exploration |
Compl::geometric::LazyRRT | Lazy RRT |
Compl::geometric::LBKPIECE1 | Lazy Bi-directional KPIECE with one level of discretization |
Compl::geometric::LBTRRT | Lower Bound Tree Rapidly-exploring Random Trees |
Compl::geometric::PDST | Path-Directed Subdivision Tree |
►Compl::geometric::PRM | Probabilistic RoadMap planner |
Compl::geometric::LazyPRM | Lazy Probabilistic RoadMap planner |
Compl::geometric::PRMstar | PRM* planner |
Compl::geometric::pRRT | Parallel RRT |
Compl::geometric::pSBL | Parallel Single-query Bi-directional Lazy collision checking planner |
Compl::geometric::RRT | Rapidly-exploring Random Trees |
Compl::geometric::RRTConnect | RRT-Connect (RRTConnect) |
Compl::geometric::RRTstar | Optimal Rapidly-exploring Random Trees |
Compl::geometric::SBL | Single-Query Bi-Directional Probabilistic Roadmap Planner with Lazy Collision Checking |
Compl::geometric::SPARS | SPArse Roadmap Spanner technique. |
Compl::geometric::SPARStwo | SPArse Roadmap Spanner Version 2.0 |
Compl::geometric::STRIDE | Search Tree with Resolution Independent Density Estimation |
Compl::geometric::TRRT | Transition-based Rapidly-exploring Random Trees |
►Compl::base::PlannerData | Object containing planner generated vertex and edge data. It is assumed that all vertices are unique, and only a single directed edge connects two vertices |
Compl::control::PlannerData | Object containing planner generated vertex and edge data. It is assumed that all vertices are unique, and only a single directed edge connects two vertices. |
Compl::base::ProblemDefinition | Definition of a problem to be solved. This includes the start state(s) for the system and a goal specification. Will contain solutions, if found |
►Compl::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 |
CKoulesProjection | |
Compl::base::MorseProjection | This class implements a generic projection for the MorseStateSpace, namely, the subspace representing the x and y positions of every rigid body |
Compl::base::RealVectorIdentityProjectionEvaluator | Define the identity projection |
►Compl::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 |
Compl::base::RealVectorRandomLinearProjectionEvaluator | Definition for a class computing a random linear projections |
Compl::base::RealVectorOrthogonalProjectionEvaluator | Definition for a class computing orthogonal projections |
Compl::base::SubspaceProjectionEvaluator | If the projection for a CompoundStateSpace is supposed to be the same as the one for one of its included subspaces, this class facilitates selecting a projection of that subspace |
►Compl::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 |
Compl::control::SpaceInformation | Space information containing necessary information for planning with controls. setup() needs to be called before use |
►Compl::base::StateSampler | Abstract definition of a state space sampler |
Compl::base::CompoundStateSampler | Definition of a compound state sampler. This is useful to construct samplers for compound states |
Compl::base::DiscreteStateSampler | State space sampler for discrete states |
Compl::base::PrecomputedStateSampler | State space sampler for discrete states |
Compl::base::RealVectorStateSampler | State sampler for the Rn state space |
Compl::base::SO2StateSampler | State space sampler for SO(2) |
Compl::base::SO3StateSampler | State space sampler for SO(3), using quaternion representation |
Compl::base::SubspaceStateSampler | Construct a sampler that samples only within a subspace of the space |
Compl::base::TimeStateSampler | State space sampler for time |
►Compl::base::StateSpace | Representation of a space in which planning can be performed. Topology specific sampling, interpolation and distance are defined |
►Compl::base::CompoundStateSpace | A space to allow the composition of state spaces |
Compl::base::MorseStateSpace | State space representing MORSE states |
►Compl::base::SE2StateSpace | A state space representing SE(2) |
Compl::base::DubinsStateSpace | An SE(2) state space where distance is measured by the length of Dubins curves |
Compl::base::ReedsSheppStateSpace | An SE(2) state space where distance is measured by the length of Reeds-Shepp curves |
Compl::base::SE3StateSpace | A state space representing SE(3) |
Compl::control::OpenDEStateSpace | State space representing OpenDE states |
Compl::base::DiscreteStateSpace | A space representing discrete states; i.e. there are a small number of discrete states the system can be in. States are represented as integers [lowerBound, upperBound], where lowerBound and upperBound are inclusive. States do not wrap around; i.e. the distance between state lowerBound and state upperBound is upperBound-lowerBound. The dimension of the space is 1 |
Compl::base::RealVectorStateSpace | A state space representing Rn. The distance function is the L2 norm |
Compl::base::SO2StateSpace | A state space representing SO(2). The distance function and interpolation take into account angle wrapping |
Compl::base::SO3StateSpace | A state space 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 |
Compl::base::TimeStateSpace | A state space 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 state space behaves as expected. After construction, the state space is unbounded. isBounded() can be used to check if the state space is bounded or not |
►Compl::base::ValidStateSampler | Abstract definition of a state sampler |
Compl::base::GaussianValidStateSampler | Generate valid samples using the Gaussian sampling strategy |
Compl::base::MaximizeClearanceValidStateSampler | Generate valid samples randomly, but with a bias towards higher clearance |
Compl::base::ObstacleBasedValidStateSampler | Generate valid samples using obstacle based sampling. First sample an invalid state, then sample a valid state. Then, interpolate from the invalid state to the valid state, returning the first valid state encountered |
Compl::base::UniformValidStateSampler | A state sampler that only samples valid states, uniformly |
►Compl::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 |
CKoulesControlSampler | |
Compl::control::CompoundControlSampler | Definition of a compound control sampler. This is useful to construct samplers for compound controls |
Compl::control::DiscreteControlSampler | Control space sampler for discrete controls |
Compl::control::RealVectorControlUniformSampler | Uniform sampler for the Rn state space |
►Compl::control::ControlSpace | A control space representing the space of applicable controls |
Compl::control::CompoundControlSpace | A control space to allow the composition of control spaces |
Compl::control::DiscreteControlSpace | A space representing discrete controls; i.e. there are a small number of discrete controls the system can react to. Controls are represented as integers [lowerBound, upperBound], where lowerBound and upperBound are inclusive |
►Compl::control::RealVectorControlSpace | A control space representing Rn |
CKoulesControlSpace | |
Compl::control::MorseControlSpace | Representation of controls applied in MORSE environments. This is an array of double values |
Compl::control::OpenDEControlSpace | Representation of controls applied in OpenDE environments. This is an array of double values |
►Compl::control::DirectedControlSampler | Abstract definition of a directed control sampler. Motion planners that need to sample controls that take the system to a desired direction will call functions from this class. Planners should call the versions of sampleTo() with most arguments, whenever this information is available. If no direction information is available, the use of a ControlSampler is perhaps more appropriate |
CKoulesDirectedControlSampler | |
Compl::control::SimpleDirectedControlSampler | Implementation of a simple directed control sampler. This is a basic implementation that does not actually take direction into account and builds upon ControlSampler. Instead, a set of k random controls are sampled, and the control that gets the system closest to the target state is returned |
Compl::tools::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 |
Compl::geometric::Discretization< ompl::geometric::BKPIECE1::Motion > | |
Compl::geometric::Discretization< ompl::geometric::KPIECE1::Motion > | |
Compl::geometric::Discretization< ompl::geometric::LBKPIECE1::Motion > | |
►Compl::Grid< CellData * > | |
►Compl::GridN< CellData * > | |
Compl::GridB< CellData *, OrderCellsByImportance > | |
Compl::Grid< ompl::control::EST::MotionInfo > | |
Compl::Grid< ompl::geometric::EST::MotionInfo > | |
Compl::Grid< ompl::geometric::pSBL::MotionInfo > | |
Compl::Grid< ompl::geometric::SBL::MotionInfo > | |
CKoulesSimulator | |
Compl::base::Cost | Definition of a cost value. Can represent the cost of a motion or the cost of a state |
Compl::base::DubinsStateSpace::DubinsPath | Complete description of a Dubins path |
►Compl::base::GenericParam | Motion planning algorithms often employ parameters to guide their exploration process. (e.g., goal biasing). Motion planners (and some of their components) use this class to declare what the parameters are, in a generic way, so that they can be set externally |
Compl::base::SpecificParam< T > | This is a helper class that instantiates parameters with different data types |
Compl::base::GoalPtr | A boost shared pointer wrapper for ompl::base::Goal |
Compl::base::MorseEnvironment | This class contains the MORSE constructs OMPL needs to know about when planning |
Compl::base::MorseEnvironmentPtr | A boost shared pointer wrapper for ompl::base::MorseEnvironment |
►Compl::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 |
Compl::base::DiscreteMotionValidator | A motion validator that only uses the state validity checker. Motions are checked for validity at a specified resolution |
Compl::base::DubinsMotionValidator | A Dubins motion validator that only uses the state validity checker. Motions are checked for validity at a specified resolution |
Compl::base::ReedsSheppMotionValidator | A Reeds-Shepp motion validator that only uses the state validity checker. Motions are checked for validity at a specified resolution |
Compl::base::MotionValidatorPtr | A boost shared pointer wrapper for ompl::base::MotionValidator |
Compl::base::MultiOptimizationObjective::Component | Defines a pairing of an objective and its weight |
Compl::base::OptimizationObjectivePtr | A boost shared pointer wrapper for ompl::base::OptimizationObjective |
Compl::base::ParamSet | Maintain a set of parameters |
Compl::base::PathPtr | A boost shared pointer wrapper for ompl::base::Path |
►Compl::base::PlannerDataEdge | Base class for a PlannerData edge |
Compl::control::PlannerDataEdgeControl | Representation of an edge in PlannerData for planning with controls. This structure encodes a specific control and a duration to apply the control |
Compl::base::PlannerDataPtr | A boost shared pointer wrapper for ompl::base::PlannerData |
►Compl::base::PlannerDataStorage | Object that handles loading/storing a PlannerData object to/from a binary stream. Serialization of vertices and edges is performed using the Boost archive method serialize. Derived vertex/edge classes are handled, presuming those classes implement the serialize method |
Compl::control::PlannerDataStorage | Object that handles loading/storing a PlannerData object to/from a binary stream. Serialization of vertices and edges is performed using the Boost archive method serialize. Derived vertex/edge classes are handled, presuming those classes implement the serialize method. |
Compl::base::PlannerDataStorage::Header | Information stored at the beginning of the PlannerData archive |
Compl::base::PlannerDataStorage::PlannerDataEdgeData | The object containing all edge data that will be stored |
Compl::base::PlannerDataStorage::PlannerDataVertexData | The object containing all vertex data that will be stored |
Compl::base::PlannerDataVertex | Base class for a vertex in the PlannerData structure. All derived classes must implement the clone and equivalence operators. It is assumed that each vertex in the PlannerData structure is unique (i.e. no duplicates allowed) |
Compl::base::PlannerInputStates | Helper class to extract valid start & goal states. Usually used internally by planners |
Compl::base::PlannerPtr | A boost shared pointer wrapper for ompl::base::Planner |
Compl::base::PlannerSolution | Representation of a solution to a planning problem |
Compl::base::PlannerSpecs | Properties that planners may have |
Compl::base::PlannerStatus | A class to store the exit status of Planner::solve() |
►Compl::base::PlannerTerminationCondition | Encapsulate a termination condition for a motion planner. Planners will call operator() to decide whether they should terminate before a solution is found or not. operator() will return true if either the implemented condition is met (the call to eval() returns true) or if the user called terminate(true) |
Compl::base::MorseTerminationCondition | This class represents a termination condition for the planner that only terminates if the user shuts down the MORSE simulation |
Compl::base::ProblemDefinitionPtr | A boost shared pointer wrapper for ompl::base::ProblemDefinition |
Compl::base::ProjectionEvaluatorPtr | A boost shared pointer wrapper for ompl::base::ProjectionEvaluator |
Compl::base::ProjectionMatrix | A projection matrix – it allows multiplication of real vectors by a specified matrix. The matrix can also be randomly generated |
Compl::base::RealVectorBounds | The lower and upper bounds for an Rn space |
Compl::base::ReedsSheppStateSpace::ReedsSheppPath | Complete description of a ReedsShepp path |
Compl::base::SamplerSelector< T > | Depending on the type of state sampler, we have different allocation routines |
Compl::base::ScopedState< T > | Definition of a scoped state |
Compl::base::SolutionNonExistenceProof | Abstract definition of a proof for the non-existence of a solution to a problem |
Compl::base::SolutionNonExistenceProofPtr | A boost shared pointer wrapper for ompl::base::SolutionNonExistenceProof |
Compl::base::SpaceInformationPtr | A boost shared pointer wrapper for ompl::base::SpaceInformation |
►Compl::base::State | Definition of an abstract state |
►Compl::base::CompoundState | Definition of a compound state |
Compl::base::MorseStateSpace::StateType | MORSE State. This is a compound state that allows accessing the properties of the bodies the state space is constructed for |
Compl::base::SE2StateSpace::StateType | A state in SE(2): (x, y, yaw) |
Compl::base::SE3StateSpace::StateType | A state in SE(3): position = (x, y, z), quaternion = (x, y, z, w) |
Compl::control::OpenDEStateSpace::StateType | OpenDE State. This is a compound state that allows accessing the properties of the bodies the state space is constructed for |
Compl::base::DiscreteStateSpace::StateType | The definition of a discrete state |
Compl::base::RealVectorStateSpace::StateType | The definition of a state in Rn |
Compl::base::SO2StateSpace::StateType | The definition of a state in SO(2) |
Compl::base::SO3StateSpace::StateType | The definition of a state in SO(3) represented as a unit quaternion |
Compl::base::TimeStateSpace::StateType | The definition of a time state |
Compl::base::StatePropagatorPtr | A boost shared pointer wrapper for ompl::control::StatePropagator |
Compl::base::StateSamplerArray< T > | Class to ease the creation of a set of samplers. This is especially useful for multi-threaded planners |
Compl::base::StateSamplerPtr | A boost shared pointer wrapper for ompl::base::StateSampler |
Compl::base::StateSpace::SubstateLocation | Representation of the address of a substate in a state. This structure stores the indexing information needed to access a particular substate of a state |
Compl::base::StateSpace::ValueLocation | Representation of the address of a value in a state. This structure stores the indexing information needed to access elements of a state (no pointer values are stored) |
Compl::base::StateSpacePtr | A boost shared pointer wrapper for ompl::base::StateSpace |
►Compl::base::StateStorage | Manage loading and storing for a set of states of a specified state space |
Compl::base::StateStorageWithMetadata< M > | State storage that allows storing state metadata as well |
Compl::base::StateStorage::Header | Information stored at the beginning of the archive |
►Compl::base::StateValidityChecker | Abstract definition for a class checking the validity of states. The implementation of this class must be thread safe |
Compl::base::AllValidStateValidityChecker | The simplest state validity checker: all states are valid |
Compl::base::MorseStateValidityChecker | The simplest state validity checker: all states are valid if they are within bounds |
Compl::control::OpenDEStateValidityChecker | The simplest state validity checker: all states are valid |
Compl::base::StateValidityCheckerPtr | A boost shared pointer wrapper for ompl::base::StateValidityChecker |
Compl::base::StateValidityCheckerSpecs | Properties that a state validity checker may have |
Compl::base::ValidStateSamplerPtr | A boost shared pointer wrapper for ompl::base::ValidStateSampler |
Compl::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 |
Compl::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 |
►Compl::control::Control | Definition of an abstract control |
Compl::control::CompoundControl | Definition of a compound control |
Compl::control::DiscreteControlSpace::ControlType | The definition of a discrete control |
Compl::control::RealVectorControlSpace::ControlType | The definition of a control in Rn |
Compl::control::ControlSamplerPtr | A boost shared pointer wrapper for ompl::control::ControlSampler |
Compl::control::ControlSpacePtr | A boost shared pointer wrapper for ompl::control::ControlSpace |
►Compl::control::Decomposition | A Decomposition is a partition of a bounded Euclidean space into a fixed number of regions which are denoted by integers |
Compl::control::GridDecomposition | A GridDecomposition is a Decomposition implemented using a grid |
Compl::control::TriangularDecomposition | A TriangularDecomposition is a triangulation that ignores obstacles |
Compl::control::DecompositionPtr | A boost shared pointer wrapper for ompl::control::Decomposition |
Compl::control::DirectedControlSamplerPtr | A boost shared pointer wrapper for ompl::control::DirectedControlSampler |
Compl::control::EST::Motion | Representation of a motion |
Compl::control::EST::MotionInfo | A struct containing an array of motions and a corresponding PDF element |
Compl::control::EST::TreeData | The data contained by a tree of exploration |
Compl::control::KPIECE1::CellData | The data held by a cell in the grid of motions |
Compl::control::KPIECE1::CloseSample | Information about a known good sample (closer to the goal than others) |
Compl::control::KPIECE1::CloseSamples | Bounded set of good samples |
Compl::control::KPIECE1::Motion | Representation of a motion for this algorithm |
Compl::control::KPIECE1::OrderCellsByImportance | Definintion of an operator passed to the Grid structure, to order cells by importance |
Compl::control::KPIECE1::TreeData | The data defining a tree of motions for this algorithm |
►Compl::control::ODESolver | Abstract base class for an object that can solve ordinary differential equations (ODE) of the type q' = f(q,u) using numerical integration. Classes deriving from this must implement the solve method. The user must supply the ODE to solve |
Compl::control::ODEAdaptiveSolver< Solver > | Adaptive step size solver for ordinary differential equations of the type q' = f(q, u), where q is the current state of the system and u is a control applied to the system. The maximum integration error is bounded in this approach. Solver is the numerical integration method used to solve the equations, and must implement the error stepper concept from boost::numeric::odeint. The default is a fifth order Runge-Kutta Cash-Karp method with a fourth order error bound |
Compl::control::ODEBasicSolver< Solver > | Basic solver for ordinary differential equations of the type q' = f(q, u), where q is the current state of the system and u is a control applied to the system. StateType defines the container object describing the state of the system. Solver is the numerical integration method used to solve the equations. The default is a fourth order Runge-Kutta method. This class wraps around the simple stepper concept from boost::numeric::odeint |
Compl::control::ODEErrorSolver< Solver > | Solver for ordinary differential equations of the type q' = f(q, u), where q is the current state of the system and u is a control applied to the system. StateType defines the container object describing the state of the system. Solver is the numerical integration method used to solve the equations. The default is a fifth order Runge-Kutta Cash-Karp method with a fourth order error bound. This class wraps around the error stepper concept from boost::numeric::odeint |
Compl::control::ODESolverPtr | A boost shared pointer wrapper for ompl::control::ODESolver |
Compl::control::OpenDEEnvironment | This class contains the OpenDE constructs OMPL needs to know about when planning |
Compl::control::OpenDEEnvironmentPtr | A boost shared pointer wrapper for ompl::control::OpenDEEnvironment |
Compl::control::PDST::Cell | Cell is a Binary Space Partition |
Compl::control::PDST::Motion | Class representing the tree of motions exploring the state space |
Compl::control::PDST::MotionCompare | Comparator used to order motions in the priority queue |
Compl::control::RRT::Motion | Representation of a motion |
►Compl::control::SimpleSetup | Create the set of classes typically needed to solve a control problem |
Compl::control::MorseSimpleSetup | Create the set of classes typically needed to solve a control problem when forward propagation is computed with MORSE |
Compl::control::OpenDESimpleSetup | Create the set of classes typically needed to solve a control problem when forward propagation is computed with OpenDE |
Compl::control::SimpleSetupPtr | A boost shared pointer wrapper for ompl::control::SimpleSetup |
Compl::control::SpaceInformationPtr | A boost shared pointer wrapper for ompl::control::SpaceInformation |
►Compl::control::StatePropagator | Model the effect of controls on system states |
CKoulesStatePropagator | |
Compl::control::MorseStatePropagator | State propagation with MORSE. Only forward propagation is possible |
Compl::control::OpenDEStatePropagator | State propagation with OpenDE. Only forward propagation is possible |
Compl::control::Syclop::Adjacency | Representation of an adjacency (a directed edge) between two regions in the Decomposition assigned to Syclop |
Compl::control::Syclop::Defaults | Contains default values for Syclop parameters |
Compl::control::Syclop::Motion | Representation of a motion |
Compl::control::Syclop::Region | Representation of a region in the Decomposition assigned to Syclop |
►Compl::control::TriangularDecomposition::Polygon | |
Compl::control::TriangularDecomposition::Triangle | |
Compl::control::TriangularDecomposition::Vertex | |
Compl::FLANNDistance< _T > | Wrapper class to allow FLANN access to the NearestNeighbors::distFun_ callback function |
Compl::geometric::BKPIECE1::Motion | Representation of a motion for this algorithm |
Compl::geometric::Discretization< Motion > | One-level discretization used for KPIECE |
Compl::geometric::Discretization< Motion >::CellData | The data held by a cell in the grid of motions |
Compl::geometric::Discretization< Motion >::OrderCellsByImportance | Definintion of an operator passed to the Grid structure, to order cells by importance |
Compl::geometric::EST::Motion | The definition of a motion |
Compl::geometric::EST::MotionInfo | A struct containing an array of motions and a corresponding PDF element |
Compl::geometric::EST::TreeData | The data contained by a tree of exploration |
Compl::geometric::GeneticSearch | Genetic Algorithm for searching valid states |
Compl::geometric::HillClimbing | Hill Climbing search |
Compl::geometric::KPIECE1::Motion | Representation of a motion for this algorithm |
►Compl::geometric::KStrategy< Milestone > | |
Compl::geometric::KStarStrategy< Milestone > | Make the minimal number of connections required to ensure asymptotic optimality |
Compl::geometric::LazyRRT::Motion | Representation of a motion |
Compl::geometric::LBKPIECE1::Motion | Representation of a motion for this algorithm |
Compl::geometric::LBTRRT::IsLessThan | |
Compl::geometric::LBTRRT::Motion | Representation of a motion |
Compl::geometric::PathHybridization | Given multiple geometric paths, attempt to combine them in order to obtain a shorter solution |
Compl::geometric::PathHybridizationPtr | A boost shared pointer wrapper for ompl::geometric::PathHybridization |
Compl::geometric::PathSimplifier | This class contains routines that attempt to simplify geometric paths |
Compl::geometric::PathSimplifierPtr | A boost shared pointer wrapper for ompl::geometric::PathSimplifier |
Compl::geometric::PDST::Cell | Cell is a Binary Space Partition |
Compl::geometric::PDST::Motion | Class representing the tree of motions exploring the state space |
Compl::geometric::PDST::MotionCompare | Comparator used to order motions in the priority queue |
Compl::geometric::PRM::edge_flags_t | |
Compl::geometric::PRM::vertex_flags_t | |
Compl::geometric::PRM::vertex_state_t | |
Compl::geometric::PRM::vertex_successful_connection_attempts_t | |
Compl::geometric::PRM::vertex_total_connection_attempts_t | |
Compl::geometric::pRRT::Motion | |
Compl::geometric::pRRT::SolutionInfo | |
Compl::geometric::pSBL::Motion | |
Compl::geometric::pSBL::MotionInfo | A struct containing an array of motions and a corresponding PDF element |
Compl::geometric::pSBL::MotionsToBeRemoved | |
Compl::geometric::pSBL::PendingRemoveMotion | |
Compl::geometric::pSBL::SolutionInfo | |
Compl::geometric::pSBL::TreeData | |
Compl::geometric::RRT::Motion | Representation of a motion |
Compl::geometric::RRTConnect::Motion | Representation of a motion |
Compl::geometric::RRTConnect::TreeGrowingInfo | Information attached to growing a tree of motions (used internally) |
Compl::geometric::RRTstar::CostIndexCompare | |
Compl::geometric::RRTstar::Motion | Representation of a motion |
Compl::geometric::SBL::Motion | Representation of a motion |
Compl::geometric::SBL::MotionInfo | A struct containing an array of motions and a corresponding PDF element |
Compl::geometric::SBL::TreeData | Representation of a search tree. Two instances will be used. One for start and one for goal |
Compl::geometric::SimpleSetup | Create the set of classes typically needed to solve a geometric problem |
Compl::geometric::SimpleSetupPtr | A boost shared pointer wrapper for ompl::geometric::SimpleSetup |
Compl::geometric::SPARS::InterfaceHashStruct | |
Compl::geometric::SPARS::vertex_color_t | |
Compl::geometric::SPARS::vertex_interface_list_t | |
Compl::geometric::SPARS::vertex_list_t | |
Compl::geometric::SPARS::vertex_representative_t | |
Compl::geometric::SPARS::vertex_state_t | |
Compl::geometric::SPARStwo::InterfaceData | Interface information storage class, which does bookkeeping for criterion four |
Compl::geometric::SPARStwo::InterfaceHashStruct | |
Compl::geometric::SPARStwo::vertex_color_t | |
Compl::geometric::SPARStwo::vertex_interface_data_t | |
Compl::geometric::SPARStwo::vertex_state_t | |
Compl::geometric::STRIDE::Motion | The definition of a motion |
Compl::geometric::TRRT::Motion | Representation of a motion |
Compl::GreedyKCenters< _T > | An instance of this class can be used to greedily select a given number of representatives from a set of data points that are all far apart from each other |
►Compl::Grid< _T > | Representation of a simple grid |
►Compl::GridN< _T > | Representation of a grid where cells keep track of how many neighbors they have |
Compl::GridB< _T, LessThanExternal, LessThanInternal > | This class defines a grid that keeps track of its boundary: it distinguishes between interior and exterior cells |
►Compl::Grid< _T >::Cell | Definition of a cell in this grid |
Compl::GridN< _T >::Cell | Definition of a cell in this grid |
Compl::Grid< _T >::EqualCoordPtr | Equality operator for coordinate pointers |
Compl::Grid< _T >::HashFunCoordPtr | Hash function for coordinates; see http://www.cs.hmc.edu/~geoff/classes/hmc.cs070.200101/homework10/hashfuncs.html |
Compl::Grid< _T >::SortComponents | Helper to sort components by size |
Compl::GridB< _T, LessThanExternal, LessThanInternal >::LessThanExternalCell | Define order for external cells |
Compl::GridB< _T, LessThanExternal, LessThanInternal >::LessThanInternalCell | Define order for internal cells |
►Compl::msg::OutputHandler | Generic class to handle output from a piece of code |
Compl::msg::OutputHandlerFile | Implementation of OutputHandler that saves messages in a file |
Compl::msg::OutputHandlerSTD | Default implementation of OutputHandler. This sends the information to the console |
►Compl::NearestNeighbors< _T > | Abstract representation of a container that can perform nearest neighbors queries |
►Compl::NearestNeighborsFLANN< _T, _Dist > | Wrapper class for nearest neighbor data structures in the FLANN library |
Compl::NearestNeighborsFLANNHierarchicalClustering< _T, _Dist > | |
Compl::NearestNeighborsFLANNLinear< _T, _Dist > | |
Compl::NearestNeighborsGNAT< _T > | Geometric Near-neighbor Access Tree (GNAT), a data structure for nearest neighbor search |
►Compl::NearestNeighborsLinear< _T > | A nearest neighbors datastructure that uses linear search |
Compl::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) |
Compl::NearestNeighborsGNAT< _T >::Node | The class used internally to define the GNAT |
Compl::PDF< _T > | A container that supports probabilistic sampling over weighted data |
Compl::PDF< _T >::Element | A class that will hold data contained in the PDF |
Compl::PPM | Load and save .ppm files |
Compl::PPM::Color | |
Compl::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 |
Compl::tools::Benchmark | Benchmark a set of planners on a problem instance |
Compl::tools::Benchmark::CompleteExperiment | This structure holds experimental data for a set of planners |
Compl::tools::Benchmark::PlannerExperiment | The data collected after running a planner multiple times |
Compl::tools::Benchmark::Request | Representation of a benchmark request |
Compl::tools::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 |
Compl::tools::OptimizePlan | Run one or more motion planners repeatedly (using a specified number of threads), and hybridize solutions, trying to optimize solutions |
Compl::tools::ParallelPlan | This is a utility that allows executing multiple planners in parallel, until one or more find a solution. Optionally, the results are automatically hybridized using ompl::geometric::PathHybridization. Between calls to solve(), the set of known solutions (maintained by ompl::base::Goal) are not cleared, and neither is the hybridization datastructure |
Compl::tools::Profiler::ScopedBlock | This instance will call Profiler::begin() when constructed and Profiler::end() when it goes out of scope |
Compl::tools::Profiler::ScopedStart | This instance will call Profiler::start() when constructed and Profiler::stop() when it goes out of scope. If the profiler was already started, this block's constructor and destructor take no action |
Compl::tools::SelfConfig | This class contains methods that automatically configure various parameters for motion planning. If expensive computation is performed, the results are cached |
Compl::PDF< GridCell * > | |
Compl::PDF< int > | |
►CPlannerDataGraph | |
Compl::base::PlannerData::Graph | Wrapper class for the Boost.Graph representation of the PlannerData. This class inherits from a boost::adjacency_list Graph structure |
CPoint2DPlanning.Plane2DEnvironment | |
Compl::base::SamplerSelector< base::StateSampler > | |
Compl::base::SamplerSelector< base::ValidStateSampler > | |
Compl::base::StateSamplerArray< base::StateSampler > | |
Compl::base::StateSamplerArray< base::ValidStateSampler > | |
►Cstd::exception | STL class |
►Cstd::runtime_error | STL class |
Compl::Exception | The exception type for ompl |