Go to the documentation of this file.
59 struct PlanningSceneMonitorOptions
63 std::string ns =
"planning_scene_monitor_options/";
64 nh.
param<std::string>(ns +
"name",
name,
"planning_scene_monitor");
86 struct PlanningPipelineOptions
90 std::string ns =
"planning_pipelines/";
113 MoveItCpp(
const Options& options,
const ros::NodeHandle& nh,
const std::shared_ptr<tf2_ros::Buffer>& tf_buffer = {});
137 bool getCurrentState(moveit::core::RobotStatePtr& current_state,
double wait_seconds);
154 const std::shared_ptr<tf2_ros::Buffer>&
getTFBuffer()
const;
163 bool blocking =
true);
167 std::shared_ptr<tf2_ros::TransformListener>
tf_listener_;
void load(const ros::NodeHandle &nh)
bool loadPlanningPipelines(const PlanningPipelineOptions &options)
Initialize and setup the planning pipelines.
planning_scene_monitor::PlanningSceneMonitorPtr planning_scene_monitor_
const std::map< std::string, planning_pipeline::PlanningPipelinePtr > & getPlanningPipelines() const
Get all loaded planning pipeline instances mapped to their reference names.
std::set< std::string > getPlanningPipelineNames(const std::string &group_name="") const
Get the names of all loaded planning pipelines. Specify group_name to filter the results by planning ...
const std::shared_ptr< tf2_ros::Buffer > & getTFBuffer() const
const ros::NodeHandle & getNodeHandle() const
Get the ROS node handle of this instance operates on.
std::map< std::string, std::set< std::string > > groups_algorithms_map_
bool getParam(const std::string &key, bool &b) const
trajectory_execution_manager::TrajectoryExecutionManagerPtr trajectory_execution_manager_
bool getCurrentState(moveit::core::RobotStatePtr ¤t_state, double wait_seconds)
Get the current state queried from the current state monitor.
double wait_for_initial_state_timeout
std::string joint_state_topic
std::string publish_planning_scene_topic
void clearContents()
Reset all member variables.
struct contains the the variables used for loading the planning pipeline
Options(const ros::NodeHandle &nh)
PlanningPipelineOptions planning_pipeline_options
MOVEIT_CLASS_FORWARD(MoveGroupInterface)
std::shared_ptr< tf2_ros::TransformListener > tf_listener_
bool loadPlanningSceneMonitor(const PlanningSceneMonitorOptions &options)
Initialize and setup the planning scene monitor.
std::vector< std::string > pipeline_names
bool execute(const std::string &group_name, const robot_trajectory::RobotTrajectoryPtr &robot_trajectory, bool blocking=true)
Execute a trajectory on the planning group specified by group_name using the trajectory execution man...
std::map< std::string, std::set< std::string > > groups_pipelines_map_
trajectory_execution_manager::TrajectoryExecutionManagerPtr getTrajectoryExecutionManagerNonConst()
PlanningSceneMonitorOptions planning_scene_monitor_options
const planning_scene_monitor::PlanningSceneMonitorPtr & getPlanningSceneMonitor() const
Get the stored instance of the planning scene monitor.
std::string robot_description
moveit::core::RobotModelConstPtr robot_model_
static const std::string DEFAULT_JOINT_STATES_TOPIC
std::shared_ptr< tf2_ros::Buffer > tf_buffer_
moveit::core::RobotModelConstPtr getRobotModel() const
Get the RobotModel object.
static const std::string DEFAULT_PLANNING_SCENE_TOPIC
static const std::string MONITORED_PLANNING_SCENE_TOPIC
MoveItCpp & operator=(const MoveItCpp &)=delete
ros::NodeHandle node_handle_
Specification of options to use when constructing the MoveItCpp class.
planning_scene_monitor::PlanningSceneMonitorPtr getPlanningSceneMonitorNonConst()
T param(const std::string ¶m_name, const T &default_val) const
std::map< std::string, planning_pipeline::PlanningPipelinePtr > planning_pipelines_
const trajectory_execution_manager::TrajectoryExecutionManagerPtr & getTrajectoryExecutionManager() const
Get the stored instance of the trajectory execution manager.
std::string monitored_planning_scene_topic
std::string attached_collision_object_topic
std::string parent_namespace
void load(const ros::NodeHandle &nh)
MoveItCpp(const ros::NodeHandle &nh, const std::shared_ptr< tf2_ros::Buffer > &tf_buffer={})
Constructor.
static const std::string DEFAULT_ATTACHED_COLLISION_OBJECT_TOPIC