Wiki

Overview

This package provides the driver for controlling the Schunk Five Finger Hand with ROS-control.

Installation

Please see the install instructions in the official Github repository. The driver communicates via a RS485-based protocol, for which the Brainbox USB to Serial converters have proven to work well. They are usually distributed together with the hand.

ROS API

svh_ros_control_node

This is the only node that's needed to control the Schunk Five Finger Hand. It uses ROS-control for managing controllers. Most topic and service communication is thus handled through the controller manager, such as publishing joint_states and receiving action goals for the joint_trajectory_controller. The node adds the following topics and services.

Subscribed Topics

connect (std_msgs/Empty) enable_channel (std_msgs/Int8)

Services

home_reset_offset_all (schunk_svh_msgs/HomeAll) home_reset_offset_by_id (schunk_svh_msgs/HomeWithChannels) set_all_force_limits (schunk_svh_msgs/SetAllChannelForceLimits) set_force_limit_by_id (schunk_svh_msgs/SetChannelForceLimit)

Parameters

~autostart (bool, default: true) ~connect_retry_count (int, default: 3) ~serial_device (string, default: /dev/ttyUSB0) ~disable_flags (vector of bool, default: 9 x false) ~reset_timeout (int, default: 5) ~finger_reset_speed (double, default: 0.2) /robot_description (urdf model, default: schunk_svh_description/urdf/svh-standalone.urdf.xacro) ~maximal_force (float, default: 0.9) ~name_prefix (string, default: right_hand)

Additional Information

You'll find additional information under the following links about

Wiki: schunk_svh_ros_driver (last edited 2023-03-29 08:07:09 by HarryArnst)