Skip to content
Snippets Groups Projects
Commit ca38fec0 authored by Florian Walch's avatar Florian Walch
Browse files

Run clang-format

parent c5152e43
Branches
Tags
No related merge requests found
...@@ -17,8 +17,7 @@ namespace franka_example_controllers { ...@@ -17,8 +17,7 @@ namespace franka_example_controllers {
class JointPositionExampleController : public controller_interface::MultiInterfaceController< class JointPositionExampleController : public controller_interface::MultiInterfaceController<
hardware_interface::PositionJointInterface> { hardware_interface::PositionJointInterface> {
public: public:
bool init(hardware_interface::RobotHW* robot_hardware, bool init(hardware_interface::RobotHW* robot_hardware, ros::NodeHandle& node_handle) override;
ros::NodeHandle& node_handle) override;
void starting(const ros::Time&) override; void starting(const ros::Time&) override;
void update(const ros::Time&, const ros::Duration& period) override; void update(const ros::Time&, const ros::Duration& period) override;
......
...@@ -18,8 +18,7 @@ class JointVelocityExampleController : public controller_interface::MultiInterfa ...@@ -18,8 +18,7 @@ class JointVelocityExampleController : public controller_interface::MultiInterfa
hardware_interface::VelocityJointInterface, hardware_interface::VelocityJointInterface,
franka_hw::FrankaStateInterface> { franka_hw::FrankaStateInterface> {
public: public:
bool init(hardware_interface::RobotHW* robot_hardware, bool init(hardware_interface::RobotHW* robot_hardware, ros::NodeHandle& node_handle) override;
ros::NodeHandle& node_handle) override;
void update(const ros::Time&, const ros::Duration& period) override; void update(const ros::Time&, const ros::Duration& period) override;
void starting(const ros::Time&) override; void starting(const ros::Time&) override;
void stopping(const ros::Time&) override; void stopping(const ros::Time&) override;
......
0% Loading or .
You are about to add 0 people to the discussion. Proceed with caution.
Please register or to comment