Class Hierarchy
Go to the graphical class hierarchy
This inheritance list is sorted roughly, but not completely, alphabetically:
[detail level
1
2
3
]
C
hpp::core::continuousCollisionChecking::BodyPairCollision
Computation of collision-free sub-intervals of a path
C
hpp::core::pathOptimization::ConfigOptimizationTraits
Optimize the waypoints of the path and optionally add the constraint::ConfigurationConstraint to the
ConfigProjector
of the path
►
C
hpp::core::ConfigurationShooter
Abstraction of configuration shooter
C
hpp::core::configurationShooter::Gaussian
Sample configuration using a gaussian distribution around a configuration
C
hpp::core::configurationShooter::Uniform
Uniformly sample with bounds of degrees of freedom
►
C
hpp::core::ConfigValidation
Abstraction of configuration validation
C
hpp::core::CollisionValidation
Validate a configuration with respect to collision
C
hpp::core::ConfigValidations
Validate a configuration with respect to collision
C
hpp::core::JointBoundValidation
Validate a configuration with respect to joint bounds
C
hpp::core::ConnectedComponent
Connected component
►
C
hpp::core::Constraint
Constraint
applicable to a robot configuration
C
hpp::core::ConfigProjector
Implicit non-linear constraint
C
hpp::core::ConstraintSet
Set of constraints applicable to a robot configuration
C
hpp::core::Container< Types, Key >
C
hpp::core::Container< AffordanceConfig_t >
C
hpp::core::Container< AffordanceObjects_t >
C
hpp::core::Container< CenterOfMassComputationPtr_t >
C
hpp::core::Container< ConfigurationShooterBuilder_t >
C
hpp::core::Container< ConfigValidationBuilder_t >
C
hpp::core::Container< constraints::ImplicitPtr_t >
C
hpp::core::Container< DistanceBuilder_t >
C
hpp::core::Container< hpp::core::Parameter >
C
hpp::core::Container< JointAndShapes_t >
C
hpp::core::Container< LockedJointPtr_t >
C
hpp::core::Container< PathOptimizerBuilder_t >
C
hpp::core::Container< PathPlannerBuilder_t >
C
hpp::core::Container< PathProjectorBuilder_t >
C
hpp::core::Container< PathValidationBuilder_t >
C
hpp::core::Container< RobotBuilder_t >
C
hpp::core::Container< segments_t >
C
hpp::core::Container< SteeringMethodBuilder_t >
►
C
hpp::constraints::DifferentiableFunction
[external]
►
C
hpp::core::pathOptimization::Cost
Numerical cost for path optimization
C
hpp::core::pathOptimization::PathLength
Path
length as a cost for optimization
C
hpp::core::TimesFrameFunction
►
C
hpp::core::Distance
Abstract class for distance between configurations
C
hpp::core::distance::ReedsShepp
Reeds and Shepp distance
C
hpp::core::WeighedDistance
Weighed distance between configurations
C
hpp::core::DistanceBetweenObjects
Computation of distances between pairs of objects
C
hpp::core::Edge
Edge
of a roadmap
►
C
std::exception
STL class
C
hpp::core::projection_error
C
hpp::core::pathOptimization::LinearConstraint
A linear constraint \( J \times x = b \)
C
hpp::core::NearestNeighbor
Optimization of the nearest neighbor search
C
hpp::core::Node
Node
of a roadmap
►
C
NumTraits
C
Eigen::NumTraits< hpp::core::RelativeMotion::RelativeMotionType >
►
C
hpp::util::parser::ObjectFactory
[external]
C
hpp::core::parser::RoadmapFactory
C
hpp::core::pathOptimization::ConfigOptimization::Optimizer
C
hpp::core::Parameter
C
hpp::core::ParameterDescription
C
hpp::core::pathOptimization::ConfigOptimization::Parameters
C
hpp::core::pathOptimization::PartialShortcut::Parameters
C
hpp::core::pathOptimization::PartialShortcutTraits
Partial shortcut
►
C
hpp::core::Path
Abstraction of paths: mapping from time to configuration space
C
hpp::core::DubinsPath
Car like motion going only forward
C
hpp::core::InterpolatedPath
Piecewise linear interpolation between two configurations
C
hpp::core::path::Spline< _PolynomeBasis, _Order >
Base class for spline paths
►
C
hpp::core::PathVector
Concatenation of several paths
C
hpp::core::ReedsSheppPath
Car like motion
C
hpp::core::steeringMethod::ConstantCurvature
Path
of constant curvature for a carlike robot
C
hpp::core::StraightPath
Linear interpolation between two configurations
C
hpp::core::SubchainPath
Result of the selection of some configuration parameter of an original path
►
C
hpp::core::path::Spline< BernsteinBasis, 3 >
C
hpp::core::path::Hermite
►
C
hpp::core::PathOptimizer
Abstraction of path optimizer
C
hpp::core::pathOptimization::ConfigOptimization
C
hpp::core::pathOptimization::GradientBased
C
hpp::core::pathOptimization::PartialShortcut
C
hpp::core::pathOptimization::SimpleTimeParameterization
Add a
TimeParameterization
to paths so that the velocity does not exceeds the velocity limits
►
C
hpp::core::pathOptimization::SplineGradientBasedAbstract< _PolynomeBasis, _SplineOrder >
Common base for optimization-based path optimizer with splines
C
hpp::core::pathOptimization::SplineGradientBased< _PolynomeBasis, _SplineOrder >
C
hpp::core::RandomShortcut
Random shortcut
►
C
hpp::core::PathPlanner
Path
planner
C
hpp::core::BiRRTPlanner
Implementation of directional bi-RRT algorithm maintaining only two connected components for respectively the start and goal configurations
C
hpp::core::DiffusingPlanner
Generic implementation of RRT algorithm
C
hpp::core::pathPlanner::kPrmStar
K-PRM* path planning algorithm as described in
https://arxiv.org/pdf/1105.1186.pdf
C
hpp::core::PlanAndOptimize
Path
planner and optimizer
C
hpp::core::VisibilityPrmPlanner
Generic implementation of visibility-PRM algorithm, based on guard nodes (which cannot see each other) and connection nodes between guards
►
C
hpp::core::PathProjector
This class projects a path using constraints
C
hpp::core::pathProjector::Dichotomy
C
hpp::core::pathProjector::Global
C
hpp::core::pathProjector::Progressive
C
hpp::core::pathProjector::RecursiveHermite
Implements "Fast Interpolation and Time-Optimization on Implicit Contact Submanifolds" from Kris Hauser
►
C
hpp::core::PathValidation
Abstraction of path validation
►
C
hpp::core::ContinuousCollisionChecking
Continuous validation of a path for collision
C
hpp::core::continuousCollisionChecking::Dichotomy
Continuous validation of a path for collision
C
hpp::core::continuousCollisionChecking::Progressive
Continuous validation of a path for collision
►
C
hpp::core::DiscretizedPathValidation
Discretized validation of a path
C
hpp::core::DiscretizedCollisionChecking
Validation of path by collision checking at discretized parameter values
C
hpp::core::PathValidations
Validation of a path with multiple path validation methods
C
hpp::core::Problem
Defines a path planning problem for one robot
C
hpp::core::ProblemSolver
Set and solve a path planning problem
►
C
hpp::core::ProblemTarget
Problem
target
C
hpp::core::problemTarget::GoalConfigurations
Goal configurations
C
hpp::core::problemTarget::TaskTarget
Task target
C
hpp::core::pathOptimization::QuadraticProgram
C
hpp::core::RelativeMotion
C
hpp::core::Roadmap
Roadmap
built by random path planning methods Nodes are configurations, paths are collision-free paths
C
hpp::core::pathOptimization::SplineGradientBasedAbstract< _PolynomeBasis, _SplineOrder >::SplineOptimizationData
►
C
hpp::core::SteeringMethod
Steering method
►
C
hpp::core::steeringMethod::CarLike
Abstract class that implements various type of trajectories for carlike vehicles
C
hpp::core::steeringMethod::Dubins
Steering method that creates
DubinsPath
instances
C
hpp::core::steeringMethod::ReedsShepp
Steering method that creates
ReedsSheppPath
instances
C
hpp::core::steeringMethod::Snibud
Steering method that creates backward
Dubins
paths
C
hpp::core::steeringMethod::Hermite
Steering method that creates
path::Hermite
instances
C
hpp::core::steeringMethod::Interpolated
Steering method that creates
StraightPath
instances
C
hpp::core::steeringMethod::Spline< _PolynomeBasis, _SplineOrder >
Steering method that creates
path::Spline
instances
C
hpp::core::steeringMethod::Straight
Steering method that creates
StraightPath
instances
►
C
hpp::core::TimeParameterization
C
hpp::core::timeParameterization::Polynomial
►
C
hpp::core::ValidationReport
Abstraction of validation report for paths and configurations
C
hpp::core::CollisionValidationReport
Validate a configuration with respect to collision
C
hpp::core::JointBoundValidationReport
Report returned when a configuration is not within the bounds
►
C
hpp::core::PathValidationReport
Abstraction of path validation report
C
hpp::core::CollisionPathValidationReport
Path
validation report used for standard collision checking
Generated on Thu Jan 24 2019 20:31:24 for hpp-core by
1.8.13