00001 
00002 #ifndef NAV_MSGS_BOOST_SERIALIZATION_ODOMETRY_H
00003 #define NAV_MSGS_BOOST_SERIALIZATION_ODOMETRY_H
00004 
00005 #include <boost/serialization/serialization.hpp>
00006 #include <boost/serialization/nvp.hpp>
00007 #include <nav_msgs/Odometry.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 "geometry_msgs/boost/PoseWithCovariance.h"
00015 #include "geometry_msgs/boost/TwistWithCovariance.h"
00016 
00017 namespace boost
00018 {
00019 namespace serialization
00020 {
00021 
00022 template<class Archive, class ContainerAllocator>
00023 void serialize(Archive& a,  ::nav_msgs::Odometry_<ContainerAllocator>  & m, unsigned int)
00024 {
00025     a & make_nvp("header",m.header);
00026     a & make_nvp("child_frame_id",m.child_frame_id);
00027     a & make_nvp("pose",m.pose);
00028     a & make_nvp("twist",m.twist);
00029 }
00030 
00031 } 
00032 } 
00033 
00034 #endif // NAV_MSGS_BOOST_SERIALIZATION_ODOMETRY_H
00035