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

Commit

Permalink
Updates for new MoveIt Servo (#98)
Browse files Browse the repository at this point in the history
  • Loading branch information
sea-bass authored Sep 27, 2023
1 parent 714279d commit a2e9e39
Show file tree
Hide file tree
Showing 7 changed files with 23 additions and 19 deletions.
6 changes: 2 additions & 4 deletions src/picknik_ur_base_config/config/moveit/ur_servo.yaml
Original file line number Diff line number Diff line change
Expand Up @@ -19,7 +19,6 @@ override_velocity_scaling_factor: 0.5

## Properties of outgoing commands
publish_period: 0.002 # 1/Nominal publish rate [seconds]
low_latency_mode: false # Set this to true to publish as soon as an incoming Twist command is received (publish_period is ignored)

# What type of topic does your robot driver expect?
# Currently supported are std_msgs/Float64MultiArray or trajectory_msgs/JointTrajectory
Expand All @@ -31,9 +30,8 @@ publish_joint_velocities: false
publish_joint_accelerations: false

## Plugins for smoothing outgoing commands
use_smoothing: true
smoothing_filter_plugin_name: "online_signal_smoothing::ButterworthFilterPlugin"

## Incoming Joint State properties
low_pass_filter_coeff: 1.5 # Larger --> trust the filtered data more, trust the measurements less.

## MoveIt properties
Expand All @@ -42,7 +40,7 @@ planning_frame: base_link # The MoveIt planning frame. Often 'base_link' or 'wo
is_primary_planning_scene_monitor: false # The MoveGroup node maintains the planning scene, so Servo needs to get its world info from there.

## Other frames
ee_frame_name: manual_grasp_link # The name of the end effector link, used to return the EE pose
ee_frame: manual_grasp_link # The name of the end effector link, used to return the EE pose
robot_link_command_frame: base_link # commands must be given in the frame of a robot link. Usually either the base or end effector

## Stopping behaviour
Expand Down
8 changes: 0 additions & 8 deletions src/picknik_ur_base_config/objectives/teleoperate.xml

This file was deleted.

Original file line number Diff line number Diff line change
@@ -0,0 +1,8 @@
<?xml version="1.0"?>
<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"/>
</Control>
</BehaviorTree>
</root>
8 changes: 8 additions & 0 deletions src/picknik_ur_base_config/objectives/teleoperate_twist.xml
Original file line number Diff line number Diff line change
@@ -0,0 +1,8 @@
<?xml version="1.0"?>
<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"/>
</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 @@ -76,7 +76,7 @@ moveit_params:
path: "config/moveit/sensors_3d.yaml"
servo:
package: "picknik_ur_gazebo_config"
path: "config/moveit/ur5e_servo.yaml"
path: "config/moveit/ur_servo.yaml"

octomap_manager:
# Input point cloud topic name. The *output* point cloud topic published by
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -19,7 +19,6 @@ override_velocity_scaling_factor: 0.5

## Properties of outgoing commands
publish_period: 0.005 # 1/Nominal publish rate [seconds]
low_latency_mode: true # Set this to true to publish as soon as an incoming Twist command is received (publish_period is ignored)

# What type of topic does your robot driver expect?
# Currently supported are std_msgs/Float64MultiArray or trajectory_msgs/JointTrajectory
Expand All @@ -31,9 +30,8 @@ publish_joint_velocities: false
publish_joint_accelerations: false

## Plugins for smoothing outgoing commands
use_smoothing: true
smoothing_filter_plugin_name: "online_signal_smoothing::ButterworthFilterPlugin"

## Incoming Joint State properties
low_pass_filter_coeff: 4.0 # Larger --> trust the filtered data more, trust the measurements less.

## MoveIt properties
Expand All @@ -42,11 +40,11 @@ planning_frame: base_link # The MoveIt planning frame. Often 'base_link' or 'wo
is_primary_planning_scene_monitor: false # The MoveGroup node maintains the planning scene, so Servo needs to get its world info from there.

## Other frames
ee_frame_name: manual_grasp_link # The name of the end effector link, used to return the EE pose
ee_frame: manual_grasp_link # The name of the end effector link, used to return the EE pose
robot_link_command_frame: base_link # commands must be given in the frame of a robot link. Usually either the base or end effector

## Stopping behaviour
incoming_command_timeout: 0.1 # Stop servoing if X seconds elapse without a new command
incoming_command_timeout: 0.05 # Stop servoing if X seconds elapse without a new command

## Configure handling of singularities and joint limits
lower_singularity_threshold: 30.0 # Start decelerating when the condition number hits this (close to singularity)
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 @@ -38,7 +38,7 @@ planning_frame: base_link # The MoveIt planning frame. Often 'base_link' or 'wo
is_primary_planning_scene_monitor: false # The MoveGroup node maintains the planning scene, so Servo needs to get its world info from there.

## Other frames
ee_frame_name: manual_grasp_link # The name of the end effector link, used to return the EE pose
ee_frame: manual_grasp_link # The name of the end effector link, used to return the EE pose
robot_link_command_frame: base_link # commands must be given in the frame of a robot link. Usually either the base or end effector

## Stopping behaviour
Expand Down

0 comments on commit a2e9e39

Please sign in to comment.