00001 """autogenerated by genpy from ethzasl_icp_mapper/GetBoundedMapRequest.msg. Do not edit."""
00002 import sys
00003 python3 = True if sys.hexversion > 0x03000000 else False
00004 import genpy
00005 import struct
00006
00007 import geometry_msgs.msg
00008
00009 class GetBoundedMapRequest(genpy.Message):
00010 _md5sum = "8cab119310bafad652e0154d699b10bf"
00011 _type = "ethzasl_icp_mapper/GetBoundedMapRequest"
00012 _has_header = False
00013 _full_text = """geometry_msgs/Pose mapCenter
00014 geometry_msgs/Point topRightCorner
00015 geometry_msgs/Point bottomLeftCorner
00016
00017 ================================================================================
00018 MSG: geometry_msgs/Pose
00019 # A representation of pose in free space, composed of postion and orientation.
00020 Point position
00021 Quaternion orientation
00022
00023 ================================================================================
00024 MSG: geometry_msgs/Point
00025 # This contains the position of a point in free space
00026 float64 x
00027 float64 y
00028 float64 z
00029
00030 ================================================================================
00031 MSG: geometry_msgs/Quaternion
00032 # This represents an orientation in free space in quaternion form.
00033
00034 float64 x
00035 float64 y
00036 float64 z
00037 float64 w
00038
00039 """
00040 __slots__ = ['mapCenter','topRightCorner','bottomLeftCorner']
00041 _slot_types = ['geometry_msgs/Pose','geometry_msgs/Point','geometry_msgs/Point']
00042
00043 def __init__(self, *args, **kwds):
00044 """
00045 Constructor. Any message fields that are implicitly/explicitly
00046 set to None will be assigned a default value. The recommend
00047 use is keyword arguments as this is more robust to future message
00048 changes. You cannot mix in-order arguments and keyword arguments.
00049
00050 The available fields are:
00051 mapCenter,topRightCorner,bottomLeftCorner
00052
00053 :param args: complete set of field values, in .msg order
00054 :param kwds: use keyword arguments corresponding to message field names
00055 to set specific fields.
00056 """
00057 if args or kwds:
00058 super(GetBoundedMapRequest, self).__init__(*args, **kwds)
00059
00060 if self.mapCenter is None:
00061 self.mapCenter = geometry_msgs.msg.Pose()
00062 if self.topRightCorner is None:
00063 self.topRightCorner = geometry_msgs.msg.Point()
00064 if self.bottomLeftCorner is None:
00065 self.bottomLeftCorner = geometry_msgs.msg.Point()
00066 else:
00067 self.mapCenter = geometry_msgs.msg.Pose()
00068 self.topRightCorner = geometry_msgs.msg.Point()
00069 self.bottomLeftCorner = geometry_msgs.msg.Point()
00070
00071 def _get_types(self):
00072 """
00073 internal API method
00074 """
00075 return self._slot_types
00076
00077 def serialize(self, buff):
00078 """
00079 serialize message into buffer
00080 :param buff: buffer, ``StringIO``
00081 """
00082 try:
00083 _x = self
00084 buff.write(_struct_13d.pack(_x.mapCenter.position.x, _x.mapCenter.position.y, _x.mapCenter.position.z, _x.mapCenter.orientation.x, _x.mapCenter.orientation.y, _x.mapCenter.orientation.z, _x.mapCenter.orientation.w, _x.topRightCorner.x, _x.topRightCorner.y, _x.topRightCorner.z, _x.bottomLeftCorner.x, _x.bottomLeftCorner.y, _x.bottomLeftCorner.z))
00085 except struct.error as se: self._check_types(se)
00086 except TypeError as te: self._check_types(te)
00087
00088 def deserialize(self, str):
00089 """
00090 unpack serialized message in str into this message instance
00091 :param str: byte array of serialized message, ``str``
00092 """
00093 try:
00094 if self.mapCenter is None:
00095 self.mapCenter = geometry_msgs.msg.Pose()
00096 if self.topRightCorner is None:
00097 self.topRightCorner = geometry_msgs.msg.Point()
00098 if self.bottomLeftCorner is None:
00099 self.bottomLeftCorner = geometry_msgs.msg.Point()
00100 end = 0
00101 _x = self
00102 start = end
00103 end += 104
00104 (_x.mapCenter.position.x, _x.mapCenter.position.y, _x.mapCenter.position.z, _x.mapCenter.orientation.x, _x.mapCenter.orientation.y, _x.mapCenter.orientation.z, _x.mapCenter.orientation.w, _x.topRightCorner.x, _x.topRightCorner.y, _x.topRightCorner.z, _x.bottomLeftCorner.x, _x.bottomLeftCorner.y, _x.bottomLeftCorner.z,) = _struct_13d.unpack(str[start:end])
00105 return self
00106 except struct.error as e:
00107 raise genpy.DeserializationError(e)
00108
00109
00110 def serialize_numpy(self, buff, numpy):
00111 """
00112 serialize message with numpy array types into buffer
00113 :param buff: buffer, ``StringIO``
00114 :param numpy: numpy python module
00115 """
00116 try:
00117 _x = self
00118 buff.write(_struct_13d.pack(_x.mapCenter.position.x, _x.mapCenter.position.y, _x.mapCenter.position.z, _x.mapCenter.orientation.x, _x.mapCenter.orientation.y, _x.mapCenter.orientation.z, _x.mapCenter.orientation.w, _x.topRightCorner.x, _x.topRightCorner.y, _x.topRightCorner.z, _x.bottomLeftCorner.x, _x.bottomLeftCorner.y, _x.bottomLeftCorner.z))
00119 except struct.error as se: self._check_types(se)
00120 except TypeError as te: self._check_types(te)
00121
00122 def deserialize_numpy(self, str, numpy):
00123 """
00124 unpack serialized message in str into this message instance using numpy for array types
00125 :param str: byte array of serialized message, ``str``
00126 :param numpy: numpy python module
00127 """
00128 try:
00129 if self.mapCenter is None:
00130 self.mapCenter = geometry_msgs.msg.Pose()
00131 if self.topRightCorner is None:
00132 self.topRightCorner = geometry_msgs.msg.Point()
00133 if self.bottomLeftCorner is None:
00134 self.bottomLeftCorner = geometry_msgs.msg.Point()
00135 end = 0
00136 _x = self
00137 start = end
00138 end += 104
00139 (_x.mapCenter.position.x, _x.mapCenter.position.y, _x.mapCenter.position.z, _x.mapCenter.orientation.x, _x.mapCenter.orientation.y, _x.mapCenter.orientation.z, _x.mapCenter.orientation.w, _x.topRightCorner.x, _x.topRightCorner.y, _x.topRightCorner.z, _x.bottomLeftCorner.x, _x.bottomLeftCorner.y, _x.bottomLeftCorner.z,) = _struct_13d.unpack(str[start:end])
00140 return self
00141 except struct.error as e:
00142 raise genpy.DeserializationError(e)
00143
00144 _struct_I = genpy.struct_I
00145 _struct_13d = struct.Struct("<13d")
00146 """autogenerated by genpy from ethzasl_icp_mapper/GetBoundedMapResponse.msg. Do not edit."""
00147 import sys
00148 python3 = True if sys.hexversion > 0x03000000 else False
00149 import genpy
00150 import struct
00151
00152 import std_msgs.msg
00153 import sensor_msgs.msg
00154
00155 class GetBoundedMapResponse(genpy.Message):
00156 _md5sum = "4c809f43088f16711ab4f6616e444088"
00157 _type = "ethzasl_icp_mapper/GetBoundedMapResponse"
00158 _has_header = False
00159 _full_text = """sensor_msgs/PointCloud2 boundedMap
00160
00161
00162 ================================================================================
00163 MSG: sensor_msgs/PointCloud2
00164 # This message holds a collection of N-dimensional points, which may
00165 # contain additional information such as normals, intensity, etc. The
00166 # point data is stored as a binary blob, its layout described by the
00167 # contents of the "fields" array.
00168
00169 # The point cloud data may be organized 2d (image-like) or 1d
00170 # (unordered). Point clouds organized as 2d images may be produced by
00171 # camera depth sensors such as stereo or time-of-flight.
00172
00173 # Time of sensor data acquisition, and the coordinate frame ID (for 3d
00174 # points).
00175 Header header
00176
00177 # 2D structure of the point cloud. If the cloud is unordered, height is
00178 # 1 and width is the length of the point cloud.
00179 uint32 height
00180 uint32 width
00181
00182 # Describes the channels and their layout in the binary data blob.
00183 PointField[] fields
00184
00185 bool is_bigendian # Is this data bigendian?
00186 uint32 point_step # Length of a point in bytes
00187 uint32 row_step # Length of a row in bytes
00188 uint8[] data # Actual point data, size is (row_step*height)
00189
00190 bool is_dense # True if there are no invalid points
00191
00192 ================================================================================
00193 MSG: std_msgs/Header
00194 # Standard metadata for higher-level stamped data types.
00195 # This is generally used to communicate timestamped data
00196 # in a particular coordinate frame.
00197 #
00198 # sequence ID: consecutively increasing ID
00199 uint32 seq
00200 #Two-integer timestamp that is expressed as:
00201 # * stamp.secs: seconds (stamp_secs) since epoch
00202 # * stamp.nsecs: nanoseconds since stamp_secs
00203 # time-handling sugar is provided by the client library
00204 time stamp
00205 #Frame this data is associated with
00206 # 0: no frame
00207 # 1: global frame
00208 string frame_id
00209
00210 ================================================================================
00211 MSG: sensor_msgs/PointField
00212 # This message holds the description of one point entry in the
00213 # PointCloud2 message format.
00214 uint8 INT8 = 1
00215 uint8 UINT8 = 2
00216 uint8 INT16 = 3
00217 uint8 UINT16 = 4
00218 uint8 INT32 = 5
00219 uint8 UINT32 = 6
00220 uint8 FLOAT32 = 7
00221 uint8 FLOAT64 = 8
00222
00223 string name # Name of field
00224 uint32 offset # Offset from start of point struct
00225 uint8 datatype # Datatype enumeration, see above
00226 uint32 count # How many elements in the field
00227
00228 """
00229 __slots__ = ['boundedMap']
00230 _slot_types = ['sensor_msgs/PointCloud2']
00231
00232 def __init__(self, *args, **kwds):
00233 """
00234 Constructor. Any message fields that are implicitly/explicitly
00235 set to None will be assigned a default value. The recommend
00236 use is keyword arguments as this is more robust to future message
00237 changes. You cannot mix in-order arguments and keyword arguments.
00238
00239 The available fields are:
00240 boundedMap
00241
00242 :param args: complete set of field values, in .msg order
00243 :param kwds: use keyword arguments corresponding to message field names
00244 to set specific fields.
00245 """
00246 if args or kwds:
00247 super(GetBoundedMapResponse, self).__init__(*args, **kwds)
00248
00249 if self.boundedMap is None:
00250 self.boundedMap = sensor_msgs.msg.PointCloud2()
00251 else:
00252 self.boundedMap = sensor_msgs.msg.PointCloud2()
00253
00254 def _get_types(self):
00255 """
00256 internal API method
00257 """
00258 return self._slot_types
00259
00260 def serialize(self, buff):
00261 """
00262 serialize message into buffer
00263 :param buff: buffer, ``StringIO``
00264 """
00265 try:
00266 _x = self
00267 buff.write(_struct_3I.pack(_x.boundedMap.header.seq, _x.boundedMap.header.stamp.secs, _x.boundedMap.header.stamp.nsecs))
00268 _x = self.boundedMap.header.frame_id
00269 length = len(_x)
00270 if python3 or type(_x) == unicode:
00271 _x = _x.encode('utf-8')
00272 length = len(_x)
00273 buff.write(struct.pack('<I%ss'%length, length, _x))
00274 _x = self
00275 buff.write(_struct_2I.pack(_x.boundedMap.height, _x.boundedMap.width))
00276 length = len(self.boundedMap.fields)
00277 buff.write(_struct_I.pack(length))
00278 for val1 in self.boundedMap.fields:
00279 _x = val1.name
00280 length = len(_x)
00281 if python3 or type(_x) == unicode:
00282 _x = _x.encode('utf-8')
00283 length = len(_x)
00284 buff.write(struct.pack('<I%ss'%length, length, _x))
00285 _x = val1
00286 buff.write(_struct_IBI.pack(_x.offset, _x.datatype, _x.count))
00287 _x = self
00288 buff.write(_struct_B2I.pack(_x.boundedMap.is_bigendian, _x.boundedMap.point_step, _x.boundedMap.row_step))
00289 _x = self.boundedMap.data
00290 length = len(_x)
00291
00292 if type(_x) in [list, tuple]:
00293 buff.write(struct.pack('<I%sB'%length, length, *_x))
00294 else:
00295 buff.write(struct.pack('<I%ss'%length, length, _x))
00296 buff.write(_struct_B.pack(self.boundedMap.is_dense))
00297 except struct.error as se: self._check_types(se)
00298 except TypeError as te: self._check_types(te)
00299
00300 def deserialize(self, str):
00301 """
00302 unpack serialized message in str into this message instance
00303 :param str: byte array of serialized message, ``str``
00304 """
00305 try:
00306 if self.boundedMap is None:
00307 self.boundedMap = sensor_msgs.msg.PointCloud2()
00308 end = 0
00309 _x = self
00310 start = end
00311 end += 12
00312 (_x.boundedMap.header.seq, _x.boundedMap.header.stamp.secs, _x.boundedMap.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00313 start = end
00314 end += 4
00315 (length,) = _struct_I.unpack(str[start:end])
00316 start = end
00317 end += length
00318 if python3:
00319 self.boundedMap.header.frame_id = str[start:end].decode('utf-8')
00320 else:
00321 self.boundedMap.header.frame_id = str[start:end]
00322 _x = self
00323 start = end
00324 end += 8
00325 (_x.boundedMap.height, _x.boundedMap.width,) = _struct_2I.unpack(str[start:end])
00326 start = end
00327 end += 4
00328 (length,) = _struct_I.unpack(str[start:end])
00329 self.boundedMap.fields = []
00330 for i in range(0, length):
00331 val1 = sensor_msgs.msg.PointField()
00332 start = end
00333 end += 4
00334 (length,) = _struct_I.unpack(str[start:end])
00335 start = end
00336 end += length
00337 if python3:
00338 val1.name = str[start:end].decode('utf-8')
00339 else:
00340 val1.name = str[start:end]
00341 _x = val1
00342 start = end
00343 end += 9
00344 (_x.offset, _x.datatype, _x.count,) = _struct_IBI.unpack(str[start:end])
00345 self.boundedMap.fields.append(val1)
00346 _x = self
00347 start = end
00348 end += 9
00349 (_x.boundedMap.is_bigendian, _x.boundedMap.point_step, _x.boundedMap.row_step,) = _struct_B2I.unpack(str[start:end])
00350 self.boundedMap.is_bigendian = bool(self.boundedMap.is_bigendian)
00351 start = end
00352 end += 4
00353 (length,) = _struct_I.unpack(str[start:end])
00354 start = end
00355 end += length
00356 if python3:
00357 self.boundedMap.data = str[start:end].decode('utf-8')
00358 else:
00359 self.boundedMap.data = str[start:end]
00360 start = end
00361 end += 1
00362 (self.boundedMap.is_dense,) = _struct_B.unpack(str[start:end])
00363 self.boundedMap.is_dense = bool(self.boundedMap.is_dense)
00364 return self
00365 except struct.error as e:
00366 raise genpy.DeserializationError(e)
00367
00368
00369 def serialize_numpy(self, buff, numpy):
00370 """
00371 serialize message with numpy array types into buffer
00372 :param buff: buffer, ``StringIO``
00373 :param numpy: numpy python module
00374 """
00375 try:
00376 _x = self
00377 buff.write(_struct_3I.pack(_x.boundedMap.header.seq, _x.boundedMap.header.stamp.secs, _x.boundedMap.header.stamp.nsecs))
00378 _x = self.boundedMap.header.frame_id
00379 length = len(_x)
00380 if python3 or type(_x) == unicode:
00381 _x = _x.encode('utf-8')
00382 length = len(_x)
00383 buff.write(struct.pack('<I%ss'%length, length, _x))
00384 _x = self
00385 buff.write(_struct_2I.pack(_x.boundedMap.height, _x.boundedMap.width))
00386 length = len(self.boundedMap.fields)
00387 buff.write(_struct_I.pack(length))
00388 for val1 in self.boundedMap.fields:
00389 _x = val1.name
00390 length = len(_x)
00391 if python3 or type(_x) == unicode:
00392 _x = _x.encode('utf-8')
00393 length = len(_x)
00394 buff.write(struct.pack('<I%ss'%length, length, _x))
00395 _x = val1
00396 buff.write(_struct_IBI.pack(_x.offset, _x.datatype, _x.count))
00397 _x = self
00398 buff.write(_struct_B2I.pack(_x.boundedMap.is_bigendian, _x.boundedMap.point_step, _x.boundedMap.row_step))
00399 _x = self.boundedMap.data
00400 length = len(_x)
00401
00402 if type(_x) in [list, tuple]:
00403 buff.write(struct.pack('<I%sB'%length, length, *_x))
00404 else:
00405 buff.write(struct.pack('<I%ss'%length, length, _x))
00406 buff.write(_struct_B.pack(self.boundedMap.is_dense))
00407 except struct.error as se: self._check_types(se)
00408 except TypeError as te: self._check_types(te)
00409
00410 def deserialize_numpy(self, str, numpy):
00411 """
00412 unpack serialized message in str into this message instance using numpy for array types
00413 :param str: byte array of serialized message, ``str``
00414 :param numpy: numpy python module
00415 """
00416 try:
00417 if self.boundedMap is None:
00418 self.boundedMap = sensor_msgs.msg.PointCloud2()
00419 end = 0
00420 _x = self
00421 start = end
00422 end += 12
00423 (_x.boundedMap.header.seq, _x.boundedMap.header.stamp.secs, _x.boundedMap.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00424 start = end
00425 end += 4
00426 (length,) = _struct_I.unpack(str[start:end])
00427 start = end
00428 end += length
00429 if python3:
00430 self.boundedMap.header.frame_id = str[start:end].decode('utf-8')
00431 else:
00432 self.boundedMap.header.frame_id = str[start:end]
00433 _x = self
00434 start = end
00435 end += 8
00436 (_x.boundedMap.height, _x.boundedMap.width,) = _struct_2I.unpack(str[start:end])
00437 start = end
00438 end += 4
00439 (length,) = _struct_I.unpack(str[start:end])
00440 self.boundedMap.fields = []
00441 for i in range(0, length):
00442 val1 = sensor_msgs.msg.PointField()
00443 start = end
00444 end += 4
00445 (length,) = _struct_I.unpack(str[start:end])
00446 start = end
00447 end += length
00448 if python3:
00449 val1.name = str[start:end].decode('utf-8')
00450 else:
00451 val1.name = str[start:end]
00452 _x = val1
00453 start = end
00454 end += 9
00455 (_x.offset, _x.datatype, _x.count,) = _struct_IBI.unpack(str[start:end])
00456 self.boundedMap.fields.append(val1)
00457 _x = self
00458 start = end
00459 end += 9
00460 (_x.boundedMap.is_bigendian, _x.boundedMap.point_step, _x.boundedMap.row_step,) = _struct_B2I.unpack(str[start:end])
00461 self.boundedMap.is_bigendian = bool(self.boundedMap.is_bigendian)
00462 start = end
00463 end += 4
00464 (length,) = _struct_I.unpack(str[start:end])
00465 start = end
00466 end += length
00467 if python3:
00468 self.boundedMap.data = str[start:end].decode('utf-8')
00469 else:
00470 self.boundedMap.data = str[start:end]
00471 start = end
00472 end += 1
00473 (self.boundedMap.is_dense,) = _struct_B.unpack(str[start:end])
00474 self.boundedMap.is_dense = bool(self.boundedMap.is_dense)
00475 return self
00476 except struct.error as e:
00477 raise genpy.DeserializationError(e)
00478
00479 _struct_I = genpy.struct_I
00480 _struct_IBI = struct.Struct("<IBI")
00481 _struct_3I = struct.Struct("<3I")
00482 _struct_B = struct.Struct("<B")
00483 _struct_2I = struct.Struct("<2I")
00484 _struct_B2I = struct.Struct("<B2I")
00485 class GetBoundedMap(object):
00486 _type = 'ethzasl_icp_mapper/GetBoundedMap'
00487 _md5sum = 'b0e234493a48c4bf1205e62b5652f4e1'
00488 _request_class = GetBoundedMapRequest
00489 _response_class = GetBoundedMapResponse