Only released in EOL distros:
rtai_integration: rtai_ros_bridge | rtai_wrapper
Package Summary
Documented
This package provides an easy way to interface with RTAI tasks via RTAI mail boxes
- Author: Johannes Mayr
- License: BSD
- Source: svn http://robin-jku-linz-ros-pkg.googlecode.com/svn/trunk/rtai_integration/
Documentation
This package provides a single node rtai_ros_bridge to interface with an RTAI task. Before running this node one should adopt the sample time and the mailbox names used by the node to the own needs (hardcoded in source).
Nodes
wheeled_robin_node
Node receives data from a mailbox and publishes this data to ROS. Data subscribed from ros is sent into an other mailbox.Subscribed Topics
data_to_rtai (std_msgs/UInt8MultiArray)- This data is directly sent to the mailbox and can then be read by the RTAI task.
Published Topics
data_from_rtai (std_msgs/UInt8MultiArray)- Any data sent into the mailbox by the RTAI task is publised on this topic.