Function rclcpp::get_typesupport_library_path

Function Documentation

std::string rclcpp::get_typesupport_library_path(const std::string &package_name, const std::string &typesupport_identifier)

Look for the library in the ament prefix paths and return the path to the type support library.

Parameters:
  • package_name[in] The name of the package containing the type support library, e.g. “std_msgs”.

  • typesupport_identifier[in] Type support identifier, typically “rosidl_typesupport_cpp”

Throws:

std::runtime_error – if the library is not found.

Returns:

The path to the type support library.