<> <> ''ROS Software Maintainer: [[http://wiki.ros.org/ROBOTIS|ROBOTIS]]'' == ROBOTIS e-Manual == * [[http://emanual.robotis.com/docs/en/platform/op3/introduction/|ROBOTIS e-Manual for ROBOTIS-OP3]] == ROS API == {{{ #!clearsilver CS/NodeAPI node.0 { name= op3_head_control_module(lib) pub{ 0{ name= robotis/status type= robotis_controller_msgs/StatusMsg desc= This message notifies the status of head_control_module. } } sub{ 0{ name= robotis/head_control/scan_command type= std_msgs/String desc= This message will request a looking around head motion to scan the environment. } 1{ name= robotis/head_control/set_joint_states type= sensor_msgs/JointState desc= Head joints will rotate to corresponding angles written in the message. } 2{ name= robotis/head_control/set_joint_states_offset type= sensor_msgs/JointState desc= Head joints will adjust angles by offset values written in the message. } } } }}}