Skip to content

Commit

Permalink
Declare dependency of gazebo_hardware_plugins to urdf in CMakeLists.t…
Browse files Browse the repository at this point in the history
…xt (#117)
  • Loading branch information
hobbeshunter authored and ahcorde committed Mar 18, 2022
1 parent 698d013 commit 35c4a09
Show file tree
Hide file tree
Showing 4 changed files with 0 additions and 6 deletions.
2 changes: 0 additions & 2 deletions gazebo_ros2_control/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -9,7 +9,6 @@ find_package(gazebo_ros REQUIRED)
find_package(hardware_interface REQUIRED)
find_package(pluginlib REQUIRED)
find_package(rclcpp REQUIRED)
find_package(urdf REQUIRED)
find_package(yaml_cpp_vendor REQUIRED)

# Default to C++14
Expand Down Expand Up @@ -37,7 +36,6 @@ ament_target_dependencies(${PROJECT_NAME}
hardware_interface
pluginlib
rclcpp
urdf
yaml_cpp_vendor
)

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -28,8 +28,6 @@

#include "rclcpp/rclcpp.hpp"

// URDF
#include "urdf/model.h"

namespace gazebo_ros2_control
{
Expand Down
1 change: 0 additions & 1 deletion gazebo_ros2_control/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -26,7 +26,6 @@
<depend>pluginlib</depend>
<depend>rclcpp</depend>
<depend>std_msgs</depend>
<depend>urdf</depend>
<depend>yaml_cpp_vendor</depend>

<test_depend>ament_lint_common</test_depend>
Expand Down
1 change: 0 additions & 1 deletion gazebo_ros2_control/src/gazebo_ros2_control_plugin.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -50,7 +50,6 @@
#include "hardware_interface/component_parser.hpp"
#include "hardware_interface/types/hardware_interface_type_values.hpp"

#include "urdf/model.h"
#include "yaml-cpp/yaml.h"

using namespace std::chrono_literals;
Expand Down

0 comments on commit 35c4a09

Please sign in to comment.