chomp_motion_planner
C++ API
Class Hierarchy
File Hierarchy
Full C++ API
Namespaces
Namespace chomp
Classes and Structs
Class ChompCost
Class ChompOptimizer
Class ChompParameters
Class ChompPlanner
Class ChompTrajectory
Class MultivariateGaussian
Functions
Function chomp::normalizeAngle
Function chomp::normalizeAnglePositive
Function chomp::robotStateToArray
Function chomp::shortestAngularDistance
Variables
Variable chomp::DIFF_RULE_LENGTH
Variable chomp::DIFF_RULES
Directories
Directory include
Directory chomp_motion_planner
Files
File chomp_cost.h
File chomp_optimizer.h
File chomp_parameters.h
File chomp_planner.h
File chomp_trajectory.h
File chomp_utils.h
File multivariate_gaussian.h
Standard Documents
CHANGELOG
Changelog for package chomp_motion_planner
2.11.0 (2024-09-16)
2.10.0 (2024-06-13)
2.9.0 (2024-01-09)
2.8.0 (2023-09-10)
2.7.4 (2023-05-18)
2.7.3 (2023-04-24)
2.7.2 (2023-04-18)
2.7.1 (2023-03-23)
2.7.0 (2023-01-29)
2.6.0 (2022-11-10)
2.5.3 (2022-07-28)
2.5.2 (2022-07-18)
2.5.1 (2022-05-31)
2.5.0 (2022-05-26)
2.4.0 (2022-01-20)
2.3.2 (2021-12-29)
2.3.1 (2021-12-23)
1.1.1 (2020-10-13)
1.1.0 (2020-09-04)
1.0.6 (2020-08-19)
1.0.5 (2020-07-08)
1.0.4 (2020-05-30)
1.0.3 (2020-04-26)
1.0.2 (2019-06-28)
1.0.1 (2019-03-08)
1.0.0 (2019-02-24)
0.10.8 (2018-12-24)
0.10.7 (2018-12-13)
0.10.6 (2018-12-09)
0.10.5 (2018-11-01)
0.10.4 (2018-10-29)
0.10.3 (2018-10-29)
0.10.2 (2018-10-24)
0.10.1 (2018-05-25)
0.9.11 (2017-12-25)
0.9.10 (2017-12-09)
0.9.9 (2017-08-06)
0.9.8 (2017-06-21)
0.9.7 (2017-06-05)
0.9.6 (2017-04-12)
0.9.5 (2017-03-08)
0.9.4 (2017-02-06)
0.9.3 (2016-11-16)
0.9.2 (2016-11-05)
0.9.0 (2016-10-19)
0.8.3 (2016-08-21)
PACKAGE
Index
chomp_motion_planner
Index
Index
C
C
chomp::ChompCost (C++ class)
chomp::ChompCost::ChompCost (C++ function)
chomp::ChompCost::getCost (C++ function)
chomp::ChompCost::getDerivative (C++ function)
chomp::ChompCost::getMaxQuadCostInvValue (C++ function)
chomp::ChompCost::getQuadraticCost (C++ function)
chomp::ChompCost::getQuadraticCostInverse (C++ function)
chomp::ChompCost::scale (C++ function)
chomp::ChompCost::~ChompCost (C++ function)
chomp::ChompOptimizer (C++ class)
chomp::ChompOptimizer::ChompOptimizer (C++ function)
chomp::ChompOptimizer::destroy (C++ function)
chomp::ChompOptimizer::isCollisionFree (C++ function)
chomp::ChompOptimizer::isInitialized (C++ function)
chomp::ChompOptimizer::optimize (C++ function)
chomp::ChompOptimizer::~ChompOptimizer (C++ function)
chomp::ChompParameters (C++ class)
chomp::ChompParameters::ChompParameters (C++ function)
chomp::ChompParameters::collision_threshold_ (C++ member)
chomp::ChompParameters::enable_failure_recovery_ (C++ member)
chomp::ChompParameters::filter_mode_ (C++ member)
chomp::ChompParameters::joint_update_limit_ (C++ member)
chomp::ChompParameters::learning_rate_ (C++ member)
chomp::ChompParameters::max_iterations_ (C++ member)
chomp::ChompParameters::max_iterations_after_collision_free_ (C++ member)
chomp::ChompParameters::max_recovery_attempts_ (C++ member)
chomp::ChompParameters::min_clearance_ (C++ member)
chomp::ChompParameters::obstacle_cost_weight_ (C++ member)
chomp::ChompParameters::planning_time_limit_ (C++ member)
chomp::ChompParameters::pseudo_inverse_ridge_factor_ (C++ member)
chomp::ChompParameters::ridge_factor_ (C++ member)
chomp::ChompParameters::setRecoveryParams (C++ function)
chomp::ChompParameters::setTrajectoryInitializationMethod (C++ function)
chomp::ChompParameters::smoothness_cost_acceleration_ (C++ member)
chomp::ChompParameters::smoothness_cost_jerk_ (C++ member)
chomp::ChompParameters::smoothness_cost_velocity_ (C++ member)
chomp::ChompParameters::smoothness_cost_weight_ (C++ member)
chomp::ChompParameters::trajectory_initialization_method_ (C++ member)
chomp::ChompParameters::use_pseudo_inverse_ (C++ member)
chomp::ChompParameters::use_stochastic_descent_ (C++ member)
chomp::ChompParameters::VALID_INITIALIZATION_METHODS (C++ member)
chomp::ChompParameters::~ChompParameters (C++ function)
chomp::ChompPlanner (C++ class)
chomp::ChompPlanner::ChompPlanner (C++ function)
chomp::ChompPlanner::solve (C++ function)
chomp::ChompPlanner::~ChompPlanner (C++ function)
chomp::ChompTrajectory (C++ class)
chomp::ChompTrajectory::assignCHOMPTrajectoryPointFromRobotState (C++ function)
chomp::ChompTrajectory::ChompTrajectory (C++ function)
,
[1]
,
[2]
,
[3]
chomp::ChompTrajectory::fillInCubicInterpolation (C++ function)
chomp::ChompTrajectory::fillInFromTrajectory (C++ function)
chomp::ChompTrajectory::fillInLinearInterpolation (C++ function)
chomp::ChompTrajectory::fillInMinJerk (C++ function)
chomp::ChompTrajectory::getDiscretization (C++ function)
chomp::ChompTrajectory::getDuration (C++ function)
chomp::ChompTrajectory::getEndIndex (C++ function)
chomp::ChompTrajectory::getFreeJointTrajectoryBlock (C++ function)
chomp::ChompTrajectory::getFreeTrajectoryBlock (C++ function)
chomp::ChompTrajectory::getFullTrajectoryIndex (C++ function)
chomp::ChompTrajectory::getJointTrajectory (C++ function)
chomp::ChompTrajectory::getJointVelocities (C++ function)
chomp::ChompTrajectory::getNumFreePoints (C++ function)
chomp::ChompTrajectory::getNumJoints (C++ function)
chomp::ChompTrajectory::getNumPoints (C++ function)
chomp::ChompTrajectory::getStartIndex (C++ function)
chomp::ChompTrajectory::getTrajectory (C++ function)
chomp::ChompTrajectory::getTrajectoryPoint (C++ function)
chomp::ChompTrajectory::operator() (C++ function)
,
[1]
chomp::ChompTrajectory::setStartEndIndex (C++ function)
chomp::ChompTrajectory::updateFromGroupTrajectory (C++ function)
chomp::ChompTrajectory::~ChompTrajectory (C++ function)
chomp::DIFF_RULE_LENGTH (C++ member)
chomp::DIFF_RULES (C++ member)
chomp::MultivariateGaussian (C++ class)
chomp::MultivariateGaussian::MultivariateGaussian (C++ function)
chomp::MultivariateGaussian::sample (C++ function)
chomp::normalizeAngle (C++ function)
chomp::normalizeAnglePositive (C++ function)
chomp::robotStateToArray (C++ function)
chomp::shortestAngularDistance (C++ function)