_GetSearchPosition.py
Go to the documentation of this file.
00001 """autogenerated by genpy from hector_nav_msgs/GetSearchPositionRequest.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 import std_msgs.msg
00009 
00010 class GetSearchPositionRequest(genpy.Message):
00011   _md5sum = "a579e8b989d066f6c17946ab060a6ff9"
00012   _type = "hector_nav_msgs/GetSearchPositionRequest"
00013   _has_header = False #flag to mark the presence of a Header object
00014   _full_text = """
00015 
00016 geometry_msgs/PoseStamped ooi_pose
00017 float32 distance
00018 
00019 ================================================================================
00020 MSG: geometry_msgs/PoseStamped
00021 # A Pose with reference coordinate frame and timestamp
00022 Header header
00023 Pose pose
00024 
00025 ================================================================================
00026 MSG: std_msgs/Header
00027 # Standard metadata for higher-level stamped data types.
00028 # This is generally used to communicate timestamped data 
00029 # in a particular coordinate frame.
00030 # 
00031 # sequence ID: consecutively increasing ID 
00032 uint32 seq
00033 #Two-integer timestamp that is expressed as:
00034 # * stamp.secs: seconds (stamp_secs) since epoch
00035 # * stamp.nsecs: nanoseconds since stamp_secs
00036 # time-handling sugar is provided by the client library
00037 time stamp
00038 #Frame this data is associated with
00039 # 0: no frame
00040 # 1: global frame
00041 string frame_id
00042 
00043 ================================================================================
00044 MSG: geometry_msgs/Pose
00045 # A representation of pose in free space, composed of postion and orientation. 
00046 Point position
00047 Quaternion orientation
00048 
00049 ================================================================================
00050 MSG: geometry_msgs/Point
00051 # This contains the position of a point in free space
00052 float64 x
00053 float64 y
00054 float64 z
00055 
00056 ================================================================================
00057 MSG: geometry_msgs/Quaternion
00058 # This represents an orientation in free space in quaternion form.
00059 
00060 float64 x
00061 float64 y
00062 float64 z
00063 float64 w
00064 
00065 """
00066   __slots__ = ['ooi_pose','distance']
00067   _slot_types = ['geometry_msgs/PoseStamped','float32']
00068 
00069   def __init__(self, *args, **kwds):
00070     """
00071     Constructor. Any message fields that are implicitly/explicitly
00072     set to None will be assigned a default value. The recommend
00073     use is keyword arguments as this is more robust to future message
00074     changes.  You cannot mix in-order arguments and keyword arguments.
00075 
00076     The available fields are:
00077        ooi_pose,distance
00078 
00079     :param args: complete set of field values, in .msg order
00080     :param kwds: use keyword arguments corresponding to message field names
00081     to set specific fields.
00082     """
00083     if args or kwds:
00084       super(GetSearchPositionRequest, self).__init__(*args, **kwds)
00085       #message fields cannot be None, assign default values for those that are
00086       if self.ooi_pose is None:
00087         self.ooi_pose = geometry_msgs.msg.PoseStamped()
00088       if self.distance is None:
00089         self.distance = 0.
00090     else:
00091       self.ooi_pose = geometry_msgs.msg.PoseStamped()
00092       self.distance = 0.
00093 
00094   def _get_types(self):
00095     """
00096     internal API method
00097     """
00098     return self._slot_types
00099 
00100   def serialize(self, buff):
00101     """
00102     serialize message into buffer
00103     :param buff: buffer, ``StringIO``
00104     """
00105     try:
00106       _x = self
00107       buff.write(_struct_3I.pack(_x.ooi_pose.header.seq, _x.ooi_pose.header.stamp.secs, _x.ooi_pose.header.stamp.nsecs))
00108       _x = self.ooi_pose.header.frame_id
00109       length = len(_x)
00110       if python3 or type(_x) == unicode:
00111         _x = _x.encode('utf-8')
00112         length = len(_x)
00113       buff.write(struct.pack('<I%ss'%length, length, _x))
00114       _x = self
00115       buff.write(_struct_7df.pack(_x.ooi_pose.pose.position.x, _x.ooi_pose.pose.position.y, _x.ooi_pose.pose.position.z, _x.ooi_pose.pose.orientation.x, _x.ooi_pose.pose.orientation.y, _x.ooi_pose.pose.orientation.z, _x.ooi_pose.pose.orientation.w, _x.distance))
00116     except struct.error as se: self._check_types(struct.error("%s: '%s' when writing '%s'" % (type(se), str(se), str(_x))))
00117     except TypeError as te: self._check_types(ValueError("%s: '%s' when writing '%s'" % (type(te), str(te), str(_x))))
00118 
00119   def deserialize(self, str):
00120     """
00121     unpack serialized message in str into this message instance
00122     :param str: byte array of serialized message, ``str``
00123     """
00124     try:
00125       if self.ooi_pose is None:
00126         self.ooi_pose = geometry_msgs.msg.PoseStamped()
00127       end = 0
00128       _x = self
00129       start = end
00130       end += 12
00131       (_x.ooi_pose.header.seq, _x.ooi_pose.header.stamp.secs, _x.ooi_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00132       start = end
00133       end += 4
00134       (length,) = _struct_I.unpack(str[start:end])
00135       start = end
00136       end += length
00137       if python3:
00138         self.ooi_pose.header.frame_id = str[start:end].decode('utf-8')
00139       else:
00140         self.ooi_pose.header.frame_id = str[start:end]
00141       _x = self
00142       start = end
00143       end += 60
00144       (_x.ooi_pose.pose.position.x, _x.ooi_pose.pose.position.y, _x.ooi_pose.pose.position.z, _x.ooi_pose.pose.orientation.x, _x.ooi_pose.pose.orientation.y, _x.ooi_pose.pose.orientation.z, _x.ooi_pose.pose.orientation.w, _x.distance,) = _struct_7df.unpack(str[start:end])
00145       return self
00146     except struct.error as e:
00147       raise genpy.DeserializationError(e) #most likely buffer underfill
00148 
00149 
00150   def serialize_numpy(self, buff, numpy):
00151     """
00152     serialize message with numpy array types into buffer
00153     :param buff: buffer, ``StringIO``
00154     :param numpy: numpy python module
00155     """
00156     try:
00157       _x = self
00158       buff.write(_struct_3I.pack(_x.ooi_pose.header.seq, _x.ooi_pose.header.stamp.secs, _x.ooi_pose.header.stamp.nsecs))
00159       _x = self.ooi_pose.header.frame_id
00160       length = len(_x)
00161       if python3 or type(_x) == unicode:
00162         _x = _x.encode('utf-8')
00163         length = len(_x)
00164       buff.write(struct.pack('<I%ss'%length, length, _x))
00165       _x = self
00166       buff.write(_struct_7df.pack(_x.ooi_pose.pose.position.x, _x.ooi_pose.pose.position.y, _x.ooi_pose.pose.position.z, _x.ooi_pose.pose.orientation.x, _x.ooi_pose.pose.orientation.y, _x.ooi_pose.pose.orientation.z, _x.ooi_pose.pose.orientation.w, _x.distance))
00167     except struct.error as se: self._check_types(struct.error("%s: '%s' when writing '%s'" % (type(se), str(se), str(_x))))
00168     except TypeError as te: self._check_types(ValueError("%s: '%s' when writing '%s'" % (type(te), str(te), str(_x))))
00169 
00170   def deserialize_numpy(self, str, numpy):
00171     """
00172     unpack serialized message in str into this message instance using numpy for array types
00173     :param str: byte array of serialized message, ``str``
00174     :param numpy: numpy python module
00175     """
00176     try:
00177       if self.ooi_pose is None:
00178         self.ooi_pose = geometry_msgs.msg.PoseStamped()
00179       end = 0
00180       _x = self
00181       start = end
00182       end += 12
00183       (_x.ooi_pose.header.seq, _x.ooi_pose.header.stamp.secs, _x.ooi_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00184       start = end
00185       end += 4
00186       (length,) = _struct_I.unpack(str[start:end])
00187       start = end
00188       end += length
00189       if python3:
00190         self.ooi_pose.header.frame_id = str[start:end].decode('utf-8')
00191       else:
00192         self.ooi_pose.header.frame_id = str[start:end]
00193       _x = self
00194       start = end
00195       end += 60
00196       (_x.ooi_pose.pose.position.x, _x.ooi_pose.pose.position.y, _x.ooi_pose.pose.position.z, _x.ooi_pose.pose.orientation.x, _x.ooi_pose.pose.orientation.y, _x.ooi_pose.pose.orientation.z, _x.ooi_pose.pose.orientation.w, _x.distance,) = _struct_7df.unpack(str[start:end])
00197       return self
00198     except struct.error as e:
00199       raise genpy.DeserializationError(e) #most likely buffer underfill
00200 
00201 _struct_I = genpy.struct_I
00202 _struct_3I = struct.Struct("<3I")
00203 _struct_7df = struct.Struct("<7df")
00204 """autogenerated by genpy from hector_nav_msgs/GetSearchPositionResponse.msg. Do not edit."""
00205 import sys
00206 python3 = True if sys.hexversion > 0x03000000 else False
00207 import genpy
00208 import struct
00209 
00210 import geometry_msgs.msg
00211 import std_msgs.msg
00212 
00213 class GetSearchPositionResponse(genpy.Message):
00214   _md5sum = "6cc90c22cc49490b4dd1ef4798491231"
00215   _type = "hector_nav_msgs/GetSearchPositionResponse"
00216   _has_header = False #flag to mark the presence of a Header object
00217   _full_text = """geometry_msgs/PoseStamped search_pose
00218 
00219 
00220 
00221 ================================================================================
00222 MSG: geometry_msgs/PoseStamped
00223 # A Pose with reference coordinate frame and timestamp
00224 Header header
00225 Pose pose
00226 
00227 ================================================================================
00228 MSG: std_msgs/Header
00229 # Standard metadata for higher-level stamped data types.
00230 # This is generally used to communicate timestamped data 
00231 # in a particular coordinate frame.
00232 # 
00233 # sequence ID: consecutively increasing ID 
00234 uint32 seq
00235 #Two-integer timestamp that is expressed as:
00236 # * stamp.secs: seconds (stamp_secs) since epoch
00237 # * stamp.nsecs: nanoseconds since stamp_secs
00238 # time-handling sugar is provided by the client library
00239 time stamp
00240 #Frame this data is associated with
00241 # 0: no frame
00242 # 1: global frame
00243 string frame_id
00244 
00245 ================================================================================
00246 MSG: geometry_msgs/Pose
00247 # A representation of pose in free space, composed of postion and orientation. 
00248 Point position
00249 Quaternion orientation
00250 
00251 ================================================================================
00252 MSG: geometry_msgs/Point
00253 # This contains the position of a point in free space
00254 float64 x
00255 float64 y
00256 float64 z
00257 
00258 ================================================================================
00259 MSG: geometry_msgs/Quaternion
00260 # This represents an orientation in free space in quaternion form.
00261 
00262 float64 x
00263 float64 y
00264 float64 z
00265 float64 w
00266 
00267 """
00268   __slots__ = ['search_pose']
00269   _slot_types = ['geometry_msgs/PoseStamped']
00270 
00271   def __init__(self, *args, **kwds):
00272     """
00273     Constructor. Any message fields that are implicitly/explicitly
00274     set to None will be assigned a default value. The recommend
00275     use is keyword arguments as this is more robust to future message
00276     changes.  You cannot mix in-order arguments and keyword arguments.
00277 
00278     The available fields are:
00279        search_pose
00280 
00281     :param args: complete set of field values, in .msg order
00282     :param kwds: use keyword arguments corresponding to message field names
00283     to set specific fields.
00284     """
00285     if args or kwds:
00286       super(GetSearchPositionResponse, self).__init__(*args, **kwds)
00287       #message fields cannot be None, assign default values for those that are
00288       if self.search_pose is None:
00289         self.search_pose = geometry_msgs.msg.PoseStamped()
00290     else:
00291       self.search_pose = geometry_msgs.msg.PoseStamped()
00292 
00293   def _get_types(self):
00294     """
00295     internal API method
00296     """
00297     return self._slot_types
00298 
00299   def serialize(self, buff):
00300     """
00301     serialize message into buffer
00302     :param buff: buffer, ``StringIO``
00303     """
00304     try:
00305       _x = self
00306       buff.write(_struct_3I.pack(_x.search_pose.header.seq, _x.search_pose.header.stamp.secs, _x.search_pose.header.stamp.nsecs))
00307       _x = self.search_pose.header.frame_id
00308       length = len(_x)
00309       if python3 or type(_x) == unicode:
00310         _x = _x.encode('utf-8')
00311         length = len(_x)
00312       buff.write(struct.pack('<I%ss'%length, length, _x))
00313       _x = self
00314       buff.write(_struct_7d.pack(_x.search_pose.pose.position.x, _x.search_pose.pose.position.y, _x.search_pose.pose.position.z, _x.search_pose.pose.orientation.x, _x.search_pose.pose.orientation.y, _x.search_pose.pose.orientation.z, _x.search_pose.pose.orientation.w))
00315     except struct.error as se: self._check_types(struct.error("%s: '%s' when writing '%s'" % (type(se), str(se), str(_x))))
00316     except TypeError as te: self._check_types(ValueError("%s: '%s' when writing '%s'" % (type(te), str(te), str(_x))))
00317 
00318   def deserialize(self, str):
00319     """
00320     unpack serialized message in str into this message instance
00321     :param str: byte array of serialized message, ``str``
00322     """
00323     try:
00324       if self.search_pose is None:
00325         self.search_pose = geometry_msgs.msg.PoseStamped()
00326       end = 0
00327       _x = self
00328       start = end
00329       end += 12
00330       (_x.search_pose.header.seq, _x.search_pose.header.stamp.secs, _x.search_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00331       start = end
00332       end += 4
00333       (length,) = _struct_I.unpack(str[start:end])
00334       start = end
00335       end += length
00336       if python3:
00337         self.search_pose.header.frame_id = str[start:end].decode('utf-8')
00338       else:
00339         self.search_pose.header.frame_id = str[start:end]
00340       _x = self
00341       start = end
00342       end += 56
00343       (_x.search_pose.pose.position.x, _x.search_pose.pose.position.y, _x.search_pose.pose.position.z, _x.search_pose.pose.orientation.x, _x.search_pose.pose.orientation.y, _x.search_pose.pose.orientation.z, _x.search_pose.pose.orientation.w,) = _struct_7d.unpack(str[start:end])
00344       return self
00345     except struct.error as e:
00346       raise genpy.DeserializationError(e) #most likely buffer underfill
00347 
00348 
00349   def serialize_numpy(self, buff, numpy):
00350     """
00351     serialize message with numpy array types into buffer
00352     :param buff: buffer, ``StringIO``
00353     :param numpy: numpy python module
00354     """
00355     try:
00356       _x = self
00357       buff.write(_struct_3I.pack(_x.search_pose.header.seq, _x.search_pose.header.stamp.secs, _x.search_pose.header.stamp.nsecs))
00358       _x = self.search_pose.header.frame_id
00359       length = len(_x)
00360       if python3 or type(_x) == unicode:
00361         _x = _x.encode('utf-8')
00362         length = len(_x)
00363       buff.write(struct.pack('<I%ss'%length, length, _x))
00364       _x = self
00365       buff.write(_struct_7d.pack(_x.search_pose.pose.position.x, _x.search_pose.pose.position.y, _x.search_pose.pose.position.z, _x.search_pose.pose.orientation.x, _x.search_pose.pose.orientation.y, _x.search_pose.pose.orientation.z, _x.search_pose.pose.orientation.w))
00366     except struct.error as se: self._check_types(struct.error("%s: '%s' when writing '%s'" % (type(se), str(se), str(_x))))
00367     except TypeError as te: self._check_types(ValueError("%s: '%s' when writing '%s'" % (type(te), str(te), str(_x))))
00368 
00369   def deserialize_numpy(self, str, numpy):
00370     """
00371     unpack serialized message in str into this message instance using numpy for array types
00372     :param str: byte array of serialized message, ``str``
00373     :param numpy: numpy python module
00374     """
00375     try:
00376       if self.search_pose is None:
00377         self.search_pose = geometry_msgs.msg.PoseStamped()
00378       end = 0
00379       _x = self
00380       start = end
00381       end += 12
00382       (_x.search_pose.header.seq, _x.search_pose.header.stamp.secs, _x.search_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00383       start = end
00384       end += 4
00385       (length,) = _struct_I.unpack(str[start:end])
00386       start = end
00387       end += length
00388       if python3:
00389         self.search_pose.header.frame_id = str[start:end].decode('utf-8')
00390       else:
00391         self.search_pose.header.frame_id = str[start:end]
00392       _x = self
00393       start = end
00394       end += 56
00395       (_x.search_pose.pose.position.x, _x.search_pose.pose.position.y, _x.search_pose.pose.position.z, _x.search_pose.pose.orientation.x, _x.search_pose.pose.orientation.y, _x.search_pose.pose.orientation.z, _x.search_pose.pose.orientation.w,) = _struct_7d.unpack(str[start:end])
00396       return self
00397     except struct.error as e:
00398       raise genpy.DeserializationError(e) #most likely buffer underfill
00399 
00400 _struct_I = genpy.struct_I
00401 _struct_3I = struct.Struct("<3I")
00402 _struct_7d = struct.Struct("<7d")
00403 class GetSearchPosition(object):
00404   _type          = 'hector_nav_msgs/GetSearchPosition'
00405   _md5sum = 'a28d7c2840927c12082b304156df4111'
00406   _request_class  = GetSearchPositionRequest
00407   _response_class = GetSearchPositionResponse


hector_nav_msgs
Author(s): Stefan Kohlbrecher
autogenerated on Mon Oct 6 2014 00:33:16