00001
00002 #ifndef GEOMETRY_MSGS_BOOST_SERIALIZATION_POLYGON_H
00003 #define GEOMETRY_MSGS_BOOST_SERIALIZATION_POLYGON_H
00004
00005 #include <boost/serialization/serialization.hpp>
00006 #include <boost/serialization/nvp.hpp>
00007 #include <geometry_msgs/Polygon.h>
00008 #include "geometry_msgs/boost/Point32.h"
00009
00010 namespace boost
00011 {
00012 namespace serialization
00013 {
00014
00015 template<class Archive, class ContainerAllocator>
00016 void serialize(Archive& a, ::geometry_msgs::Polygon_<ContainerAllocator> & m, unsigned int)
00017 {
00018 a & make_nvp("points",m.points);
00019 }
00020
00021 }
00022 }
00023
00024 #endif // GEOMETRY_MSGS_BOOST_SERIALIZATION_POLYGON_H
00025