Classes | |
| class | ChompCost |
| class | ChompOptimizer |
| class | ChompParameters |
| class | ChompPlanner |
| class | ChompTrajectory |
| class | MultivariateGaussian |
| class | OptimizerAdapter |
Functions | |
| double | getRandomDouble () |
| static void | jointStateToArray (const moveit::core::RobotModelConstPtr &kmodel, const sensor_msgs::JointState &joint_state, const std::string &planning_group_name, Eigen::MatrixXd::RowXpr joint_array) |
| static double | normalizeAngle (double angle) |
| static double | normalizeAnglePositive (double angle) |
| static double | shortestAngularDistance (double start, double end) |
Variables | |
| static const int | DIFF_RULE_LENGTH |
| static const double | DIFF_RULES [3][DIFF_RULE_LENGTH] |