hpp-core  6.0.0
Implement basic classes for canonical path planning for kinematic chains.
hpp::core Namespace Reference

Namespaces

 configurationShooter
 
 continuousValidation
 
 distance
 
 nearestNeighbor
 
 parser
 
 path
 
 pathOptimization
 
 pathPlanner
 
 pathProjector
 
 pathValidation
 
 plugin
 
 problemTarget
 
 steeringMethod
 
 timeParameterization
 

Classes

class  BiRRTPlanner
 
struct  CollisionPair
 
struct  CollisionPathValidationReport
 Path validation report used for standard collision checking. More...
 
struct  CollisionValidationReport
 
struct  AllCollisionsValidationReport
 
class  CollisionValidation
 
class  ConfigProjector
 
class  ConfigValidation
 
class  ConfigValidations
 
class  ConfigurationShooter
 
class  ConnectedComponent
 
class  ConstraintSet
 
class  Constraint
 
struct  Container
 
class  ContinuousValidation
 
class  DiffusingPlanner
 Generic implementation of RRT algorithm. More...
 
class  DistanceBetweenObjects
 Computation of distances between pairs of objects. More...
 
class  Distance
 Abstract class for distance between configurations. More...
 
class  DubinsPath
 
class  Edge
 
struct  SharedComparator
 
class  InterpolatedPath
 
class  JointBoundValidationReport
 report returned when a configuration is not within the bounds More...
 
class  JointBoundValidation
 
class  KinodynamicDistance
 
class  KinodynamicOrientedPath
 
class  KinodynamicPath
 
class  NearestNeighbor
 Optimization of the nearest neighbor search. More...
 
class  Node
 
class  ObstacleUserInterface
 
class  ObstacleUserVector
 
class  ObstacleUser
 Stores a set of obstacles (movable or static). More...
 
class  Parameter
 
class  ParameterDescription
 
class  PathOptimizer
 
class  PathPlanner
 
struct  path_planning_failed
 
class  PathProjector
 This class projects a path using constraints. More...
 
struct  PathValidationReport
 
class  PathValidation
 
class  PathValidations
 
class  PathVector
 Concatenation of several paths. More...
 
class  Path
 
class  PlanAndOptimize
 
class  ProblemSolverPlugin
 Plugin mechanism to declare new features in ProblemSolver class. More...
 
class  Member_lockedJoints_in_class_ProblemSolver_has_been_removed_use_member_numericalConstraints_instead
 
class  ProblemSolver
 
class  ProblemTarget
 
class  Problem
 
struct  projection_error
 
struct  ProjectionError
 Handles projection errors when evaluating a path. More...
 
struct  RelativeMotion
 
class  Roadmap
 
class  SteeringMethod
 
class  StraightPath
 
class  SubchainPath
 
class  TimeParameterization
 
class  ValidationReport
 
class  VisibilityPrmPlanner
 
class  WeighedDistance
 

Typedefs

typedef std::vector< coal::CollisionRequest > CollisionRequests_t
 
typedef constraints::solver::BySubstitution BySubstitution
 
typedef constraints::ComparisonTypes_t ComparisonTypes_t
 
typedef constraints::ComparisonType ComparisonType
 
typedef shared_ptr< BiRRTPlannerBiRRTPlannerPtr_t
 
typedef hpp::pinocchio::Body Body
 
typedef hpp::pinocchio::BodyPtr_t BodyPtr_t
 
typedef shared_ptr< CollisionValidationCollisionValidationPtr_t
 
typedef shared_ptr< CollisionValidationReportCollisionValidationReportPtr_t
 
typedef shared_ptr< AllCollisionsValidationReportAllCollisionsValidationReportPtr_t
 
typedef pinocchio::CollisionObjectPtr_t CollisionObjectPtr_t
 
typedef pinocchio::CollisionObjectConstPtr_t CollisionObjectConstPtr_t
 
typedef pinocchio::CollisionGeometryPtr_t CollisionGeometryPtr_t
 
typedef pinocchio::FclCollisionObject FclCollisionObject
 
typedef FclCollisionObjectFclCollisionObjectPtr_t
 
typedef const FclCollisionObjectFclConstCollisionObjectPtr_t
 
typedef shared_ptr< FclCollisionObjectFclCollisionObjectSharePtr_t
 
typedef pinocchio::Configuration_t Configuration_t
 
typedef pinocchio::ConfigurationIn_t ConfigurationIn_t
 
typedef pinocchio::ConfigurationOut_t ConfigurationOut_t
 
typedef std::vector< Configuration_tConfigurations_t
 
