File tree Expand file tree Collapse file tree 2 files changed +3
-1
lines changed
Expand file tree Collapse file tree 2 files changed +3
-1
lines changed Original file line number Diff line number Diff line change @@ -46,6 +46,7 @@ sudo apt-get install --no-install-recommends -y \
4646 wget \
4747 qt5-default \
4848 ros-$ROS_DISTRO -pcl-conversions \
49+ ros-$ROS_DISTRO -tf2-geometry-msgs \
4950 $ADDITIONAL_PACKAGES
5051
5152pip$PYTHON_SUFFIX install --upgrade pip$PYTHON_SUFFIX
Original file line number Diff line number Diff line change 1818
1919 <build_depend >qtbase5-dev</build_depend >
2020 <depend >carla_msgs</depend >
21+ <build_depend >tf2_geometry_msgs</build_depend >
2122 <build_depend >nav_msgs</build_depend >
2223 <build_depend >geometry_msgs</build_depend >
2324 <build_depend >carla_ros_scenario_runner_types</build_depend >
2728 <exec_depend >libqt5-core</exec_depend >
2829 <exec_depend >libqt5-gui</exec_depend >
2930 <exec_depend >libqt5-widgets</exec_depend >
30-
31+
3132 <export >
3233 <rviz condition =" $ROS_VERSION == 1" plugin =" ${prefix}/plugin_description.xml" /> -->
3334 <build_type condition =" $ROS_VERSION == 1" >catkin</build_type >
You can’t perform that action at this time.
0 commit comments