Only released in EOL distros:  

ROS Software Maintainer: ROBOTIS

ROBOTIS e-Manual

ROS API

op3_manager

Subscribed Topics

robotis/open_cr/button (std_msgs/String)
  • If the user button is pressed above 2 secs, ROBOTIS-OP3 will be torque on and go to init pose.
robotis/dxl_torque (std_msgs/String)
  • torque on command

Published Topics

robotis/status (robotis_controller_msgs/StatusMsg)
  • Message that describes status of action_module.
robotis/base/ini_pose (std_msgs/String)
  • message to let ROBOTIS-OP3 go init pose.

Parameters

gazebo (bool, default: false)
  • Configure whether to run the program in gazebo mode.
gazebo_robot_name (string, default: "")
  • Configure the robot name for joint_state topic name when running in gazebo mode.
    ex) If 'op3' is the 'gazebo_robot_name', '/op3/joint_states' will be subscribed.
offset_file_path (string, default: "")
  • This path indicates the location of the file that contains offset data of each joint and initial posture data for offset adjustment.
robot_file_path (string, default: "")
  • This path indicates the location of .robot file that contains robot description data.
init_file_path (string, default: "")
  • This path indicates the location of the file that contains initialization information of each joint.
device_name (string, default: "/dev/ttyUSB0")
  • This port name is used to open the communication port of OpenCR that manages Dynamixel power supply.
baud_rate (int, default: "2000000")
  • This baud rate is used to open the communication port of OpenCR that manages Dynamixel power supply.

Using Libraries

Each library has publishers and subcribers. Please refer to the information on the link.

Wiki: op3_manager (last edited 2018-04-04 05:54:07 by Gilbert)