typedef Configurations_t::iterator ConfigIterator_t
 
typedef Configurations_t::const_iterator ConfigConstIterator_t
 
typedef shared_ptr< ConfigurationShooterConfigurationShooterPtr_t
 
typedef shared_ptr< ConfigProjectorConfigProjectorPtr_t
 
typedef shared_ptr< ConfigValidationConfigValidationPtr_t
 
typedef shared_ptr< ConfigValidationsConfigValidationsPtr_t
 
typedef shared_ptr< ConnectedComponentConnectedComponentPtr_t
 
typedef std::set< ConnectedComponentPtr_t, SharedComparatorConnectedComponents_t
 
typedef shared_ptr< ConstraintConstraintPtr_t
 
typedef shared_ptr< ConstraintSetConstraintSetPtr_t
 
typedef shared_ptr< const ConstraintSetConstraintSetConstPtr_t
 
typedef std::vector< ConstraintPtr_tConstraints_t
 
typedef pinocchio::Device Device_t
 
typedef pinocchio::DevicePtr_t DevicePtr_t
 
typedef pinocchio::DeviceWkPtr_t DeviceWkPtr_t
 
typedef pinocchio::CenterOfMassComputationPtr_t CenterOfMassComputationPtr_t
 
typedef std::deque< DevicePtr_tDevices_t
 
typedef constraints::DifferentiableFunction DifferentiableFunction
 
typedef constraints::DifferentiableFunctionPtr_t DifferentiableFunctionPtr_t
 
typedef shared_ptr< DiffusingPlannerDiffusingPlannerPtr_t
 
typedef shared_ptr< DistanceDistancePtr_t
 
typedef shared_ptr< DistanceBetweenObjectsDistanceBetweenObjectsPtr_t
 
typedef pinocchio::DistanceResults_t DistanceResults_t
 
typedef EdgeEdgePtr_t
 
typedef std::list< Edge * > Edges_t
 
typedef shared_ptr< ExtractedPath > ExtractedPathPtr_t
 
typedef shared_ptr< SubchainPathSubchainPathPtr_t
 
typedef pinocchio::JointJacobian_t JointJacobian_t
 
typedef pinocchio::Joint Joint
 
typedef pinocchio::JointConstPtr_t JointConstPtr_t
 
typedef pinocchio::JointPtr_t JointPtr_t
 
typedef shared_ptr< JointBoundValidationJointBoundValidationPtr_t
 
typedef shared_ptr< JointBoundValidationReportJointBoundValidationReportPtr_t
 
typedef pinocchio::HalfJointJacobian_t HalfJointJacobian_t
 
typedef pinocchio::JointVector_t JointVector_t
 
typedef KDTree * KDTreePtr_t
 
typedef constraints::LockedJoint LockedJoint
 
typedef constraints::LockedJointPtr_t LockedJointPtr_t
 
typedef constraints::LockedJointConstPtr_t LockedJointConstPtr_t
 
typedef constraints::LockedJoints_t LockedJoints_t
 
typedef pinocchio::matrix_t matrix_t
 
typedef pinocchio::matrix3_t matrix3_t
 
typedef constraints::matrix6_t matrix6_t
 
typedef pinocchio::vector3_t vector3_t
 
typedef constraints::matrixIn_t matrixIn_t
 
typedef constraints::matrixOut_t matrixOut_t
 
typedef constraints::LiegroupElement LiegroupElement
 
typedef constraints::LiegroupElementRef LiegroupElementRef
 
typedef pinocchio::LiegroupElementConstRef LiegroupElementConstRef
 
typedef constraints::LiegroupSpace LiegroupSpace
 
typedef constraints::LiegroupSpacePtr_t LiegroupSpacePtr_t
 
typedef pinocchio::size_type size_type
 
typedef pinocchio::value_type value_type
 
typedef std::pair< value_type, value_typeinterval_t
 
typedef Eigen::BlockIndex BlockIndex
 Interval of indices as (first index, number of indices) More...
 
typedef constraints::segment_t segment_t
 
typedef constraints::segments_t segments_t
 
typedef NodeNodePtr_t
 
typedef std::list< NodePtr_tNodes_t
 
typedef std::vector< NodePtr_tNodeVector_t
 
typedef pinocchio::ObjectVector_t ObjectVector_t
 
typedef std::vector< CollisionObjectPtr_tObjectStdVector_t
 
typedef std::vector< CollisionObjectConstPtr_tConstObjectStdVector_t
 
typedef shared_ptr< PathPathPtr_t
 
typedef shared_ptr< const PathPathConstPtr_t
 
