| Namespaces | |
| dynamics | |
| msgs | |
| Classes | |
| class | CameraInfoPublisher | 
| class | CameraParamPublisher | 
| class | ConfidencePublisher | 
| class | DepthPublisher | 
| class | DeviceNodelet | 
| class | DisparityColorPublisher | 
| class | DisparityPublisher | 
| class | DynamicsStream | 
| Specific implementation for roboception::msgs::Dynamics messages.  More... | |
| class | ErrorDepthPublisher | 
| class | ErrorDisparityPublisher | 
| class | GenICam2RosPublisher | 
| Interface for all publishers relating to images, point clouds or other stereo-camera data.  More... | |
| class | ImagePublisher | 
| class | Points2Publisher | 
| class | PoseAndTFStream | 
| Specific implementation for roboception::msgs::Frame messages that publishes received messages not only as ros StampedPoses but also on tf if desired.  More... | |
| class | Protobuf2RosPublisher | 
| Generic implementation for publishing protobuf messages to ros.  More... | |
| class | Protobuf2RosStream | 
| Implementation of a ThreadedStream that receives rc_visard's dynamics protobuf messages and re-publishes them as ros messages.  More... | |
| class | ThreadedStream | 
| Convenience classes to implement and manage different types of data streams in separate threads.  More... | |
| class | TrajectoryTime | 
| Functions | |
| bool | getThisHostsIP (std::string &this_hosts_ip, const std::string &other_hosts_ip, const std::string &network_interface="") | 
| bool | getThisHostsIP (string &this_hosts_ip, const string &other_hosts_ip, const string &network_interface) | 
| uint32_t | ipToUInt (const std::string &ip) | 
| bool | isIPInRange (const std::string &ip, const std::string &network, const std::string &mask) | 
| bool | isValidIPAddress (const std::string &ip) | 
| sensor_msgs::ImuPtr | toRosImu (const roboception::msgs::Imu &imu) | 
| geometry_msgs::PosePtr | toRosPose (const roboception::msgs::Pose &pose) | 
| geometry_msgs::PoseStampedPtr | toRosPoseStamped (const roboception::msgs::Frame &frame) | 
| geometry_msgs::PoseStampedPtr | toRosPoseStamped (const roboception::msgs::Pose &pose, const roboception::msgs::Time &time, const std::string &frame_id) | 
| geometry_msgs::PoseWithCovarianceStampedPtr | toRosPoseWithCovarianceStamped (const roboception::msgs::Frame &frame) | 
| tf::StampedTransform | toRosTfStampedTransform (const roboception::msgs::Frame &frame) | 
| tf::Transform | toRosTfTransform (const roboception::msgs::Pose &pose) | 
| ros::Time | toRosTime (const roboception::msgs::Time &time) | 
| sensor_msgs::ImuPtr rc::toRosImu | ( | const roboception::msgs::Imu & | imu | ) | 
Definition at line 23 of file protobuf2ros_conversions.cc.
| geometry_msgs::PosePtr rc::toRosPose | ( | const roboception::msgs::Pose & | pose | ) | 
Definition at line 39 of file protobuf2ros_conversions.cc.
| geometry_msgs::PoseStampedPtr rc::toRosPoseStamped | ( | const roboception::msgs::Frame & | frame | ) | 
Definition at line 52 of file protobuf2ros_conversions.cc.
| geometry_msgs::PoseStampedPtr rc::toRosPoseStamped | ( | const roboception::msgs::Pose & | pose, | 
| const roboception::msgs::Time & | time, | ||
| const std::string & | frame_id | ||
| ) | 
Definition at line 70 of file protobuf2ros_conversions.cc.
| geometry_msgs::PoseWithCovarianceStampedPtr rc::toRosPoseWithCovarianceStamped | ( | const roboception::msgs::Frame & | frame | ) | 
Definition at line 86 of file protobuf2ros_conversions.cc.
| tf::StampedTransform rc::toRosTfStampedTransform | ( | const roboception::msgs::Frame & | frame | ) | 
Definition at line 118 of file protobuf2ros_conversions.cc.
| tf::Transform rc::toRosTfTransform | ( | const roboception::msgs::Pose & | pose | ) | 
Definition at line 109 of file protobuf2ros_conversions.cc.
| ros::Time rc::toRosTime | ( | const roboception::msgs::Time & | time | ) | 
Definition at line 18 of file protobuf2ros_conversions.cc.