Skip to content

Commit

Permalink
FIx linters
Browse files Browse the repository at this point in the history
  • Loading branch information
christophfroehlich committed Jul 5, 2024
1 parent 35e8046 commit f758cfc
Showing 1 changed file with 4 additions and 2 deletions.
6 changes: 4 additions & 2 deletions gazebo_ros2_control/src/gazebo_ros2_control_plugin.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -67,7 +67,7 @@ class GazeboResourceManager : public hardware_interface::ResourceManager
sdf::ElementPtr sdf)
: hardware_interface::ResourceManager(),
gazebo_system_loader_("gazebo_ros2_control",
"gazebo_ros2_control::GazeboSystemInterface"),
"gazebo_ros2_control::GazeboSystemInterface"),
logger_(node->get_logger().get_child("GazeboResourceManager"))
{
node_ = node;
Expand Down Expand Up @@ -352,7 +352,9 @@ void GazeboRosControlPlugin::Load(gazebo::physics::ModelPtr parent, sdf::Element
impl_->executor_ = std::make_shared<rclcpp::executors::MultiThreadedExecutor>();

std::unique_ptr<hardware_interface::ResourceManager> resource_manager_ =
std::make_unique<gazebo_ros2_control::GazeboResourceManager>(node_ros2, impl_->parent_model_, sdf);
std::make_unique<gazebo_ros2_control::GazeboResourceManager>(
node_ros2,
impl_->parent_model_, sdf);

// Create the controller manager
RCLCPP_INFO(impl_->model_nh_->get_logger(), "Loading controller_manager");
Expand Down

0 comments on commit f758cfc

Please sign in to comment.