Skip to content

Commit

Permalink
fix format and add control_msgs to repos file
Browse files Browse the repository at this point in the history
Signed-off-by: Paul Gesel <[email protected]>
  • Loading branch information
pac48 committed Apr 8, 2024
1 parent 6b44ba8 commit 254ae07
Show file tree
Hide file tree
Showing 7 changed files with 19 additions and 22 deletions.
6 changes: 3 additions & 3 deletions parallel_gripper_controller/doc/userdoc.rst
Original file line number Diff line number Diff line change
Expand Up @@ -7,10 +7,10 @@ Parallel Gripper Action Controller

Controller for executing a ``ParallelGripperCommand`` action for simple parallel grippers.
This controller supports grippers that offer position only control as well as grippers that allow configuring the velocity and effort.
By default, the controller will only claim the `{joint}/position` interface for control.
The velocity and effort interfaces can be optionally claimed by setting the `max_velocity_interface` and `max_effort_interface` parameter, respectively.
By default, the controller will only claim the ``{joint}/position`` interface for control.
The velocity and effort interfaces can be optionally claimed by setting the ``max_velocity_interface`` and ``max_effort_interface`` parameter, respectively.
By default, the controller will try to claim position and velocity state interfaces.
The claimed state interfaces can be configured by setting the `state_interfaces` parameter.
The claimed state interfaces can be configured by setting the ``state_interfaces`` parameter.

Parameters
^^^^^^^^^^^
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -14,8 +14,8 @@

/// \author Sachin Chitta, Adolfo Rodriguez Tsouroukdissian

#ifndef PARALLEL_GRIPPER_CONTROLLER__GRIPPER_ACTION_CONTROLLER_HPP_
#define PARALLEL_GRIPPER_CONTROLLER__GRIPPER_ACTION_CONTROLLER_HPP_
#ifndef PARALLEL_GRIPPER_CONTROLLER__PARALLEL_GRIPPER_ACTION_CONTROLLER_HPP_
#define PARALLEL_GRIPPER_CONTROLLER__PARALLEL_GRIPPER_ACTION_CONTROLLER_HPP_

// C++ standard
#include <cassert>
Expand All @@ -33,10 +33,10 @@
#include "rclcpp_action/create_server.hpp"

// ros_controls
#include "parallel_gripper_controller/visibility_control.hpp"
#include "controller_interface/controller_interface.hpp"
#include "hardware_interface/loaned_command_interface.hpp"
#include "hardware_interface/loaned_state_interface.hpp"
#include "parallel_gripper_controller/visibility_control.hpp"
#include "realtime_tools/realtime_buffer.h"
#include "realtime_tools/realtime_server_goal_handle.h"

Expand Down Expand Up @@ -171,4 +171,4 @@ class GripperActionController : public controller_interface::ControllerInterface

#include "parallel_gripper_controller/parallel_gripper_action_controller_impl.hpp"

#endif // PARALLEL_GRIPPER_CONTROLLER__GRIPPER_ACTION_CONTROLLER_HPP_
#endif // PARALLEL_GRIPPER_CONTROLLER__PARALLEL_GRIPPER_ACTION_CONTROLLER_HPP_
Original file line number Diff line number Diff line change
Expand Up @@ -14,14 +14,15 @@

/// \author Sachin Chitta, Adolfo Rodriguez Tsouroukdissian, Stu Glaser

#ifndef PARALLEL_GRIPPER_CONTROLLER__GRIPPER_ACTION_CONTROLLER_IMPL_HPP_
#define PARALLEL_GRIPPER_CONTROLLER__GRIPPER_ACTION_CONTROLLER_IMPL_HPP_
#ifndef PARALLEL_GRIPPER_CONTROLLER__PARALLEL_GRIPPER_ACTION_CONTROLLER_IMPL_HPP_
#define PARALLEL_GRIPPER_CONTROLLER__PARALLEL_GRIPPER_ACTION_CONTROLLER_IMPL_HPP_

#include "parallel_gripper_controller/parallel_gripper_action_controller.hpp"

#include <hardware_interface/types/hardware_interface_type_values.hpp>
#include <memory>
#include <string>
#include <vector>

#include <hardware_interface/types/hardware_interface_type_values.hpp>
#include "parallel_gripper_controller/parallel_gripper_action_controller.hpp"

namespace parallel_gripper_action_controller
{
Expand Down Expand Up @@ -395,4 +396,4 @@ GripperActionController::GripperActionController()

} // namespace parallel_gripper_action_controller

#endif // PARALLEL_GRIPPER_CONTROLLER__GRIPPER_ACTION_CONTROLLER_IMPL_HPP_
#endif // PARALLEL_GRIPPER_CONTROLLER__PARALLEL_GRIPPER_ACTION_CONTROLLER_IMPL_HPP_
Original file line number Diff line number Diff line change
Expand Up @@ -15,11 +15,11 @@
/// \author Sachin Chitta

// Project
#include <parallel_gripper_controller/parallel_gripper_action_controller.hpp>
#include <hardware_interface/types/hardware_interface_type_values.hpp>
#include <parallel_gripper_controller/parallel_gripper_action_controller.hpp>

#include "pluginlib/class_list_macros.hpp"

PLUGINLIB_EXPORT_CLASS(
parallel_gripper_action_controller::GripperActionController,
parallel_gripper_action_controller::GripperActionController,
controller_interface::ControllerInterface)
Original file line number Diff line number Diff line change
Expand Up @@ -21,9 +21,9 @@

#include "gmock/gmock.h"

#include "parallel_gripper_controller/parallel_gripper_action_controller.hpp"
#include "hardware_interface/handle.hpp"
#include "hardware_interface/types/hardware_interface_type_values.hpp"
#include "parallel_gripper_controller/parallel_gripper_action_controller.hpp"

namespace
{
Expand Down
4 changes: 0 additions & 4 deletions ros2_controllers-not-released.rolling.repos
Original file line number Diff line number Diff line change
Expand Up @@ -3,7 +3,3 @@ repositories:
type: git
url: https://github.com/picknikrobotics/generate_parameter_library.git
version: main
control_msgs:
type: git
url: https://github.com/pac48/control_msgs.git
version: pr-add-gripper-velocity-target-main
4 changes: 2 additions & 2 deletions ros2_controllers.rolling.repos
Original file line number Diff line number Diff line change
Expand Up @@ -9,8 +9,8 @@ repositories:
version: master
control_msgs:
type: git
url: https://github.com/ros-controls/control_msgs.git
version: master
url: https://github.com/pac48/control_msgs.git
version: pr-add-gripper-velocity-target-main
control_toolbox:
type: git
url: https://github.com/ros-controls/control_toolbox.git
Expand Down

0 comments on commit 254ae07

Please sign in to comment.