#include <sensor_msgs/PointField.h>
#include <sensor_msgs/PointCloud2.h>
#include <ros/console.h>
#include "mrpt_bridge/point_cloud2.h"
#include <mrpt/version.h>
#include <mrpt/maps/CSimplePointsMap.h>
#include <mrpt/maps/CColouredPointsMap.h>
Go to the source code of this file.
Namespaces | |
mrpt_bridge | |
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types. | |
Functions | |
bool | mrpt_bridge::check_field (const sensor_msgs::PointField &input_field, std::string check_name, const sensor_msgs::PointField **output) |
void | mrpt_bridge::get_float_from_field (const sensor_msgs::PointField *field, const unsigned char *data, float &output) |
sensor_msgs::PointCloud2: ROS <-> MRPT | |
bool | mrpt_bridge::copy (const sensor_msgs::PointCloud2 &msg, mrpt::maps::CSimplePointsMap &obj) |
bool | mrpt_bridge::copy (const mrpt::maps::CSimplePointsMap &obj, const std_msgs::Header &msg_header, sensor_msgs::PointCloud2 &msg) |