Go to the source code of this file.
Functions | |
int | main () |
DigitalOut | myled (LED1) |
void | servo_cb (const std_msgs::UInt16 &cmd_msg) |
Variables | |
ros::NodeHandle | nh |
ros::Subscriber< std_msgs::UInt16 > | sub ("servo", servo_cb) |
int main | ( | void | ) |
Definition at line 36 of file ServoControl.cpp.
DigitalOut myled | ( | LED1 | ) |
void servo_cb | ( | const std_msgs::UInt16 & | cmd_msg | ) |
Definition at line 28 of file ServoControl.cpp.
Definition at line 17 of file ServoControl.cpp.
ros::Subscriber<std_msgs::UInt16> sub("servo", servo_cb) |