Class Hierarchy

Go to the graphical class hierarchy

This inheritance list is sorted roughly, but not completely, alphabetically:
[detail level 123456]
 CAStarVisitorConcept
 CAtlasOptions
 CBaseCell
 Compl::BinaryHeap< aitstar::Edge, std::function< bool(const aitstar::Edge &, const aitstar::Edge &)> >
 Compl::BinaryHeap< BiDirMotion *, BiDirMotionCompare >
 Compl::BinaryHeap< CellX *, LessThanExternalCell >
 Compl::BinaryHeap< CellX *, LessThanInternalCell >
 Compl::BinaryHeap< KeyVertexPair, std::function< bool(const KeyVertexPair &, const KeyVertexPair &)> >
 Compl::BinaryHeap< Motion *, MotionCompare >
 Compl::BinaryHeap< ompl::control::PDST::Motion *, ompl::control::PDST::MotionCompare >
 Compl::BinaryHeap< ompl::geometric::PDST::Motion *, ompl::geometric::PDST::MotionCompare >
 Compl::BinaryHeap< ompl::geometric::RRTXstatic::Motion *, ompl::geometric::RRTXstatic::MotionCompare >
 Compl::BinaryHeap< SortKeyAndVertexPtrPair, EdgeComparisonFunction >
 Cboost::default_astar_visitor
 CConstrainedOptions
 CConstrainedProblem
 CConstraintGeneration.Constraint
 CConvexPolygon
 Compl::geometric::Discretization< ompl::geometric::BKPIECE1::Motion >
 Compl::geometric::Discretization< ompl::geometric::KPIECE1::Motion >
 Compl::geometric::Discretization< ompl::geometric::LBKPIECE1::Motion >
 CEigen::Map
 Compl::GreedyKCenters< NNElement >
 Compl::GreedyKCenters< std::shared_ptr< ompl::geometric::aitstar::Vertex > >
 Compl::Grid< CellData * >
 Compl::Grid< ompl::control::EST::MotionInfo >
 Compl::Grid< ompl::geometric::ProjEST::MotionInfo >
 Compl::Grid< ompl::geometric::pSBL::MotionInfo >
 Compl::Grid< ompl::geometric::SBL::MotionInfo >
 CKoulesSimulator
 Compl::NearestNeighbors< NNElement >
 Compl::NearestNeighbors< std::shared_ptr< ompl::geometric::aitstar::Vertex > >
 Cobject
 Compl::AdjacencyList
 Compl::base::AtlasChartTangent space and bounding polytope approximating some patch of the manifold
 Compl::base::ConstraintDefinition of a differentiable holonomic constraint on a configuration space. See Constrained Planning for more details
 CConstraintPtrA shared pointer wrapper for ompl::base::Constraint
 Compl::base::CostDefinition of a cost value. Can represent the cost of a motion or the cost of a state
 Compl::base::DeterministicSequenceAn abstract class for deterministic sequences in arbitrary dimensions
 Compl::base::DubinsStateSpace::DubinsPathComplete description of a Dubins path
 Compl::base::GenericParamMotion 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::GoalAbstract definition of goals
 CGoalPtrA shared pointer wrapper for ompl::base::Goal
 Compl::base::HaltonSequence1DRealization of the Halton sequence for the generation of arbitrary dimensional, low-dispersion sequences
 Compl::base::InformedSamplerAn abstract class for the concept of using information about the state space and the current solution cost to limit future search to a planning subproblem that contains all possibly better solutions
 Compl::base::IterationTerminationConditionA class to run a planner for a specific number of iterations. Casts to a PTC for use with Planner::solve
 CLightningRetrieveRepairPtrA shared pointer wrapper for ompl::base::LightningRetrieveRepair
 Compl::base::MorseEnvironmentThis class contains the MORSE constructs OMPL needs to know about when planning
 CMorseEnvironmentPtrA shared pointer wrapper for ompl::base::MorseEnvironment
 Compl::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
 CMotionValidatorPtrA shared pointer wrapper for ompl::base::MotionValidator
 Compl::base::MultiOptimizationObjective::ComponentDefines a pairing of an objective and its weight
 Compl::base::OptimizationObjectiveAbstract definition of optimization objectives
 COptimizationObjectivePtrA shared pointer wrapper for ompl::base::OptimizationObjective
 Compl::base::ParamSetMaintain a set of parameters
 Compl::base::PathAbstract definition of a path
 CPathPtrA shared pointer wrapper for ompl::base::Path
 Compl::base::PlannerBase class for a planner
 Compl::base::PlannerDataObject 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::PlannerDataEdgeBase class for a PlannerData edge
 CPlannerDataPtrA shared pointer wrapper for ompl::base::PlannerData
 Compl::base::PlannerDataStorageObject 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::HeaderInformation stored at the beginning of the PlannerData archive
 Compl::base::PlannerDataStorage::PlannerDataEdgeDataThe object containing all edge data that will be stored
 Compl::base::PlannerDataStorage::PlannerDataVertexDataThe object containing all vertex data that will be stored
 Compl::base::PlannerDataVertexBase 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::PlannerInputStatesHelper class to extract valid start & goal states. Usually used internally by planners
 CPlannerPtrA shared pointer wrapper for ompl::base::Planner
 Compl::base::PlannerSolutionRepresentation of a solution to a planning problem
 Compl::base::PlannerSpecsProperties that planners may have
 Compl::base::PlannerStatusA class to store the exit status of Planner::solve()
 Compl::base::PlannerTerminationConditionEncapsulate 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::ProblemDefinitionDefinition of a problem to be solved. This includes the start state(s) for the system and a goal specification. Will contain solutions, if found.
 CProblemDefinitionPtrA shared pointer wrapper for ompl::base::ProblemDefinition
 Compl::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
 CProjectionEvaluatorPtrA shared pointer wrapper for ompl::base::ProjectionEvaluator
 Compl::base::ProjectionMatrixA projection matrix – it allows multiplication of real vectors by a specified matrix. The matrix can also be randomly generated
 Compl::base::RealVectorBoundsThe lower and upper bounds for an Rn space
 Compl::base::ReedsSheppStateSpace::ReedsSheppPathComplete 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::SolutionNonExistenceProofAbstract definition of a proof for the non-existence of a solution to a problem
 CSolutionNonExistenceProofPtrA shared pointer wrapper for ompl::base::SolutionNonExistenceProof
 Compl::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
 CSpaceInformationPtrA shared pointer wrapper for ompl::base::SpaceInformation
 Compl::base::StateDefinition of an abstract state
 CStatePropagatorPtrA shared pointer wrapper for ompl::control::StatePropagator
 Compl::base::StateSamplerAbstract definition of a state space sampler
 Compl::base::StateSamplerArray< T >Class to ease the creation of a set of samplers. This is especially useful for multi-threaded planners
 CStateSamplerPtrA shared pointer wrapper for ompl::base::StateSampler
 Compl::base::StateSpaceRepresentation of a space in which planning can be performed. Topology specific sampling, interpolation and distance are defined
 Compl::base::StateSpace::SubstateLocationRepresentation 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::ValueLocationRepresentation 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)
 CStateSpacePtrA shared pointer wrapper for ompl::base::StateSpace
 Compl::base::StateStorageManage loading and storing for a set of states of a specified state space
 Compl::base::StateStorage::HeaderInformation stored at the beginning of the archive
 Compl::base::StateValidityCheckerAbstract definition for a class checking the validity of states. The implementation of this class must be thread safe
 CStateValidityCheckerPtrA shared pointer wrapper for ompl::base::StateValidityChecker
 Compl::base::StateValidityCheckerSpecsProperties that a state validity checker may have
 CThunderRetrieveRepairPtrA shared pointer wrapper for ompl::base::ThunderRetrieveRepair
 Compl::base::ValidStateSamplerAbstract definition of a state sampler
 CValidStateSamplerPtrA 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 >::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
 Compl::control::AutomatonA class to represent a deterministic finite automaton, each edge of which corresponds to a World. A system trajectory, by way of project() and worldAtRegion() in PropositionalDecomposition, determines a sequence of Worlds, which are read by an Automaton to determine whether a trajectory satisfies a given specification
 Compl::control::Automaton::TransitionMapEach automaton state has a transition map, which maps from a World to another automaton state. A set \(P\) of true propositions correponds to the formula \(\bigwedge_{p\in P} p\)
 CAutomatonPtrA shared pointer wrapper for ompl::control::Automaton
 Compl::control::ControlDefinition of an abstract control
 Compl::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
 CControlSamplerPtrA shared pointer wrapper for ompl::control::ControlSampler
 Compl::control::ControlSpaceA control space representing the space of applicable controls
 CControlSpacePtrA shared pointer wrapper for ompl::control::ControlSpace
 Compl::control::DecompositionA Decomposition is a partition of a bounded Euclidean space into a fixed number of regions which are denoted by integers
 CDecompositionPtrA shared pointer wrapper for ompl::control::Decomposition
 Compl::control::DirectedControlSamplerAbstract 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
 CDirectedControlSamplerPtrA shared pointer wrapper for ompl::control::DirectedControlSampler
 Compl::control::EST::MotionRepresentation of a motion
 Compl::control::EST::MotionInfoA struct containing an array of motions and a corresponding PDF element
 Compl::control::EST::TreeDataThe data contained by a tree of exploration
 Compl::control::KPIECE1::CellDataThe data held by a cell in the grid of motions
 Compl::control::KPIECE1::CloseSampleInformation about a known good sample (closer to the goal than others)
 Compl::control::KPIECE1::CloseSamplesBounded set of good samples
 Compl::control::KPIECE1::MotionRepresentation of a motion for this algorithm
 Compl::control::KPIECE1::OrderCellsByImportanceDefinintion of an operator passed to the Grid structure, to order cells by importance
 Compl::control::KPIECE1::TreeDataThe data defining a tree of motions for this algorithm
 Compl::control::LTLPlanner::MotionRepresentation of a motion
 Compl::control::LTLPlanner::ProductGraphStateInfoA structure to hold measurement information for a high-level state, as well as the set of tree motions belonging to that high-level state. Exactly one ProductGraphStateInfo will exist for each ProductGraph::State
 CLTLProblemDefinitionPtrA shared pointer wrapper for ompl::control::LTLProblemDefinition
 CLTLSpaceInformationPtrA shared pointer wrapper for ompl::control::LTLSpaceInformation
 Compl::control::ODESolverAbstract 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
 CODESolverPtrA shared pointer wrapper for ompl::control::ODESolver
 Compl::control::OpenDEEnvironmentThis class contains the OpenDE constructs OMPL needs to know about when planning
 COpenDEEnvironmentPtrA shared pointer wrapper for ompl::control::OpenDEEnvironment
 Compl::control::PDST::CellCell is a Binary Space Partition
 Compl::control::PDST::MotionClass representing the tree of motions exploring the state space
 Compl::control::PDST::MotionCompareComparator used to order motions in the priority queue
 Compl::control::ProductGraphA ProductGraph represents the weighted, directed, graph-based Cartesian product of a PropositionalDecomposition object, an Automaton corresponding to a co-safe LTL specification, and an Automaton corresponding to a safe LTL specification
 Compl::control::ProductGraph::Edge
 Compl::control::ProductGraph::StateA State of a ProductGraph represents a vertex in the graph-based Cartesian product represented by the ProductGraph. A State is simply a tuple consisting of a PropositionalDecomposition region, a co-safe Automaton state, and a safe Automaton state
 CProductGraphPtrA shared pointer wrapper for ompl::control::ProductGraph
 CPropositionalDecompositionPtrA shared pointer wrapper for ompl::control::PropositionalDecomposition
 Compl::control::RRT::MotionRepresentation of a motion
 Compl::control::SimpleSetupCreate the set of classes typically needed to solve a control problem
 CSimpleSetupPtrA shared pointer wrapper for ompl::control::SimpleSetup
 CSpaceInformationPtrA shared pointer wrapper for ompl::control::SpaceInformation
 Compl::control::SST::MotionRepresentation of a motion
 Compl::control::StatePropagatorModel the effect of controls on system states
 Compl::control::Syclop::AdjacencyRepresentation of an adjacency (a directed edge) between two regions in the Decomposition assigned to Syclop
 Compl::control::Syclop::DefaultsContains default values for Syclop parameters
 Compl::control::Syclop::MotionRepresentation of a motion
 Compl::control::Syclop::RegionRepresentation of a region in the Decomposition assigned to Syclop
 Compl::control::TriangularDecomposition::Polygon
 Compl::control::TriangularDecomposition::Vertex
 Compl::control::WorldA class to represent an assignment of boolean values to propositions. A World can be partially restrictive, i.e., some propositions do not have to be assigned a value, in which case it can take on any value. Our notion of a World is similar to a set of truth assignments in propositional logic
 Compl::DynamicSSSP
 Compl::FLANNDistance< _T >Wrapper class to allow FLANN access to the NearestNeighbors::distFun_ callback function
 Compl::geometric::aitstar::Edge
 Compl::geometric::aitstar::ImplicitGraph
 Compl::geometric::aitstar::Vertex
 Compl::geometric::BFMT::BiDirMotionRepresentation of a bidirectional motion
 Compl::geometric::BFMT::BiDirMotionCompareComparator used to order motions in a binary heap
 Compl::geometric::BFMT::CostIndexCompare
 Compl::geometric::BiEST::MotionThe definition of a motion
 Compl::geometric::BiRLRT::MotionA motion (tree node) with parent pointer
 Compl::geometric::BiTRRT::MotionRepresentation of a motion in the search tree
 Compl::geometric::BITstar::CostHelperA helper class to handle the various heuristic functions in one place
 Compl::geometric::BITstar::IdGeneratorAn ID generator class for vertex IDs
 Compl::geometric::BITstar::ImplicitGraphA conceptual representation of samples as an edge-implicit random geometric graph
 Compl::geometric::BITstar::SearchQueueA queue of edges, sorted according to a sort key
 Compl::geometric::BITstar::VertexThe vertex of the underlying graphs in gBITstar BIT*
 Compl::geometric::BKPIECE1::MotionRepresentation of a motion for this algorithm
 Compl::geometric::Discretization< Motion >One-level discretization used for KPIECE
 Compl::geometric::Discretization< Motion >::CellDataThe data held by a cell in the grid of motions
 Compl::geometric::Discretization< Motion >::OrderCellsByImportanceDefinintion of an operator passed to the Grid structure, to order cells by importance
 CDynamicTimeWarpPtrA shared pointer wrapper for ompl::tools::DynamicTimeWarp
 Compl::geometric::EST::MotionThe definition of a motion
 CExperienceSetupPtrA shared pointer wrapper for ompl::geometric::ExperienceSetup
 Compl::geometric::FMT::CostIndexCompare
 Compl::geometric::FMT::MotionRepresentation of a motion
 Compl::geometric::FMT::MotionCompareComparator used to order motions in a binary heap
 Compl::geometric::GeneticSearchGenetic Algorithm for searching valid states
 Compl::geometric::HillClimbingHill Climbing search
 Compl::geometric::KPIECE1::MotionRepresentation of a motion for this algorithm
 Compl::geometric::KStrategy< Milestone >
 Compl::geometric::LazyLBTRRT::CostEstimatorApx
 Compl::geometric::LazyLBTRRT::CostEstimatorLb
 Compl::geometric::LazyLBTRRT::MotionRepresentation of a motion
 Compl::geometric::LazyPRM::edge_flags_t
 Compl::geometric::LazyPRM::vertex_component_t
 Compl::geometric::LazyPRM::vertex_flags_t
 Compl::geometric::LazyPRM::vertex_state_t
 Compl::geometric::LazyRRT::MotionRepresentation of a motion
 Compl::geometric::LBKPIECE1::MotionRepresentation of a motion for this algorithm
 Compl::geometric::LBTRRT::IsLessThanComparator - metric is the cost to reach state via a specific state
 Compl::geometric::LBTRRT::IsLessThanLBComparator - metric is the lower bound cost
 Compl::geometric::LBTRRT::MotionRepresentation of a motion
 CLightningDBPtrA shared pointer wrapper for ompl::tools::LightningDB
 CLightningPtrA shared pointer wrapper for ompl::tools::Lightning
 Compl::geometric::MultiQuotient< T >::CmpQuotientSpacePtrsCompare function for priority queue
 Compl::geometric::PathHybridizationGiven multiple geometric paths, attempt to combine them in order to obtain a shorter solution
 CPathHybridizationPtrA shared pointer wrapper for ompl::geometric::PathHybridization
 Compl::geometric::PathSimplifierThis class contains routines that attempt to simplify geometric paths
 CPathSimplifierPtrA shared pointer wrapper for ompl::geometric::PathSimplifier
 Compl::geometric::PDST::CellCell is a Binary Space Partition
 Compl::geometric::PDST::MotionClass representing the tree of motions exploring the state space
 Compl::geometric::PDST::MotionCompareComparator used to order motions in the priority queue
 Compl::geometric::PRM::vertex_state_t
 Compl::geometric::PRM::vertex_successful_connection_attempts_t
 Compl::geometric::PRM::vertex_total_connection_attempts_t
 Compl::geometric::ProjEST::MotionThe definition of a motion
 Compl::geometric::ProjEST::MotionInfoA struct containing an array of motions and a corresponding PDF element
 Compl::geometric::ProjEST::TreeDataThe data contained by a tree of exploration
 Compl::geometric::pRRT::Motion
 Compl::geometric::pRRT::SolutionInfo
 Compl::geometric::pSBL::Motion
 Compl::geometric::pSBL::MotionInfoA 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::QuotientSpaceGraph::ConfigurationA configuration in quotient-space
 Compl::geometric::QuotientSpaceGraph::EdgeInternalStateAn edge in quotient-space
 Compl::geometric::QuotientSpaceGraph::GraphBundle
 Compl::geometric::RLRT::MotionA motion (tree node) with parent pointer
 Compl::geometric::RRT::MotionRepresentation of a motion
 Compl::geometric::RRTConnect::MotionRepresentation of a motion
 Compl::geometric::RRTConnect::TreeGrowingInfoInformation attached to growing a tree of motions (used internally)
 Compl::geometric::RRTstar::CostIndexCompare
 Compl::geometric::RRTstar::MotionRepresentation of a motion
 Compl::geometric::RRTXstatic::MotionRepresentation of a motion (node of the tree)
 Compl::geometric::RRTXstatic::MotionCompareDefines the operator to compare motions
 Compl::geometric::SBL::MotionRepresentation of a motion
 Compl::geometric::SBL::MotionInfoA struct containing an array of motions and a corresponding PDF element
 Compl::geometric::SBL::TreeDataRepresentation of a search tree. Two instances will be used. One for start and one for goal
 Compl::geometric::SimpleSetupCreate the set of classes typically needed to solve a geometric problem
 CSimpleSetupPtrA shared pointer wrapper for ompl::geometric::SimpleSetup
 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::SPARSdb::CandidateSolutionStruct for passing around partially solved solutions
 Compl::geometric::SPARSdb::edge_collision_state_t
 Compl::geometric::SPARSdb::foundGoalException
 Compl::geometric::SPARSdb::InterfaceDataInterface information storage class, which does bookkeeping for criterion four
 Compl::geometric::SPARSdb::InterfaceHashStruct
 Compl::geometric::SPARSdb::vertex_color_t
 Compl::geometric::SPARSdb::vertex_interface_data_t
 Compl::geometric::SPARSdb::vertex_state_t
 Compl::geometric::SPARStwo::InterfaceDataInterface information storage class, which does bookkeeping for criterion four
 Compl::geometric::SPARStwo::vertex_color_t
 Compl::geometric::SPARStwo::vertex_interface_data_t
 Compl::geometric::SPARStwo::vertex_state_t
 Compl::geometric::SST::MotionRepresentation of a motion
 Compl::geometric::STRIDE::MotionThe definition of a motion
 Compl::geometric::TaskSpaceConfig
 CThunderDBPtrA shared pointer wrapper for ompl::tools::ThunderDB
 CThunderPtrA shared pointer wrapper for ompl::tools::Thunder
 Compl::geometric::TRRT::MotionRepresentation of a motion
 Compl::geometric::TSRRT::MotionRepresentation of a motion
 Compl::geometric::XXL::Layer
 Compl::geometric::XXL::Motion
 Compl::geometric::XXL::PerfectSet
 Compl::geometric::XXL::Region
 Compl::geometric::XXLDecomposition
 CXXLDecompositionPtrA shared pointer wrapper for ompl::geometric::XXLDecomposition
 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::Grid< _T >::CellDefinition of a cell in this grid
 Compl::Grid< _T >::EqualCoordPtrEquality operator for coordinate pointers
 Compl::Grid< _T >::HashFunCoordPtr
 Compl::Grid< _T >::SortComponentsHelper to sort components by size
 Compl::GridB< _T, LessThanExternal, LessThanInternal >::LessThanExternalCellDefine order for external cells
 Compl::GridB< _T, LessThanExternal, LessThanInternal >::LessThanInternalCellDefine order for internal cells
 Compl::LPAstarOnGraph< Graph, Heuristic >
 Compl::msg::OutputHandlerGeneric class to handle output from a piece of code
 Compl::NearestNeighbors< _T >Abstract representation of a container that can perform nearest neighbors queries
 Compl::NearestNeighborsGNAT< _T >::NodeThe class used internally to define the GNAT
 Compl::NearestNeighborsGNATNoThreadSafety< _T >::NodeThe class used internally to define the GNAT
 Compl::PDF< _T >A container that supports probabilistic sampling over weighted data
 Compl::PDF< _T >::ElementA class that will hold data contained in the PDF
 Compl::PPMLoad and save .ppm files - "portable pixmap format" an image file formats designed to be easily exchanged between platforms
 Compl::PPM::Color
 Compl::ProlateHyperspheroidA class describing a prolate hyperspheroid, a special symmetric type of n-dimensional ellipse, for use in direct informed sampling for problems seeking to minimize path length
 Compl::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
 Compl::time::ProgressDisplay
 Compl::tools::BenchmarkBenchmark a set of planners on a problem instance
 Compl::tools::Benchmark::CompleteExperimentThis structure holds experimental data for a set of planners
 Compl::tools::Benchmark::PlannerExperimentThe data collected after running a planner multiple times
 Compl::tools::Benchmark::RequestRepresentation of a benchmark request
 Compl::tools::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
 Compl::tools::DynamicTimeWarp
 Compl::tools::ExperienceSetup::ExperienceLogSingle entry for the csv data logging file
 Compl::tools::ExperienceSetup::ExperienceStatsSimple logging functionality encapsled in a struct
 Compl::tools::LightningDBSave and load entire paths from file
 Compl::tools::OptimizePlanRun one or more motion planners repeatedly (using a specified number of threads), and hybridize solutions, trying to optimize solutions
 Compl::tools::ParallelPlanThis 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::PlannerMonitorMonitor the properties a planner exposes, as the planner is running. Dump the planner properties to a stream, periodically
 Compl::tools::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
 Compl::tools::Profiler::ScopedBlockThis instance will call Profiler::begin() when constructed and Profiler::end() when it goes out of scope
 Compl::tools::Profiler::ScopedStartThis 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::SelfConfigThis class contains methods that automatically configure various parameters for motion planning. If expensive computation is performed, the results are cached
 Compl::tools::ThunderDBSave and load entire paths from file
 Compl::PDF< GridCell * >
 Compl::PDF< int >
 Compl::PDF< ompl::base::AtlasChart * >
 Compl::PDF< ompl::control::LTLPlanner::Motion * >
 Compl::PDF< ompl::control::ProductGraph::State * >
 Compl::PDF< ompl::geometric::BiEST::Motion * >
 Compl::PDF< ompl::geometric::EST::Motion * >
 CPlanarManipulator
 CPlannerDataGraph
 CPoint2DPlanning.Plane2DEnvironment
 CPolyWorld
 CReadablePropertyMapConcept
 CSegment
 Compl::base::StateSamplerArray< ompl::base::StateSampler >
 Compl::base::StateSamplerArray< ompl::base::ValidStateSampler >
 Cstd::exceptionSTL class
 Cstd::hash< std::pair< U, V > >
 Cstd::hash< std::vector< T > >
 Cstd::vector< T >STL class