#include "moveit_goal_builder/builder.h"#include <map>#include <string>#include "geometry_msgs/Pose.h"#include "moveit/robot_state/conversions.h"#include "moveit/robot_state/robot_state.h"#include "moveit_msgs/BoundingVolume.h"#include "moveit_msgs/Constraints.h"#include "moveit_msgs/JointConstraint.h"#include "moveit_msgs/MoveGroupGoal.h"#include "moveit_msgs/PositionConstraint.h"#include "shape_msgs/SolidPrimitive.h"#include "ros/ros.h"
Go to the source code of this file.
Namespaces | |
| namespace | moveit_goal_builder |
Typedefs | |
| typedef std::map< std::string, double > | JointValues |
| typedef std::map< std::string, geometry_msgs::Pose > | PoseGoals |
| typedef std::map<std::string, double> JointValues |
Definition at line 18 of file builder.cpp.
| typedef std::map<std::string, geometry_msgs::Pose> PoseGoals |
Definition at line 19 of file builder.cpp.