carla-simulator / ros-bridge

ROS bridge for CARLA Simulator
MIT License
523 stars 430 forks source link

Fix fromMsg missing symbol rviz plugin error #713

Open FelipeGdM opened 9 months ago

FelipeGdM commented 9 months ago

This PR fixes the problem described here https://github.com/carla-simulator/ros-bridge/issues/711

The solution was found after some discussion at https://github.com/ros2/geometry2/issues/639

When loading the rviz plugin, the system crashes with a error translated to

undefined symbol: tf2::fromMsg(geometry_msgs::msg::Quaternion_<std::allocator<void> > const&, tf2::Quaternion&)

It was due to the definition of fromMsg being missing. This function is declared at tf2_geometry_msgs/tf2_geometry_msgs.hpp, so this file is included and tf2_geometry_msgs is linked to our plugin

Closes #711


This change is Reviewable