ROS Microcontroller cpp support?
In this momment I only know a cpp API for Arduino/AVR. Do you know other existing cases?
It is planned to support more microcontrollers?
ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange |
In this momment I only know a cpp API for Arduino/AVR. Do you know other existing cases?
It is planned to support more microcontrollers?
rosserial is not tied explicitly to Arduino/AVR, but is instead a serial protocol that could be used with any embedded-scale device.
I believe that it was intended to be easily portable to embedded devices with a C++ compiler.
Something else that may be of interest to you is rosserial_embeddedlinux, which uses the same rosserial protocol to communicate with embedded linux devices. The author writes:
This package contains embedded-linux-specific extensions required to run rosserial on a small embedded linux system such as the VEXPro controller, Chumby alarm clock, WRT54GL router, Raspberry Pi, or many similar devices.
If you are interested in contributing to the longer-term embedded device goals of the ROS community, I encourage you to check out the ROS Embedded SIG.
Thanks. Pretty cool. Specially this is what I was looking for. That stack doc has changed substantialy since I last visited it.
Asked: 2013-01-17 01:35:03 -0600
Seen: 274 times
Last updated: Jan 17 '13
Subscriber::shutdown() required to be called manually on destruction?
Do I need to know any specific computer language or framework to use ROS?
Problem with sensor_msgs::Image::ConstPtr conversion to IplImage
is ros client c++ code thread safe?