typedef shared_ptr< TimeParameterizationTimeParameterizationPtr_t
 
typedef shared_ptr< PathOptimizerPathOptimizerPtr_t
 
typedef shared_ptr< PathPlannerPathPlannerPtr_t
 
typedef shared_ptr< ProblemTargetProblemTargetPtr_t
 
typedef shared_ptr< PathVectorPathVectorPtr_t
 
typedef shared_ptr< const PathVectorPathVectorConstPtr_t
 
typedef shared_ptr< PlanAndOptimizePlanAndOptimizePtr_t
 
typedef shared_ptr< ProblemProblemPtr_t
 
typedef shared_ptr< const ProblemProblemConstPtr_t
 
typedef ProblemSolverProblemSolverPtr_t
 
typedef shared_ptr< RoadmapRoadmapPtr_t
 
typedef shared_ptr< StraightPathStraightPathPtr_t
 
typedef shared_ptr< const StraightPathStraightPathConstPtr_t
 
typedef shared_ptr< ReedsSheppPath > ReedsSheppPathPtr_t
 
typedef shared_ptr< const ReedsSheppPath > ReedsSheppPathConstPtr_t
 
typedef shared_ptr< DubinsPathDubinsPathPtr_t
 
typedef shared_ptr< const DubinsPathDubinsPathConstPtr_t
 
typedef shared_ptr< KinodynamicPathKinodynamicPathPtr_t
 
typedef shared_ptr< const KinodynamicPathKinodynamicPathConstPtr_t
 
typedef shared_ptr< KinodynamicOrientedPathKinodynamicOrientedPathPtr_t
 
typedef shared_ptr< const KinodynamicOrientedPathKinodynamicOrientedPathConstPtr_t
 
typedef shared_ptr< InterpolatedPathInterpolatedPathPtr_t
 
typedef shared_ptr< const InterpolatedPathInterpolatedPathConstPtr_t
 
typedef shared_ptr< SteeringMethodSteeringMethodPtr_t
 
typedef std::vector< PathPtr_tPaths_t
 
typedef std::vector< PathVectorPtr_tPathVectors_t
 
typedef pinocchio::Transform3s Transform3s
 
typedef Eigen::Matrix< value_type, 2, 1 > vector2_t
 
typedef pinocchio::vector_t vector_t
 
typedef pinocchio::vectorIn_t vectorIn_t
 
typedef pinocchio::vectorOut_t vectorOut_t
 
typedef Eigen::Matrix< value_type, 1, Eigen::Dynamic > rowvector_t
 
typedef shared_ptr< VisibilityPrmPlannerVisibilityPrmPlannerPtr_t
 
typedef shared_ptr< ValidationReportValidationReportPtr_t
 
typedef shared_ptr< WeighedDistanceWeighedDistancePtr_t
 
typedef shared_ptr< KinodynamicDistanceKinodynamicDistancePtr_t
 
typedef std::map< std::string, constraints::ImplicitPtr_t > NumericalConstraintMap_t
 
typedef std::map< std::string, ComparisonTypes_tComparisonTypeMap_t
 
typedef std::map< std::string, segments_tsegmentsMap_t
 
typedef constraints::NumericalConstraints_t NumericalConstraints_t
 
typedef std::map< std::string, CenterOfMassComputationPtr_tCenterOfMassComputationMap_t
 
typedef CollisionPair CollisionPair_t
 
typedef std::vector< CollisionPair_tCollisionPairs_t
 
typedef shared_ptr< ContinuousValidationContinuousValidationPtr_t
 
typedef NearestNeighborNearestNeighborPtr_t
 
typedef shared_ptr< PathValidationPathValidationPtr_t
 
typedef shared_ptr< PathValidationsPathValidationsPtr_t
 
typedef shared_ptr< PathValidationReportPathValidationReportPtr_t
 
typedef shared_ptr< CollisionPathValidationReportCollisionPathValidationReportPtr_t
 
typedef std::vector< CollisionPathValidationReportCollisionPathValidationReports_t
 
typedef shared_ptr< PathProjectorPathProjectorPtr_t
 
typedef constraints::Shape_t Shape_t
 
typedef constraints::JointAndShape_t JointAndShape_t
 
typedef constraints::JointAndShapes_t JointAndShapes_t
 
typedef std::function< DevicePtr_t(const std::string &)> RobotBuilder_t
 
typedef std::function< PathOptimizerPtr_t(const ProblemConstPtr_t &)> PathOptimizerBuilder_t
 
typedef std::function< PathPlannerPtr_t(const ProblemConstPtr_t &, const RoadmapPtr_t &)> PathPlannerBuilder_t
 
