00001 """autogenerated by genpy from asctec_hl_comm/WaypointActionResult.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 WaypointActionResult(genpy.Message):
00014 _md5sum = "98dea99f8d3ca1caab80159128839c26"
00015 _type = "asctec_hl_comm/WaypointActionResult"
00016 _has_header = True
00017 _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00018
00019 Header header
00020 actionlib_msgs/GoalStatus status
00021 WaypointResult result
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/GoalStatus
00043 GoalID goal_id
00044 uint8 status
00045 uint8 PENDING = 0 # The goal has yet to be processed by the action server
00046 uint8 ACTIVE = 1 # The goal is currently being processed by the action server
00047 uint8 PREEMPTED = 2 # The goal received a cancel request after it started executing
00048 # and has since completed its execution (Terminal State)
00049 uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server (Terminal State)
00050 uint8 ABORTED = 4 # The goal was aborted during execution by the action server due
00051 # to some failure (Terminal State)
00052 uint8 REJECTED = 5 # The goal was rejected by the action server without being processed,
00053 # because the goal was unattainable or invalid (Terminal State)
00054 uint8 PREEMPTING = 6 # The goal received a cancel request after it started executing
00055 # and has not yet completed execution
00056 uint8 RECALLING = 7 # The goal received a cancel request before it started executing,
00057 # but the action server has not yet confirmed that the goal is canceled
00058 uint8 RECALLED = 8 # The goal received a cancel request before it started executing
00059 # and was successfully cancelled (Terminal State)
00060 uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not be
00061 # sent over the wire by an action server
00062
00063 #Allow for the user to associate a string with GoalStatus for debugging
00064 string text
00065
00066
00067 ================================================================================
00068 MSG: actionlib_msgs/GoalID
00069 # The stamp should store the time at which this goal was requested.
00070 # It is used by an action server when it tries to preempt all
00071 # goals that were requested before a certain time
00072 time stamp
00073
00074 # The id provides a way to associate feedback and
00075 # result message with specific goal requests. The id
00076 # specified must be unique.
00077 string id
00078
00079
00080 ================================================================================
00081 MSG: asctec_hl_comm/WaypointResult
00082 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00083 #result
00084 Header header
00085 geometry_msgs/Point32 result_pos
00086 float32 result_yaw
00087 string status
00088
00089 ================================================================================
00090 MSG: geometry_msgs/Point32
00091 # This contains the position of a point in free space(with 32 bits of precision).
00092 # It is recommeded to use Point wherever possible instead of Point32.
00093 #
00094 # This recommendation is to promote interoperability.
00095 #
00096 # This message is designed to take up less space when sending
00097 # lots of points at once, as in the case of a PointCloud.
00098
00099 float32 x
00100 float32 y
00101 float32 z
00102 """
00103 __slots__ = ['header','status','result']
00104 _slot_types = ['std_msgs/Header','actionlib_msgs/GoalStatus','asctec_hl_comm/WaypointResult']
00105
00106 def __init__(self, *args, **kwds):
00107 """
00108 Constructor. Any message fields that are implicitly/explicitly
00109 set to None will be assigned a default value. The recommend
00110 use is keyword arguments as this is more robust to future message
00111 changes. You cannot mix in-order arguments and keyword arguments.
00112
00113 The available fields are:
00114 header,status,result
00115
00116 :param args: complete set of field values, in .msg order
00117 :param kwds: use keyword arguments corresponding to message field names
00118 to set specific fields.
00119 """
00120 if args or kwds:
00121 super(WaypointActionResult, self).__init__(*args, **kwds)
00122
00123 if self.header is None:
00124 self.header = std_msgs.msg.Header()
00125 if self.status is None:
00126 self.status = actionlib_msgs.msg.GoalStatus()
00127 if self.result is None:
00128 self.result = asctec_hl_comm.msg.WaypointResult()
00129 else:
00130 self.header = std_msgs.msg.Header()
00131 self.status = actionlib_msgs.msg.GoalStatus()
00132 self.result = asctec_hl_comm.msg.WaypointResult()
00133
00134 def _get_types(self):
00135 """
00136 internal API method
00137 """
00138 return self._slot_types
00139
00140 def serialize(self, buff):
00141 """
00142 serialize message into buffer
00143 :param buff: buffer, ``StringIO``
00144 """
00145 try:
00146 _x = self
00147 buff.write(_struct_3I.pack(_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs))
00148 _x = self.header.frame_id
00149 length = len(_x)
00150 if python3 or type(_x) == unicode:
00151 _x = _x.encode('utf-8')
00152 length = len(_x)
00153 buff.write(struct.pack('<I%ss'%length, length, _x))
00154 _x = self
00155 buff.write(_struct_2I.pack(_x.status.goal_id.stamp.secs, _x.status.goal_id.stamp.nsecs))
00156 _x = self.status.goal_id.id
00157 length = len(_x)
00158 if python3 or type(_x) == unicode:
00159 _x = _x.encode('utf-8')
00160 length = len(_x)
00161 buff.write(struct.pack('<I%ss'%length, length, _x))
00162 buff.write(_struct_B.pack(self.status.status))
00163 _x = self.status.text
00164 length = len(_x)
00165 if python3 or type(_x) == unicode:
00166 _x = _x.encode('utf-8')
00167 length = len(_x)
00168 buff.write(struct.pack('<I%ss'%length, length, _x))
00169 _x = self
00170 buff.write(_struct_3I.pack(_x.result.header.seq, _x.result.header.stamp.secs, _x.result.header.stamp.nsecs))
00171 _x = self.result.header.frame_id
00172 length = len(_x)
00173 if python3 or type(_x) == unicode:
00174 _x = _x.encode('utf-8')
00175 length = len(_x)
00176 buff.write(struct.pack('<I%ss'%length, length, _x))
00177 _x = self
00178 buff.write(_struct_4f.pack(_x.result.result_pos.x, _x.result.result_pos.y, _x.result.result_pos.z, _x.result.result_yaw))
00179 _x = self.result.status
00180 length = len(_x)
00181 if python3 or type(_x) == unicode:
00182 _x = _x.encode('utf-8')
00183 length = len(_x)
00184 buff.write(struct.pack('<I%ss'%length, length, _x))
00185 except struct.error as se: self._check_types(se)
00186 except TypeError as te: self._check_types(te)
00187
00188 def deserialize(self, str):
00189 """
00190 unpack serialized message in str into this message instance
00191 :param str: byte array of serialized message, ``str``
00192 """
00193 try:
00194 if self.header is None:
00195 self.header = std_msgs.msg.Header()
00196 if self.status is None:
00197 self.status = actionlib_msgs.msg.GoalStatus()
00198 if self.result is None:
00199 self.result = asctec_hl_comm.msg.WaypointResult()
00200 end = 0
00201 _x = self
00202 start = end
00203 end += 12
00204 (_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00205 start = end
00206 end += 4
00207 (length,) = _struct_I.unpack(str[start:end])
00208 start = end
00209 end += length
00210 if python3:
00211 self.header.frame_id = str[start:end].decode('utf-8')
00212 else:
00213 self.header.frame_id = str[start:end]
00214 _x = self
00215 start = end
00216 end += 8
00217 (_x.status.goal_id.stamp.secs, _x.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00218 start = end
00219 end += 4
00220 (length,) = _struct_I.unpack(str[start:end])
00221 start = end
00222 end += length
00223 if python3:
00224 self.status.goal_id.id = str[start:end].decode('utf-8')
00225 else:
00226 self.status.goal_id.id = str[start:end]
00227 start = end
00228 end += 1
00229 (self.status.status,) = _struct_B.unpack(str[start:end])
00230 start = end
00231 end += 4
00232 (length,) = _struct_I.unpack(str[start:end])
00233 start = end
00234 end += length
00235 if python3:
00236 self.status.text = str[start:end].decode('utf-8')
00237 else:
00238 self.status.text = str[start:end]
00239 _x = self
00240 start = end
00241 end += 12
00242 (_x.result.header.seq, _x.result.header.stamp.secs, _x.result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00243 start = end
00244 end += 4
00245 (length,) = _struct_I.unpack(str[start:end])
00246 start = end
00247 end += length
00248 if python3:
00249 self.result.header.frame_id = str[start:end].decode('utf-8')
00250 else:
00251 self.result.header.frame_id = str[start:end]
00252 _x = self
00253 start = end
00254 end += 16
00255 (_x.result.result_pos.x, _x.result.result_pos.y, _x.result.result_pos.z, _x.result.result_yaw,) = _struct_4f.unpack(str[start:end])
00256 start = end
00257 end += 4
00258 (length,) = _struct_I.unpack(str[start:end])
00259 start = end
00260 end += length
00261 if python3:
00262 self.result.status = str[start:end].decode('utf-8')
00263 else:
00264 self.result.status = str[start:end]
00265 return self
00266 except struct.error as e:
00267 raise genpy.DeserializationError(e)
00268
00269
00270 def serialize_numpy(self, buff, numpy):
00271 """
00272 serialize message with numpy array types into buffer
00273 :param buff: buffer, ``StringIO``
00274 :param numpy: numpy python module
00275 """
00276 try:
00277 _x = self
00278 buff.write(_struct_3I.pack(_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs))
00279 _x = self.header.frame_id
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 = self
00286 buff.write(_struct_2I.pack(_x.status.goal_id.stamp.secs, _x.status.goal_id.stamp.nsecs))
00287 _x = self.status.goal_id.id
00288 length = len(_x)
00289 if python3 or type(_x) == unicode:
00290 _x = _x.encode('utf-8')
00291 length = len(_x)
00292 buff.write(struct.pack('<I%ss'%length, length, _x))
00293 buff.write(_struct_B.pack(self.status.status))
00294 _x = self.status.text
00295 length = len(_x)
00296 if python3 or type(_x) == unicode:
00297 _x = _x.encode('utf-8')
00298 length = len(_x)
00299 buff.write(struct.pack('<I%ss'%length, length, _x))
00300 _x = self
00301 buff.write(_struct_3I.pack(_x.result.header.seq, _x.result.header.stamp.secs, _x.result.header.stamp.nsecs))
00302 _x = self.result.header.frame_id
00303 length = len(_x)
00304 if python3 or type(_x) == unicode:
00305 _x = _x.encode('utf-8')
00306 length = len(_x)
00307 buff.write(struct.pack('<I%ss'%length, length, _x))
00308 _x = self
00309 buff.write(_struct_4f.pack(_x.result.result_pos.x, _x.result.result_pos.y, _x.result.result_pos.z, _x.result.result_yaw))
00310 _x = self.result.status
00311 length = len(_x)
00312 if python3 or type(_x) == unicode:
00313 _x = _x.encode('utf-8')
00314 length = len(_x)
00315 buff.write(struct.pack('<I%ss'%length, length, _x))
00316 except struct.error as se: self._check_types(se)
00317 except TypeError as te: self._check_types(te)
00318
00319 def deserialize_numpy(self, str, numpy):
00320 """
00321 unpack serialized message in str into this message instance using numpy for array types
00322 :param str: byte array of serialized message, ``str``
00323 :param numpy: numpy python module
00324 """
00325 try:
00326 if self.header is None:
00327 self.header = std_msgs.msg.Header()
00328 if self.status is None:
00329 self.status = actionlib_msgs.msg.GoalStatus()
00330 if self.result is None:
00331 self.result = asctec_hl_comm.msg.WaypointResult()
00332 end = 0
00333 _x = self
00334 start = end
00335 end += 12
00336 (_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00337 start = end
00338 end += 4
00339 (length,) = _struct_I.unpack(str[start:end])
00340 start = end
00341 end += length
00342 if python3:
00343 self.header.frame_id = str[start:end].decode('utf-8')
00344 else:
00345 self.header.frame_id = str[start:end]
00346 _x = self
00347 start = end
00348 end += 8
00349 (_x.status.goal_id.stamp.secs, _x.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00350 start = end
00351 end += 4
00352 (length,) = _struct_I.unpack(str[start:end])
00353 start = end
00354 end += length
00355 if python3:
00356 self.status.goal_id.id = str[start:end].decode('utf-8')
00357 else:
00358 self.status.goal_id.id = str[start:end]
00359 start = end
00360 end += 1
00361 (self.status.status,) = _struct_B.unpack(str[start:end])
00362 start = end
00363 end += 4
00364 (length,) = _struct_I.unpack(str[start:end])
00365 start = end
00366 end += length
00367 if python3:
00368 self.status.text = str[start:end].decode('utf-8')
00369 else:
00370 self.status.text = str[start:end]
00371 _x = self
00372 start = end
00373 end += 12
00374 (_x.result.header.seq, _x.result.header.stamp.secs, _x.result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00375 start = end
00376 end += 4
00377 (length,) = _struct_I.unpack(str[start:end])
00378 start = end
00379 end += length
00380 if python3:
00381 self.result.header.frame_id = str[start:end].decode('utf-8')
00382 else:
00383 self.result.header.frame_id = str[start:end]
00384 _x = self
00385 start = end
00386 end += 16
00387 (_x.result.result_pos.x, _x.result.result_pos.y, _x.result.result_pos.z, _x.result.result_yaw,) = _struct_4f.unpack(str[start:end])
00388 start = end
00389 end += 4
00390 (length,) = _struct_I.unpack(str[start:end])
00391 start = end
00392 end += length
00393 if python3:
00394 self.result.status = str[start:end].decode('utf-8')
00395 else:
00396 self.result.status = str[start:end]
00397 return self
00398 except struct.error as e:
00399 raise genpy.DeserializationError(e)
00400
00401 _struct_I = genpy.struct_I
00402 _struct_4f = struct.Struct("<4f")
00403 _struct_3I = struct.Struct("<3I")
00404 _struct_B = struct.Struct("<B")
00405 _struct_2I = struct.Struct("<2I")