44 #include <moveit_msgs/msg/planning_scene.hpp>
45 #include <moveit_msgs/msg/planning_scene_world.hpp>
46 #include <moveit_msgs/msg/robot_state.hpp>
47 #include <moveit_msgs/msg/constraints.hpp>
48 #include <geometry_msgs/msg/quaternion.hpp>
49 #include <geometry_msgs/msg/pose.hpp>
56 bool isEmpty(
const moveit_msgs::msg::PlanningScene& msg);
59 bool isEmpty(
const moveit_msgs::msg::PlanningSceneWorld& msg);
62 bool isEmpty(
const moveit_msgs::msg::RobotState& msg);
65 bool isEmpty(
const moveit_msgs::msg::Constraints& msg);
68 bool isEmpty(
const geometry_msgs::msg::Quaternion& msg);
71 bool isEmpty(
const geometry_msgs::msg::Pose& msg);
bool isEmpty(const moveit_msgs::msg::PlanningScene &msg)
Check if a message includes any information about a planning scene, or whether it is empty.
Main namespace for MoveIt.