File tree Expand file tree Collapse file tree 2 files changed +4
-1
lines changed Expand file tree Collapse file tree 2 files changed +4
-1
lines changed Original file line number Diff line number Diff line change @@ -52,6 +52,7 @@ elseif(${ROS_VERSION} EQUAL 2)
52
52
find_package (carla_ros_scenario_runner_types COMPONENTS )
53
53
find_package (pluginlib REQUIRED )
54
54
find_package (rviz_ogre_vendor REQUIRED )
55
+ find_package (tf2_geometry_msgs REQUIRED )
55
56
56
57
set (CMAKE_AUTOMOC ON )
57
58
@@ -74,7 +75,8 @@ elseif(${ROS_VERSION} EQUAL 2)
74
75
plugin_description_ros2.xml )
75
76
76
77
ament_target_dependencies (rviz_carla_plugin rclcpp carla_msgs nav_msgs
77
- carla_ros_scenario_runner_types rviz_common )
78
+ carla_ros_scenario_runner_types rviz_common
79
+ tf2_geometry_msgs )
78
80
79
81
ament_export_libraries (${PROJECT_NAME} )
80
82
Original file line number Diff line number Diff line change 22
22
#include < chrono>
23
23
#include < iomanip>
24
24
25
+ #include < tf2_geometry_msgs/tf2_geometry_msgs.hpp>
25
26
#include < tf2/utils.h>
26
27
27
28
#include < OgreCamera.h>
You can’t perform that action at this time.
0 commit comments