This program is porting rosserial_arduino for mbed http://www.ros.org/wiki/rosserial_arduino This program supported the revision of 169 of rosserial. This program contains an example.

Dependencies:   rosserial_mbed_lib mbed Servo

Revision:
0:06fc856e99ca
--- /dev/null	Thu Jan 01 00:00:00 1970 +0000
+++ b/examples/ServoControl.cpp	Fri Aug 19 09:06:16 2011 +0000
@@ -0,0 +1,46 @@
+//#define COMPILE_SERVOCONTROL_CODE_ROSSERIAL
+#ifdef  COMPILE_SERVOCONTROL_CODE_ROSSERIAL
+
+/*
+ * rosserial Servo Control Example
+ *
+ * This sketch demonstrates the control of hobby R/C servos
+ * using ROS and the arduiono
+ *
+ * For the full tutorial write up, visit
+ * www.ros.org/wiki/rosserial_arduino_demos
+ *
+ * For more information on the Arduino Servo Library
+ * Checkout :
+ * http://www.arduino.cc/en/Reference/Servo
+ */
+
+#include "mbed.h"
+#include "Servo.h"
+#include <ros.h>
+#include <std_msgs/UInt16.h>
+
+ros::NodeHandle  nh;
+
+Servo servo(p21);
+DigitalOut myled(LED1);
+
+void servo_cb( const std_msgs::UInt16& cmd_msg) {
+    servo.position(cmd_msg.data); //set servo angle, should be from 0-180
+    myled = !myled;  //toggle led
+}
+
+
+ros::Subscriber<std_msgs::UInt16> sub("servo", servo_cb);
+
+int main() {
+
+    nh.initNode();
+    nh.subscribe(sub);
+
+    while (1) {
+        nh.spinOnce();
+        wait_ms(1);
+    }
+}
+#endif
\ No newline at end of file