Only released in EOL distros:
robotis_op3: cm_740_module | op3_action_module | op3_balance_control | op3_base_module | op3_direct_control_module | op3_head_control_module | op3_kinematics_dynamics | op3_localization | op3_manager | op3_online_walking_module | op3_walking_module | open_cr_module
Package Summary
Released
Documented
The op3_manager package
- Maintainer status: developed
- Maintainer: Pyo <pyo AT robotis DOT com>
- Author: Kayman <kmjung AT robotis DOT com>
- License: Apache 2.0
- Bug / feature tracker: https://github.com/ROBOTIS-GIT/ROBOTIS-OP3/issues
- Source: git https://github.com/ROBOTIS-GIT/ROBOTIS-OP3.git (branch: kinetic-devel)
Contents
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.
- torque on command
Published Topics
robotis/status (robotis_controller_msgs/StatusMsg)- Message that describes status of action_module.
- message to let ROBOTIS-OP3 go init pose.
Parameters
gazebo (bool, default: false)- Configure whether to run the program in gazebo mode.
- 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.
- This path indicates the location of the file that contains offset data of each joint and initial posture data for offset adjustment.
- This path indicates the location of .robot file that contains robot description data.
- This path indicates the location of the file that contains initialization information of each joint.
- This port name is used to open the communication port of OpenCR that manages Dynamixel power supply.
- 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.