_WaypointActionGoal.py
Go to the documentation of this file.
00001 """autogenerated by genpy from asctec_hl_comm/WaypointActionGoal.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 genpy
00009 import actionlib_msgs.msg
00010 import asctec_hl_comm.msg
00011 import std_msgs.msg
00012 
00013 class WaypointActionGoal(genpy.Message):
00014   _md5sum = "fa35b0fbc9b50aade196a7f44b283346"
00015   _type = "asctec_hl_comm/WaypointActionGoal"
00016   _has_header = True #flag to mark the presence of a Header object
00017   _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00018 
00019 Header header
00020 actionlib_msgs/GoalID goal_id
00021 WaypointGoal goal
00022 
00023 ================================================================================
00024 MSG: std_msgs/Header
00025 # Standard metadata for higher-level stamped data types.
00026 # This is generally used to communicate timestamped data 
00027 # in a particular coordinate frame.
00028 # 
00029 # sequence ID: consecutively increasing ID 
00030 uint32 seq
00031 #Two-integer timestamp that is expressed as:
00032 # * stamp.secs: seconds (stamp_secs) since epoch
00033 # * stamp.nsecs: nanoseconds since stamp_secs
00034 # time-handling sugar is provided by the client library
00035 time stamp
00036 #Frame this data is associated with
00037 # 0: no frame
00038 # 1: global frame
00039 string frame_id
00040 
00041 ================================================================================
00042 MSG: actionlib_msgs/GoalID
00043 # The stamp should store the time at which this goal was requested.
00044 # It is used by an action server when it tries to preempt all
00045 # goals that were requested before a certain time
00046 time stamp
00047 
00048 # The id provides a way to associate feedback and
00049 # result message with specific goal requests. The id
00050 # specified must be unique.
00051 string id
00052 
00053 
00054 ================================================================================
00055 MSG: asctec_hl_comm/WaypointGoal
00056 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00057 #goal
00058 Header header
00059 geometry_msgs/Point32   goal_pos
00060 float32                 goal_yaw
00061 geometry_msgs/Point32   max_speed
00062 float32                                 accuracy_position        # determines the radius around the goal within the goal is considered as reached
00063 float32                 accuracy_orientation     # determines the range within the goal orientation is considered as reached, for the heli only yaw
00064 float32                 timeout                  # timeout in [s] after which flying to the waypoint stops
00065 
00066 ================================================================================
00067 MSG: geometry_msgs/Point32
00068 # This contains the position of a point in free space(with 32 bits of precision).
00069 # It is recommeded to use Point wherever possible instead of Point32.  
00070 # 
00071 # This recommendation is to promote interoperability.  
00072 #
00073 # This message is designed to take up less space when sending
00074 # lots of points at once, as in the case of a PointCloud.  
00075 
00076 float32 x
00077 float32 y
00078 float32 z
00079 """
00080   __slots__ = ['header','goal_id','goal']
00081   _slot_types = ['std_msgs/Header','actionlib_msgs/GoalID','asctec_hl_comm/WaypointGoal']
00082 
00083   def __init__(self, *args, **kwds):
00084     """
00085     Constructor. Any message fields that are implicitly/explicitly
00086     set to None will be assigned a default value. The recommend
00087     use is keyword arguments as this is more robust to future message
00088     changes.  You cannot mix in-order arguments and keyword arguments.
00089 
00090     The available fields are:
00091        header,goal_id,goal
00092 
00093     :param args: complete set of field values, in .msg order
00094     :param kwds: use keyword arguments corresponding to message field names
00095     to set specific fields.
00096     """
00097     if args or kwds:
00098       super(WaypointActionGoal, self).__init__(*args, **kwds)
00099       #message fields cannot be None, assign default values for those that are
00100       if self.header is None:
00101         self.header = std_msgs.msg.Header()
00102       if self.goal_id is None:
00103         self.goal_id = actionlib_msgs.msg.GoalID()
00104       if self.goal is None:
00105         self.goal = asctec_hl_comm.msg.WaypointGoal()
00106     else:
00107       self.header = std_msgs.msg.Header()
00108       self.goal_id = actionlib_msgs.msg.GoalID()
00109       self.goal = asctec_hl_comm.msg.WaypointGoal()
00110 
00111   def _get_types(self):
00112     """
00113     internal API method
00114     """
00115     return self._slot_types
00116 
00117   def serialize(self, buff):
00118     """
00119     serialize message into buffer
00120     :param buff: buffer, ``StringIO``
00121     """
00122     try:
00123       _x = self
00124       buff.write(_struct_3I.pack(_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs))
00125       _x = self.header.frame_id
00126       length = len(_x)
00127       if python3 or type(_x) == unicode:
00128         _x = _x.encode('utf-8')
00129         length = len(_x)
00130       buff.write(struct.pack('<I%ss'%length, length, _x))
00131       _x = self
00132       buff.write(_struct_2I.pack(_x.goal_id.stamp.secs, _x.goal_id.stamp.nsecs))
00133       _x = self.goal_id.id
00134       length = len(_x)
00135       if python3 or type(_x) == unicode:
00136         _x = _x.encode('utf-8')
00137         length = len(_x)
00138       buff.write(struct.pack('<I%ss'%length, length, _x))
00139       _x = self
00140       buff.write(_struct_3I.pack(_x.goal.header.seq, _x.goal.header.stamp.secs, _x.goal.header.stamp.nsecs))
00141       _x = self.goal.header.frame_id
00142       length = len(_x)
00143       if python3 or type(_x) == unicode:
00144         _x = _x.encode('utf-8')
00145         length = len(_x)
00146       buff.write(struct.pack('<I%ss'%length, length, _x))
00147       _x = self
00148       buff.write(_struct_10f.pack(_x.goal.goal_pos.x, _x.goal.goal_pos.y, _x.goal.goal_pos.z, _x.goal.goal_yaw, _x.goal.max_speed.x, _x.goal.max_speed.y, _x.goal.max_speed.z, _x.goal.accuracy_position, _x.goal.accuracy_orientation, _x.goal.timeout))
00149     except struct.error as se: self._check_types(se)
00150     except TypeError as te: self._check_types(te)
00151 
00152   def deserialize(self, str):
00153     """
00154     unpack serialized message in str into this message instance
00155     :param str: byte array of serialized message, ``str``
00156     """
00157     try:
00158       if self.header is None:
00159         self.header = std_msgs.msg.Header()
00160       if self.goal_id is None:
00161         self.goal_id = actionlib_msgs.msg.GoalID()
00162       if self.goal is None:
00163         self.goal = asctec_hl_comm.msg.WaypointGoal()
00164       end = 0
00165       _x = self
00166       start = end
00167       end += 12
00168       (_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00169       start = end
00170       end += 4
00171       (length,) = _struct_I.unpack(str[start:end])
00172       start = end
00173       end += length
00174       if python3:
00175         self.header.frame_id = str[start:end].decode('utf-8')
00176       else:
00177         self.header.frame_id = str[start:end]
00178       _x = self
00179       start = end
00180       end += 8
00181       (_x.goal_id.stamp.secs, _x.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00182       start = end
00183       end += 4
00184       (length,) = _struct_I.unpack(str[start:end])
00185       start = end
00186       end += length
00187       if python3:
00188         self.goal_id.id = str[start:end].decode('utf-8')
00189       else:
00190         self.goal_id.id = str[start:end]
00191       _x = self
00192       start = end
00193       end += 12
00194       (_x.goal.header.seq, _x.goal.header.stamp.secs, _x.goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00195       start = end
00196       end += 4
00197       (length,) = _struct_I.unpack(str[start:end])
00198       start = end
00199       end += length
00200       if python3:
00201         self.goal.header.frame_id = str[start:end].decode('utf-8')
00202       else:
00203         self.goal.header.frame_id = str[start:end]
00204       _x = self
00205       start = end
00206       end += 40
00207       (_x.goal.goal_pos.x, _x.goal.goal_pos.y, _x.goal.goal_pos.z, _x.goal.goal_yaw, _x.goal.max_speed.x, _x.goal.max_speed.y, _x.goal.max_speed.z, _x.goal.accuracy_position, _x.goal.accuracy_orientation, _x.goal.timeout,) = _struct_10f.unpack(str[start:end])
00208       return self
00209     except struct.error as e:
00210       raise genpy.DeserializationError(e) #most likely buffer underfill
00211 
00212 
00213   def serialize_numpy(self, buff, numpy):
00214     """
00215     serialize message with numpy array types into buffer
00216     :param buff: buffer, ``StringIO``
00217     :param numpy: numpy python module
00218     """
00219     try:
00220       _x = self
00221       buff.write(_struct_3I.pack(_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs))
00222       _x = self.header.frame_id
00223       length = len(_x)
00224       if python3 or type(_x) == unicode:
00225         _x = _x.encode('utf-8')
00226         length = len(_x)
00227       buff.write(struct.pack('<I%ss'%length, length, _x))
00228       _x = self
00229       buff.write(_struct_2I.pack(_x.goal_id.stamp.secs, _x.goal_id.stamp.nsecs))
00230       _x = self.goal_id.id
00231       length = len(_x)
00232       if python3 or type(_x) == unicode:
00233         _x = _x.encode('utf-8')
00234         length = len(_x)
00235       buff.write(struct.pack('<I%ss'%length, length, _x))
00236       _x = self
00237       buff.write(_struct_3I.pack(_x.goal.header.seq, _x.goal.header.stamp.secs, _x.goal.header.stamp.nsecs))
00238       _x = self.goal.header.frame_id
00239       length = len(_x)
00240       if python3 or type(_x) == unicode:
00241         _x = _x.encode('utf-8')
00242         length = len(_x)
00243       buff.write(struct.pack('<I%ss'%length, length, _x))
00244       _x = self
00245       buff.write(_struct_10f.pack(_x.goal.goal_pos.x, _x.goal.goal_pos.y, _x.goal.goal_pos.z, _x.goal.goal_yaw, _x.goal.max_speed.x, _x.goal.max_speed.y, _x.goal.max_speed.z, _x.goal.accuracy_position, _x.goal.accuracy_orientation, _x.goal.timeout))
00246     except struct.error as se: self._check_types(se)
00247     except TypeError as te: self._check_types(te)
00248 
00249   def deserialize_numpy(self, str, numpy):
00250     """
00251     unpack serialized message in str into this message instance using numpy for array types
00252     :param str: byte array of serialized message, ``str``
00253     :param numpy: numpy python module
00254     """
00255     try:
00256       if self.header is None:
00257         self.header = std_msgs.msg.Header()
00258       if self.goal_id is None:
00259         self.goal_id = actionlib_msgs.msg.GoalID()
00260       if self.goal is None:
00261         self.goal = asctec_hl_comm.msg.WaypointGoal()
00262       end = 0
00263       _x = self
00264       start = end
00265       end += 12
00266       (_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00267       start = end
00268       end += 4
00269       (length,) = _struct_I.unpack(str[start:end])
00270       start = end
00271       end += length
00272       if python3:
00273         self.header.frame_id = str[start:end].decode('utf-8')
00274       else:
00275         self.header.frame_id = str[start:end]
00276       _x = self
00277       start = end
00278       end += 8
00279       (_x.goal_id.stamp.secs, _x.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00280       start = end
00281       end += 4
00282       (length,) = _struct_I.unpack(str[start:end])
00283       start = end
00284       end += length
00285       if python3:
00286         self.goal_id.id = str[start:end].decode('utf-8')
00287       else:
00288         self.goal_id.id = str[start:end]
00289       _x = self
00290       start = end
00291       end += 12
00292       (_x.goal.header.seq, _x.goal.header.stamp.secs, _x.goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00293       start = end
00294       end += 4
00295       (length,) = _struct_I.unpack(str[start:end])
00296       start = end
00297       end += length
00298       if python3:
00299         self.goal.header.frame_id = str[start:end].decode('utf-8')
00300       else:
00301         self.goal.header.frame_id = str[start:end]
00302       _x = self
00303       start = end
00304       end += 40
00305       (_x.goal.goal_pos.x, _x.goal.goal_pos.y, _x.goal.goal_pos.z, _x.goal.goal_yaw, _x.goal.max_speed.x, _x.goal.max_speed.y, _x.goal.max_speed.z, _x.goal.accuracy_position, _x.goal.accuracy_orientation, _x.goal.timeout,) = _struct_10f.unpack(str[start:end])
00306       return self
00307     except struct.error as e:
00308       raise genpy.DeserializationError(e) #most likely buffer underfill
00309 
00310 _struct_I = genpy.struct_I
00311 _struct_3I = struct.Struct("<3I")
00312 _struct_10f = struct.Struct("<10f")
00313 _struct_2I = struct.Struct("<2I")


asctec_hl_comm
Author(s): Markus Achtelik, Michael Achtelik, Stephan Weiss, Laurent Kneip
autogenerated on Tue Jan 7 2014 11:05:05