diff --git a/franka_example_controllers/include/franka_example_controllers/joint_position_example_controller.h b/franka_example_controllers/include/franka_example_controllers/joint_position_example_controller.h index b4e252b88d16505bb008731e4f9749b111c802f0..414885106b372223a8b43b951668c5d47efc3271 100644 --- a/franka_example_controllers/include/franka_example_controllers/joint_position_example_controller.h +++ b/franka_example_controllers/include/franka_example_controllers/joint_position_example_controller.h @@ -17,8 +17,7 @@ namespace franka_example_controllers { class JointPositionExampleController : public controller_interface::MultiInterfaceController< hardware_interface::PositionJointInterface> { public: - bool init(hardware_interface::RobotHW* robot_hardware, - ros::NodeHandle& node_handle) override; + bool init(hardware_interface::RobotHW* robot_hardware, ros::NodeHandle& node_handle) override; void starting(const ros::Time&) override; void update(const ros::Time&, const ros::Duration& period) override; diff --git a/franka_example_controllers/include/franka_example_controllers/joint_velocity_example_controller.h b/franka_example_controllers/include/franka_example_controllers/joint_velocity_example_controller.h index a09580a4944710c92e2eaf8bf7635c69d519d156..3c20999d8578a5bf1b1d073bedf24d95d3bbf08e 100644 --- a/franka_example_controllers/include/franka_example_controllers/joint_velocity_example_controller.h +++ b/franka_example_controllers/include/franka_example_controllers/joint_velocity_example_controller.h @@ -18,8 +18,7 @@ class JointVelocityExampleController : public controller_interface::MultiInterfa hardware_interface::VelocityJointInterface, franka_hw::FrankaStateInterface> { public: - bool init(hardware_interface::RobotHW* robot_hardware, - ros::NodeHandle& node_handle) override; + bool init(hardware_interface::RobotHW* robot_hardware, ros::NodeHandle& node_handle) override; void update(const ros::Time&, const ros::Duration& period) override; void starting(const ros::Time&) override; void stopping(const ros::Time&) override;