ProcessPointCloud2.h
Go to the documentation of this file.
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-fuerte-all-iri-ros.pub/doc_stacks/2013-12-06_19-37-16.229269/iri_perception/iri_perception_msgs/srv/ProcessPointCloud2.srv */
00002 #ifndef IRI_PERCEPTION_MSGS_SERVICE_PROCESSPOINTCLOUD2_H
00003 #define IRI_PERCEPTION_MSGS_SERVICE_PROCESSPOINTCLOUD2_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 "ros/service_traits.h"
00018 
00019 #include "sensor_msgs/PointCloud2.h"
00020 
00021 
00022 
00023 namespace iri_perception_msgs
00024 {
00025 template <class ContainerAllocator>
00026 struct ProcessPointCloud2Request_ {
00027   typedef ProcessPointCloud2Request_<ContainerAllocator> Type;
00028 
00029   ProcessPointCloud2Request_()
00030   : input()
00031   {
00032   }
00033 
00034   ProcessPointCloud2Request_(const ContainerAllocator& _alloc)
00035   : input(_alloc)
00036   {
00037   }
00038 
00039   typedef  ::sensor_msgs::PointCloud2_<ContainerAllocator>  _input_type;
00040    ::sensor_msgs::PointCloud2_<ContainerAllocator>  input;
00041 
00042 
00043   typedef boost::shared_ptr< ::iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator> > Ptr;
00044   typedef boost::shared_ptr< ::iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator>  const> ConstPtr;
00045   boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00046 }; // struct ProcessPointCloud2Request
00047 typedef  ::iri_perception_msgs::ProcessPointCloud2Request_<std::allocator<void> > ProcessPointCloud2Request;
00048 
00049 typedef boost::shared_ptr< ::iri_perception_msgs::ProcessPointCloud2Request> ProcessPointCloud2RequestPtr;
00050 typedef boost::shared_ptr< ::iri_perception_msgs::ProcessPointCloud2Request const> ProcessPointCloud2RequestConstPtr;
00051 
00052 
00053 template <class ContainerAllocator>
00054 struct ProcessPointCloud2Response_ {
00055   typedef ProcessPointCloud2Response_<ContainerAllocator> Type;
00056 
00057   ProcessPointCloud2Response_()
00058   {
00059   }
00060 
00061   ProcessPointCloud2Response_(const ContainerAllocator& _alloc)
00062   {
00063   }
00064 
00065 
00066   typedef boost::shared_ptr< ::iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator> > Ptr;
00067   typedef boost::shared_ptr< ::iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator>  const> ConstPtr;
00068   boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00069 }; // struct ProcessPointCloud2Response
00070 typedef  ::iri_perception_msgs::ProcessPointCloud2Response_<std::allocator<void> > ProcessPointCloud2Response;
00071 
00072 typedef boost::shared_ptr< ::iri_perception_msgs::ProcessPointCloud2Response> ProcessPointCloud2ResponsePtr;
00073 typedef boost::shared_ptr< ::iri_perception_msgs::ProcessPointCloud2Response const> ProcessPointCloud2ResponseConstPtr;
00074 
00075 struct ProcessPointCloud2
00076 {
00077 
00078 typedef ProcessPointCloud2Request Request;
00079 typedef ProcessPointCloud2Response Response;
00080 Request request;
00081 Response response;
00082 
00083 typedef Request RequestType;
00084 typedef Response ResponseType;
00085 }; // struct ProcessPointCloud2
00086 } // namespace iri_perception_msgs
00087 
00088 namespace ros
00089 {
00090 namespace message_traits
00091 {
00092 template<class ContainerAllocator> struct IsMessage< ::iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator> > : public TrueType {};
00093 template<class ContainerAllocator> struct IsMessage< ::iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator>  const> : public TrueType {};
00094 template<class ContainerAllocator>
00095 struct MD5Sum< ::iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator> > {
00096   static const char* value() 
00097   {
00098     return "55c5f2a1ba5379341fa496de58e8d437";
00099   }
00100 
00101   static const char* value(const  ::iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator> &) { return value(); } 
00102   static const uint64_t static_value1 = 0x55c5f2a1ba537934ULL;
00103   static const uint64_t static_value2 = 0x1fa496de58e8d437ULL;
00104 };
00105 
00106 template<class ContainerAllocator>
00107 struct DataType< ::iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator> > {
00108   static const char* value() 
00109   {
00110     return "iri_perception_msgs/ProcessPointCloud2Request";
00111   }
00112 
00113   static const char* value(const  ::iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator> &) { return value(); } 
00114 };
00115 
00116 template<class ContainerAllocator>
00117 struct Definition< ::iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator> > {
00118   static const char* value() 
00119   {
00120     return "\n\
00121 sensor_msgs/PointCloud2 input\n\
00122 \n\
00123 ================================================================================\n\
00124 MSG: sensor_msgs/PointCloud2\n\
00125 # This message holds a collection of N-dimensional points, which may\n\
00126 # contain additional information such as normals, intensity, etc. The\n\
00127 # point data is stored as a binary blob, its layout described by the\n\
00128 # contents of the \"fields\" array.\n\
00129 \n\
00130 # The point cloud data may be organized 2d (image-like) or 1d\n\
00131 # (unordered). Point clouds organized as 2d images may be produced by\n\
00132 # camera depth sensors such as stereo or time-of-flight.\n\
00133 \n\
00134 # Time of sensor data acquisition, and the coordinate frame ID (for 3d\n\
00135 # points).\n\
00136 Header header\n\
00137 \n\
00138 # 2D structure of the point cloud. If the cloud is unordered, height is\n\
00139 # 1 and width is the length of the point cloud.\n\
00140 uint32 height\n\
00141 uint32 width\n\
00142 \n\
00143 # Describes the channels and their layout in the binary data blob.\n\
00144 PointField[] fields\n\
00145 \n\
00146 bool    is_bigendian # Is this data bigendian?\n\
00147 uint32  point_step   # Length of a point in bytes\n\
00148 uint32  row_step     # Length of a row in bytes\n\
00149 uint8[] data         # Actual point data, size is (row_step*height)\n\
00150 \n\
00151 bool is_dense        # True if there are no invalid points\n\
00152 \n\
00153 ================================================================================\n\
00154 MSG: std_msgs/Header\n\
00155 # Standard metadata for higher-level stamped data types.\n\
00156 # This is generally used to communicate timestamped data \n\
00157 # in a particular coordinate frame.\n\
00158 # \n\
00159 # sequence ID: consecutively increasing ID \n\
00160 uint32 seq\n\
00161 #Two-integer timestamp that is expressed as:\n\
00162 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00163 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00164 # time-handling sugar is provided by the client library\n\
00165 time stamp\n\
00166 #Frame this data is associated with\n\
00167 # 0: no frame\n\
00168 # 1: global frame\n\
00169 string frame_id\n\
00170 \n\
00171 ================================================================================\n\
00172 MSG: sensor_msgs/PointField\n\
00173 # This message holds the description of one point entry in the\n\
00174 # PointCloud2 message format.\n\
00175 uint8 INT8    = 1\n\
00176 uint8 UINT8   = 2\n\
00177 uint8 INT16   = 3\n\
00178 uint8 UINT16  = 4\n\
00179 uint8 INT32   = 5\n\
00180 uint8 UINT32  = 6\n\
00181 uint8 FLOAT32 = 7\n\
00182 uint8 FLOAT64 = 8\n\
00183 \n\
00184 string name      # Name of field\n\
00185 uint32 offset    # Offset from start of point struct\n\
00186 uint8  datatype  # Datatype enumeration, see above\n\
00187 uint32 count     # How many elements in the field\n\
00188 \n\
00189 ";
00190   }
00191 
00192   static const char* value(const  ::iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator> &) { return value(); } 
00193 };
00194 
00195 } // namespace message_traits
00196 } // namespace ros
00197 
00198 
00199 namespace ros
00200 {
00201 namespace message_traits
00202 {
00203 template<class ContainerAllocator> struct IsMessage< ::iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator> > : public TrueType {};
00204 template<class ContainerAllocator> struct IsMessage< ::iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator>  const> : public TrueType {};
00205 template<class ContainerAllocator>
00206 struct MD5Sum< ::iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator> > {
00207   static const char* value() 
00208   {
00209     return "d41d8cd98f00b204e9800998ecf8427e";
00210   }
00211 
00212   static const char* value(const  ::iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator> &) { return value(); } 
00213   static const uint64_t static_value1 = 0xd41d8cd98f00b204ULL;
00214   static const uint64_t static_value2 = 0xe9800998ecf8427eULL;
00215 };
00216 
00217 template<class ContainerAllocator>
00218 struct DataType< ::iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator> > {
00219   static const char* value() 
00220   {
00221     return "iri_perception_msgs/ProcessPointCloud2Response";
00222   }
00223 
00224   static const char* value(const  ::iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator> &) { return value(); } 
00225 };
00226 
00227 template<class ContainerAllocator>
00228 struct Definition< ::iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator> > {
00229   static const char* value() 
00230   {
00231     return "\n\
00232 \n\
00233 \n\
00234 \n\
00235 ";
00236   }
00237 
00238   static const char* value(const  ::iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator> &) { return value(); } 
00239 };
00240 
00241 template<class ContainerAllocator> struct IsFixedSize< ::iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator> > : public TrueType {};
00242 } // namespace message_traits
00243 } // namespace ros
00244 
00245 namespace ros
00246 {
00247 namespace serialization
00248 {
00249 
00250 template<class ContainerAllocator> struct Serializer< ::iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator> >
00251 {
00252   template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00253   {
00254     stream.next(m.input);
00255   }
00256 
00257   ROS_DECLARE_ALLINONE_SERIALIZER;
00258 }; // struct ProcessPointCloud2Request_
00259 } // namespace serialization
00260 } // namespace ros
00261 
00262 
00263 namespace ros
00264 {
00265 namespace serialization
00266 {
00267 
00268 template<class ContainerAllocator> struct Serializer< ::iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator> >
00269 {
00270   template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00271   {
00272   }
00273 
00274   ROS_DECLARE_ALLINONE_SERIALIZER;
00275 }; // struct ProcessPointCloud2Response_
00276 } // namespace serialization
00277 } // namespace ros
00278 
00279 namespace ros
00280 {
00281 namespace service_traits
00282 {
00283 template<>
00284 struct MD5Sum<iri_perception_msgs::ProcessPointCloud2> {
00285   static const char* value() 
00286   {
00287     return "55c5f2a1ba5379341fa496de58e8d437";
00288   }
00289 
00290   static const char* value(const iri_perception_msgs::ProcessPointCloud2&) { return value(); } 
00291 };
00292 
00293 template<>
00294 struct DataType<iri_perception_msgs::ProcessPointCloud2> {
00295   static const char* value() 
00296   {
00297     return "iri_perception_msgs/ProcessPointCloud2";
00298   }
00299 
00300   static const char* value(const iri_perception_msgs::ProcessPointCloud2&) { return value(); } 
00301 };
00302 
00303 template<class ContainerAllocator>
00304 struct MD5Sum<iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator> > {
00305   static const char* value() 
00306   {
00307     return "55c5f2a1ba5379341fa496de58e8d437";
00308   }
00309 
00310   static const char* value(const iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator> &) { return value(); } 
00311 };
00312 
00313 template<class ContainerAllocator>
00314 struct DataType<iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator> > {
00315   static const char* value() 
00316   {
00317     return "iri_perception_msgs/ProcessPointCloud2";
00318   }
00319 
00320   static const char* value(const iri_perception_msgs::ProcessPointCloud2Request_<ContainerAllocator> &) { return value(); } 
00321 };
00322 
00323 template<class ContainerAllocator>
00324 struct MD5Sum<iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator> > {
00325   static const char* value() 
00326   {
00327     return "55c5f2a1ba5379341fa496de58e8d437";
00328   }
00329 
00330   static const char* value(const iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator> &) { return value(); } 
00331 };
00332 
00333 template<class ContainerAllocator>
00334 struct DataType<iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator> > {
00335   static const char* value() 
00336   {
00337     return "iri_perception_msgs/ProcessPointCloud2";
00338   }
00339 
00340   static const char* value(const iri_perception_msgs::ProcessPointCloud2Response_<ContainerAllocator> &) { return value(); } 
00341 };
00342 
00343 } // namespace service_traits
00344 } // namespace ros
00345 
00346 #endif // IRI_PERCEPTION_MSGS_SERVICE_PROCESSPOINTCLOUD2_H
00347 


iri_perception_msgs
Author(s):
autogenerated on Fri Dec 6 2013 20:02:16