Skip to content
Open
Show file tree
Hide file tree
Changes from all commits
Commits
File filter

Filter by extension

Filter by extension

Conversations
Failed to load comments.
Loading
Jump to
Jump to file
Failed to load files.
Loading
Diff view
Diff view
Original file line number Diff line number Diff line change
Expand Up @@ -23,7 +23,6 @@ find_package(rosbag2_storage REQUIRED)
find_package(rmw REQUIRED)
find_package(rosbag2_performance_benchmarking_msgs REQUIRED)
find_package(sensor_msgs REQUIRED)
find_package(yaml_cpp_vendor REQUIRED)
find_package(yaml-cpp REQUIRED)

add_executable(writer_benchmark
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -25,7 +25,7 @@
<depend>rmw</depend>
<depend>rosbag2_performance_benchmarking_msgs</depend>
<depend>sensor_msgs</depend>
<depend>yaml_cpp_vendor</depend>
<depend>yaml-cpp</depend>

<test_depend>ament_lint_auto</test_depend>
<test_depend>ament_lint_common</test_depend>
Expand Down
3 changes: 1 addition & 2 deletions rosbag2_storage/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -26,7 +26,6 @@ find_package(pluginlib REQUIRED)
find_package(rcutils REQUIRED)
find_package(rclcpp REQUIRED)
find_package(rmw REQUIRED)
find_package(yaml_cpp_vendor REQUIRED)
find_package(yaml-cpp REQUIRED)

add_library(
Expand Down Expand Up @@ -76,7 +75,7 @@ ament_export_libraries(${PROJECT_NAME})
# Export modern CMake targets
ament_export_targets(export_${PROJECT_NAME})

ament_export_dependencies(rclcpp rcutils rmw yaml-cpp yaml_cpp_vendor)
ament_export_dependencies(rclcpp rcutils rmw yaml-cpp)

if(BUILD_TESTING)
find_package(ament_lint_auto REQUIRED)
Expand Down
2 changes: 1 addition & 1 deletion rosbag2_storage/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -16,7 +16,7 @@
<depend>rcutils</depend>
<depend>rclcpp</depend>
<depend>rmw</depend>
<depend>yaml_cpp_vendor</depend>
<depend>yaml-cpp</depend>

<test_depend>ament_cmake_gtest</test_depend>
<test_depend>ament_cmake_gmock</test_depend>
Expand Down
1 change: 0 additions & 1 deletion rosbag2_storage_mcap/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -28,7 +28,6 @@ find_package(mcap_vendor REQUIRED)
find_package(pluginlib REQUIRED)
find_package(rcutils REQUIRED)
find_package(rosbag2_storage REQUIRED)
find_package(yaml_cpp_vendor REQUIRED)
find_package(yaml-cpp REQUIRED)

ament_python_install_package(ros2bag_mcap_cli)
Expand Down
2 changes: 1 addition & 1 deletion rosbag2_storage_mcap/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -17,7 +17,7 @@
<depend>pluginlib</depend>
<depend>rcutils</depend>
<depend>rosbag2_storage</depend>
<depend>yaml_cpp_vendor</depend>
<depend>yaml-cpp</depend>

<test_depend>ament_cmake_clang_format</test_depend>
<test_depend>ament_cmake_gmock</test_depend>
Expand Down
1 change: 0 additions & 1 deletion rosbag2_transport/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -40,7 +40,6 @@ find_package(rosbag2_cpp REQUIRED)
find_package(rosbag2_interfaces REQUIRED)
find_package(rosbag2_storage REQUIRED)
find_package(rmw_implementation_cmake REQUIRED)
find_package(yaml_cpp_vendor REQUIRED)
find_package(yaml-cpp REQUIRED)

add_library(${PROJECT_NAME} SHARED
Expand Down
2 changes: 1 addition & 1 deletion rosbag2_transport/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -23,7 +23,7 @@
<depend>rosbag2_cpp</depend>
<depend>rosbag2_interfaces</depend>
<depend>rosbag2_storage</depend>
<depend>yaml_cpp_vendor</depend>
<depend>yaml-cpp</depend>
<depend>keyboard_handler</depend>

<test_depend>ament_cmake_gmock</test_depend>
Expand Down
Loading