MoveIt Pro Behavior Interface  5.0.1
Library for developing custom behaviors for use in MoveIt Pro
publisher_interface.hpp File Reference
#include <memory>
#include <rclcpp/publisher_base.hpp>
#include <string>
#include <tl_expected/expected.hpp>
#include <rclcpp/node.hpp>
#include <rclcpp/publisher.hpp>
#include <rclcpp/qos.hpp>
#include <moveit_studio_behavior_interface/impl/publisher_interface_impl.hpp>
Include dependency graph for publisher_interface.hpp:
This graph shows which files directly or indirectly include this file:

Classes

class  moveit_studio::behaviors::PublisherInterfaceBase< MessageT >
 Defines an interface to a publisher that sends a message to a topic. More...
 
class  moveit_studio::behaviors::RclcppPublisherInterface< MessageT >
 Implementation of the publisher interface for a rclcpp publisher. More...
 

Namespaces

 moveit_studio
 
 moveit_studio::behaviors
 

Functions

bool moveit_studio::behaviors::shouldRecreatePublisher (const std::shared_ptr< rclcpp::PublisherBase > &publisher, const std::string_view topic_name, const size_t queue_size, const rclcpp::ReliabilityPolicy reliability_policy)
 Compare a publisher's current configuration to the desired new configuration to determine if the publisher needs to be recreated. More...