#include "flirtlib.h"#include <flirtlib_ros/ScanMap.h>#include <sensor_msgs/LaserScan.h>#include <visualization_msgs/Marker.h>#include <geometry_msgs/Pose.h>

Go to the source code of this file.
Classes | |
| struct | flirtlib_ros::RefScan |
Namespaces | |
| namespace | flirtlib_ros |
Functions | |
| boost::shared_ptr< LaserReading > | flirtlib_ros::fromRos (const sensor_msgs::LaserScan &scan) |
| Convert a ROS laser scan message to a flirtlib scan. | |
| InterestPoint * | flirtlib_ros::fromRos (const InterestPointRos &m) |
| RefScan | flirtlib_ros::fromRos (const RefScanRos &r) |
| Convert a single RefScanRos message to a RefScan. | |
| std::vector< RefScan > | flirtlib_ros::fromRos (const ScanMap &scan_map) |
| Convert a ScanMap to a set of ref scans. | |
| visualization_msgs::Marker | flirtlib_ros::interestPointMarkers (const std::vector< InterestPoint * > &pts, const geometry_msgs::Pose &pose, unsigned id=0) |
| std::vector < visualization_msgs::Marker > | flirtlib_ros::poseMarkers (const std::vector< geometry_msgs::Pose > &poses) |
| Markers for a set of poses. | |
| InterestPointRos | flirtlib_ros::toRos (const InterestPoint &pt) |
| Convert a flirtlib interest point to InterestPointRos. | |
| RefScanRos | flirtlib_ros::toRos (const RefScan &r) |
| Convert a single RefScan to a ROS message. | |
| ScanMap | flirtlib_ros::toRos (const std::vector< RefScan > &scans) |
| Convert a vector of RefScan's to a ScanMap. | |
Conversions between ROS types and those expected by flirtlib
Definition in file conversions.h.