Only released in EOL distros:  

Nodes

revel_driver

The revel driver is responsible for communicating and interfacing between the motors and ROS. The driver can be run in several modes, including position, velocity and gravity control mode. Use cases for these modes are trajectory playback, cartesian velocity and kinesthetic teaching respectively.

Subscribed Topics

/joint_states (sensor_msgs/JointState)
  • Standardized joint state information used to inform tf, moveit, etc.

Published Topics

/revel/motor_state (svenzva_msgs/MotorStateList)
  • Raw motor state information collected directly from motor packets.
/svenzva_joint_action/ (svenzva_msgs/SvenzvaJointAction)
  • A forward kinematics joint action interface.
/revel/follow_joint_trajectory (control_msgs/FollowJointTrajectoryAction)
  • A trajectory playback action interface for MoveIt! and compliant controllers.
/revel/gripper_action/ (svenzva_msgs/GripperAction)
  • A gripper action interface used to open and close the Revel gripper.

Services

/home_arm_service (svenzva_msgs/HomeArmService)
  • commands the arm to the all-zero configuration
/revel/SetTorqueEnable (svenzva_msgs/SetTorqueEnable)
  • commands individual joints to enable or disable torque actuation without turning off the motor
/revel/gripper/insert_finger (svenzva_msgs/HomeArmService)
  • resets finger position in model. Useful when hot-swapping for fingers of a different size or shape

Parameters

~data_frequency (int, default: 50)
  • The frequency (Hz) that state information is gathered from the arm's motors. Stable maximum is 100 Hz.
~mode (str, default: user_defined (position control))
  • The initial, internal mode of the arm motors set in the svenzva_bringup.launch file. Possible values are user_defined, velocity and gravity.

revel_dynamic_model

The revel dynamic model uses the current position of the robot along with an internal model of the arms dynamics to estimate the amount of force required to hold the arm up at that position against gravity. This module is required for gravity mode.

Subscribed Topics

/joint_states (sensor_msgs/JointState)
  • Standardized joint state information used to inform tf, moveit, etc.

Published Topics

/revel/model_efforts (sensor_msgs/JointState)
  • Estimated torque information for each motor given the current position of the arm.

Wiki: svenzva_drivers (last edited 2018-02-20 15:59:20 by MaxSvetlik)