<<PackageHeader(op3_action_module)>>
<<TOC(4)>>

''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_action_module(lib)

pub{
  0{
    name= robotis/status
    type= robotis_controller_msgs/StatusMsg
    desc= Message that describes status of action_module.
  }
}

sub{
  0{
    name= robotis/action/page_num
    type= std_msgs/Int32
    desc= The page number of action to run in the Module. <<BR>> 1 ~ 255 : play action <<BR>> -1 : stop action<<BR>> -2 :brake action
  }
}

srv{
  0{
    name= robotis/action/is_running
    type= op3_action_module_msgs/IsRunning
    desc= Service that checks whether the action is running or not.
  }
}

param{
  0{
    name= action file path
    default= '''''op3_action_module/data/motion_4095.bin'''''
    type= string
    desc= File path that indicates the location of action libraries for OP3.
  }
}
}}}