moveit2
The MoveIt Motion Planning Framework for ROS 2.
Classes | Namespaces | Typedefs
synchronized_string_parameter.h File Reference
#include <std_msgs/msg/string.hpp>
#include <rclcpp/rclcpp.hpp>
Include dependency graph for synchronized_string_parameter.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  rdf_loader::SynchronizedStringParameter
 SynchronizedStringParameter is a way to load a string from the ROS environment. More...
 

Namespaces

 rdf_loader
 

Typedefs

using rdf_loader::StringCallback = std::function< void(const std::string &)>