moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <moveit_msgs/msg/planning_scene.hpp>
#include <moveit_msgs/msg/planning_scene_world.hpp>
#include <moveit_msgs/msg/robot_state.hpp>
#include <moveit_msgs/msg/constraints.hpp>
#include <geometry_msgs/msg/quaternion.hpp>
#include <geometry_msgs/msg/pose.hpp>
Go to the source code of this file.
Namespaces | |
moveit | |
Main namespace for MoveIt. | |
moveit::core | |
Core components of MoveIt. | |
Functions | |
bool | moveit::core::isEmpty (const moveit_msgs::msg::PlanningScene &msg) |
Check if a message includes any information about a planning scene, or whether it is empty. More... | |
bool | moveit::core::isEmpty (const moveit_msgs::msg::PlanningSceneWorld &msg) |
Check if a message includes any information about a planning scene world, or whether it is empty. More... | |
bool | moveit::core::isEmpty (const moveit_msgs::msg::RobotState &msg) |
Check if a message includes any information about a robot state, or whether it is empty. More... | |
bool | moveit::core::isEmpty (const moveit_msgs::msg::Constraints &msg) |
Check if a message specifies constraints. More... | |
bool | moveit::core::isEmpty (const geometry_msgs::msg::Quaternion &msg) |
Check if the message contains any non-zero entries. More... | |
bool | moveit::core::isEmpty (const geometry_msgs::msg::Pose &msg) |
Check if the message contains any non-zero entries. More... | |