#include <fstream>
#include <iostream>
#include <string>
#include <vector>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/PointField.h>
Go to the source code of this file.
Functions | |
bool | serialize_sensor_msg (const sensor_msgs::PointCloud2::ConstPtr &cloud, const std::string text_file_name, const std::string binary_blob_file_name) |
bool | unserialize_sensor_msg (const sensor_msgs::PointCloud2::Ptr &cloud, const std::string text_file_name, const std::string binary_blob_file_name) |
bool serialize_sensor_msg | ( | const sensor_msgs::PointCloud2::ConstPtr & | cloud, |
const std::string | text_file_name, | ||
const std::string | binary_blob_file_name | ||
) |
Definition at line 25 of file sensor_msg_serialization.h.
bool unserialize_sensor_msg | ( | const sensor_msgs::PointCloud2::Ptr & | cloud, |
const std::string | text_file_name, | ||
const std::string | binary_blob_file_name | ||
) |
Definition at line 71 of file sensor_msg_serialization.h.