typedef std::function< PathValidationPtr_t(const DevicePtr_t &, const value_type &)> PathValidationBuilder_t
 
typedef std::function< ConfigValidationPtr_t(const DevicePtr_t &)> ConfigValidationBuilder_t
 
typedef std::function< PathProjectorPtr_t(const ProblemConstPtr_t &, const value_type &)> PathProjectorBuilder_t
 
typedef std::function< ConfigurationShooterPtr_t(const ProblemConstPtr_t &)> ConfigurationShooterBuilder_t
 
typedef std::function< DistancePtr_t(const ProblemConstPtr_t &)> DistanceBuilder_t
 
typedef std::function< SteeringMethodPtr_t(const ProblemConstPtr_t &)> SteeringMethodBuilder_t
 
typedef std::vector< std::pair< std::string, CollisionObjectPtr_t > > AffordanceObjects_t
 
typedef vector3_t AffordanceConfig_t
 

Functions

std::ostream & operator<< (std::ostream &os, const Constraint &constraint)
 
template<>
void ContinuousValidation::add< ContinuousValidation::AddObstacle > (const ContinuousValidation::AddObstacle &delegate)
 
template<>
void ContinuousValidation::reset< ContinuousValidation::AddObstacle > ()
 
template<>
void ContinuousValidation::add< ContinuousValidation::Initialize > (const ContinuousValidation::Initialize &delegate)
 
template<>
void ContinuousValidation::reset< ContinuousValidation::Initialize > ()
 
 HPP_PREDEF_CLASS (BiRRTPlanner)
 
 HPP_PREDEF_CLASS (CollisionValidation)
 
 HPP_PREDEF_CLASS (CollisionValidationReport)
 
 HPP_PREDEF_CLASS (AllCollisionsValidationReport)
 
 HPP_PREDEF_CLASS (ConfigurationShooter)
 
 HPP_PREDEF_CLASS (ConfigProjector)
 
 HPP_PREDEF_CLASS (ConfigValidation)
 
 HPP_PREDEF_CLASS (ConfigValidations)
 
 HPP_PREDEF_CLASS (ConnectedComponent)
 
 HPP_PREDEF_CLASS (Constraint)
 
 HPP_PREDEF_CLASS (ConstraintSet)
 
 HPP_PREDEF_CLASS (DiffusingPlanner)
 
 HPP_PREDEF_CLASS (Distance)
 
 HPP_PREDEF_CLASS (DistanceBetweenObjects)
 
 HPP_PREDEF_CLASS (ExtractedPath)
 
 HPP_PREDEF_CLASS (SubchainPath)
 
 HPP_PREDEF_CLASS (JointBoundValidation)
 
 HPP_PREDEF_CLASS (Path)
 
 HPP_PREDEF_CLASS (TimeParameterization)
 
 HPP_PREDEF_CLASS (PathOptimizer)
 
 HPP_PREDEF_CLASS (PathPlanner)
 
 HPP_PREDEF_CLASS (ProblemTarget)
 
 HPP_PREDEF_CLASS (PathVector)
 
 HPP_PREDEF_CLASS (PlanAndOptimize)
 
 HPP_PREDEF_CLASS (Problem)
 
 HPP_PREDEF_CLASS (Roadmap)
 
 HPP_PREDEF_CLASS (SteeringMethod)
 
 HPP_PREDEF_CLASS (StraightPath)
 
 HPP_PREDEF_CLASS (InterpolatedPath)
 
 HPP_PREDEF_CLASS (DubinsPath)
 
 HPP_PREDEF_CLASS (ReedsSheppPath)
 
 HPP_PREDEF_CLASS (KinodynamicPath)
 
 HPP_PREDEF_CLASS (KinodynamicOrientedPath)
 
 HPP_PREDEF_CLASS (ValidationReport)
 
 HPP_PREDEF_CLASS (VisibilityPrmPlanner)
 
 HPP_PREDEF_CLASS (WeighedDistance)
 
 HPP_PREDEF_CLASS (KinodynamicDistance)
 
 HPP_PREDEF_CLASS (ContinuousValidation)
 
 HPP_PREDEF_CLASS (PathValidations)
 
 HPP_PREDEF_CLASS (PathValidation)
 
 HPP_PREDEF_CLASS (PathProjector)
 
std::ostream & operator<< (std::ostream &os, const Node &n)
 
std::ostream & operator<< (std::ostream &os, const Path &path)
 
std::ostream & operator<< (std::ostream &os, const Roadmap &r)
 
