MoveIt Pro Behavior Interface  5.0.1
Library for developing custom behaviors for use in MoveIt Pro
logger.hpp File Reference
#include <moveit_studio_agent_msgs/msg/log.hpp>
#include <moveit_msgs/msg/move_it_error_codes.hpp>
#include <rclcpp/rclcpp.hpp>
#include <std_msgs/msg/string.hpp>
Include dependency graph for logger.hpp:
This graph shows which files directly or indirectly include this file:

Classes

class  moveit_studio::behavior::LoggerBase
 Base class to allow Behaviors to report messages with detailed explanations to MoveIt Studio UI. More...
 
class  moveit_studio::behavior::LoggerROS
 A ROS-specialized implementation of LoggerBase that publishes the error message on a topic and logs it through an rclcpp Logger. More...
 

Namespaces

 moveit_studio
 
 moveit_studio::behavior