moveit2
The MoveIt Motion Planning Framework for ROS 2.
Loading...
Searching...
No Matches
Namespaces | Functions
message_checks.h File Reference
#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>
Include dependency graph for message_checks.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

namespace  moveit
 Main namespace for MoveIt.
 
namespace  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.
 
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.
 
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.
 
bool moveit::core::isEmpty (const moveit_msgs::msg::Constraints &msg)
 Check if a message specifies constraints.
 
bool moveit::core::isEmpty (const geometry_msgs::msg::Quaternion &msg)
 Check if the message contains any non-zero entries.
 
bool moveit::core::isEmpty (const geometry_msgs::msg::Pose &msg)
 Check if the message contains any non-zero entries.