std::ostream & operator<< (std::ostream &os, const ValidationReport &report)
 

Typedef Documentation

◆ AffordanceConfig_t

◆ AffordanceObjects_t

typedef std::vector<std::pair<std::string, CollisionObjectPtr_t> > hpp::core::AffordanceObjects_t

◆ AllCollisionsValidationReportPtr_t

◆ BiRRTPlannerPtr_t

◆ BlockIndex

typedef Eigen::BlockIndex hpp::core::BlockIndex

Interval of indices as (first index, number of indices)

◆ Body

typedef hpp::pinocchio::Body hpp::core::Body

◆ BodyPtr_t

typedef hpp::pinocchio::BodyPtr_t hpp::core::BodyPtr_t

◆ BySubstitution

typedef constraints::solver::BySubstitution hpp::core::BySubstitution

◆ CenterOfMassComputationMap_t

◆ CenterOfMassComputationPtr_t

typedef pinocchio::CenterOfMassComputationPtr_t hpp::core::CenterOfMassComputationPtr_t

◆ CollisionGeometryPtr_t

typedef pinocchio::CollisionGeometryPtr_t hpp::core::CollisionGeometryPtr_t

◆ CollisionObjectConstPtr_t

typedef pinocchio::CollisionObjectConstPtr_t hpp::core::CollisionObjectConstPtr_t

◆ CollisionObjectPtr_t

typedef pinocchio::CollisionObjectPtr_t hpp::core::CollisionObjectPtr_t

◆ CollisionPair_t

◆ CollisionPairs_t

◆ CollisionPathValidationReportPtr_t

◆ CollisionPathValidationReports_t

◆ CollisionRequests_t

typedef std::vector<coal::CollisionRequest> hpp::core::CollisionRequests_t

◆ CollisionValidationPtr_t

◆ CollisionValidationReportPtr_t

◆ ComparisonType

typedef constraints::ComparisonType hpp::core::ComparisonType

◆ ComparisonTypeMap_t

typedef std::map<std::string, ComparisonTypes_t> hpp::core::ComparisonTypeMap_t

◆ ComparisonTypes_t

typedef constraints::ComparisonTypes_t hpp::core::ComparisonTypes_t

◆ ConfigConstIterator_t

typedef Configurations_t::const_iterator hpp::core::ConfigConstIterator_t

◆ ConfigIterator_t

typedef Configurations_t::iterator hpp::core::ConfigIterator_t

◆ ConfigProjectorPtr_t

◆ Configuration_t

typedef pinocchio::Configuration_t hpp::core::Configuration_t

◆ ConfigurationIn_t

typedef pinocchio::ConfigurationIn_t hpp::core::ConfigurationIn_t

◆ ConfigurationOut_t

typedef pinocchio::ConfigurationOut_t hpp::core::ConfigurationOut_t

◆ Configurations_t

◆ ConfigurationShooterBuilder_t

◆ ConfigurationShooterPtr_t

◆ ConfigValidationBuilder_t

◆ ConfigValidationPtr_t

◆ ConfigValidationsPtr_t

◆ ConnectedComponentPtr_t

◆ ConnectedComponents_t

◆ ConstObjectStdVector_t

◆ ConstraintPtr_t

◆ Constraints_t

◆ ConstraintSetConstPtr_t

◆ ConstraintSetPtr_t

◆ ContinuousValidationPtr_t

◆ Device_t

typedef pinocchio::Device hpp::core::Device_t

◆ DevicePtr_t

typedef pinocchio::DevicePtr_t hpp::core::DevicePtr_t

◆ Devices_t

typedef std::deque<DevicePtr_t> hpp::core::Devices_t

◆ DeviceWkPtr_t

typedef pinocchio::DeviceWkPtr_t hpp::core::DeviceWkPtr_t

◆ DifferentiableFunction

typedef constraints::DifferentiableFunction hpp::core::DifferentiableFunction

◆ DifferentiableFunctionPtr_t

typedef constraints::DifferentiableFunctionPtr_t hpp::core::DifferentiableFunctionPtr_t

◆ DiffusingPlannerPtr_t

◆ DistanceBetweenObjectsPtr_t

◆ DistanceBuilder_t

◆ DistancePtr_t

typedef shared_ptr<Distance> hpp::core::DistancePtr_t

◆ DistanceResults_t

typedef pinocchio::DistanceResults_t hpp::core::DistanceResults_t

◆ DubinsPathConstPtr_t

typedef shared_ptr<const DubinsPath> hpp::core::DubinsPathConstPtr_t

◆ DubinsPathPtr_t

◆ EdgePtr_t

