Skip to content

Commit

Permalink
fix lint warning
Browse files Browse the repository at this point in the history
  • Loading branch information
chameau5050 committed Apr 5, 2024
1 parent 6acca41 commit d97d839
Show file tree
Hide file tree
Showing 4 changed files with 96 additions and 131 deletions.
6 changes: 3 additions & 3 deletions gazebo_ros2_control/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -4,10 +4,10 @@ project(gazebo_ros2_control)
find_package(ament_cmake REQUIRED)
find_package(angles REQUIRED)
find_package(controller_manager REQUIRED)
find_package(control_toolbox REQUIRED)
find_package(gazebo_dev REQUIRED)
find_package(gazebo_ros REQUIRED)
find_package(hardware_interface REQUIRED)
find_package(control_toolbox REQUIRED)
find_package(pluginlib REQUIRED)
find_package(rclcpp REQUIRED)
find_package(yaml_cpp_vendor REQUIRED)
Expand All @@ -34,12 +34,12 @@ add_library(${PROJECT_NAME} SHARED
ament_target_dependencies(${PROJECT_NAME}
angles
controller_manager
control_toolbox
gazebo_dev
gazebo_ros
hardware_interface
pluginlib
rclcpp
control_toolbox
yaml_cpp_vendor
)

Expand All @@ -48,9 +48,9 @@ add_library(gazebo_hardware_plugins SHARED
)
ament_target_dependencies(gazebo_hardware_plugins
angles
control_toolbox
gazebo_dev
hardware_interface
control_toolbox
rclcpp
)

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -26,6 +26,7 @@
#include "angles/angles.h"

#include "control_toolbox/pid.hpp"

#include "gazebo_ros2_control/gazebo_system_interface.hpp"

#include "std_msgs/msg/bool.hpp"
Expand All @@ -42,7 +43,7 @@ class GazeboSystemPrivate;

class GazeboSystem : public GazeboSystemInterface
{
public:
public:
// Documentation Inherited
CallbackReturn on_init(const hardware_interface::HardwareInfo & system_info)
override;
Expand Down Expand Up @@ -81,7 +82,7 @@ class GazeboSystem : public GazeboSystemInterface
const hardware_interface::HardwareInfo & hardware_info,
sdf::ElementPtr sdf) override;

private:
private:
void registerJoints(
const hardware_interface::HardwareInfo & hardware_info,
gazebo::physics::ModelPtr parent_model);
Expand All @@ -90,7 +91,7 @@ class GazeboSystem : public GazeboSystemInterface
const hardware_interface::HardwareInfo & hardware_info,
gazebo::physics::ModelPtr parent_model);

control_toolbox::Pid extractPID(std::string prefix,
control_toolbox::Pid extractPID(std::string prefix,
hardware_interface::ComponentInfo joint_info);

/// \brief Private data class
Expand Down
4 changes: 2 additions & 2 deletions gazebo_ros2_control/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -19,15 +19,15 @@
<buildtool_depend>ament_cmake</buildtool_depend>

<depend>angles</depend>
<depend>controller_manager</depend>
<depend>control_toolbox</depend>
<depend>gazebo_dev</depend>
<depend>gazebo_ros</depend>
<depend>controller_manager</depend>
<depend>hardware_interface</depend>
<depend>pluginlib</depend>
<depend>rclcpp</depend>
<depend>std_msgs</depend>
<depend>yaml_cpp_vendor</depend>
<depend>control_toolbox</depend>

<test_depend>ament_lint_common</test_depend>
<test_depend>ament_lint_auto</test_depend>
Expand Down
Loading

0 comments on commit d97d839

Please sign in to comment.