Skip to content
This repository has been archived by the owner on Dec 13, 2024. It is now read-only.

Commit

Permalink
rename streaming_controller to servo_controller
Browse files Browse the repository at this point in the history
Signed-off-by: Paul Gesel <paulgesel@gmail.com>
  • Loading branch information
pac48 authored and sjahr committed Jan 23, 2024
1 parent 7ae8298 commit 89fe3f3
Show file tree
Hide file tree
Showing 9 changed files with 12 additions and 12 deletions.
2 changes: 1 addition & 1 deletion src/picknik_ur_base_config/config/config.yaml
Original file line number Diff line number Diff line change
Expand Up @@ -187,7 +187,7 @@ ros2_control:
- "force_torque_sensor_broadcaster"
- "robotiq_gripper_controller"
- "joint_state_broadcaster"
- "streaming_controller"
- "servo_controller"
- "io_and_status_controller"
- "robotiq_activation_controller"
# Load but do not start these controllers so they can be activated later if needed.
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -13,7 +13,7 @@ controller_manager:
type: position_controllers/GripperActionController
robotiq_activation_controller:
type: robotiq_controllers/RobotiqActivationController
streaming_controller:
servo_controller:
type: joint_trajectory_controller/JointTrajectoryController
admittance_controller_open_door:
type: admittance_controller/AdmittanceController
Expand Down Expand Up @@ -118,7 +118,7 @@ joint_trajectory_controller_chained_open_door:
wrist_3_joint:
goal: 0.25

streaming_controller:
servo_controller:
ros__parameters:
joints:
- shoulder_pan_joint
Expand Down
2 changes: 1 addition & 1 deletion src/picknik_ur_base_config/config/moveit/ur_servo.yaml
Original file line number Diff line number Diff line change
Expand Up @@ -53,7 +53,7 @@ cartesian_command_in_topic: ~/delta_twist_cmds # Topic for incoming Cartesian t
joint_command_in_topic: ~/delta_joint_cmds # Topic for incoming joint angle commands
joint_topic: /joint_states
status_topic: ~/status # Publish status to this topic
command_out_topic: /streaming_controller/joint_trajectory # Publish outgoing commands here
command_out_topic: /servo_controller/joint_trajectory # Publish outgoing commands here

## Collision checking for the entire robot body
check_collisions: true # Check collisions?
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<root BTCPP_format="4" main_tree_to_execute="Teleoperate Joint Jog">
<BehaviorTree ID="Teleoperate Joint Jog" _description="Teleoperate the robot in joint jog mode from the Web UI">
<Control ID="Sequence" name="root">
<Action ID="TeleoperateJointJog" controller_name="streaming_controller"/>
<Action ID="TeleoperateJointJog" controller_name="servo_controller"/>
</Control>
</BehaviorTree>
</root>
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<root BTCPP_format="4" main_tree_to_execute="Teleoperate Twist">
<BehaviorTree ID="Teleoperate Twist" _description="Teleoperate the robot in Cartesian twist mode from the Web UI">
<Control ID="Sequence" name="root">
<Action ID="TeleoperateTwist" controller_name="streaming_controller"/>
<Action ID="TeleoperateTwist" controller_name="servo_controller"/>
</Control>
</BehaviorTree>
</root>
2 changes: 1 addition & 1 deletion src/picknik_ur_gazebo_config/config/config.yaml
Original file line number Diff line number Diff line change
Expand Up @@ -88,7 +88,7 @@ octomap_manager:
ros2_control:
controllers_active_at_startup:
- "joint_state_broadcaster"
- "streaming_controller"
- "servo_controller"
- "robotiq_gripper_controller"
controllers_inactive_at_startup:
- "joint_trajectory_controller"
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -7,7 +7,7 @@ controller_manager:
type: joint_trajectory_controller/JointTrajectoryController
robotiq_gripper_controller:
type: position_controllers/GripperActionController
streaming_controller:
servo_controller:
type: joint_trajectory_controller/JointTrajectoryController

joint_trajectory_controller:
Expand Down Expand Up @@ -50,7 +50,7 @@ joint_trajectory_controller:
wrist_3_joint:
goal: 0.05

streaming_controller:
servo_controller:
ros__parameters:
joints:
- shoulder_pan_joint
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -176,8 +176,8 @@
<plugin filename="ign_ros2_control-system" name="ign_ros2_control::IgnitionROS2ControlPlugin">
<parameters>$(find picknik_ur_gazebo_config)/config/control/picknik_ur5e.ros2_control.yaml</parameters>
<ros>
<remapping>/streaming_controller/commands:=/robot_controllers/commands</remapping>
<remapping>/streaming_controller/joint_trajectory:=/robot_controllers/joint_trajectory</remapping>
<remapping>/servo_controller/commands:=/robot_controllers/commands</remapping>
<remapping>/servo_controller/joint_trajectory:=/robot_controllers/joint_trajectory</remapping>
</ros>
</plugin>
</gazebo>
Expand Down
2 changes: 1 addition & 1 deletion src/picknik_ur_mock_hw_config/config/moveit/ur_servo.yaml
Original file line number Diff line number Diff line change
Expand Up @@ -51,7 +51,7 @@ cartesian_command_in_topic: ~/delta_twist_cmds # Topic for incoming Cartesian t
joint_command_in_topic: ~/delta_joint_cmds # Topic for incoming joint angle commands
joint_topic: /joint_states
status_topic: ~/status # Publish status to this topic
command_out_topic: /streaming_controller/joint_trajectory # Publish outgoing commands here
command_out_topic: /servo_controller/joint_trajectory # Publish outgoing commands here

## Collision checking for the entire robot body
check_collisions: true # Check collisions?
Expand Down

0 comments on commit 89fe3f3

Please sign in to comment.