Template Struct ImplicitTypeAdapter

Struct Documentation

template<typename CustomType>
struct ImplicitTypeAdapter

Implicit type adapter used as a short hand way to create something with just the custom type.

This is used when creating a publisher or subscription using just the custom type in conjunction with RCLCPP_USING_CUSTOM_TYPE_AS_ROS_MESSAGE_TYPE(). For example:

#include "type_adapter_for_std_string_to_std_msgs_String.hpp"

RCLCPP_USING_CUSTOM_TYPE_AS_ROS_MESSAGE_TYPE(std::string, std_msgs::msg::String);

int main(...) {
  // ...
  auto pub = node->create_publisher<std::string>(...);
}

See also

TypeAdapter for more examples.

Public Types

using is_specialized = std::false_type