◆ Edges_t

typedef std::list<Edge*> hpp::core::Edges_t

◆ ExtractedPathPtr_t

typedef shared_ptr<ExtractedPath> hpp::core::ExtractedPathPtr_t

◆ FclCollisionObject

typedef pinocchio::FclCollisionObject hpp::core::FclCollisionObject

◆ FclCollisionObjectPtr_t

◆ FclCollisionObjectSharePtr_t

◆ FclConstCollisionObjectPtr_t

◆ HalfJointJacobian_t

typedef pinocchio::HalfJointJacobian_t hpp::core::HalfJointJacobian_t

◆ InterpolatedPathConstPtr_t

◆ InterpolatedPathPtr_t

◆ interval_t

◆ Joint

typedef pinocchio::Joint hpp::core::Joint

◆ JointAndShape_t

typedef constraints::JointAndShape_t hpp::core::JointAndShape_t

◆ JointAndShapes_t

typedef constraints::JointAndShapes_t hpp::core::JointAndShapes_t

◆ JointBoundValidationPtr_t

◆ JointBoundValidationReportPtr_t

◆ JointConstPtr_t

typedef pinocchio::JointConstPtr_t hpp::core::JointConstPtr_t

◆ JointJacobian_t

typedef pinocchio::JointJacobian_t hpp::core::JointJacobian_t

◆ JointPtr_t

typedef pinocchio::JointPtr_t hpp::core::JointPtr_t

◆ JointVector_t

typedef pinocchio::JointVector_t hpp::core::JointVector_t

◆ KDTreePtr_t

typedef KDTree* hpp::core::KDTreePtr_t

◆ KinodynamicDistancePtr_t

◆ KinodynamicOrientedPathConstPtr_t

◆ KinodynamicOrientedPathPtr_t

◆ KinodynamicPathConstPtr_t

◆ KinodynamicPathPtr_t

◆ LiegroupElement

typedef constraints::LiegroupElement hpp::core::LiegroupElement

◆ LiegroupElementConstRef

typedef pinocchio::LiegroupElementConstRef hpp::core::LiegroupElementConstRef

◆ LiegroupElementRef

typedef constraints::LiegroupElementRef hpp::core::LiegroupElementRef

◆ LiegroupSpace

typedef constraints::LiegroupSpace hpp::core::LiegroupSpace

◆ LiegroupSpacePtr_t

typedef constraints::LiegroupSpacePtr_t hpp::core::LiegroupSpacePtr_t

◆ LockedJoint

typedef constraints::LockedJoint hpp::core::LockedJoint

◆ LockedJointConstPtr_t

typedef constraints::LockedJointConstPtr_t hpp::core::LockedJointConstPtr_t

◆ LockedJointPtr_t

typedef constraints::LockedJointPtr_t hpp::core::LockedJointPtr_t

◆ LockedJoints_t

typedef constraints::LockedJoints_t hpp::core::LockedJoints_t

◆ matrix3_t

typedef pinocchio::matrix3_t hpp::core::matrix3_t

◆ matrix6_t

typedef constraints::matrix6_t hpp::core::matrix6_t

◆ matrix_t

typedef pinocchio::matrix_t hpp::core::matrix_t

◆ matrixIn_t

typedef constraints::matrixIn_t hpp::core::matrixIn_t

◆ matrixOut_t

typedef constraints::matrixOut_t hpp::core::matrixOut_t

◆ NearestNeighborPtr_t

◆ NodePtr_t

◆ Nodes_t

typedef std::list<NodePtr_t> hpp::core::Nodes_t

◆ NodeVector_t

typedef std::vector<NodePtr_t> hpp::core::NodeVector_t

◆ NumericalConstraintMap_t

typedef std::map<std::string, constraints::ImplicitPtr_t> hpp::core::NumericalConstraintMap_t

◆ NumericalConstraints_t

typedef constraints::NumericalConstraints_t hpp::core::NumericalConstraints_t

◆ ObjectStdVector_t

◆ ObjectVector_t

typedef pinocchio::ObjectVector_t hpp::core::ObjectVector_t

◆ PathConstPtr_t

typedef shared_ptr<const Path> hpp::core::PathConstPtr_t

◆ PathOptimizerBuilder_t

◆ PathOptimizerPtr_t

◆ PathPlannerBuilder_t

◆ PathPlannerPtr_t

◆ PathProjectorBuilder_t

◆ PathProjectorPtr_t

◆ PathPtr_t

typedef shared_ptr<Path> hpp::core::PathPtr_t

◆ Paths_t

