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