moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <std_msgs/msg/string.hpp>
#include <rclcpp/rclcpp.hpp>
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 | |
namespace | rdf_loader |
Typedefs | |
using | rdf_loader::StringCallback = std::function< void(const std::string &)> |