00001 """autogenerated by genpy from pr2_object_manipulation_msgs/RunScriptAction.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 pr2_object_manipulation_msgs.msg
00008 import genpy
00009 import actionlib_msgs.msg
00010 import std_msgs.msg
00011
00012 class RunScriptAction(genpy.Message):
00013 _md5sum = "80760198528fb253a33d82a566c40f8b"
00014 _type = "pr2_object_manipulation_msgs/RunScriptAction"
00015 _has_header = False
00016 _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00017
00018 RunScriptActionGoal action_goal
00019 RunScriptActionResult action_result
00020 RunScriptActionFeedback action_feedback
00021
00022 ================================================================================
00023 MSG: pr2_object_manipulation_msgs/RunScriptActionGoal
00024 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00025
00026 Header header
00027 actionlib_msgs/GoalID goal_id
00028 RunScriptGoal goal
00029
00030 ================================================================================
00031 MSG: std_msgs/Header
00032 # Standard metadata for higher-level stamped data types.
00033 # This is generally used to communicate timestamped data
00034 # in a particular coordinate frame.
00035 #
00036 # sequence ID: consecutively increasing ID
00037 uint32 seq
00038 #Two-integer timestamp that is expressed as:
00039 # * stamp.secs: seconds (stamp_secs) since epoch
00040 # * stamp.nsecs: nanoseconds since stamp_secs
00041 # time-handling sugar is provided by the client library
00042 time stamp
00043 #Frame this data is associated with
00044 # 0: no frame
00045 # 1: global frame
00046 string frame_id
00047
00048 ================================================================================
00049 MSG: actionlib_msgs/GoalID
00050 # The stamp should store the time at which this goal was requested.
00051 # It is used by an action server when it tries to preempt all
00052 # goals that were requested before a certain time
00053 time stamp
00054
00055 # The id provides a way to associate feedback and
00056 # result message with specific goal requests. The id
00057 # specified must be unique.
00058 string id
00059
00060
00061 ================================================================================
00062 MSG: pr2_object_manipulation_msgs/RunScriptGoal
00063 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00064 string action_name
00065 string group_name
00066
00067 ================================================================================
00068 MSG: pr2_object_manipulation_msgs/RunScriptActionResult
00069 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00070
00071 Header header
00072 actionlib_msgs/GoalStatus status
00073 RunScriptResult result
00074
00075 ================================================================================
00076 MSG: actionlib_msgs/GoalStatus
00077 GoalID goal_id
00078 uint8 status
00079 uint8 PENDING = 0 # The goal has yet to be processed by the action server
00080 uint8 ACTIVE = 1 # The goal is currently being processed by the action server
00081 uint8 PREEMPTED = 2 # The goal received a cancel request after it started executing
00082 # and has since completed its execution (Terminal State)
00083 uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server (Terminal State)
00084 uint8 ABORTED = 4 # The goal was aborted during execution by the action server due
00085 # to some failure (Terminal State)
00086 uint8 REJECTED = 5 # The goal was rejected by the action server without being processed,
00087 # because the goal was unattainable or invalid (Terminal State)
00088 uint8 PREEMPTING = 6 # The goal received a cancel request after it started executing
00089 # and has not yet completed execution
00090 uint8 RECALLING = 7 # The goal received a cancel request before it started executing,
00091 # but the action server has not yet confirmed that the goal is canceled
00092 uint8 RECALLED = 8 # The goal received a cancel request before it started executing
00093 # and was successfully cancelled (Terminal State)
00094 uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not be
00095 # sent over the wire by an action server
00096
00097 #Allow for the user to associate a string with GoalStatus for debugging
00098 string text
00099
00100
00101 ================================================================================
00102 MSG: pr2_object_manipulation_msgs/RunScriptResult
00103 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00104 string result
00105
00106 ================================================================================
00107 MSG: pr2_object_manipulation_msgs/RunScriptActionFeedback
00108 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00109
00110 Header header
00111 actionlib_msgs/GoalStatus status
00112 RunScriptFeedback feedback
00113
00114 ================================================================================
00115 MSG: pr2_object_manipulation_msgs/RunScriptFeedback
00116 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00117
00118
00119 """
00120 __slots__ = ['action_goal','action_result','action_feedback']
00121 _slot_types = ['pr2_object_manipulation_msgs/RunScriptActionGoal','pr2_object_manipulation_msgs/RunScriptActionResult','pr2_object_manipulation_msgs/RunScriptActionFeedback']
00122
00123 def __init__(self, *args, **kwds):
00124 """
00125 Constructor. Any message fields that are implicitly/explicitly
00126 set to None will be assigned a default value. The recommend
00127 use is keyword arguments as this is more robust to future message
00128 changes. You cannot mix in-order arguments and keyword arguments.
00129
00130 The available fields are:
00131 action_goal,action_result,action_feedback
00132
00133 :param args: complete set of field values, in .msg order
00134 :param kwds: use keyword arguments corresponding to message field names
00135 to set specific fields.
00136 """
00137 if args or kwds:
00138 super(RunScriptAction, self).__init__(*args, **kwds)
00139
00140 if self.action_goal is None:
00141 self.action_goal = pr2_object_manipulation_msgs.msg.RunScriptActionGoal()
00142 if self.action_result is None:
00143 self.action_result = pr2_object_manipulation_msgs.msg.RunScriptActionResult()
00144 if self.action_feedback is None:
00145 self.action_feedback = pr2_object_manipulation_msgs.msg.RunScriptActionFeedback()
00146 else:
00147 self.action_goal = pr2_object_manipulation_msgs.msg.RunScriptActionGoal()
00148 self.action_result = pr2_object_manipulation_msgs.msg.RunScriptActionResult()
00149 self.action_feedback = pr2_object_manipulation_msgs.msg.RunScriptActionFeedback()
00150
00151 def _get_types(self):
00152 """
00153 internal API method
00154 """
00155 return self._slot_types
00156
00157 def serialize(self, buff):
00158 """
00159 serialize message into buffer
00160 :param buff: buffer, ``StringIO``
00161 """
00162 try:
00163 _x = self
00164 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00165 _x = self.action_goal.header.frame_id
00166 length = len(_x)
00167 if python3 or type(_x) == unicode:
00168 _x = _x.encode('utf-8')
00169 length = len(_x)
00170 buff.write(struct.pack('<I%ss'%length, length, _x))
00171 _x = self
00172 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00173 _x = self.action_goal.goal_id.id
00174 length = len(_x)
00175 if python3 or type(_x) == unicode:
00176 _x = _x.encode('utf-8')
00177 length = len(_x)
00178 buff.write(struct.pack('<I%ss'%length, length, _x))
00179 _x = self.action_goal.goal.action_name
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 _x = self.action_goal.goal.group_name
00186 length = len(_x)
00187 if python3 or type(_x) == unicode:
00188 _x = _x.encode('utf-8')
00189 length = len(_x)
00190 buff.write(struct.pack('<I%ss'%length, length, _x))
00191 _x = self
00192 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00193 _x = self.action_result.header.frame_id
00194 length = len(_x)
00195 if python3 or type(_x) == unicode:
00196 _x = _x.encode('utf-8')
00197 length = len(_x)
00198 buff.write(struct.pack('<I%ss'%length, length, _x))
00199 _x = self
00200 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00201 _x = self.action_result.status.goal_id.id
00202 length = len(_x)
00203 if python3 or type(_x) == unicode:
00204 _x = _x.encode('utf-8')
00205 length = len(_x)
00206 buff.write(struct.pack('<I%ss'%length, length, _x))
00207 buff.write(_struct_B.pack(self.action_result.status.status))
00208 _x = self.action_result.status.text
00209 length = len(_x)
00210 if python3 or type(_x) == unicode:
00211 _x = _x.encode('utf-8')
00212 length = len(_x)
00213 buff.write(struct.pack('<I%ss'%length, length, _x))
00214 _x = self.action_result.result.result
00215 length = len(_x)
00216 if python3 or type(_x) == unicode:
00217 _x = _x.encode('utf-8')
00218 length = len(_x)
00219 buff.write(struct.pack('<I%ss'%length, length, _x))
00220 _x = self
00221 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00222 _x = self.action_feedback.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.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00230 _x = self.action_feedback.status.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 buff.write(_struct_B.pack(self.action_feedback.status.status))
00237 _x = self.action_feedback.status.text
00238 length = len(_x)
00239 if python3 or type(_x) == unicode:
00240 _x = _x.encode('utf-8')
00241 length = len(_x)
00242 buff.write(struct.pack('<I%ss'%length, length, _x))
00243 except struct.error as se: self._check_types(struct.error("%s: '%s' when writing '%s'" % (type(se), str(se), str(_x))))
00244 except TypeError as te: self._check_types(ValueError("%s: '%s' when writing '%s'" % (type(te), str(te), str(_x))))
00245
00246 def deserialize(self, str):
00247 """
00248 unpack serialized message in str into this message instance
00249 :param str: byte array of serialized message, ``str``
00250 """
00251 try:
00252 if self.action_goal is None:
00253 self.action_goal = pr2_object_manipulation_msgs.msg.RunScriptActionGoal()
00254 if self.action_result is None:
00255 self.action_result = pr2_object_manipulation_msgs.msg.RunScriptActionResult()
00256 if self.action_feedback is None:
00257 self.action_feedback = pr2_object_manipulation_msgs.msg.RunScriptActionFeedback()
00258 end = 0
00259 _x = self
00260 start = end
00261 end += 12
00262 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00263 start = end
00264 end += 4
00265 (length,) = _struct_I.unpack(str[start:end])
00266 start = end
00267 end += length
00268 if python3:
00269 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00270 else:
00271 self.action_goal.header.frame_id = str[start:end]
00272 _x = self
00273 start = end
00274 end += 8
00275 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00276 start = end
00277 end += 4
00278 (length,) = _struct_I.unpack(str[start:end])
00279 start = end
00280 end += length
00281 if python3:
00282 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00283 else:
00284 self.action_goal.goal_id.id = str[start:end]
00285 start = end
00286 end += 4
00287 (length,) = _struct_I.unpack(str[start:end])
00288 start = end
00289 end += length
00290 if python3:
00291 self.action_goal.goal.action_name = str[start:end].decode('utf-8')
00292 else:
00293 self.action_goal.goal.action_name = str[start:end]
00294 start = end
00295 end += 4
00296 (length,) = _struct_I.unpack(str[start:end])
00297 start = end
00298 end += length
00299 if python3:
00300 self.action_goal.goal.group_name = str[start:end].decode('utf-8')
00301 else:
00302 self.action_goal.goal.group_name = str[start:end]
00303 _x = self
00304 start = end
00305 end += 12
00306 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00307 start = end
00308 end += 4
00309 (length,) = _struct_I.unpack(str[start:end])
00310 start = end
00311 end += length
00312 if python3:
00313 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00314 else:
00315 self.action_result.header.frame_id = str[start:end]
00316 _x = self
00317 start = end
00318 end += 8
00319 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00320 start = end
00321 end += 4
00322 (length,) = _struct_I.unpack(str[start:end])
00323 start = end
00324 end += length
00325 if python3:
00326 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00327 else:
00328 self.action_result.status.goal_id.id = str[start:end]
00329 start = end
00330 end += 1
00331 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00332 start = end
00333 end += 4
00334 (length,) = _struct_I.unpack(str[start:end])
00335 start = end
00336 end += length
00337 if python3:
00338 self.action_result.status.text = str[start:end].decode('utf-8')
00339 else:
00340 self.action_result.status.text = str[start:end]
00341 start = end
00342 end += 4
00343 (length,) = _struct_I.unpack(str[start:end])
00344 start = end
00345 end += length
00346 if python3:
00347 self.action_result.result.result = str[start:end].decode('utf-8')
00348 else:
00349 self.action_result.result.result = str[start:end]
00350 _x = self
00351 start = end
00352 end += 12
00353 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00354 start = end
00355 end += 4
00356 (length,) = _struct_I.unpack(str[start:end])
00357 start = end
00358 end += length
00359 if python3:
00360 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00361 else:
00362 self.action_feedback.header.frame_id = str[start:end]
00363 _x = self
00364 start = end
00365 end += 8
00366 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00367 start = end
00368 end += 4
00369 (length,) = _struct_I.unpack(str[start:end])
00370 start = end
00371 end += length
00372 if python3:
00373 self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00374 else:
00375 self.action_feedback.status.goal_id.id = str[start:end]
00376 start = end
00377 end += 1
00378 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00379 start = end
00380 end += 4
00381 (length,) = _struct_I.unpack(str[start:end])
00382 start = end
00383 end += length
00384 if python3:
00385 self.action_feedback.status.text = str[start:end].decode('utf-8')
00386 else:
00387 self.action_feedback.status.text = str[start:end]
00388 return self
00389 except struct.error as e:
00390 raise genpy.DeserializationError(e)
00391
00392
00393 def serialize_numpy(self, buff, numpy):
00394 """
00395 serialize message with numpy array types into buffer
00396 :param buff: buffer, ``StringIO``
00397 :param numpy: numpy python module
00398 """
00399 try:
00400 _x = self
00401 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00402 _x = self.action_goal.header.frame_id
00403 length = len(_x)
00404 if python3 or type(_x) == unicode:
00405 _x = _x.encode('utf-8')
00406 length = len(_x)
00407 buff.write(struct.pack('<I%ss'%length, length, _x))
00408 _x = self
00409 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00410 _x = self.action_goal.goal_id.id
00411 length = len(_x)
00412 if python3 or type(_x) == unicode:
00413 _x = _x.encode('utf-8')
00414 length = len(_x)
00415 buff.write(struct.pack('<I%ss'%length, length, _x))
00416 _x = self.action_goal.goal.action_name
00417 length = len(_x)
00418 if python3 or type(_x) == unicode:
00419 _x = _x.encode('utf-8')
00420 length = len(_x)
00421 buff.write(struct.pack('<I%ss'%length, length, _x))
00422 _x = self.action_goal.goal.group_name
00423 length = len(_x)
00424 if python3 or type(_x) == unicode:
00425 _x = _x.encode('utf-8')
00426 length = len(_x)
00427 buff.write(struct.pack('<I%ss'%length, length, _x))
00428 _x = self
00429 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00430 _x = self.action_result.header.frame_id
00431 length = len(_x)
00432 if python3 or type(_x) == unicode:
00433 _x = _x.encode('utf-8')
00434 length = len(_x)
00435 buff.write(struct.pack('<I%ss'%length, length, _x))
00436 _x = self
00437 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00438 _x = self.action_result.status.goal_id.id
00439 length = len(_x)
00440 if python3 or type(_x) == unicode:
00441 _x = _x.encode('utf-8')
00442 length = len(_x)
00443 buff.write(struct.pack('<I%ss'%length, length, _x))
00444 buff.write(_struct_B.pack(self.action_result.status.status))
00445 _x = self.action_result.status.text
00446 length = len(_x)
00447 if python3 or type(_x) == unicode:
00448 _x = _x.encode('utf-8')
00449 length = len(_x)
00450 buff.write(struct.pack('<I%ss'%length, length, _x))
00451 _x = self.action_result.result.result
00452 length = len(_x)
00453 if python3 or type(_x) == unicode:
00454 _x = _x.encode('utf-8')
00455 length = len(_x)
00456 buff.write(struct.pack('<I%ss'%length, length, _x))
00457 _x = self
00458 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00459 _x = self.action_feedback.header.frame_id
00460 length = len(_x)
00461 if python3 or type(_x) == unicode:
00462 _x = _x.encode('utf-8')
00463 length = len(_x)
00464 buff.write(struct.pack('<I%ss'%length, length, _x))
00465 _x = self
00466 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00467 _x = self.action_feedback.status.goal_id.id
00468 length = len(_x)
00469 if python3 or type(_x) == unicode:
00470 _x = _x.encode('utf-8')
00471 length = len(_x)
00472 buff.write(struct.pack('<I%ss'%length, length, _x))
00473 buff.write(_struct_B.pack(self.action_feedback.status.status))
00474 _x = self.action_feedback.status.text
00475 length = len(_x)
00476 if python3 or type(_x) == unicode:
00477 _x = _x.encode('utf-8')
00478 length = len(_x)
00479 buff.write(struct.pack('<I%ss'%length, length, _x))
00480 except struct.error as se: self._check_types(struct.error("%s: '%s' when writing '%s'" % (type(se), str(se), str(_x))))
00481 except TypeError as te: self._check_types(ValueError("%s: '%s' when writing '%s'" % (type(te), str(te), str(_x))))
00482
00483 def deserialize_numpy(self, str, numpy):
00484 """
00485 unpack serialized message in str into this message instance using numpy for array types
00486 :param str: byte array of serialized message, ``str``
00487 :param numpy: numpy python module
00488 """
00489 try:
00490 if self.action_goal is None:
00491 self.action_goal = pr2_object_manipulation_msgs.msg.RunScriptActionGoal()
00492 if self.action_result is None:
00493 self.action_result = pr2_object_manipulation_msgs.msg.RunScriptActionResult()
00494 if self.action_feedback is None:
00495 self.action_feedback = pr2_object_manipulation_msgs.msg.RunScriptActionFeedback()
00496 end = 0
00497 _x = self
00498 start = end
00499 end += 12
00500 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00501 start = end
00502 end += 4
00503 (length,) = _struct_I.unpack(str[start:end])
00504 start = end
00505 end += length
00506 if python3:
00507 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00508 else:
00509 self.action_goal.header.frame_id = str[start:end]
00510 _x = self
00511 start = end
00512 end += 8
00513 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00514 start = end
00515 end += 4
00516 (length,) = _struct_I.unpack(str[start:end])
00517 start = end
00518 end += length
00519 if python3:
00520 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00521 else:
00522 self.action_goal.goal_id.id = str[start:end]
00523 start = end
00524 end += 4
00525 (length,) = _struct_I.unpack(str[start:end])
00526 start = end
00527 end += length
00528 if python3:
00529 self.action_goal.goal.action_name = str[start:end].decode('utf-8')
00530 else:
00531 self.action_goal.goal.action_name = str[start:end]
00532 start = end
00533 end += 4
00534 (length,) = _struct_I.unpack(str[start:end])
00535 start = end
00536 end += length
00537 if python3:
00538 self.action_goal.goal.group_name = str[start:end].decode('utf-8')
00539 else:
00540 self.action_goal.goal.group_name = str[start:end]
00541 _x = self
00542 start = end
00543 end += 12
00544 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00545 start = end
00546 end += 4
00547 (length,) = _struct_I.unpack(str[start:end])
00548 start = end
00549 end += length
00550 if python3:
00551 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00552 else:
00553 self.action_result.header.frame_id = str[start:end]
00554 _x = self
00555 start = end
00556 end += 8
00557 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00558 start = end
00559 end += 4
00560 (length,) = _struct_I.unpack(str[start:end])
00561 start = end
00562 end += length
00563 if python3:
00564 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00565 else:
00566 self.action_result.status.goal_id.id = str[start:end]
00567 start = end
00568 end += 1
00569 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00570 start = end
00571 end += 4
00572 (length,) = _struct_I.unpack(str[start:end])
00573 start = end
00574 end += length
00575 if python3:
00576 self.action_result.status.text = str[start:end].decode('utf-8')
00577 else:
00578 self.action_result.status.text = str[start:end]
00579 start = end
00580 end += 4
00581 (length,) = _struct_I.unpack(str[start:end])
00582 start = end
00583 end += length
00584 if python3:
00585 self.action_result.result.result = str[start:end].decode('utf-8')
00586 else:
00587 self.action_result.result.result = str[start:end]
00588 _x = self
00589 start = end
00590 end += 12
00591 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00592 start = end
00593 end += 4
00594 (length,) = _struct_I.unpack(str[start:end])
00595 start = end
00596 end += length
00597 if python3:
00598 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00599 else:
00600 self.action_feedback.header.frame_id = str[start:end]
00601 _x = self
00602 start = end
00603 end += 8
00604 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00605 start = end
00606 end += 4
00607 (length,) = _struct_I.unpack(str[start:end])
00608 start = end
00609 end += length
00610 if python3:
00611 self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00612 else:
00613 self.action_feedback.status.goal_id.id = str[start:end]
00614 start = end
00615 end += 1
00616 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00617 start = end
00618 end += 4
00619 (length,) = _struct_I.unpack(str[start:end])
00620 start = end
00621 end += length
00622 if python3:
00623 self.action_feedback.status.text = str[start:end].decode('utf-8')
00624 else:
00625 self.action_feedback.status.text = str[start:end]
00626 return self
00627 except struct.error as e:
00628 raise genpy.DeserializationError(e)
00629
00630 _struct_I = genpy.struct_I
00631 _struct_3I = struct.Struct("<3I")
00632 _struct_B = struct.Struct("<B")
00633 _struct_2I = struct.Struct("<2I")