_SearchFor.py
Go to the documentation of this file.
00001 """autogenerated by genpy from re_vision/SearchForRequest.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 sensor_msgs.msg
00008 import std_msgs.msg
00009 
00010 class SearchForRequest(genpy.Message):
00011   _md5sum = "d580d8a9a163fc1ccacaa074884f44fa"
00012   _type = "re_vision/SearchForRequest"
00013   _has_header = True #flag to mark the presence of a Header object
00014   _full_text = """Header header
00015 sensor_msgs/Image Image
00016 string[] Objects
00017 int32 MaxPointsPerObject
00018 
00019 ================================================================================
00020 MSG: std_msgs/Header
00021 # Standard metadata for higher-level stamped data types.
00022 # This is generally used to communicate timestamped data 
00023 # in a particular coordinate frame.
00024 # 
00025 # sequence ID: consecutively increasing ID 
00026 uint32 seq
00027 #Two-integer timestamp that is expressed as:
00028 # * stamp.secs: seconds (stamp_secs) since epoch
00029 # * stamp.nsecs: nanoseconds since stamp_secs
00030 # time-handling sugar is provided by the client library
00031 time stamp
00032 #Frame this data is associated with
00033 # 0: no frame
00034 # 1: global frame
00035 string frame_id
00036 
00037 ================================================================================
00038 MSG: sensor_msgs/Image
00039 # This message contains an uncompressed image
00040 # (0, 0) is at top-left corner of image
00041 #
00042 
00043 Header header        # Header timestamp should be acquisition time of image
00044                      # Header frame_id should be optical frame of camera
00045                      # origin of frame should be optical center of cameara
00046                      # +x should point to the right in the image
00047                      # +y should point down in the image
00048                      # +z should point into to plane of the image
00049                      # If the frame_id here and the frame_id of the CameraInfo
00050                      # message associated with the image conflict
00051                      # the behavior is undefined
00052 
00053 uint32 height         # image height, that is, number of rows
00054 uint32 width          # image width, that is, number of columns
00055 
00056 # The legal values for encoding are in file src/image_encodings.cpp
00057 # If you want to standardize a new string format, join
00058 # ros-users@lists.sourceforge.net and send an email proposing a new encoding.
00059 
00060 string encoding       # Encoding of pixels -- channel meaning, ordering, size
00061                       # taken from the list of strings in src/image_encodings.cpp
00062 
00063 uint8 is_bigendian    # is this data bigendian?
00064 uint32 step           # Full row length in bytes
00065 uint8[] data          # actual matrix data, size is (step * rows)
00066 
00067 """
00068   __slots__ = ['header','Image','Objects','MaxPointsPerObject']
00069   _slot_types = ['std_msgs/Header','sensor_msgs/Image','string[]','int32']
00070 
00071   def __init__(self, *args, **kwds):
00072     """
00073     Constructor. Any message fields that are implicitly/explicitly
00074     set to None will be assigned a default value. The recommend
00075     use is keyword arguments as this is more robust to future message
00076     changes.  You cannot mix in-order arguments and keyword arguments.
00077 
00078     The available fields are:
00079        header,Image,Objects,MaxPointsPerObject
00080 
00081     :param args: complete set of field values, in .msg order
00082     :param kwds: use keyword arguments corresponding to message field names
00083     to set specific fields.
00084     """
00085     if args or kwds:
00086       super(SearchForRequest, self).__init__(*args, **kwds)
00087       #message fields cannot be None, assign default values for those that are
00088       if self.header is None:
00089         self.header = std_msgs.msg.Header()
00090       if self.Image is None:
00091         self.Image = sensor_msgs.msg.Image()
00092       if self.Objects is None:
00093         self.Objects = []
00094       if self.MaxPointsPerObject is None:
00095         self.MaxPointsPerObject = 0
00096     else:
00097       self.header = std_msgs.msg.Header()
00098       self.Image = sensor_msgs.msg.Image()
00099       self.Objects = []
00100       self.MaxPointsPerObject = 0
00101 
00102   def _get_types(self):
00103     """
00104     internal API method
00105     """
00106     return self._slot_types
00107 
00108   def serialize(self, buff):
00109     """
00110     serialize message into buffer
00111     :param buff: buffer, ``StringIO``
00112     """
00113     try:
00114       _x = self
00115       buff.write(_struct_3I.pack(_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs))
00116       _x = self.header.frame_id
00117       length = len(_x)
00118       if python3 or type(_x) == unicode:
00119         _x = _x.encode('utf-8')
00120         length = len(_x)
00121       buff.write(struct.pack('<I%ss'%length, length, _x))
00122       _x = self
00123       buff.write(_struct_3I.pack(_x.Image.header.seq, _x.Image.header.stamp.secs, _x.Image.header.stamp.nsecs))
00124       _x = self.Image.header.frame_id
00125       length = len(_x)
00126       if python3 or type(_x) == unicode:
00127         _x = _x.encode('utf-8')
00128         length = len(_x)
00129       buff.write(struct.pack('<I%ss'%length, length, _x))
00130       _x = self
00131       buff.write(_struct_2I.pack(_x.Image.height, _x.Image.width))
00132       _x = self.Image.encoding
00133       length = len(_x)
00134       if python3 or type(_x) == unicode:
00135         _x = _x.encode('utf-8')
00136         length = len(_x)
00137       buff.write(struct.pack('<I%ss'%length, length, _x))
00138       _x = self
00139       buff.write(_struct_BI.pack(_x.Image.is_bigendian, _x.Image.step))
00140       _x = self.Image.data
00141       length = len(_x)
00142       # - if encoded as a list instead, serialize as bytes instead of string
00143       if type(_x) in [list, tuple]:
00144         buff.write(struct.pack('<I%sB'%length, length, *_x))
00145       else:
00146         buff.write(struct.pack('<I%ss'%length, length, _x))
00147       length = len(self.Objects)
00148       buff.write(_struct_I.pack(length))
00149       for val1 in self.Objects:
00150         length = len(val1)
00151         if python3 or type(val1) == unicode:
00152           val1 = val1.encode('utf-8')
00153           length = len(val1)
00154         buff.write(struct.pack('<I%ss'%length, length, val1))
00155       buff.write(_struct_i.pack(self.MaxPointsPerObject))
00156     except struct.error as se: self._check_types(se)
00157     except TypeError as te: self._check_types(te)
00158 
00159   def deserialize(self, str):
00160     """
00161     unpack serialized message in str into this message instance
00162     :param str: byte array of serialized message, ``str``
00163     """
00164     try:
00165       if self.header is None:
00166         self.header = std_msgs.msg.Header()
00167       if self.Image is None:
00168         self.Image = sensor_msgs.msg.Image()
00169       end = 0
00170       _x = self
00171       start = end
00172       end += 12
00173       (_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00174       start = end
00175       end += 4
00176       (length,) = _struct_I.unpack(str[start:end])
00177       start = end
00178       end += length
00179       if python3:
00180         self.header.frame_id = str[start:end].decode('utf-8')
00181       else:
00182         self.header.frame_id = str[start:end]
00183       _x = self
00184       start = end
00185       end += 12
00186       (_x.Image.header.seq, _x.Image.header.stamp.secs, _x.Image.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00187       start = end
00188       end += 4
00189       (length,) = _struct_I.unpack(str[start:end])
00190       start = end
00191       end += length
00192       if python3:
00193         self.Image.header.frame_id = str[start:end].decode('utf-8')
00194       else:
00195         self.Image.header.frame_id = str[start:end]
00196       _x = self
00197       start = end
00198       end += 8
00199       (_x.Image.height, _x.Image.width,) = _struct_2I.unpack(str[start:end])
00200       start = end
00201       end += 4
00202       (length,) = _struct_I.unpack(str[start:end])
00203       start = end
00204       end += length
00205       if python3:
00206         self.Image.encoding = str[start:end].decode('utf-8')
00207       else:
00208         self.Image.encoding = str[start:end]
00209       _x = self
00210       start = end
00211       end += 5
00212       (_x.Image.is_bigendian, _x.Image.step,) = _struct_BI.unpack(str[start:end])
00213       start = end
00214       end += 4
00215       (length,) = _struct_I.unpack(str[start:end])
00216       start = end
00217       end += length
00218       if python3:
00219         self.Image.data = str[start:end].decode('utf-8')
00220       else:
00221         self.Image.data = str[start:end]
00222       start = end
00223       end += 4
00224       (length,) = _struct_I.unpack(str[start:end])
00225       self.Objects = []
00226       for i in range(0, length):
00227         start = end
00228         end += 4
00229         (length,) = _struct_I.unpack(str[start:end])
00230         start = end
00231         end += length
00232         if python3:
00233           val1 = str[start:end].decode('utf-8')
00234         else:
00235           val1 = str[start:end]
00236         self.Objects.append(val1)
00237       start = end
00238       end += 4
00239       (self.MaxPointsPerObject,) = _struct_i.unpack(str[start:end])
00240       return self
00241     except struct.error as e:
00242       raise genpy.DeserializationError(e) #most likely buffer underfill
00243 
00244 
00245   def serialize_numpy(self, buff, numpy):
00246     """
00247     serialize message with numpy array types into buffer
00248     :param buff: buffer, ``StringIO``
00249     :param numpy: numpy python module
00250     """
00251     try:
00252       _x = self
00253       buff.write(_struct_3I.pack(_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs))
00254       _x = self.header.frame_id
00255       length = len(_x)
00256       if python3 or type(_x) == unicode:
00257         _x = _x.encode('utf-8')
00258         length = len(_x)
00259       buff.write(struct.pack('<I%ss'%length, length, _x))
00260       _x = self
00261       buff.write(_struct_3I.pack(_x.Image.header.seq, _x.Image.header.stamp.secs, _x.Image.header.stamp.nsecs))
00262       _x = self.Image.header.frame_id
00263       length = len(_x)
00264       if python3 or type(_x) == unicode:
00265         _x = _x.encode('utf-8')
00266         length = len(_x)
00267       buff.write(struct.pack('<I%ss'%length, length, _x))
00268       _x = self
00269       buff.write(_struct_2I.pack(_x.Image.height, _x.Image.width))
00270       _x = self.Image.encoding
00271       length = len(_x)
00272       if python3 or type(_x) == unicode:
00273         _x = _x.encode('utf-8')
00274         length = len(_x)
00275       buff.write(struct.pack('<I%ss'%length, length, _x))
00276       _x = self
00277       buff.write(_struct_BI.pack(_x.Image.is_bigendian, _x.Image.step))
00278       _x = self.Image.data
00279       length = len(_x)
00280       # - if encoded as a list instead, serialize as bytes instead of string
00281       if type(_x) in [list, tuple]:
00282         buff.write(struct.pack('<I%sB'%length, length, *_x))
00283       else:
00284         buff.write(struct.pack('<I%ss'%length, length, _x))
00285       length = len(self.Objects)
00286       buff.write(_struct_I.pack(length))
00287       for val1 in self.Objects:
00288         length = len(val1)
00289         if python3 or type(val1) == unicode:
00290           val1 = val1.encode('utf-8')
00291           length = len(val1)
00292         buff.write(struct.pack('<I%ss'%length, length, val1))
00293       buff.write(_struct_i.pack(self.MaxPointsPerObject))
00294     except struct.error as se: self._check_types(se)
00295     except TypeError as te: self._check_types(te)
00296 
00297   def deserialize_numpy(self, str, numpy):
00298     """
00299     unpack serialized message in str into this message instance using numpy for array types
00300     :param str: byte array of serialized message, ``str``
00301     :param numpy: numpy python module
00302     """
00303     try:
00304       if self.header is None:
00305         self.header = std_msgs.msg.Header()
00306       if self.Image is None:
00307         self.Image = sensor_msgs.msg.Image()
00308       end = 0
00309       _x = self
00310       start = end
00311       end += 12
00312       (_x.header.seq, _x.header.stamp.secs, _x.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.header.frame_id = str[start:end].decode('utf-8')
00320       else:
00321         self.header.frame_id = str[start:end]
00322       _x = self
00323       start = end
00324       end += 12
00325       (_x.Image.header.seq, _x.Image.header.stamp.secs, _x.Image.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00326       start = end
00327       end += 4
00328       (length,) = _struct_I.unpack(str[start:end])
00329       start = end
00330       end += length
00331       if python3:
00332         self.Image.header.frame_id = str[start:end].decode('utf-8')
00333       else:
00334         self.Image.header.frame_id = str[start:end]
00335       _x = self
00336       start = end
00337       end += 8
00338       (_x.Image.height, _x.Image.width,) = _struct_2I.unpack(str[start:end])
00339       start = end
00340       end += 4
00341       (length,) = _struct_I.unpack(str[start:end])
00342       start = end
00343       end += length
00344       if python3:
00345         self.Image.encoding = str[start:end].decode('utf-8')
00346       else:
00347         self.Image.encoding = str[start:end]
00348       _x = self
00349       start = end
00350       end += 5
00351       (_x.Image.is_bigendian, _x.Image.step,) = _struct_BI.unpack(str[start:end])
00352       start = end
00353       end += 4
00354       (length,) = _struct_I.unpack(str[start:end])
00355       start = end
00356       end += length
00357       if python3:
00358         self.Image.data = str[start:end].decode('utf-8')
00359       else:
00360         self.Image.data = str[start:end]
00361       start = end
00362       end += 4
00363       (length,) = _struct_I.unpack(str[start:end])
00364       self.Objects = []
00365       for i in range(0, length):
00366         start = end
00367         end += 4
00368         (length,) = _struct_I.unpack(str[start:end])
00369         start = end
00370         end += length
00371         if python3:
00372           val1 = str[start:end].decode('utf-8')
00373         else:
00374           val1 = str[start:end]
00375         self.Objects.append(val1)
00376       start = end
00377       end += 4
00378       (self.MaxPointsPerObject,) = _struct_i.unpack(str[start:end])
00379       return self
00380     except struct.error as e:
00381       raise genpy.DeserializationError(e) #most likely buffer underfill
00382 
00383 _struct_I = genpy.struct_I
00384 _struct_i = struct.Struct("<i")
00385 _struct_3I = struct.Struct("<3I")
00386 _struct_2I = struct.Struct("<2I")
00387 _struct_BI = struct.Struct("<BI")
00388 """autogenerated by genpy from re_vision/SearchForResponse.msg. Do not edit."""
00389 import sys
00390 python3 = True if sys.hexversion > 0x03000000 else False
00391 import genpy
00392 import struct
00393 
00394 import re_msgs.msg
00395 import geometry_msgs.msg
00396 
00397 class SearchForResponse(genpy.Message):
00398   _md5sum = "aeec124a9861d0de2b52c994f7e655a9"
00399   _type = "re_vision/SearchForResponse"
00400   _has_header = False #flag to mark the presence of a Header object
00401   _full_text = """re_msgs/DetectedObject[] Detections
00402 
00403 
00404 
00405 ================================================================================
00406 MSG: re_msgs/DetectedObject
00407 # Information of object detected in an image by re_vision
00408 #
00409 
00410 # detected points in the image
00411 Pixel[] points2d
00412 # detected 3d points in the camera reference
00413 geometry_msgs/Point[] points3d
00414 # pose of the object in the camera reference
00415 geometry_msgs/Pose pose
00416 # detected 3d points in the model reference
00417 geometry_msgs/Point[] points3d_model
00418 # detected 3d points octave
00419 int32[] octave
00420 
00421 ================================================================================
00422 MSG: re_msgs/Pixel
00423 # top-left corner: (0,0)
00424 
00425 int32 x
00426 int32 y
00427 ================================================================================
00428 MSG: geometry_msgs/Point
00429 # This contains the position of a point in free space
00430 float64 x
00431 float64 y
00432 float64 z
00433 
00434 ================================================================================
00435 MSG: geometry_msgs/Pose
00436 # A representation of pose in free space, composed of postion and orientation. 
00437 Point position
00438 Quaternion orientation
00439 
00440 ================================================================================
00441 MSG: geometry_msgs/Quaternion
00442 # This represents an orientation in free space in quaternion form.
00443 
00444 float64 x
00445 float64 y
00446 float64 z
00447 float64 w
00448 
00449 """
00450   __slots__ = ['Detections']
00451   _slot_types = ['re_msgs/DetectedObject[]']
00452 
00453   def __init__(self, *args, **kwds):
00454     """
00455     Constructor. Any message fields that are implicitly/explicitly
00456     set to None will be assigned a default value. The recommend
00457     use is keyword arguments as this is more robust to future message
00458     changes.  You cannot mix in-order arguments and keyword arguments.
00459 
00460     The available fields are:
00461        Detections
00462 
00463     :param args: complete set of field values, in .msg order
00464     :param kwds: use keyword arguments corresponding to message field names
00465     to set specific fields.
00466     """
00467     if args or kwds:
00468       super(SearchForResponse, self).__init__(*args, **kwds)
00469       #message fields cannot be None, assign default values for those that are
00470       if self.Detections is None:
00471         self.Detections = []
00472     else:
00473       self.Detections = []
00474 
00475   def _get_types(self):
00476     """
00477     internal API method
00478     """
00479     return self._slot_types
00480 
00481   def serialize(self, buff):
00482     """
00483     serialize message into buffer
00484     :param buff: buffer, ``StringIO``
00485     """
00486     try:
00487       length = len(self.Detections)
00488       buff.write(_struct_I.pack(length))
00489       for val1 in self.Detections:
00490         length = len(val1.points2d)
00491         buff.write(_struct_I.pack(length))
00492         for val2 in val1.points2d:
00493           _x = val2
00494           buff.write(_struct_2i.pack(_x.x, _x.y))
00495         length = len(val1.points3d)
00496         buff.write(_struct_I.pack(length))
00497         for val2 in val1.points3d:
00498           _x = val2
00499           buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00500         _v1 = val1.pose
00501         _v2 = _v1.position
00502         _x = _v2
00503         buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00504         _v3 = _v1.orientation
00505         _x = _v3
00506         buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00507         length = len(val1.points3d_model)
00508         buff.write(_struct_I.pack(length))
00509         for val2 in val1.points3d_model:
00510           _x = val2
00511           buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00512         length = len(val1.octave)
00513         buff.write(_struct_I.pack(length))
00514         pattern = '<%si'%length
00515         buff.write(struct.pack(pattern, *val1.octave))
00516     except struct.error as se: self._check_types(se)
00517     except TypeError as te: self._check_types(te)
00518 
00519   def deserialize(self, str):
00520     """
00521     unpack serialized message in str into this message instance
00522     :param str: byte array of serialized message, ``str``
00523     """
00524     try:
00525       if self.Detections is None:
00526         self.Detections = None
00527       end = 0
00528       start = end
00529       end += 4
00530       (length,) = _struct_I.unpack(str[start:end])
00531       self.Detections = []
00532       for i in range(0, length):
00533         val1 = re_msgs.msg.DetectedObject()
00534         start = end
00535         end += 4
00536         (length,) = _struct_I.unpack(str[start:end])
00537         val1.points2d = []
00538         for i in range(0, length):
00539           val2 = re_msgs.msg.Pixel()
00540           _x = val2
00541           start = end
00542           end += 8
00543           (_x.x, _x.y,) = _struct_2i.unpack(str[start:end])
00544           val1.points2d.append(val2)
00545         start = end
00546         end += 4
00547         (length,) = _struct_I.unpack(str[start:end])
00548         val1.points3d = []
00549         for i in range(0, length):
00550           val2 = geometry_msgs.msg.Point()
00551           _x = val2
00552           start = end
00553           end += 24
00554           (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00555           val1.points3d.append(val2)
00556         _v4 = val1.pose
00557         _v5 = _v4.position
00558         _x = _v5
00559         start = end
00560         end += 24
00561         (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00562         _v6 = _v4.orientation
00563         _x = _v6
00564         start = end
00565         end += 32
00566         (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
00567         start = end
00568         end += 4
00569         (length,) = _struct_I.unpack(str[start:end])
00570         val1.points3d_model = []
00571         for i in range(0, length):
00572           val2 = geometry_msgs.msg.Point()
00573           _x = val2
00574           start = end
00575           end += 24
00576           (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00577           val1.points3d_model.append(val2)
00578         start = end
00579         end += 4
00580         (length,) = _struct_I.unpack(str[start:end])
00581         pattern = '<%si'%length
00582         start = end
00583         end += struct.calcsize(pattern)
00584         val1.octave = struct.unpack(pattern, str[start:end])
00585         self.Detections.append(val1)
00586       return self
00587     except struct.error as e:
00588       raise genpy.DeserializationError(e) #most likely buffer underfill
00589 
00590 
00591   def serialize_numpy(self, buff, numpy):
00592     """
00593     serialize message with numpy array types into buffer
00594     :param buff: buffer, ``StringIO``
00595     :param numpy: numpy python module
00596     """
00597     try:
00598       length = len(self.Detections)
00599       buff.write(_struct_I.pack(length))
00600       for val1 in self.Detections:
00601         length = len(val1.points2d)
00602         buff.write(_struct_I.pack(length))
00603         for val2 in val1.points2d:
00604           _x = val2
00605           buff.write(_struct_2i.pack(_x.x, _x.y))
00606         length = len(val1.points3d)
00607         buff.write(_struct_I.pack(length))
00608         for val2 in val1.points3d:
00609           _x = val2
00610           buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00611         _v7 = val1.pose
00612         _v8 = _v7.position
00613         _x = _v8
00614         buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00615         _v9 = _v7.orientation
00616         _x = _v9
00617         buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00618         length = len(val1.points3d_model)
00619         buff.write(_struct_I.pack(length))
00620         for val2 in val1.points3d_model:
00621           _x = val2
00622           buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00623         length = len(val1.octave)
00624         buff.write(_struct_I.pack(length))
00625         pattern = '<%si'%length
00626         buff.write(val1.octave.tostring())
00627     except struct.error as se: self._check_types(se)
00628     except TypeError as te: self._check_types(te)
00629 
00630   def deserialize_numpy(self, str, numpy):
00631     """
00632     unpack serialized message in str into this message instance using numpy for array types
00633     :param str: byte array of serialized message, ``str``
00634     :param numpy: numpy python module
00635     """
00636     try:
00637       if self.Detections is None:
00638         self.Detections = None
00639       end = 0
00640       start = end
00641       end += 4
00642       (length,) = _struct_I.unpack(str[start:end])
00643       self.Detections = []
00644       for i in range(0, length):
00645         val1 = re_msgs.msg.DetectedObject()
00646         start = end
00647         end += 4
00648         (length,) = _struct_I.unpack(str[start:end])
00649         val1.points2d = []
00650         for i in range(0, length):
00651           val2 = re_msgs.msg.Pixel()
00652           _x = val2
00653           start = end
00654           end += 8
00655           (_x.x, _x.y,) = _struct_2i.unpack(str[start:end])
00656           val1.points2d.append(val2)
00657         start = end
00658         end += 4
00659         (length,) = _struct_I.unpack(str[start:end])
00660         val1.points3d = []
00661         for i in range(0, length):
00662           val2 = geometry_msgs.msg.Point()
00663           _x = val2
00664           start = end
00665           end += 24
00666           (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00667           val1.points3d.append(val2)
00668         _v10 = val1.pose
00669         _v11 = _v10.position
00670         _x = _v11
00671         start = end
00672         end += 24
00673         (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00674         _v12 = _v10.orientation
00675         _x = _v12
00676         start = end
00677         end += 32
00678         (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
00679         start = end
00680         end += 4
00681         (length,) = _struct_I.unpack(str[start:end])
00682         val1.points3d_model = []
00683         for i in range(0, length):
00684           val2 = geometry_msgs.msg.Point()
00685           _x = val2
00686           start = end
00687           end += 24
00688           (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00689           val1.points3d_model.append(val2)
00690         start = end
00691         end += 4
00692         (length,) = _struct_I.unpack(str[start:end])
00693         pattern = '<%si'%length
00694         start = end
00695         end += struct.calcsize(pattern)
00696         val1.octave = numpy.frombuffer(str[start:end], dtype=numpy.int32, count=length)
00697         self.Detections.append(val1)
00698       return self
00699     except struct.error as e:
00700       raise genpy.DeserializationError(e) #most likely buffer underfill
00701 
00702 _struct_I = genpy.struct_I
00703 _struct_4d = struct.Struct("<4d")
00704 _struct_2i = struct.Struct("<2i")
00705 _struct_3d = struct.Struct("<3d")
00706 class SearchFor(object):
00707   _type          = 're_vision/SearchFor'
00708   _md5sum = '1750b3eb6ab327ff73f77a82f3fd6f57'
00709   _request_class  = SearchForRequest
00710   _response_class = SearchForResponse


re_vision
Author(s): Dorian Galvez-Lopez
autogenerated on Sun Jan 5 2014 11:30:42