#include <chomp_optimizer.h>
Public Member Functions | |
ChompOptimizer (ChompTrajectory *trajectory, const planning_scene::PlanningSceneConstPtr &planning_scene, const std::string &planning_group, const ChompParameters *parameters, const moveit::core::RobotState &start_state) | |
void | destroy () |
bool | isCollisionFree () const |
bool | isInitialized () const |
bool | optimize () |
virtual | ~ChompOptimizer () |
Private Member Functions | |
void | addIncrementsToTrajectory () |
void | calculateCollisionIncrements () |
void | calculatePseudoInverse () |
void | calculateSmoothnessIncrements () |
void | calculateTotalIncrements () |
void | computeJointProperties (int trajectoryPoint) |
void | debugCost () |
double | getCollisionCost () |
template<typename Derived > | |
void | getJacobian (int trajectoryPoint, Eigen::Vector3d &collision_point_pos, std::string &jointName, Eigen::MatrixBase< Derived > &jacobian) const |
double | getPotential (double field_distance, double radius, double clearance) |
void | getRandomMomentum () |
double | getSmoothnessCost () |
double | getTrajectoryCost () |
void | handleJointLimits () |
void | initialize () |
bool | isCurrentTrajectoryMeshToMeshCollisionFree () const |
bool | isParent (const std::string &childLink, const std::string &parentLink) const |
void | performForwardKinematics () |
void | perturbTrajectory () |
void | registerParents (const moveit::core::JointModel *model) |
void | setRobotStateFromPoint (ChompTrajectory &group_trajectory, int i) |
void | updateFullTrajectory () |
void | updateMomentum () |
void | updatePositionFromMomentum () |
Definition at line 85 of file chomp_optimizer.h.
chomp::ChompOptimizer::ChompOptimizer | ( | ChompTrajectory * | trajectory, |
const planning_scene::PlanningSceneConstPtr & | planning_scene, | ||
const std::string & | planning_group, | ||
const ChompParameters * | parameters, | ||
const moveit::core::RobotState & | start_state | ||
) |
Definition at line 89 of file chomp_optimizer.cpp.
|
virtual |
Definition at line 281 of file chomp_optimizer.cpp.
|
private |
Definition at line 709 of file chomp_optimizer.cpp.
|
private |
Definition at line 614 of file chomp_optimizer.cpp.
|
private |
Definition at line 691 of file chomp_optimizer.cpp.
|
private |
TODO: HMC BASED COMMENTED CODE BELOW, Need to uncomment and perform extensive testing by varying the HMC parameters values in the chomp_planning.yaml file so that CHOMP can find optimal paths
Definition at line 605 of file chomp_optimizer.cpp.
|
private |
Definition at line 698 of file chomp_optimizer.cpp.
|
private |
Definition at line 783 of file chomp_optimizer.cpp.
|
private |
Definition at line 734 of file chomp_optimizer.cpp.
|
inline |
Definition at line 132 of file chomp_optimizer.h.
|
private |
Definition at line 757 of file chomp_optimizer.cpp.
|
private |
Definition at line 823 of file chomp_optimizer.cpp.
|
inlineprivate |
Definition at line 148 of file chomp_optimizer.h.
|
private |
|
private |
Definition at line 747 of file chomp_optimizer.cpp.
|
private |
Definition at line 742 of file chomp_optimizer.cpp.
|
private |
Definition at line 847 of file chomp_optimizer.cpp.
|
private |
TODO: HMC BASED COMMENTED CODE BELOW, Need to uncomment and perform extensive testing by varying the HMC parameters values in the chomp_planning.yaml file so that CHOMP can find optimal paths
Definition at line 124 of file chomp_optimizer.cpp.
|
inline |
Definition at line 142 of file chomp_optimizer.h.
|
private |
Definition at line 552 of file chomp_optimizer.cpp.
|
inline |
Definition at line 137 of file chomp_optimizer.h.
|
inlineprivate |
Definition at line 246 of file chomp_optimizer.h.
bool chomp::ChompOptimizer::optimize | ( | ) |
Optimizes the CHOMP cost function and tries to find an optimal path
TODO: HMC BASED COMMENTED CODE BELOW, Need to uncomment and perform extensive testing by varying the HMC parameters values in the chomp_planning.yaml file so that CHOMP can find optimal paths
TODO: HMC BASED COMMENTED CODE BELOW, Need to uncomment and perform extensive testing by varying the HMC parameters values in the chomp_planning.yaml file so that CHOMP can find optimal paths
TODO: HMC BASED COMMENTED CODE BELOW, Need to uncomment and perform extensive testing by varying the HMC parameters values in the chomp_planning.yaml file so that CHOMP can find optimal paths
TODO: HMC BASED COMMENTED CODE BELOW, Need to uncomment and perform extensive testing by varying the HMC parameters values in the chomp_planning.yaml file so that CHOMP can find optimal paths
Definition at line 325 of file chomp_optimizer.cpp.
|
private |
Definition at line 928 of file chomp_optimizer.cpp.
|
private |
Definition at line 1037 of file chomp_optimizer.cpp.
|
private |
Definition at line 286 of file chomp_optimizer.cpp.
|
private |
Definition at line 1024 of file chomp_optimizer.cpp.
|
private |
Definition at line 729 of file chomp_optimizer.cpp.
|
private |
|
private |
|
private |
Definition at line 213 of file chomp_optimizer.h.
|
private |
Definition at line 214 of file chomp_optimizer.h.
|
private |
Definition at line 186 of file chomp_optimizer.h.
|
private |
Definition at line 232 of file chomp_optimizer.h.
|
private |
Definition at line 206 of file chomp_optimizer.h.
|
private |
Definition at line 203 of file chomp_optimizer.h.
|
private |
Definition at line 204 of file chomp_optimizer.h.
|
private |
Definition at line 207 of file chomp_optimizer.h.
|
private |
Definition at line 209 of file chomp_optimizer.h.
|
private |
Definition at line 205 of file chomp_optimizer.h.
|
private |
Definition at line 208 of file chomp_optimizer.h.
|
private |
Definition at line 233 of file chomp_optimizer.h.
|
private |
Definition at line 184 of file chomp_optimizer.h.
|
private |
Definition at line 183 of file chomp_optimizer.h.
|
private |
Definition at line 188 of file chomp_optimizer.h.
|
private |
Definition at line 192 of file chomp_optimizer.h.
|
private |
Definition at line 212 of file chomp_optimizer.h.
|
private |
Definition at line 200 of file chomp_optimizer.h.
|
private |
Definition at line 197 of file chomp_optimizer.h.
|
private |
Definition at line 201 of file chomp_optimizer.h.
|
private |
Definition at line 228 of file chomp_optimizer.h.
|
private |
Definition at line 185 of file chomp_optimizer.h.
|
private |
Definition at line 237 of file chomp_optimizer.h.
|
private |
Definition at line 239 of file chomp_optimizer.h.
|
private |
Definition at line 238 of file chomp_optimizer.h.
|
private |
Definition at line 210 of file chomp_optimizer.h.
|
private |
Definition at line 199 of file chomp_optimizer.h.
|
private |
Definition at line 196 of file chomp_optimizer.h.
|
private |
Definition at line 243 of file chomp_optimizer.h.
|
private |
Definition at line 244 of file chomp_optimizer.h.
|
private |
Definition at line 211 of file chomp_optimizer.h.
|
private |
Definition at line 241 of file chomp_optimizer.h.
|
private |
Definition at line 215 of file chomp_optimizer.h.
|
private |
Definition at line 219 of file chomp_optimizer.h.
|
private |
Definition at line 222 of file chomp_optimizer.h.
|
private |
Definition at line 216 of file chomp_optimizer.h.
|
private |
Definition at line 182 of file chomp_optimizer.h.
|
private |
Definition at line 179 of file chomp_optimizer.h.
|
private |
Definition at line 181 of file chomp_optimizer.h.
|
private |
Definition at line 180 of file chomp_optimizer.h.
|
private |
Definition at line 191 of file chomp_optimizer.h.
|
private |
Definition at line 190 of file chomp_optimizer.h.
|
private |
Definition at line 193 of file chomp_optimizer.h.
|
private |
Definition at line 227 of file chomp_optimizer.h.
|
private |
Definition at line 221 of file chomp_optimizer.h.
|
private |
Definition at line 220 of file chomp_optimizer.h.
|
private |
Definition at line 240 of file chomp_optimizer.h.
|
private |
Definition at line 189 of file chomp_optimizer.h.
|
private |
Definition at line 236 of file chomp_optimizer.h.
|
private |
Definition at line 231 of file chomp_optimizer.h.
|
private |
Definition at line 195 of file chomp_optimizer.h.
|
private |
Definition at line 194 of file chomp_optimizer.h.
|
private |
Array containing a boolean about collision info for each point in the trajectory
Definition at line 225 of file chomp_optimizer.h.
|
private |
Definition at line 223 of file chomp_optimizer.h.
|
private |
Definition at line 229 of file chomp_optimizer.h.