00001
00002 #ifndef SENSOR_MSGS_BOOST_SERIALIZATION_POINTCLOUD2_H
00003 #define SENSOR_MSGS_BOOST_SERIALIZATION_POINTCLOUD2_H
00004
00005 #include <boost/serialization/serialization.hpp>
00006 #include <boost/serialization/nvp.hpp>
00007 #include <sensor_msgs/PointCloud2.h>
00008 #include <ros/common.h>
00009 #if ROS_VERSION_MINIMUM(1,4,0)
00010 #include <std_msgs/Header.h>
00011 #else
00012 #include <roslib/Header.h>
00013 #endif
00014 #include "sensor_msgs/boost/PointField.h"
00015
00016 namespace boost
00017 {
00018 namespace serialization
00019 {
00020
00021 template<class Archive, class ContainerAllocator>
00022 void serialize(Archive& a, ::sensor_msgs::PointCloud2_<ContainerAllocator> & m, unsigned int)
00023 {
00024 a & make_nvp("header",m.header);
00025 a & make_nvp("height",m.height);
00026 a & make_nvp("width",m.width);
00027 a & make_nvp("fields",m.fields);
00028 a & make_nvp("is_bigendian",m.is_bigendian);
00029 a & make_nvp("point_step",m.point_step);
00030 a & make_nvp("row_step",m.row_step);
00031 a & make_nvp("data",m.data);
00032 a & make_nvp("is_dense",m.is_dense);
00033 }
00034
00035 }
00036 }
00037
00038 #endif // SENSOR_MSGS_BOOST_SERIALIZATION_POINTCLOUD2_H
00039