typedef std::vector<PathPtr_t> hpp::core::Paths_t

◆ PathValidationBuilder_t

◆ PathValidationPtr_t

◆ PathValidationReportPtr_t

◆ PathValidationsPtr_t

◆ PathVectorConstPtr_t

typedef shared_ptr<const PathVector> hpp::core::PathVectorConstPtr_t

◆ PathVectorPtr_t

◆ PathVectors_t

typedef std::vector< PathVectorPtr_t > hpp::core::PathVectors_t

◆ PlanAndOptimizePtr_t

◆ ProblemConstPtr_t

typedef shared_ptr<const Problem> hpp::core::ProblemConstPtr_t

◆ ProblemPtr_t

typedef shared_ptr<Problem> hpp::core::ProblemPtr_t

◆ ProblemSolverPtr_t

◆ ProblemTargetPtr_t

◆ ReedsSheppPathConstPtr_t

typedef shared_ptr<const ReedsSheppPath> hpp::core::ReedsSheppPathConstPtr_t

◆ ReedsSheppPathPtr_t

typedef shared_ptr<ReedsSheppPath> hpp::core::ReedsSheppPathPtr_t

◆ RoadmapPtr_t

typedef shared_ptr<Roadmap> hpp::core::RoadmapPtr_t

◆ RobotBuilder_t

typedef std::function<DevicePtr_t(const std::string&)> hpp::core::RobotBuilder_t

◆ rowvector_t

typedef Eigen::Matrix<value_type, 1, Eigen::Dynamic> hpp::core::rowvector_t

◆ segment_t

typedef constraints::segment_t hpp::core::segment_t

◆ segments_t

typedef constraints::segments_t hpp::core::segments_t

◆ segmentsMap_t

typedef std::map<std::string, segments_t> hpp::core::segmentsMap_t

◆ Shape_t

typedef constraints::Shape_t hpp::core::Shape_t

Plane polygon represented by its vertices Used to model contact surfaces for manipulation applications

◆ size_type

typedef pinocchio::size_type hpp::core::size_type

◆ SteeringMethodBuilder_t

◆ SteeringMethodPtr_t

◆ StraightPathConstPtr_t

◆ StraightPathPtr_t

◆ SubchainPathPtr_t

◆ TimeParameterizationPtr_t

◆ Transform3s

typedef pinocchio::Transform3s hpp::core::Transform3s

◆ ValidationReportPtr_t

◆ value_type

typedef pinocchio::value_type hpp::core::value_type

◆ vector2_t

typedef Eigen::Matrix<value_type, 2, 1> hpp::core::vector2_t

◆ vector3_t

typedef pinocchio::vector3_t hpp::core::vector3_t

◆ vector_t

typedef pinocchio::vector_t hpp::core::vector_t

◆ vectorIn_t

typedef pinocchio::vectorIn_t hpp::core::vectorIn_t

◆ vectorOut_t

typedef pinocchio::vectorOut_t hpp::core::vectorOut_t

◆ VisibilityPrmPlannerPtr_t

◆ WeighedDistancePtr_t

Function Documentation

◆ ContinuousValidation::add< ContinuousValidation::AddObstacle >()

◆ ContinuousValidation::add< ContinuousValidation::Initialize >()

◆ ContinuousValidation::reset< ContinuousValidation::AddObstacle >()

◆ ContinuousValidation::reset< ContinuousValidation::Initialize >()

◆ HPP_PREDEF_CLASS() [1/41]

hpp::core::HPP_PREDEF_CLASS ( AllCollisionsValidationReport  )

◆ HPP_PREDEF_CLASS() [2/41]

hpp::core::HPP_PREDEF_CLASS ( BiRRTPlanner  )

◆ HPP_PREDEF_CLASS() [3/41]

hpp::core::HPP_PREDEF_CLASS ( CollisionValidation  )

◆ HPP_PREDEF_CLASS() [4/41]

hpp::core::HPP_PREDEF_CLASS ( CollisionValidationReport  )

◆ HPP_PREDEF_CLASS() [5/41]

hpp::core::HPP_PREDEF_CLASS ( ConfigProjector  )

◆ HPP_PREDEF_CLASS() [6/41]

hpp::core::HPP_PREDEF_CLASS ( ConfigurationShooter  )

◆ HPP_PREDEF_CLASS() [7/41]

hpp::core::HPP_PREDEF_CLASS ( ConfigValidation  )

◆ HPP_PREDEF_CLASS() [8/41]

hpp::core::HPP_PREDEF_CLASS ( ConfigValidations  )

◆ HPP_PREDEF_CLASS() [9/41]

