This defines the stomp planner for MoveIt. More...
#include <ros/ros.h>#include <moveit/robot_state/conversions.h>#include <stomp_moveit/stomp_planner.h>#include <class_loader/class_loader.h>#include <stomp_core/utils.h>#include <moveit/trajectory_processing/iterative_time_parameterization.h>#include <stomp_moveit/utils/kinematics.h>#include <stomp_moveit/utils/polynomial.h>
Go to the source code of this file.
Namespaces | |
| namespace | stomp_moveit |
Functions | |
| bool | parseConfig (XmlRpc::XmlRpcValue config, const moveit::core::JointModelGroup *group, stomp_core::StompConfiguration &stomp_config) |
| Parses a XmlRpcValue and populates a StompComfiguration structure. | |
Variables | |
| static const std::string | DESCRIPTION = "STOMP" |
| static int const | IK_ATTEMPTS = 10 |
| static int const | IK_TIMEOUT = 0.05 |
| static const double | MAX_START_DISTANCE_THRESH = 0.5 |
| static const double | TIMEOUT_INTERVAL = 0.05 |
This defines the stomp planner for MoveIt.
Definition in file stomp_planner.cpp.
| bool parseConfig | ( | XmlRpc::XmlRpcValue | config, |
| const moveit::core::JointModelGroup * | group, | ||
| stomp_core::StompConfiguration & | stomp_config | ||
| ) |
Parses a XmlRpcValue and populates a StompComfiguration structure.
| config | The XmlRpcValue of stomp configuration parameters |
| group | The moveit planning group |
| stomp_config | The stomp configuration structure |
Definition at line 49 of file stomp_planner.cpp.
const std::string DESCRIPTION = "STOMP" [static] |
Definition at line 36 of file stomp_planner.cpp.
int const IK_ATTEMPTS = 10 [static] |
Definition at line 38 of file stomp_planner.cpp.
int const IK_TIMEOUT = 0.05 [static] |
Definition at line 39 of file stomp_planner.cpp.
const double MAX_START_DISTANCE_THRESH = 0.5 [static] |
Definition at line 40 of file stomp_planner.cpp.
const double TIMEOUT_INTERVAL = 0.05 [static] |
Definition at line 37 of file stomp_planner.cpp.