AidingSensorParams.h
Go to the documentation of this file.
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-fuerte-applanix_driver/doc_stacks/2014-01-02_11-02-36.446834/applanix_driver/applanix_msgs/msg/AidingSensorParams.msg */
00002 #ifndef APPLANIX_MSGS_MESSAGE_AIDINGSENSORPARAMS_H
00003 #define APPLANIX_MSGS_MESSAGE_AIDINGSENSORPARAMS_H
00004 #include <string>
00005 #include <vector>
00006 #include <map>
00007 #include <ostream>
00008 #include "ros/serialization.h"
00009 #include "ros/builtin_message_traits.h"
00010 #include "ros/message_operations.h"
00011 #include "ros/time.h"
00012 
00013 #include "ros/macros.h"
00014 
00015 #include "ros/assert.h"
00016 
00017 #include "geometry_msgs/Point32.h"
00018 
00019 namespace applanix_msgs
00020 {
00021 template <class ContainerAllocator>
00022 struct AidingSensorParams_ {
00023   typedef AidingSensorParams_<ContainerAllocator> Type;
00024 
00025   AidingSensorParams_()
00026   : transaction(0)
00027   , dmi_scale_factor(0.0)
00028   , dmi_lever_arm()
00029   , reserved1(0.0)
00030   , reserved2(0.0)
00031   , reserved3(0.0)
00032   , reserved5(0.0)
00033   , reserved6(0.0)
00034   , reserved7(0.0)
00035   {
00036   }
00037 
00038   AidingSensorParams_(const ContainerAllocator& _alloc)
00039   : transaction(0)
00040   , dmi_scale_factor(0.0)
00041   , dmi_lever_arm(_alloc)
00042   , reserved1(0.0)
00043   , reserved2(0.0)
00044   , reserved3(0.0)
00045   , reserved5(0.0)
00046   , reserved6(0.0)
00047   , reserved7(0.0)
00048   {
00049   }
00050 
00051   typedef uint16_t _transaction_type;
00052   uint16_t transaction;
00053 
00054   typedef float _dmi_scale_factor_type;
00055   float dmi_scale_factor;
00056 
00057   typedef  ::geometry_msgs::Point32_<ContainerAllocator>  _dmi_lever_arm_type;
00058    ::geometry_msgs::Point32_<ContainerAllocator>  dmi_lever_arm;
00059 
00060   typedef float _reserved1_type;
00061   float reserved1;
00062 
00063   typedef float _reserved2_type;
00064   float reserved2;
00065 
00066   typedef float _reserved3_type;
00067   float reserved3;
00068 
00069   typedef float _reserved5_type;
00070   float reserved5;
00071 
00072   typedef float _reserved6_type;
00073   float reserved6;
00074 
00075   typedef float _reserved7_type;
00076   float reserved7;
00077 
00078 
00079   typedef boost::shared_ptr< ::applanix_msgs::AidingSensorParams_<ContainerAllocator> > Ptr;
00080   typedef boost::shared_ptr< ::applanix_msgs::AidingSensorParams_<ContainerAllocator>  const> ConstPtr;
00081   boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00082 }; // struct AidingSensorParams
00083 typedef  ::applanix_msgs::AidingSensorParams_<std::allocator<void> > AidingSensorParams;
00084 
00085 typedef boost::shared_ptr< ::applanix_msgs::AidingSensorParams> AidingSensorParamsPtr;
00086 typedef boost::shared_ptr< ::applanix_msgs::AidingSensorParams const> AidingSensorParamsConstPtr;
00087 
00088 
00089 template<typename ContainerAllocator>
00090 std::ostream& operator<<(std::ostream& s, const  ::applanix_msgs::AidingSensorParams_<ContainerAllocator> & v)
00091 {
00092   ros::message_operations::Printer< ::applanix_msgs::AidingSensorParams_<ContainerAllocator> >::stream(s, "", v);
00093   return s;}
00094 
00095 } // namespace applanix_msgs
00096 
00097 namespace ros
00098 {
00099 namespace message_traits
00100 {
00101 template<class ContainerAllocator> struct IsMessage< ::applanix_msgs::AidingSensorParams_<ContainerAllocator> > : public TrueType {};
00102 template<class ContainerAllocator> struct IsMessage< ::applanix_msgs::AidingSensorParams_<ContainerAllocator>  const> : public TrueType {};
00103 template<class ContainerAllocator>
00104 struct MD5Sum< ::applanix_msgs::AidingSensorParams_<ContainerAllocator> > {
00105   static const char* value() 
00106   {
00107     return "c5f8cdbc1fbfdcb4567e70396891f001";
00108   }
00109 
00110   static const char* value(const  ::applanix_msgs::AidingSensorParams_<ContainerAllocator> &) { return value(); } 
00111   static const uint64_t static_value1 = 0xc5f8cdbc1fbfdcb4ULL;
00112   static const uint64_t static_value2 = 0x567e70396891f001ULL;
00113 };
00114 
00115 template<class ContainerAllocator>
00116 struct DataType< ::applanix_msgs::AidingSensorParams_<ContainerAllocator> > {
00117   static const char* value() 
00118   {
00119     return "applanix_msgs/AidingSensorParams";
00120   }
00121 
00122   static const char* value(const  ::applanix_msgs::AidingSensorParams_<ContainerAllocator> &) { return value(); } 
00123 };
00124 
00125 template<class ContainerAllocator>
00126 struct Definition< ::applanix_msgs::AidingSensorParams_<ContainerAllocator> > {
00127   static const char* value() 
00128   {
00129     return "# Msg 22\n\
00130 uint16 transaction\n\
00131 \n\
00132 float32 dmi_scale_factor\n\
00133 geometry_msgs/Point32 dmi_lever_arm\n\
00134 \n\
00135 float32 reserved1\n\
00136 float32 reserved2\n\
00137 float32 reserved3\n\
00138 float32 reserved5\n\
00139 float32 reserved6\n\
00140 float32 reserved7\n\
00141 \n\
00142 ================================================================================\n\
00143 MSG: geometry_msgs/Point32\n\
00144 # This contains the position of a point in free space(with 32 bits of precision).\n\
00145 # It is recommeded to use Point wherever possible instead of Point32.  \n\
00146 # \n\
00147 # This recommendation is to promote interoperability.  \n\
00148 #\n\
00149 # This message is designed to take up less space when sending\n\
00150 # lots of points at once, as in the case of a PointCloud.  \n\
00151 \n\
00152 float32 x\n\
00153 float32 y\n\
00154 float32 z\n\
00155 ";
00156   }
00157 
00158   static const char* value(const  ::applanix_msgs::AidingSensorParams_<ContainerAllocator> &) { return value(); } 
00159 };
00160 
00161 template<class ContainerAllocator> struct IsFixedSize< ::applanix_msgs::AidingSensorParams_<ContainerAllocator> > : public TrueType {};
00162 } // namespace message_traits
00163 } // namespace ros
00164 
00165 namespace ros
00166 {
00167 namespace serialization
00168 {
00169 
00170 template<class ContainerAllocator> struct Serializer< ::applanix_msgs::AidingSensorParams_<ContainerAllocator> >
00171 {
00172   template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00173   {
00174     stream.next(m.transaction);
00175     stream.next(m.dmi_scale_factor);
00176     stream.next(m.dmi_lever_arm);
00177     stream.next(m.reserved1);
00178     stream.next(m.reserved2);
00179     stream.next(m.reserved3);
00180     stream.next(m.reserved5);
00181     stream.next(m.reserved6);
00182     stream.next(m.reserved7);
00183   }
00184 
00185   ROS_DECLARE_ALLINONE_SERIALIZER;
00186 }; // struct AidingSensorParams_
00187 } // namespace serialization
00188 } // namespace ros
00189 
00190 namespace ros
00191 {
00192 namespace message_operations
00193 {
00194 
00195 template<class ContainerAllocator>
00196 struct Printer< ::applanix_msgs::AidingSensorParams_<ContainerAllocator> >
00197 {
00198   template<typename Stream> static void stream(Stream& s, const std::string& indent, const  ::applanix_msgs::AidingSensorParams_<ContainerAllocator> & v) 
00199   {
00200     s << indent << "transaction: ";
00201     Printer<uint16_t>::stream(s, indent + "  ", v.transaction);
00202     s << indent << "dmi_scale_factor: ";
00203     Printer<float>::stream(s, indent + "  ", v.dmi_scale_factor);
00204     s << indent << "dmi_lever_arm: ";
00205 s << std::endl;
00206     Printer< ::geometry_msgs::Point32_<ContainerAllocator> >::stream(s, indent + "  ", v.dmi_lever_arm);
00207     s << indent << "reserved1: ";
00208     Printer<float>::stream(s, indent + "  ", v.reserved1);
00209     s << indent << "reserved2: ";
00210     Printer<float>::stream(s, indent + "  ", v.reserved2);
00211     s << indent << "reserved3: ";
00212     Printer<float>::stream(s, indent + "  ", v.reserved3);
00213     s << indent << "reserved5: ";
00214     Printer<float>::stream(s, indent + "  ", v.reserved5);
00215     s << indent << "reserved6: ";
00216     Printer<float>::stream(s, indent + "  ", v.reserved6);
00217     s << indent << "reserved7: ";
00218     Printer<float>::stream(s, indent + "  ", v.reserved7);
00219   }
00220 };
00221 
00222 
00223 } // namespace message_operations
00224 } // namespace ros
00225 
00226 #endif // APPLANIX_MSGS_MESSAGE_AIDINGSENSORPARAMS_H
00227 


applanix_msgs
Author(s): Mike Purvis
autogenerated on Thu Jan 2 2014 11:04:51