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