MoveIt Pro Behavior Interface  5.0.1
Library for developing custom behaviors for use in MoveIt Pro
YAML::convert< Eigen::Isometry3d > Struct Reference

Macro to add YAML support for a given ROS message. More...

#include <yaml_parsing_tools.hpp>

Static Public Member Functions

static bool decode (const Node &node, Eigen::Isometry3d &rhs)
 

Detailed Description

Macro to add YAML support for a given ROS message.

For instance, to add support for geometry_msgs::msg::Pose: ROS_MESSAGE_YAML_PARSER(geometry_msgs, Pose)

Member Function Documentation

◆ decode()

static bool YAML::convert< Eigen::Isometry3d >::decode ( const Node &  node,
Eigen::Isometry3d &  rhs 
)
inlinestatic

The documentation for this struct was generated from the following file: