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