moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <moveit/warehouse/moveit_message_storage.h>
#include <moveit/macros/class_forward.h>
#include <moveit_msgs/msg/robot_state.hpp>
#include <rclcpp/logger.hpp>
#include <moveit_warehouse_export.h>
Go to the source code of this file.
Classes | |
class | moveit_warehouse::RobotStateStorage |
Namespaces | |
namespace | moveit_warehouse |
Typedefs | |
typedef warehouse_ros::MessageWithMetadata< moveit_msgs::msg::RobotState >::ConstPtr | moveit_warehouse::RobotStateWithMetadata |
typedef warehouse_ros::MessageCollection< moveit_msgs::msg::RobotState >::Ptr | moveit_warehouse::RobotStateCollection |
Functions | |
moveit_warehouse::MOVEIT_CLASS_FORWARD (RobotStateStorage) | |