hpp-core  4.9.0
Implement basic classes for canonical path planning for kinematic chains.
hpp::core::ProblemSolver Member List

This is the complete list of members for hpp::core::ProblemSolver, including all inherited members.

addConfigToRoadmap(const ConfigurationPtr_t &config)hpp::core::ProblemSolver
addConfigValidation(const std::string &type)hpp::core::ProblemSolvervirtual
addConfigValidationBuilder(const std::string &type, const ConfigValidationBuilder_t &builder)hpp::core::ProblemSolver
addConstraint(const ConstraintPtr_t &constraint)hpp::core::ProblemSolver
addEdgeToRoadmap(const ConfigurationPtr_t &config1, const ConfigurationPtr_t &config2, const PathPtr_t &path)hpp::core::ProblemSolver
addGoalConfig(const ConfigurationPtr_t &config)hpp::core::ProblemSolvervirtual
addLockedJointToConfigProjector(const std::string &configProjName, const std::string &lockedJointName) HPP_CORE_DEPRECATEDhpp::core::ProblemSolvervirtual
addNumericalConstraint(const std::string &name, const constraints::ImplicitPtr_t &constraint)hpp::core::ProblemSolverinline
addNumericalConstraintToConfigProjector(const std::string &configProjName, const std::string &constraintName, const std::size_t priority=0)hpp::core::ProblemSolvervirtual
addObstacle(const DevicePtr_t &device, bool collision, bool distance)hpp::core::ProblemSolvervirtual
addObstacle(const CollisionObjectPtr_t &inObject, bool collision, bool distance)hpp::core::ProblemSolvervirtual
addObstacle(const std::string &name, FclCollisionObject &inObject, bool collision, bool distance)hpp::core::ProblemSolvervirtual
addPath(const PathVectorPtr_t &path)hpp::core::ProblemSolverinline
addPathOptimizer(const std::string &type)hpp::core::ProblemSolver
affordanceConfigshpp::core::ProblemSolver
affordanceObjectshpp::core::ProblemSolver
centerOfMassComputationshpp::core::ProblemSolver
clearConfigValidations()hpp::core::ProblemSolver
clearPathOptimizers()hpp::core::ProblemSolver
collisionObstacles() consthpp::core::ProblemSolver
comparisonType(const std::string &name, const ComparisonTypes_t types)hpp::core::ProblemSolver
comparisonType(const std::string &name, const ComparisonType &type)hpp::core::ProblemSolver
comparisonType(const std::string &name) consthpp::core::ProblemSolver
computeValueAndJacobian(const Configuration_t &configuration, vector_t &value, matrix_t &jacobian) consthpp::core::ProblemSolver
configurationShootershpp::core::ProblemSolver
configurationShooterType(const std::string &type)hpp::core::ProblemSolver
configurationShooterType() consthpp::core::ProblemSolverinline
configValidationshpp::core::ProblemSolver
configValidationTypes()hpp::core::ProblemSolverinline
ConfigValidationTypes_t typedefhpp::core::ProblemSolver
constraints() consthpp::core::ProblemSolverinline
constraints_hpp::core::ProblemSolverprotected
create()hpp::core::ProblemSolverstatic
createPathOptimizers()hpp::core::ProblemSolver
createRobot(const std::string &name)hpp::core::ProblemSolver
cutObstacle(const std::string &name, const fcl::AABB &aabb)hpp::core::ProblemSolver
directPath(ConfigurationIn_t start, ConfigurationIn_t end, bool validate, std::size_t &pathId, std::string &report)hpp::core::ProblemSolver
distanceBetweenObjects() consthpp::core::ProblemSolverinline
distanceObstacles() consthpp::core::ProblemSolver
distanceshpp::core::ProblemSolver
distanceType(const std::string &type)hpp::core::ProblemSolver
distanceType() consthpp::core::ProblemSolverinline
erasePath(std::size_t pathId)hpp::core::ProblemSolverinline
errorThreshold(const value_type &threshold)hpp::core::ProblemSolver
errorThreshold() consthpp::core::ProblemSolverinline
executeOneStep()hpp::core::ProblemSolvervirtual
filterCollisionPairs()hpp::core::ProblemSolver
finishSolveStepByStep()hpp::core::ProblemSolvervirtual
getTimeOutPathPlanning()hpp::core::ProblemSolverinline
goalConfigs() consthpp::core::ProblemSolver
initConfig() consthpp::core::ProblemSolverinline
initConfig(const ConfigurationPtr_t &config)hpp::core::ProblemSolvervirtual
initConfigValidation()hpp::core::ProblemSolver
initDistance()hpp::core::ProblemSolver
initializeProblem(ProblemPtr_t problem)hpp::core::ProblemSolverprotectedvirtual
initPathProjector()hpp::core::ProblemSolver
initPathValidation()hpp::core::ProblemSolver
initProblemTarget()hpp::core::ProblemSolvervirtual
initSteeringMethod()hpp::core::ProblemSolver
initValidations()hpp::core::ProblemSolver
interrupt()hpp::core::ProblemSolver
jointAndShapeshpp::core::ProblemSolver
lockedJointshpp::core::ProblemSolver
maxIterPathPlanning(size_type iterations)hpp::core::ProblemSolver
maxIterPathPlanning() consthpp::core::ProblemSolverinline
maxIterProjection(size_type iterations)hpp::core::ProblemSolver
maxIterProjection() consthpp::core::ProblemSolverinline
numericalConstraint(const std::string &name)hpp::core::ProblemSolverinline
numericalConstraintshpp::core::ProblemSolver
obstacle(const std::string &name) consthpp::core::ProblemSolver
obstacleFramePosition(const std::string &name) consthpp::core::ProblemSolver
obstacleGeomData() consthpp::core::ProblemSolverinline
obstacleGeomModel() consthpp::core::ProblemSolverinline
obstacleNames(bool collision, bool distance) consthpp::core::ProblemSolver
optimizePath(PathVectorPtr_t path)hpp::core::ProblemSolver
passiveDofshpp::core::ProblemSolver
pathOptimizer(std::size_t rank) consthpp::core::ProblemSolverinline
pathOptimizershpp::core::ProblemSolver
PathOptimizers_t typedefhpp::core::ProblemSolver
pathOptimizerTypes() consthpp::core::ProblemSolverinline
PathOptimizerTypes_t typedefhpp::core::ProblemSolver
pathPlanner() consthpp::core::ProblemSolverinline
pathPlanner_hpp::core::ProblemSolverprotected
pathPlannershpp::core::ProblemSolver
pathPlannerType(const std::string &type)hpp::core::ProblemSolvervirtual
pathPlannerType() consthpp::core::ProblemSolverinline
pathPlannerType_hpp::core::ProblemSolverprotected
pathProjectorshpp::core::ProblemSolver
pathProjectorTolerance_hpp::core::ProblemSolverprotected
pathProjectorType(const std::string &type, const value_type &step)hpp::core::ProblemSolver
pathProjectorType(value_type &tolerance) consthpp::core::ProblemSolverinline
pathProjectorType_hpp::core::ProblemSolverprotected
paths() consthpp::core::ProblemSolverinline
paths_hpp::core::ProblemSolverprotected
pathValidationshpp::core::ProblemSolver
pathValidationType(const std::string &type, const value_type &tolerance)hpp::core::ProblemSolvervirtual
pathValidationType(value_type &tolerance) consthpp::core::ProblemSolverinline
prepareSolveStepByStep()hpp::core::ProblemSolvervirtual
problem()hpp::core::ProblemSolverinline
problem(ProblemPtr_t problem)hpp::core::ProblemSolverprotected
problem_hpp::core::ProblemSolverprotected
ProblemSolver()hpp::core::ProblemSolverprotected
removeObstacle(const std::string &name)hpp::core::ProblemSolvervirtual
removeObstacleFromJoint(const std::string &jointName, const std::string &obstacleName)hpp::core::ProblemSolver
resetConstraints()hpp::core::ProblemSolvervirtual
resetGoalConfigs()hpp::core::ProblemSolver
resetProblem()hpp::core::ProblemSolvervirtual
resetRoadmap()hpp::core::ProblemSolvervirtual
roadmap() consthpp::core::ProblemSolverinline
roadmap(const RoadmapPtr_t &roadmap)hpp::core::ProblemSolverinline
roadmap_hpp::core::ProblemSolverprotected
robot(const DevicePtr_t &robot)hpp::core::ProblemSolvervirtual
robot() consthpp::core::ProblemSolver
robot_hpp::core::ProblemSolverprotected
robotshpp::core::ProblemSolver
robotType(const std::string &type)hpp::core::ProblemSolver
robotType() consthpp::core::ProblemSolver
setTimeOutPathPlanning(double timeOut)hpp::core::ProblemSolverinline
solve()hpp::core::ProblemSolvervirtual
steeringMethodshpp::core::ProblemSolver
steeringMethodType(const std::string &type)hpp::core::ProblemSolver
steeringMethodType() consthpp::core::ProblemSolverinline
target_hpp::core::ProblemSolverprotected
~ProblemSolver()hpp::core::ProblemSolvervirtual