#include <map>#include <string>#include "geometry_msgs/Pose.h"#include "moveit/robot_state/robot_state.h"#include "moveit_msgs/Constraints.h"#include "moveit_msgs/MoveGroupGoal.h"#include "moveit_msgs/OrientationConstraint.h"#include "moveit_msgs/WorkspaceParameters.h"

Go to the source code of this file.
Classes | |
| class | moveit_goal_builder::Builder |
| A MoveGroup action goal builder. More... | |
Namespaces | |
| namespace | moveit_goal_builder |
Enumerations | |
| enum | moveit_goal_builder::ActiveTargetType { moveit_goal_builder::JOINT, moveit_goal_builder::POSE, moveit_goal_builder::POSITION, moveit_goal_builder::ORIENTATION } |
Variables | |
| const char | moveit_goal_builder::kRRTConnect [] = "RRTConnectkConfigDefault" |