1 #ifndef _RAPID_MOVEIT_PLANNING_SCENE_H_
2 #define _RAPID_MOVEIT_PLANNING_SCENE_H_
6 #include "geometry_msgs/PoseStamped.h"
7 #include "geometry_msgs/Vector3.h"
41 const geometry_msgs::PoseStamped& pose_stamped,
42 const geometry_msgs::Vector3& dims);
58 #endif // _RAPID_MOVEIT_PLANNING_SCENE_H_
void AddBoxObstacle(const std::string &name, const geometry_msgs::PoseStamped &pose_stamped, const geometry_msgs::Vector3 &dims)
Adds a box-shaped obstacle to the planning scene.
MoveItPlanningScene()
Default constructor, planning scene topic is "/planning_scene".
Simple interface to the MoveIt planning scene monitor.
void RemoveObstacle(const std::string &name)
Removes an obstacle from the planning scene.