Class Hierarchy
This inheritance list is sorted roughly, but not completely, alphabetically:
[detail level 12345]
▶CAStarVisitorConcept | |
▶CBaseCell | |
Compl::BinaryHeap< BiDirMotion *, BiDirMotionCompare > | |
Compl::BinaryHeap< CellX *, LessThanExternalCell > | |
Compl::BinaryHeap< CellX *, LessThanInternalCell > | |
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 > | |
▶Cdefault_astar_visitor | |
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::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::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::Goal | Abstract definition of goals |
Compl::base::GoalPtr | A shared pointer wrapper for ompl::base::Goal |
▶Compl::base::InformedSampler | An 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::IterationTerminationCondition | A class to run a planner for a specific number of iterations. Casts to a PTC for use with Planner::solve |
Compl::base::LightningRetrieveRepairPtr | A shared pointer wrapper for ompl::base::LightningRetrieveRepair |
Compl::base::MorseEnvironment | This class contains the MORSE constructs OMPL needs to know about when planning |
Compl::base::MorseEnvironmentPtr | A 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::MotionValidatorPtr | A shared pointer wrapper for ompl::base::MotionValidator |
Compl::base::MultiOptimizationObjective::Component | Defines a pairing of an objective and its weight |
▶Compl::base::OptimizationObjective | Abstract definition of optimization objectives |
Compl::base::OptimizationObjectivePtr | A shared pointer wrapper for ompl::base::OptimizationObjective |
Compl::base::ParamSet | Maintain a set of parameters |
▶Compl::base::Path | Abstract definition of a path |
Compl::base::PathPtr | A shared pointer wrapper for ompl::base::Path |
▶Compl::base::Planner | Base class for a planner |
▶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::base::PlannerDataEdge | Base class for a PlannerData edge |
Compl::base::PlannerDataPtr | A 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::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 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::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::ProblemDefinitionPtr | A shared pointer wrapper for ompl::base::ProblemDefinition |
▶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 |
Compl::base::ProjectionEvaluatorPtr | A 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 shared pointer wrapper for ompl::base::SolutionNonExistenceProof |
▶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::base::SpaceInformationPtr | A shared pointer wrapper for ompl::base::SpaceInformation |
▶Compl::base::State | Definition of an abstract state |
Compl::base::StatePropagatorPtr | A shared pointer wrapper for ompl::control::StatePropagator |
▶Compl::base::StateSampler | Abstract 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 |
Compl::base::StateSamplerPtr | A shared pointer wrapper for ompl::base::StateSampler |
▶Compl::base::StateSpace | Representation of a space in which planning can be performed. Topology specific sampling, interpolation and distance are defined |
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 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::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::StateValidityCheckerPtr | A shared pointer wrapper for ompl::base::StateValidityChecker |
Compl::base::StateValidityCheckerSpecs | Properties that a state validity checker may have |
Compl::base::ThunderRetrieveRepairPtr | A shared pointer wrapper for ompl::base::ThunderRetrieveRepair |
▶Compl::base::ValidStateSampler | Abstract definition of a state sampler |
Compl::base::ValidStateSamplerPtr | A 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::Automaton | A 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::TransitionMap | Each automaton state has a transition map, which maps from a World to another automaton state. A set ![]() ![]() |
Compl::control::AutomatonPtr | A shared pointer wrapper for ompl::control::Automaton |
▶Compl::control::Control | Definition of an abstract control |
▶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 |
Compl::control::ControlSamplerPtr | A shared pointer wrapper for ompl::control::ControlSampler |
▶Compl::control::ControlSpace | A control space representing the space of applicable controls |
Compl::control::ControlSpacePtr | A 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::DecompositionPtr | A shared pointer wrapper for ompl::control::Decomposition |
▶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 |
Compl::control::DirectedControlSamplerPtr | A 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::LTLPlanner::Motion | Representation of a motion |
Compl::control::LTLPlanner::ProductGraphStateInfo | A 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 |
Compl::control::LTLProblemDefinitionPtr | A shared pointer wrapper for ompl::control::LTLProblemDefinition |
Compl::control::LTLSpaceInformationPtr | A shared pointer wrapper for ompl::control::LTLSpaceInformation |
▶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::ODESolverPtr | A 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 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::ProductGraph | A 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::State | A 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 |
Compl::control::ProductGraphPtr | A shared pointer wrapper for ompl::control::ProductGraph |
Compl::control::PropositionalDecompositionPtr | A shared pointer wrapper for ompl::control::PropositionalDecomposition |
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::SimpleSetupPtr | A shared pointer wrapper for ompl::control::SimpleSetup |
Compl::control::SpaceInformationPtr | A shared pointer wrapper for ompl::control::SpaceInformation |
▶Compl::control::SST::Motion | Representation of a motion |
▶Compl::control::StatePropagator | Model the effect of controls on system states |
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::Vertex | |
Compl::control::World | A 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::BFMT::BiDirMotion | Representation of a bidirectional motion |
Compl::geometric::BFMT::BiDirMotionCompare | Comparator used to order motions in a binary heap |
Compl::geometric::BFMT::CostIndexCompare | |
Compl::geometric::BiEST::Motion | The definition of a motion |
Compl::geometric::BiTRRT::Motion | Representation of a motion in the search tree |
Compl::geometric::BITstar::CostHelper | A helper class to handle the various heuristic functions in one place |
Compl::geometric::BITstar::IdGenerator | An ID generator class for vertex IDs |
Compl::geometric::BITstar::ImplicitGraph | A conceptual representation of samples as an edge-implicit random geometric graph |
Compl::geometric::BITstar::SearchQueue | A queue of edges to be processed that integrates both the expansion of Vertices and the ordering of the resulting edges |
Compl::geometric::BITstar::Vertex | The vertex of the underlying graphs in BIT* |
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::DynamicTimeWarpPtr | A shared pointer wrapper for ompl::tools::DynamicTimeWarp |
Compl::geometric::EST::Motion | The definition of a motion |
Compl::geometric::ExperienceSetupPtr | A shared pointer wrapper for ompl::geometric::ExperienceSetup |
Compl::geometric::FMT::CostIndexCompare | |
Compl::geometric::FMT::Motion | Representation of a motion |
Compl::geometric::FMT::MotionCompare | Comparator used to order motions in a binary heap |
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::LazyLBTRRT::CostEstimatorApx | |
Compl::geometric::LazyLBTRRT::CostEstimatorLb | |
Compl::geometric::LazyLBTRRT::Motion | Representation 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::Motion | Representation of a motion |
Compl::geometric::LBKPIECE1::Motion | Representation of a motion for this algorithm |
Compl::geometric::LBTRRT::IsLessThan | Comparator - metric is the cost to reach state via a specific state |
Compl::geometric::LBTRRT::IsLessThanLB | Comparator - metric is the lower bound cost |
Compl::geometric::LBTRRT::Motion | Representation of a motion |
Compl::geometric::LightningDBPtr | A shared pointer wrapper for ompl::tools::LightningDB |
Compl::geometric::LightningPtr | A shared pointer wrapper for ompl::tools::Lightning |
Compl::geometric::PathHybridization | Given multiple geometric paths, attempt to combine them in order to obtain a shorter solution |
Compl::geometric::PathHybridizationPtr | A shared pointer wrapper for ompl::geometric::PathHybridization |
Compl::geometric::PathSimplifier | This class contains routines that attempt to simplify geometric paths |
Compl::geometric::PathSimplifierPtr | A 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::vertex_state_t | |
Compl::geometric::PRM::vertex_successful_connection_attempts_t | |
Compl::geometric::PRM::vertex_total_connection_attempts_t | |
Compl::geometric::ProjEST::Motion | The definition of a motion |
Compl::geometric::ProjEST::MotionInfo | A struct containing an array of motions and a corresponding PDF element |
Compl::geometric::ProjEST::TreeData | The data contained by a tree of exploration |
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::RRTXstatic::Motion | Representation of a motion (node of the tree) |
Compl::geometric::RRTXstatic::MotionCompare | Defines the operator to compare motions |
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 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::CandidateSolution | Struct for passing around partially solved solutions |
Compl::geometric::SPARSdb::edge_collision_state_t | |
Compl::geometric::SPARSdb::foundGoalException | |
Compl::geometric::SPARSdb::InterfaceData | Interface 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::InterfaceData | Interface 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::Motion | Representation of a motion |
Compl::geometric::STRIDE::Motion | The definition of a motion |
Compl::geometric::ThunderDBPtr | A shared pointer wrapper for ompl::tools::ThunderDB |
Compl::geometric::ThunderPtr | A shared pointer wrapper for ompl::tools::Thunder |
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::Grid< _T >::Cell | Definition of a cell in this grid |
Compl::Grid< _T >::EqualCoordPtr | Equality operator for coordinate pointers |
Compl::Grid< _T >::HashFunCoordPtr | |
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::LPAstarOnGraph< Graph, Heuristic > | |
▶Compl::msg::OutputHandler | Generic 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 >::Node | The class used internally to define the GNAT |
Compl::NearestNeighborsGNATNoThreadSafety< _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 - "portable pixmap format" an image file formats designed to be easily exchanged between platforms |
Compl::PPM::Color | |
Compl::ProlateHyperspheroid | A 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::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::DynamicTimeWarp | |
Compl::tools::ExperienceSetup::ExperienceLog | Single entry for the csv data logging file |
Compl::tools::ExperienceSetup::ExperienceStats | Simple logging functionality encapsled in a struct |
Compl::tools::LightningDB | Save and load entire paths from file |
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::PlannerMonitor | Monitor the properties a planner exposes, as the planner is running. Dump the planner properties to a stream, periodically |
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::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::tools::ThunderDB | Save and load entire paths from file |
Compl::PDF< GridCell * > | |
Compl::PDF< int > | |
Compl::PDF< ompl::control::LTLPlanner::Motion *> | |
Compl::PDF< ompl::control::ProductGraph::State *> | |
Compl::PDF< ompl::geometric::BiEST::Motion *> | |
Compl::PDF< ompl::geometric::EST::Motion *> | |
▶CPlannerDataGraph | |
CPoint2DPlanning.Plane2DEnvironment | |
▶CReadablePropertyMapConcept | |
Compl::base::SamplerSelector< ompl::base::StateSampler > | |
Compl::base::SamplerSelector< ompl::base::ValidStateSampler > | |
Compl::base::StateSamplerArray< ompl::base::StateSampler > | |
Compl::base::StateSamplerArray< ompl::base::ValidStateSampler > | |
▶Cstd::exception | STL class |
Cstd::hash< std::pair< U, V > > | |
▶Cstd::vector< T > | STL class |