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