00001 """autogenerated by genpy from srs_decision_making_interface/srs_actionAction.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 std_msgs.msg
00008 import genpy
00009 import actionlib_msgs.msg
00010 import srs_decision_making_interface.msg
00011
00012 class srs_actionAction(genpy.Message):
00013 _md5sum = "7a2b9b0f6e9547ef64a37ec111611476"
00014 _type = "srs_decision_making_interface/srs_actionAction"
00015 _has_header = False
00016 _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00017
00018 srs_actionActionGoal action_goal
00019 srs_actionActionResult action_result
00020 srs_actionActionFeedback action_feedback
00021
00022 ================================================================================
00023 MSG: srs_decision_making_interface/srs_actionActionGoal
00024 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00025
00026 Header header
00027 actionlib_msgs/GoalID goal_id
00028 srs_actionGoal 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: srs_decision_making_interface/srs_actionGoal
00063 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00064 #define the goal, srs_msgs/srs_action[] action_sequence #Specify what action sequence to be applied
00065 string action # to deprecate, replaced by json_parameters. Kept for backward compatibility
00066 string parameter # to deprecate, replaced by json_parameters
00067 uint32 priority # to deprecate
00068 string json_parameters # new added parameter in json (test by Ze)
00069 # string[] parameters # to deprecate
00070
00071 ================================================================================
00072 MSG: srs_decision_making_interface/srs_actionActionResult
00073 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00074
00075 Header header
00076 actionlib_msgs/GoalStatus status
00077 srs_actionResult result
00078
00079 ================================================================================
00080 MSG: actionlib_msgs/GoalStatus
00081 GoalID goal_id
00082 uint8 status
00083 uint8 PENDING = 0 # The goal has yet to be processed by the action server
00084 uint8 ACTIVE = 1 # The goal is currently being processed by the action server
00085 uint8 PREEMPTED = 2 # The goal received a cancel request after it started executing
00086 # and has since completed its execution (Terminal State)
00087 uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server (Terminal State)
00088 uint8 ABORTED = 4 # The goal was aborted during execution by the action server due
00089 # to some failure (Terminal State)
00090 uint8 REJECTED = 5 # The goal was rejected by the action server without being processed,
00091 # because the goal was unattainable or invalid (Terminal State)
00092 uint8 PREEMPTING = 6 # The goal received a cancel request after it started executing
00093 # and has not yet completed execution
00094 uint8 RECALLING = 7 # The goal received a cancel request before it started executing,
00095 # but the action server has not yet confirmed that the goal is canceled
00096 uint8 RECALLED = 8 # The goal received a cancel request before it started executing
00097 # and was successfully cancelled (Terminal State)
00098 uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not be
00099 # sent over the wire by an action server
00100
00101 #Allow for the user to associate a string with GoalStatus for debugging
00102 string text
00103
00104
00105 ================================================================================
00106 MSG: srs_decision_making_interface/srs_actionResult
00107 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00108 #define the result
00109 uint32 return_value
00110
00111 ================================================================================
00112 MSG: srs_decision_making_interface/srs_actionActionFeedback
00113 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00114
00115 Header header
00116 actionlib_msgs/GoalStatus status
00117 srs_actionFeedback feedback
00118
00119 ================================================================================
00120 MSG: srs_decision_making_interface/srs_actionFeedback
00121 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00122 #define a feedback message
00123 string current_state # to deprecate
00124 bool solution_required # to deprecate
00125 uint32 exceptional_case_id # to deprecate
00126 string json_feedback # new added feedback in json (test by ze)
00127
00128
00129 """
00130 __slots__ = ['action_goal','action_result','action_feedback']
00131 _slot_types = ['srs_decision_making_interface/srs_actionActionGoal','srs_decision_making_interface/srs_actionActionResult','srs_decision_making_interface/srs_actionActionFeedback']
00132
00133 def __init__(self, *args, **kwds):
00134 """
00135 Constructor. Any message fields that are implicitly/explicitly
00136 set to None will be assigned a default value. The recommend
00137 use is keyword arguments as this is more robust to future message
00138 changes. You cannot mix in-order arguments and keyword arguments.
00139
00140 The available fields are:
00141 action_goal,action_result,action_feedback
00142
00143 :param args: complete set of field values, in .msg order
00144 :param kwds: use keyword arguments corresponding to message field names
00145 to set specific fields.
00146 """
00147 if args or kwds:
00148 super(srs_actionAction, self).__init__(*args, **kwds)
00149
00150 if self.action_goal is None:
00151 self.action_goal = srs_decision_making_interface.msg.srs_actionActionGoal()
00152 if self.action_result is None:
00153 self.action_result = srs_decision_making_interface.msg.srs_actionActionResult()
00154 if self.action_feedback is None:
00155 self.action_feedback = srs_decision_making_interface.msg.srs_actionActionFeedback()
00156 else:
00157 self.action_goal = srs_decision_making_interface.msg.srs_actionActionGoal()
00158 self.action_result = srs_decision_making_interface.msg.srs_actionActionResult()
00159 self.action_feedback = srs_decision_making_interface.msg.srs_actionActionFeedback()
00160
00161 def _get_types(self):
00162 """
00163 internal API method
00164 """
00165 return self._slot_types
00166
00167 def serialize(self, buff):
00168 """
00169 serialize message into buffer
00170 :param buff: buffer, ``StringIO``
00171 """
00172 try:
00173 _x = self
00174 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00175 _x = self.action_goal.header.frame_id
00176 length = len(_x)
00177 if python3 or type(_x) == unicode:
00178 _x = _x.encode('utf-8')
00179 length = len(_x)
00180 buff.write(struct.pack('<I%ss'%length, length, _x))
00181 _x = self
00182 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00183 _x = self.action_goal.goal_id.id
00184 length = len(_x)
00185 if python3 or type(_x) == unicode:
00186 _x = _x.encode('utf-8')
00187 length = len(_x)
00188 buff.write(struct.pack('<I%ss'%length, length, _x))
00189 _x = self.action_goal.goal.action
00190 length = len(_x)
00191 if python3 or type(_x) == unicode:
00192 _x = _x.encode('utf-8')
00193 length = len(_x)
00194 buff.write(struct.pack('<I%ss'%length, length, _x))
00195 _x = self.action_goal.goal.parameter
00196 length = len(_x)
00197 if python3 or type(_x) == unicode:
00198 _x = _x.encode('utf-8')
00199 length = len(_x)
00200 buff.write(struct.pack('<I%ss'%length, length, _x))
00201 buff.write(_struct_I.pack(self.action_goal.goal.priority))
00202 _x = self.action_goal.goal.json_parameters
00203 length = len(_x)
00204 if python3 or type(_x) == unicode:
00205 _x = _x.encode('utf-8')
00206 length = len(_x)
00207 buff.write(struct.pack('<I%ss'%length, length, _x))
00208 _x = self
00209 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00210 _x = self.action_result.header.frame_id
00211 length = len(_x)
00212 if python3 or type(_x) == unicode:
00213 _x = _x.encode('utf-8')
00214 length = len(_x)
00215 buff.write(struct.pack('<I%ss'%length, length, _x))
00216 _x = self
00217 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00218 _x = self.action_result.status.goal_id.id
00219 length = len(_x)
00220 if python3 or type(_x) == unicode:
00221 _x = _x.encode('utf-8')
00222 length = len(_x)
00223 buff.write(struct.pack('<I%ss'%length, length, _x))
00224 buff.write(_struct_B.pack(self.action_result.status.status))
00225 _x = self.action_result.status.text
00226 length = len(_x)
00227 if python3 or type(_x) == unicode:
00228 _x = _x.encode('utf-8')
00229 length = len(_x)
00230 buff.write(struct.pack('<I%ss'%length, length, _x))
00231 _x = self
00232 buff.write(_struct_4I.pack(_x.action_result.result.return_value, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00233 _x = self.action_feedback.header.frame_id
00234 length = len(_x)
00235 if python3 or type(_x) == unicode:
00236 _x = _x.encode('utf-8')
00237 length = len(_x)
00238 buff.write(struct.pack('<I%ss'%length, length, _x))
00239 _x = self
00240 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00241 _x = self.action_feedback.status.goal_id.id
00242 length = len(_x)
00243 if python3 or type(_x) == unicode:
00244 _x = _x.encode('utf-8')
00245 length = len(_x)
00246 buff.write(struct.pack('<I%ss'%length, length, _x))
00247 buff.write(_struct_B.pack(self.action_feedback.status.status))
00248 _x = self.action_feedback.status.text
00249 length = len(_x)
00250 if python3 or type(_x) == unicode:
00251 _x = _x.encode('utf-8')
00252 length = len(_x)
00253 buff.write(struct.pack('<I%ss'%length, length, _x))
00254 _x = self.action_feedback.feedback.current_state
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_BI.pack(_x.action_feedback.feedback.solution_required, _x.action_feedback.feedback.exceptional_case_id))
00262 _x = self.action_feedback.feedback.json_feedback
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 except struct.error as se: self._check_types(struct.error("%s: '%s' when writing '%s'" % (type(se), str(se), str(_x))))
00269 except TypeError as te: self._check_types(ValueError("%s: '%s' when writing '%s'" % (type(te), str(te), str(_x))))
00270
00271 def deserialize(self, str):
00272 """
00273 unpack serialized message in str into this message instance
00274 :param str: byte array of serialized message, ``str``
00275 """
00276 try:
00277 if self.action_goal is None:
00278 self.action_goal = srs_decision_making_interface.msg.srs_actionActionGoal()
00279 if self.action_result is None:
00280 self.action_result = srs_decision_making_interface.msg.srs_actionActionResult()
00281 if self.action_feedback is None:
00282 self.action_feedback = srs_decision_making_interface.msg.srs_actionActionFeedback()
00283 end = 0
00284 _x = self
00285 start = end
00286 end += 12
00287 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00288 start = end
00289 end += 4
00290 (length,) = _struct_I.unpack(str[start:end])
00291 start = end
00292 end += length
00293 if python3:
00294 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00295 else:
00296 self.action_goal.header.frame_id = str[start:end]
00297 _x = self
00298 start = end
00299 end += 8
00300 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00301 start = end
00302 end += 4
00303 (length,) = _struct_I.unpack(str[start:end])
00304 start = end
00305 end += length
00306 if python3:
00307 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00308 else:
00309 self.action_goal.goal_id.id = str[start:end]
00310 start = end
00311 end += 4
00312 (length,) = _struct_I.unpack(str[start:end])
00313 start = end
00314 end += length
00315 if python3:
00316 self.action_goal.goal.action = str[start:end].decode('utf-8')
00317 else:
00318 self.action_goal.goal.action = str[start:end]
00319 start = end
00320 end += 4
00321 (length,) = _struct_I.unpack(str[start:end])
00322 start = end
00323 end += length
00324 if python3:
00325 self.action_goal.goal.parameter = str[start:end].decode('utf-8')
00326 else:
00327 self.action_goal.goal.parameter = str[start:end]
00328 start = end
00329 end += 4
00330 (self.action_goal.goal.priority,) = _struct_I.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.action_goal.goal.json_parameters = str[start:end].decode('utf-8')
00338 else:
00339 self.action_goal.goal.json_parameters = str[start:end]
00340 _x = self
00341 start = end
00342 end += 12
00343 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00344 start = end
00345 end += 4
00346 (length,) = _struct_I.unpack(str[start:end])
00347 start = end
00348 end += length
00349 if python3:
00350 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00351 else:
00352 self.action_result.header.frame_id = str[start:end]
00353 _x = self
00354 start = end
00355 end += 8
00356 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00357 start = end
00358 end += 4
00359 (length,) = _struct_I.unpack(str[start:end])
00360 start = end
00361 end += length
00362 if python3:
00363 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00364 else:
00365 self.action_result.status.goal_id.id = str[start:end]
00366 start = end
00367 end += 1
00368 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00369 start = end
00370 end += 4
00371 (length,) = _struct_I.unpack(str[start:end])
00372 start = end
00373 end += length
00374 if python3:
00375 self.action_result.status.text = str[start:end].decode('utf-8')
00376 else:
00377 self.action_result.status.text = str[start:end]
00378 _x = self
00379 start = end
00380 end += 16
00381 (_x.action_result.result.return_value, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_4I.unpack(str[start:end])
00382 start = end
00383 end += 4
00384 (length,) = _struct_I.unpack(str[start:end])
00385 start = end
00386 end += length
00387 if python3:
00388 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00389 else:
00390 self.action_feedback.header.frame_id = str[start:end]
00391 _x = self
00392 start = end
00393 end += 8
00394 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00395 start = end
00396 end += 4
00397 (length,) = _struct_I.unpack(str[start:end])
00398 start = end
00399 end += length
00400 if python3:
00401 self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00402 else:
00403 self.action_feedback.status.goal_id.id = str[start:end]
00404 start = end
00405 end += 1
00406 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00407 start = end
00408 end += 4
00409 (length,) = _struct_I.unpack(str[start:end])
00410 start = end
00411 end += length
00412 if python3:
00413 self.action_feedback.status.text = str[start:end].decode('utf-8')
00414 else:
00415 self.action_feedback.status.text = str[start:end]
00416 start = end
00417 end += 4
00418 (length,) = _struct_I.unpack(str[start:end])
00419 start = end
00420 end += length
00421 if python3:
00422 self.action_feedback.feedback.current_state = str[start:end].decode('utf-8')
00423 else:
00424 self.action_feedback.feedback.current_state = str[start:end]
00425 _x = self
00426 start = end
00427 end += 5
00428 (_x.action_feedback.feedback.solution_required, _x.action_feedback.feedback.exceptional_case_id,) = _struct_BI.unpack(str[start:end])
00429 self.action_feedback.feedback.solution_required = bool(self.action_feedback.feedback.solution_required)
00430 start = end
00431 end += 4
00432 (length,) = _struct_I.unpack(str[start:end])
00433 start = end
00434 end += length
00435 if python3:
00436 self.action_feedback.feedback.json_feedback = str[start:end].decode('utf-8')
00437 else:
00438 self.action_feedback.feedback.json_feedback = str[start:end]
00439 return self
00440 except struct.error as e:
00441 raise genpy.DeserializationError(e)
00442
00443
00444 def serialize_numpy(self, buff, numpy):
00445 """
00446 serialize message with numpy array types into buffer
00447 :param buff: buffer, ``StringIO``
00448 :param numpy: numpy python module
00449 """
00450 try:
00451 _x = self
00452 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00453 _x = self.action_goal.header.frame_id
00454 length = len(_x)
00455 if python3 or type(_x) == unicode:
00456 _x = _x.encode('utf-8')
00457 length = len(_x)
00458 buff.write(struct.pack('<I%ss'%length, length, _x))
00459 _x = self
00460 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00461 _x = self.action_goal.goal_id.id
00462 length = len(_x)
00463 if python3 or type(_x) == unicode:
00464 _x = _x.encode('utf-8')
00465 length = len(_x)
00466 buff.write(struct.pack('<I%ss'%length, length, _x))
00467 _x = self.action_goal.goal.action
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 _x = self.action_goal.goal.parameter
00474 length = len(_x)
00475 if python3 or type(_x) == unicode:
00476 _x = _x.encode('utf-8')
00477 length = len(_x)
00478 buff.write(struct.pack('<I%ss'%length, length, _x))
00479 buff.write(_struct_I.pack(self.action_goal.goal.priority))
00480 _x = self.action_goal.goal.json_parameters
00481 length = len(_x)
00482 if python3 or type(_x) == unicode:
00483 _x = _x.encode('utf-8')
00484 length = len(_x)
00485 buff.write(struct.pack('<I%ss'%length, length, _x))
00486 _x = self
00487 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00488 _x = self.action_result.header.frame_id
00489 length = len(_x)
00490 if python3 or type(_x) == unicode:
00491 _x = _x.encode('utf-8')
00492 length = len(_x)
00493 buff.write(struct.pack('<I%ss'%length, length, _x))
00494 _x = self
00495 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00496 _x = self.action_result.status.goal_id.id
00497 length = len(_x)
00498 if python3 or type(_x) == unicode:
00499 _x = _x.encode('utf-8')
00500 length = len(_x)
00501 buff.write(struct.pack('<I%ss'%length, length, _x))
00502 buff.write(_struct_B.pack(self.action_result.status.status))
00503 _x = self.action_result.status.text
00504 length = len(_x)
00505 if python3 or type(_x) == unicode:
00506 _x = _x.encode('utf-8')
00507 length = len(_x)
00508 buff.write(struct.pack('<I%ss'%length, length, _x))
00509 _x = self
00510 buff.write(_struct_4I.pack(_x.action_result.result.return_value, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00511 _x = self.action_feedback.header.frame_id
00512 length = len(_x)
00513 if python3 or type(_x) == unicode:
00514 _x = _x.encode('utf-8')
00515 length = len(_x)
00516 buff.write(struct.pack('<I%ss'%length, length, _x))
00517 _x = self
00518 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00519 _x = self.action_feedback.status.goal_id.id
00520 length = len(_x)
00521 if python3 or type(_x) == unicode:
00522 _x = _x.encode('utf-8')
00523 length = len(_x)
00524 buff.write(struct.pack('<I%ss'%length, length, _x))
00525 buff.write(_struct_B.pack(self.action_feedback.status.status))
00526 _x = self.action_feedback.status.text
00527 length = len(_x)
00528 if python3 or type(_x) == unicode:
00529 _x = _x.encode('utf-8')
00530 length = len(_x)
00531 buff.write(struct.pack('<I%ss'%length, length, _x))
00532 _x = self.action_feedback.feedback.current_state
00533 length = len(_x)
00534 if python3 or type(_x) == unicode:
00535 _x = _x.encode('utf-8')
00536 length = len(_x)
00537 buff.write(struct.pack('<I%ss'%length, length, _x))
00538 _x = self
00539 buff.write(_struct_BI.pack(_x.action_feedback.feedback.solution_required, _x.action_feedback.feedback.exceptional_case_id))
00540 _x = self.action_feedback.feedback.json_feedback
00541 length = len(_x)
00542 if python3 or type(_x) == unicode:
00543 _x = _x.encode('utf-8')
00544 length = len(_x)
00545 buff.write(struct.pack('<I%ss'%length, length, _x))
00546 except struct.error as se: self._check_types(struct.error("%s: '%s' when writing '%s'" % (type(se), str(se), str(_x))))
00547 except TypeError as te: self._check_types(ValueError("%s: '%s' when writing '%s'" % (type(te), str(te), str(_x))))
00548
00549 def deserialize_numpy(self, str, numpy):
00550 """
00551 unpack serialized message in str into this message instance using numpy for array types
00552 :param str: byte array of serialized message, ``str``
00553 :param numpy: numpy python module
00554 """
00555 try:
00556 if self.action_goal is None:
00557 self.action_goal = srs_decision_making_interface.msg.srs_actionActionGoal()
00558 if self.action_result is None:
00559 self.action_result = srs_decision_making_interface.msg.srs_actionActionResult()
00560 if self.action_feedback is None:
00561 self.action_feedback = srs_decision_making_interface.msg.srs_actionActionFeedback()
00562 end = 0
00563 _x = self
00564 start = end
00565 end += 12
00566 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00567 start = end
00568 end += 4
00569 (length,) = _struct_I.unpack(str[start:end])
00570 start = end
00571 end += length
00572 if python3:
00573 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00574 else:
00575 self.action_goal.header.frame_id = str[start:end]
00576 _x = self
00577 start = end
00578 end += 8
00579 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00580 start = end
00581 end += 4
00582 (length,) = _struct_I.unpack(str[start:end])
00583 start = end
00584 end += length
00585 if python3:
00586 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00587 else:
00588 self.action_goal.goal_id.id = str[start:end]
00589 start = end
00590 end += 4
00591 (length,) = _struct_I.unpack(str[start:end])
00592 start = end
00593 end += length
00594 if python3:
00595 self.action_goal.goal.action = str[start:end].decode('utf-8')
00596 else:
00597 self.action_goal.goal.action = str[start:end]
00598 start = end
00599 end += 4
00600 (length,) = _struct_I.unpack(str[start:end])
00601 start = end
00602 end += length
00603 if python3:
00604 self.action_goal.goal.parameter = str[start:end].decode('utf-8')
00605 else:
00606 self.action_goal.goal.parameter = str[start:end]
00607 start = end
00608 end += 4
00609 (self.action_goal.goal.priority,) = _struct_I.unpack(str[start:end])
00610 start = end
00611 end += 4
00612 (length,) = _struct_I.unpack(str[start:end])
00613 start = end
00614 end += length
00615 if python3:
00616 self.action_goal.goal.json_parameters = str[start:end].decode('utf-8')
00617 else:
00618 self.action_goal.goal.json_parameters = str[start:end]
00619 _x = self
00620 start = end
00621 end += 12
00622 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00623 start = end
00624 end += 4
00625 (length,) = _struct_I.unpack(str[start:end])
00626 start = end
00627 end += length
00628 if python3:
00629 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00630 else:
00631 self.action_result.header.frame_id = str[start:end]
00632 _x = self
00633 start = end
00634 end += 8
00635 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00636 start = end
00637 end += 4
00638 (length,) = _struct_I.unpack(str[start:end])
00639 start = end
00640 end += length
00641 if python3:
00642 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00643 else:
00644 self.action_result.status.goal_id.id = str[start:end]
00645 start = end
00646 end += 1
00647 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00648 start = end
00649 end += 4
00650 (length,) = _struct_I.unpack(str[start:end])
00651 start = end
00652 end += length
00653 if python3:
00654 self.action_result.status.text = str[start:end].decode('utf-8')
00655 else:
00656 self.action_result.status.text = str[start:end]
00657 _x = self
00658 start = end
00659 end += 16
00660 (_x.action_result.result.return_value, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_4I.unpack(str[start:end])
00661 start = end
00662 end += 4
00663 (length,) = _struct_I.unpack(str[start:end])
00664 start = end
00665 end += length
00666 if python3:
00667 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00668 else:
00669 self.action_feedback.header.frame_id = str[start:end]
00670 _x = self
00671 start = end
00672 end += 8
00673 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00674 start = end
00675 end += 4
00676 (length,) = _struct_I.unpack(str[start:end])
00677 start = end
00678 end += length
00679 if python3:
00680 self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00681 else:
00682 self.action_feedback.status.goal_id.id = str[start:end]
00683 start = end
00684 end += 1
00685 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00686 start = end
00687 end += 4
00688 (length,) = _struct_I.unpack(str[start:end])
00689 start = end
00690 end += length
00691 if python3:
00692 self.action_feedback.status.text = str[start:end].decode('utf-8')
00693 else:
00694 self.action_feedback.status.text = str[start:end]
00695 start = end
00696 end += 4
00697 (length,) = _struct_I.unpack(str[start:end])
00698 start = end
00699 end += length
00700 if python3:
00701 self.action_feedback.feedback.current_state = str[start:end].decode('utf-8')
00702 else:
00703 self.action_feedback.feedback.current_state = str[start:end]
00704 _x = self
00705 start = end
00706 end += 5
00707 (_x.action_feedback.feedback.solution_required, _x.action_feedback.feedback.exceptional_case_id,) = _struct_BI.unpack(str[start:end])
00708 self.action_feedback.feedback.solution_required = bool(self.action_feedback.feedback.solution_required)
00709 start = end
00710 end += 4
00711 (length,) = _struct_I.unpack(str[start:end])
00712 start = end
00713 end += length
00714 if python3:
00715 self.action_feedback.feedback.json_feedback = str[start:end].decode('utf-8')
00716 else:
00717 self.action_feedback.feedback.json_feedback = str[start:end]
00718 return self
00719 except struct.error as e:
00720 raise genpy.DeserializationError(e)
00721
00722 _struct_I = genpy.struct_I
00723 _struct_B = struct.Struct("<B")
00724 _struct_BI = struct.Struct("<BI")
00725 _struct_3I = struct.Struct("<3I")
00726 _struct_4I = struct.Struct("<4I")
00727 _struct_2I = struct.Struct("<2I")