#include <sensor_msgs/PointField.h>
#include <sensor_msgs/PointCloud2.h>
#include <mrpt/slam/CSimplePointsMap.h>
#include <mrpt/slam/CColouredPointsMap.h>
#include "mrpt_bridge/point_cloud2.h"
#include <ros/console.h>
Go to the source code of this file.
Namespaces | |
namespace | mrpt_bridge |
Functions | |
bool | mrpt_bridge::check_field (const sensor_msgs::PointField &input_field, std::string check_name, const sensor_msgs::PointField **output) |
bool | mrpt_bridge::copy (const sensor_msgs::PointCloud2 &msg, mrpt::slam::CSimplePointsMap &obj) |
bool | mrpt_bridge::copy (const mrpt::slam::CSimplePointsMap &obj, const std_msgs::Header &msg_header, sensor_msgs::PointCloud2 &msg) |
void | mrpt_bridge::get_float_from_field (const sensor_msgs::PointField *field, const unsigned char *data, float &output) |