Function rclcpp::get_typesupport_library
Defined in File typesupport_helpers.hpp
Function Documentation
-
std::shared_ptr<rcpputils::SharedLibrary> rclcpp::get_typesupport_library(const std::string &type, const std::string &typesupport_identifier)
Load the type support library for the given type.
- Parameters:
type – [in] The topic type, e.g. “std_msgs/msg/String”
typesupport_identifier – [in] Type support identifier, typically “rosidl_typesupport_cpp”
- Returns:
A shared library