Function rclcpp::get_typesupport_handle
Defined in File typesupport_helpers.hpp
Function Documentation
Extract the type support handle from the library.
- Deprecated:
Use get_message_typesupport_handle() instead
Note
The library needs to match the topic type. The shared library must stay loaded for the lifetime of the result.
- Parameters:
type – [in] The topic type, e.g. “std_msgs/msg/String”
typesupport_identifier – [in] Type support identifier, typically “rosidl_typesupport_cpp”
library – [in] The shared type support library
- Returns:
A type support handle