Only released in EOL distros:
robotis_framework: robotis_controller | robotis_device | robotis_framework_common
Package Summary
Released
Documented
robotis_controller package for ROBOTIS's platform like Manipulator-H, THORMANG and OP series
- Maintainer status: developed
- Maintainer: Pyo <pyo AT robotis DOT com>
- Author: Zerom <zerom AT robotis DOT com>, Kayman <kmjung AT robotis DOT com>, SCH <sch AT robotis DOT com>
- License: Apache 2.0
- Bug / feature tracker: https://github.com/ROBOTIS-GIT/ROBOTIS-Framework/issues
- Source: git https://github.com/ROBOTIS-GIT/ROBOTIS-Framework.git (branch: kinetic-devel)
ROS Software Maintainer: ROBOTIS
ROBOTIS e-Manual
ROS API
robotis_controller
Subscribed Topics
/robotis/write_control_table (robotis_controller_msgs/WriteControlTable)- The message can write multiple item values to a specific joint by using Sync Write.
- The message can write a specific item value to multiple joints by using Sync Write.
- The message can configure motion modules that controls specific joints.
- This message assigns a specific motion module that manages specific joints to a motion control module.
- The message sets the control mode of robotis_controller to ether DIRECT_CONTROL_MODE or MOTION_MODULE_MODE.
- This message includes status data for each joint. The data in this message is transmitted to each joint to control the joint.
- This message includes status data for each joint from gazebo. When gazebo mode is enabled, the data in this message is transmitted to each joint to control the joint.
Published Topics
/robotis/goal_joint_states (sensor_msgs/JointState)- The message publishes goal joint status value for each joint.
- The message publishes present joint status value read from each joint.
- The message publishes current status of motion module that controls each joint.
Services
/robotis/get_present_joint_ctrl_modules (robotis_controller_msgs/GetJointModule)- The service to get the configuration of motion module that controls each joint.
- The service to set the configuration of motion module that controls each joint.
- The service to set the configuration of motion module that controls all joints.