Skip to content

Commit

Permalink
Remove unneeded class variables
Browse files Browse the repository at this point in the history
  • Loading branch information
christophfroehlich committed Jul 5, 2024
1 parent 3463502 commit 4b89eae
Showing 1 changed file with 0 additions and 5 deletions.
5 changes: 0 additions & 5 deletions gz_ros2_control/src/gz_ros2_control_plugin.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -159,11 +159,6 @@ class GazeboSimROS2ControlPluginPrivate
/// \brief Timing
rclcpp::Duration control_period_ = rclcpp::Duration(1, 0);

/// \brief Interface loader
std::shared_ptr<pluginlib::ClassLoader<
gz_ros2_control::GazeboSimSystemInterface>>
robot_hw_sim_loader_{nullptr};

/// \brief Controller manager
std::shared_ptr<controller_manager::ControllerManager>
controller_manager_{nullptr};
Expand Down

0 comments on commit 4b89eae

Please sign in to comment.