hpp::core::HPP_PREDEF_CLASS ( ConnectedComponent  )

◆ HPP_PREDEF_CLASS() [10/41]

hpp::core::HPP_PREDEF_CLASS ( Constraint  )

◆ HPP_PREDEF_CLASS() [11/41]

hpp::core::HPP_PREDEF_CLASS ( ConstraintSet  )

◆ HPP_PREDEF_CLASS() [12/41]

hpp::core::HPP_PREDEF_CLASS ( ContinuousValidation  )

◆ HPP_PREDEF_CLASS() [13/41]

hpp::core::HPP_PREDEF_CLASS ( DiffusingPlanner  )

◆ HPP_PREDEF_CLASS() [14/41]

hpp::core::HPP_PREDEF_CLASS ( Distance  )

◆ HPP_PREDEF_CLASS() [15/41]

hpp::core::HPP_PREDEF_CLASS ( DistanceBetweenObjects  )

◆ HPP_PREDEF_CLASS() [16/41]

hpp::core::HPP_PREDEF_CLASS ( DubinsPath  )

◆ HPP_PREDEF_CLASS() [17/41]

hpp::core::HPP_PREDEF_CLASS ( ExtractedPath  )

◆ HPP_PREDEF_CLASS() [18/41]

hpp::core::HPP_PREDEF_CLASS ( InterpolatedPath  )

◆ HPP_PREDEF_CLASS() [19/41]

hpp::core::HPP_PREDEF_CLASS ( JointBoundValidation  )

◆ HPP_PREDEF_CLASS() [20/41]

hpp::core::HPP_PREDEF_CLASS ( KinodynamicDistance  )

◆ HPP_PREDEF_CLASS() [21/41]

hpp::core::HPP_PREDEF_CLASS ( KinodynamicOrientedPath  )

◆ HPP_PREDEF_CLASS() [22/41]

hpp::core::HPP_PREDEF_CLASS ( KinodynamicPath  )

◆ HPP_PREDEF_CLASS() [23/41]

hpp::core::HPP_PREDEF_CLASS ( Path  )

◆ HPP_PREDEF_CLASS() [24/41]

hpp::core::HPP_PREDEF_CLASS ( PathOptimizer  )

◆ HPP_PREDEF_CLASS() [25/41]

hpp::core::HPP_PREDEF_CLASS ( PathPlanner  )

◆ HPP_PREDEF_CLASS() [26/41]

hpp::core::HPP_PREDEF_CLASS ( PathProjector  )

◆ HPP_PREDEF_CLASS() [27/41]

hpp::core::HPP_PREDEF_CLASS ( PathValidation  )

◆ HPP_PREDEF_CLASS() [28/41]

hpp::core::HPP_PREDEF_CLASS ( PathValidations  )

◆ HPP_PREDEF_CLASS() [29/41]

hpp::core::HPP_PREDEF_CLASS ( PathVector  )

◆ HPP_PREDEF_CLASS() [30/41]

hpp::core::HPP_PREDEF_CLASS ( PlanAndOptimize  )

◆ HPP_PREDEF_CLASS() [31/41]

hpp::core::HPP_PREDEF_CLASS ( Problem  )

◆ HPP_PREDEF_CLASS() [32/41]

hpp::core::HPP_PREDEF_CLASS ( ProblemTarget  )

◆ HPP_PREDEF_CLASS() [33/41]

hpp::core::HPP_PREDEF_CLASS ( ReedsSheppPath  )

◆ HPP_PREDEF_CLASS() [34/41]

hpp::core::HPP_PREDEF_CLASS ( Roadmap  )

◆ HPP_PREDEF_CLASS() [35/41]

hpp::core::HPP_PREDEF_CLASS ( SteeringMethod  )

◆ HPP_PREDEF_CLASS() [36/41]

hpp::core::HPP_PREDEF_CLASS ( StraightPath  )

◆ HPP_PREDEF_CLASS() [37/41]

hpp::core::HPP_PREDEF_CLASS ( SubchainPath  )

◆ HPP_PREDEF_CLASS() [38/41]

hpp::core::HPP_PREDEF_CLASS ( TimeParameterization  )

◆ HPP_PREDEF_CLASS() [39/41]

hpp::core::HPP_PREDEF_CLASS ( ValidationReport  )

◆ HPP_PREDEF_CLASS() [40/41]

hpp::core::HPP_PREDEF_CLASS ( VisibilityPrmPlanner  )

◆ HPP_PREDEF_CLASS() [41/41]

hpp::core::HPP_PREDEF_CLASS ( WeighedDistance  )