Skip to content

Commit

Permalink
Split rviz_yaml_cpp_vendor into it's own repo (#361)
Browse files Browse the repository at this point in the history
* Split yaml_cpp_vendor into it's own package.
  • Loading branch information
mjcarroll authored Oct 11, 2018
1 parent 3fc5e3f commit 42e3c4b
Show file tree
Hide file tree
Showing 8 changed files with 5 additions and 403 deletions.
8 changes: 4 additions & 4 deletions rviz_common/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -48,14 +48,14 @@ find_package(rclcpp REQUIRED)
find_package(resource_retriever REQUIRED)
find_package(rviz_assimp_vendor REQUIRED)
find_package(rviz_rendering REQUIRED)
find_package(rviz_yaml_cpp_vendor REQUIRED)
find_package(sensor_msgs REQUIRED)
find_package(std_msgs REQUIRED)
find_package(tinyxml_vendor REQUIRED)
find_package(tf2 REQUIRED)
find_package(tf2_geometry_msgs REQUIRED)
find_package(tf2_ros REQUIRED)
find_package(urdf REQUIRED)
find_package(yaml_cpp_vendor REQUIRED)

find_package(TinyXML REQUIRED) # provided by tinyxml_vendor

Expand Down Expand Up @@ -263,13 +263,13 @@ ament_target_dependencies(rviz_common
rclcpp
resource_retriever
rviz_assimp_vendor
rviz_yaml_cpp_vendor
sensor_msgs
std_msgs
tf2
tf2_geometry_msgs
tf2_ros
urdf
yaml_cpp_vendor
)
# prevent pluginlib from using boost
target_compile_definitions(rviz_common PUBLIC "PLUGINLIB__DISABLE_BOOST_FUNCTIONS")
Expand All @@ -283,12 +283,12 @@ ament_export_dependencies(
geometry_msgs
pluginlib
rclcpp
rviz_yaml_cpp_vendor
sensor_msgs
std_msgs
tf2
tf2_geometry_msgs
tf2_ros
yaml_cpp_vendor
)
ament_export_include_directories(include)
ament_export_libraries(rviz_common)
Expand Down Expand Up @@ -443,7 +443,7 @@ if(BUILD_TESTING)
${SKIP_DISPLAY_TESTS})
if(TARGET rviz_common_display_test)
target_link_libraries(rviz_common_display_test rviz_common Qt5::Widgets)
ament_target_dependencies(rviz_common_display_test rviz_yaml_cpp_vendor)
ament_target_dependencies(rviz_common_display_test yaml_cpp_vendor)
endif()
endif()

Expand Down
2 changes: 1 addition & 1 deletion rviz_common/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -34,14 +34,14 @@
<depend>resource_retriever</depend>
<depend>rviz_ogre_vendor</depend>
<depend>rviz_rendering</depend>
<depend>rviz_yaml_cpp_vendor</depend>
<depend>sensor_msgs</depend>
<depend>std_msgs</depend>
<depend>tf2</depend>
<depend>tf2_geometry_msgs</depend>
<depend>tf2_ros</depend>
<depend>tinyxml_vendor</depend>
<depend>urdf</depend>
<depend>yaml_cpp_vendor</depend>

<test_depend>ament_cmake_cppcheck</test_depend>
<test_depend>ament_cmake_cpplint</test_depend>
Expand Down
234 changes: 0 additions & 234 deletions rviz_yaml_cpp_vendor/CHANGELOG.rst

This file was deleted.

67 changes: 0 additions & 67 deletions rviz_yaml_cpp_vendor/CMakeLists.txt

This file was deleted.

Loading

0 comments on commit 42e3c4b

Please sign in to comment.