00001 """autogenerated by genpy from pr2_object_manipulation_msgs/GetPoseAction.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 geometry_msgs.msg
00009 import genpy
00010 import actionlib_msgs.msg
00011 import std_msgs.msg
00012
00013 class GetPoseAction(genpy.Message):
00014 _md5sum = "a84575fda2ec9f0e3524c2db02ef3d20"
00015 _type = "pr2_object_manipulation_msgs/GetPoseAction"
00016 _has_header = False
00017 _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00018
00019 GetPoseActionGoal action_goal
00020 GetPoseActionResult action_result
00021 GetPoseActionFeedback action_feedback
00022
00023 ================================================================================
00024 MSG: pr2_object_manipulation_msgs/GetPoseActionGoal
00025 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00026
00027 Header header
00028 actionlib_msgs/GoalID goal_id
00029 GetPoseGoal 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_object_manipulation_msgs/GetPoseGoal
00064 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00065
00066 # a seed position for the pose marker. If empty (quaternion of norm 0)
00067 # the marker will be initialized at the current pose of the header frame.
00068 geometry_msgs/PoseStamped starting_pose
00069
00070
00071 ================================================================================
00072 MSG: geometry_msgs/PoseStamped
00073 # A Pose with reference coordinate frame and timestamp
00074 Header header
00075 Pose pose
00076
00077 ================================================================================
00078 MSG: geometry_msgs/Pose
00079 # A representation of pose in free space, composed of postion and orientation.
00080 Point position
00081 Quaternion orientation
00082
00083 ================================================================================
00084 MSG: geometry_msgs/Point
00085 # This contains the position of a point in free space
00086 float64 x
00087 float64 y
00088 float64 z
00089
00090 ================================================================================
00091 MSG: geometry_msgs/Quaternion
00092 # This represents an orientation in free space in quaternion form.
00093
00094 float64 x
00095 float64 y
00096 float64 z
00097 float64 w
00098
00099 ================================================================================
00100 MSG: pr2_object_manipulation_msgs/GetPoseActionResult
00101 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00102
00103 Header header
00104 actionlib_msgs/GoalStatus status
00105 GetPoseResult result
00106
00107 ================================================================================
00108 MSG: actionlib_msgs/GoalStatus
00109 GoalID goal_id
00110 uint8 status
00111 uint8 PENDING = 0 # The goal has yet to be processed by the action server
00112 uint8 ACTIVE = 1 # The goal is currently being processed by the action server
00113 uint8 PREEMPTED = 2 # The goal received a cancel request after it started executing
00114 # and has since completed its execution (Terminal State)
00115 uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server (Terminal State)
00116 uint8 ABORTED = 4 # The goal was aborted during execution by the action server due
00117 # to some failure (Terminal State)
00118 uint8 REJECTED = 5 # The goal was rejected by the action server without being processed,
00119 # because the goal was unattainable or invalid (Terminal State)
00120 uint8 PREEMPTING = 6 # The goal received a cancel request after it started executing
00121 # and has not yet completed execution
00122 uint8 RECALLING = 7 # The goal received a cancel request before it started executing,
00123 # but the action server has not yet confirmed that the goal is canceled
00124 uint8 RECALLED = 8 # The goal received a cancel request before it started executing
00125 # and was successfully cancelled (Terminal State)
00126 uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not be
00127 # sent over the wire by an action server
00128
00129 #Allow for the user to associate a string with GoalStatus for debugging
00130 string text
00131
00132
00133 ================================================================================
00134 MSG: pr2_object_manipulation_msgs/GetPoseResult
00135 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00136 # the returned pose, assuming the user has clicked "accept"
00137 # if the user clicks "cancel" the action aborts
00138 geometry_msgs/PoseStamped pose
00139
00140
00141 ================================================================================
00142 MSG: pr2_object_manipulation_msgs/GetPoseActionFeedback
00143 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00144
00145 Header header
00146 actionlib_msgs/GoalStatus status
00147 GetPoseFeedback feedback
00148
00149 ================================================================================
00150 MSG: pr2_object_manipulation_msgs/GetPoseFeedback
00151 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00152
00153
00154 """
00155 __slots__ = ['action_goal','action_result','action_feedback']
00156 _slot_types = ['pr2_object_manipulation_msgs/GetPoseActionGoal','pr2_object_manipulation_msgs/GetPoseActionResult','pr2_object_manipulation_msgs/GetPoseActionFeedback']
00157
00158 def __init__(self, *args, **kwds):
00159 """
00160 Constructor. Any message fields that are implicitly/explicitly
00161 set to None will be assigned a default value. The recommend
00162 use is keyword arguments as this is more robust to future message
00163 changes. You cannot mix in-order arguments and keyword arguments.
00164
00165 The available fields are:
00166 action_goal,action_result,action_feedback
00167
00168 :param args: complete set of field values, in .msg order
00169 :param kwds: use keyword arguments corresponding to message field names
00170 to set specific fields.
00171 """
00172 if args or kwds:
00173 super(GetPoseAction, self).__init__(*args, **kwds)
00174
00175 if self.action_goal is None:
00176 self.action_goal = pr2_object_manipulation_msgs.msg.GetPoseActionGoal()
00177 if self.action_result is None:
00178 self.action_result = pr2_object_manipulation_msgs.msg.GetPoseActionResult()
00179 if self.action_feedback is None:
00180 self.action_feedback = pr2_object_manipulation_msgs.msg.GetPoseActionFeedback()
00181 else:
00182 self.action_goal = pr2_object_manipulation_msgs.msg.GetPoseActionGoal()
00183 self.action_result = pr2_object_manipulation_msgs.msg.GetPoseActionResult()
00184 self.action_feedback = pr2_object_manipulation_msgs.msg.GetPoseActionFeedback()
00185
00186 def _get_types(self):
00187 """
00188 internal API method
00189 """
00190 return self._slot_types
00191
00192 def serialize(self, buff):
00193 """
00194 serialize message into buffer
00195 :param buff: buffer, ``StringIO``
00196 """
00197 try:
00198 _x = self
00199 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00200 _x = self.action_goal.header.frame_id
00201 length = len(_x)
00202 if python3 or type(_x) == unicode:
00203 _x = _x.encode('utf-8')
00204 length = len(_x)
00205 buff.write(struct.pack('<I%ss'%length, length, _x))
00206 _x = self
00207 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00208 _x = self.action_goal.goal_id.id
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
00215 buff.write(_struct_3I.pack(_x.action_goal.goal.starting_pose.header.seq, _x.action_goal.goal.starting_pose.header.stamp.secs, _x.action_goal.goal.starting_pose.header.stamp.nsecs))
00216 _x = self.action_goal.goal.starting_pose.header.frame_id
00217 length = len(_x)
00218 if python3 or type(_x) == unicode:
00219 _x = _x.encode('utf-8')
00220 length = len(_x)
00221 buff.write(struct.pack('<I%ss'%length, length, _x))
00222 _x = self
00223 buff.write(_struct_7d3I.pack(_x.action_goal.goal.starting_pose.pose.position.x, _x.action_goal.goal.starting_pose.pose.position.y, _x.action_goal.goal.starting_pose.pose.position.z, _x.action_goal.goal.starting_pose.pose.orientation.x, _x.action_goal.goal.starting_pose.pose.orientation.y, _x.action_goal.goal.starting_pose.pose.orientation.z, _x.action_goal.goal.starting_pose.pose.orientation.w, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00224 _x = self.action_result.header.frame_id
00225 length = len(_x)
00226 if python3 or type(_x) == unicode:
00227 _x = _x.encode('utf-8')
00228 length = len(_x)
00229 buff.write(struct.pack('<I%ss'%length, length, _x))
00230 _x = self
00231 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00232 _x = self.action_result.status.goal_id.id
00233 length = len(_x)
00234 if python3 or type(_x) == unicode:
00235 _x = _x.encode('utf-8')
00236 length = len(_x)
00237 buff.write(struct.pack('<I%ss'%length, length, _x))
00238 buff.write(_struct_B.pack(self.action_result.status.status))
00239 _x = self.action_result.status.text
00240 length = len(_x)
00241 if python3 or type(_x) == unicode:
00242 _x = _x.encode('utf-8')
00243 length = len(_x)
00244 buff.write(struct.pack('<I%ss'%length, length, _x))
00245 _x = self
00246 buff.write(_struct_3I.pack(_x.action_result.result.pose.header.seq, _x.action_result.result.pose.header.stamp.secs, _x.action_result.result.pose.header.stamp.nsecs))
00247 _x = self.action_result.result.pose.header.frame_id
00248 length = len(_x)
00249 if python3 or type(_x) == unicode:
00250 _x = _x.encode('utf-8')
00251 length = len(_x)
00252 buff.write(struct.pack('<I%ss'%length, length, _x))
00253 _x = self
00254 buff.write(_struct_7d3I.pack(_x.action_result.result.pose.pose.position.x, _x.action_result.result.pose.pose.position.y, _x.action_result.result.pose.pose.position.z, _x.action_result.result.pose.pose.orientation.x, _x.action_result.result.pose.pose.orientation.y, _x.action_result.result.pose.pose.orientation.z, _x.action_result.result.pose.pose.orientation.w, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00255 _x = self.action_feedback.header.frame_id
00256 length = len(_x)
00257 if python3 or type(_x) == unicode:
00258 _x = _x.encode('utf-8')
00259 length = len(_x)
00260 buff.write(struct.pack('<I%ss'%length, length, _x))
00261 _x = self
00262 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00263 _x = self.action_feedback.status.goal_id.id
00264 length = len(_x)
00265 if python3 or type(_x) == unicode:
00266 _x = _x.encode('utf-8')
00267 length = len(_x)
00268 buff.write(struct.pack('<I%ss'%length, length, _x))
00269 buff.write(_struct_B.pack(self.action_feedback.status.status))
00270 _x = self.action_feedback.status.text
00271 length = len(_x)
00272 if python3 or type(_x) == unicode:
00273 _x = _x.encode('utf-8')
00274 length = len(_x)
00275 buff.write(struct.pack('<I%ss'%length, length, _x))
00276 except struct.error as se: self._check_types(se)
00277 except TypeError as te: self._check_types(te)
00278
00279 def deserialize(self, str):
00280 """
00281 unpack serialized message in str into this message instance
00282 :param str: byte array of serialized message, ``str``
00283 """
00284 try:
00285 if self.action_goal is None:
00286 self.action_goal = pr2_object_manipulation_msgs.msg.GetPoseActionGoal()
00287 if self.action_result is None:
00288 self.action_result = pr2_object_manipulation_msgs.msg.GetPoseActionResult()
00289 if self.action_feedback is None:
00290 self.action_feedback = pr2_object_manipulation_msgs.msg.GetPoseActionFeedback()
00291 end = 0
00292 _x = self
00293 start = end
00294 end += 12
00295 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00296 start = end
00297 end += 4
00298 (length,) = _struct_I.unpack(str[start:end])
00299 start = end
00300 end += length
00301 if python3:
00302 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00303 else:
00304 self.action_goal.header.frame_id = str[start:end]
00305 _x = self
00306 start = end
00307 end += 8
00308 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00309 start = end
00310 end += 4
00311 (length,) = _struct_I.unpack(str[start:end])
00312 start = end
00313 end += length
00314 if python3:
00315 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00316 else:
00317 self.action_goal.goal_id.id = str[start:end]
00318 _x = self
00319 start = end
00320 end += 12
00321 (_x.action_goal.goal.starting_pose.header.seq, _x.action_goal.goal.starting_pose.header.stamp.secs, _x.action_goal.goal.starting_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00322 start = end
00323 end += 4
00324 (length,) = _struct_I.unpack(str[start:end])
00325 start = end
00326 end += length
00327 if python3:
00328 self.action_goal.goal.starting_pose.header.frame_id = str[start:end].decode('utf-8')
00329 else:
00330 self.action_goal.goal.starting_pose.header.frame_id = str[start:end]
00331 _x = self
00332 start = end
00333 end += 68
00334 (_x.action_goal.goal.starting_pose.pose.position.x, _x.action_goal.goal.starting_pose.pose.position.y, _x.action_goal.goal.starting_pose.pose.position.z, _x.action_goal.goal.starting_pose.pose.orientation.x, _x.action_goal.goal.starting_pose.pose.orientation.y, _x.action_goal.goal.starting_pose.pose.orientation.z, _x.action_goal.goal.starting_pose.pose.orientation.w, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_7d3I.unpack(str[start:end])
00335 start = end
00336 end += 4
00337 (length,) = _struct_I.unpack(str[start:end])
00338 start = end
00339 end += length
00340 if python3:
00341 self.action_result.header.frame_id = str[start:end].decode('utf-8')
00342 else:
00343 self.action_result.header.frame_id = str[start:end]
00344 _x = self
00345 start = end
00346 end += 8
00347 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00348 start = end
00349 end += 4
00350 (length,) = _struct_I.unpack(str[start:end])
00351 start = end
00352 end += length
00353 if python3:
00354 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00355 else:
00356 self.action_result.status.goal_id.id = str[start:end]
00357 start = end
00358 end += 1
00359 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00360 start = end
00361 end += 4
00362 (length,) = _struct_I.unpack(str[start:end])
00363 start = end
00364 end += length
00365 if python3:
00366 self.action_result.status.text = str[start:end].decode('utf-8')
00367 else:
00368 self.action_result.status.text = str[start:end]
00369 _x = self
00370 start = end
00371 end += 12
00372 (_x.action_result.result.pose.header.seq, _x.action_result.result.pose.header.stamp.secs, _x.action_result.result.pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00373 start = end
00374 end += 4
00375 (length,) = _struct_I.unpack(str[start:end])
00376 start = end
00377 end += length
00378 if python3:
00379 self.action_result.result.pose.header.frame_id = str[start:end].decode('utf-8')
00380 else:
00381 self.action_result.result.pose.header.frame_id = str[start:end]
00382 _x = self
00383 start = end
00384 end += 68
00385 (_x.action_result.result.pose.pose.position.x, _x.action_result.result.pose.pose.position.y, _x.action_result.result.pose.pose.position.z, _x.action_result.result.pose.pose.orientation.x, _x.action_result.result.pose.pose.orientation.y, _x.action_result.result.pose.pose.orientation.z, _x.action_result.result.pose.pose.orientation.w, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_7d3I.unpack(str[start:end])
00386 start = end
00387 end += 4
00388 (length,) = _struct_I.unpack(str[start:end])
00389 start = end
00390 end += length
00391 if python3:
00392 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00393 else:
00394 self.action_feedback.header.frame_id = str[start:end]
00395 _x = self
00396 start = end
00397 end += 8
00398 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00399 start = end
00400 end += 4
00401 (length,) = _struct_I.unpack(str[start:end])
00402 start = end
00403 end += length
00404 if python3:
00405 self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00406 else:
00407 self.action_feedback.status.goal_id.id = str[start:end]
00408 start = end
00409 end += 1
00410 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00411 start = end
00412 end += 4
00413 (length,) = _struct_I.unpack(str[start:end])
00414 start = end
00415 end += length
00416 if python3:
00417 self.action_feedback.status.text = str[start:end].decode('utf-8')
00418 else:
00419 self.action_feedback.status.text = str[start:end]
00420 return self
00421 except struct.error as e:
00422 raise genpy.DeserializationError(e)
00423
00424
00425 def serialize_numpy(self, buff, numpy):
00426 """
00427 serialize message with numpy array types into buffer
00428 :param buff: buffer, ``StringIO``
00429 :param numpy: numpy python module
00430 """
00431 try:
00432 _x = self
00433 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00434 _x = self.action_goal.header.frame_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_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00442 _x = self.action_goal.goal_id.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_3I.pack(_x.action_goal.goal.starting_pose.header.seq, _x.action_goal.goal.starting_pose.header.stamp.secs, _x.action_goal.goal.starting_pose.header.stamp.nsecs))
00450 _x = self.action_goal.goal.starting_pose.header.frame_id
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_7d3I.pack(_x.action_goal.goal.starting_pose.pose.position.x, _x.action_goal.goal.starting_pose.pose.position.y, _x.action_goal.goal.starting_pose.pose.position.z, _x.action_goal.goal.starting_pose.pose.orientation.x, _x.action_goal.goal.starting_pose.pose.orientation.y, _x.action_goal.goal.starting_pose.pose.orientation.z, _x.action_goal.goal.starting_pose.pose.orientation.w, _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_result.result.pose.header.seq, _x.action_result.result.pose.header.stamp.secs, _x.action_result.result.pose.header.stamp.nsecs))
00481 _x = self.action_result.result.pose.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_7d3I.pack(_x.action_result.result.pose.pose.position.x, _x.action_result.result.pose.pose.position.y, _x.action_result.result.pose.pose.position.z, _x.action_result.result.pose.pose.orientation.x, _x.action_result.result.pose.pose.orientation.y, _x.action_result.result.pose.pose.orientation.z, _x.action_result.result.pose.pose.orientation.w, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00489 _x = self.action_feedback.header.frame_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 _x = self
00496 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00497 _x = self.action_feedback.status.goal_id.id
00498 length = len(_x)
00499 if python3 or type(_x) == unicode:
00500 _x = _x.encode('utf-8')
00501 length = len(_x)
00502 buff.write(struct.pack('<I%ss'%length, length, _x))
00503 buff.write(_struct_B.pack(self.action_feedback.status.status))
00504 _x = self.action_feedback.status.text
00505 length = len(_x)
00506 if python3 or type(_x) == unicode:
00507 _x = _x.encode('utf-8')
00508 length = len(_x)
00509 buff.write(struct.pack('<I%ss'%length, length, _x))
00510 except struct.error as se: self._check_types(se)
00511 except TypeError as te: self._check_types(te)
00512
00513 def deserialize_numpy(self, str, numpy):
00514 """
00515 unpack serialized message in str into this message instance using numpy for array types
00516 :param str: byte array of serialized message, ``str``
00517 :param numpy: numpy python module
00518 """
00519 try:
00520 if self.action_goal is None:
00521 self.action_goal = pr2_object_manipulation_msgs.msg.GetPoseActionGoal()
00522 if self.action_result is None:
00523 self.action_result = pr2_object_manipulation_msgs.msg.GetPoseActionResult()
00524 if self.action_feedback is None:
00525 self.action_feedback = pr2_object_manipulation_msgs.msg.GetPoseActionFeedback()
00526 end = 0
00527 _x = self
00528 start = end
00529 end += 12
00530 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00531 start = end
00532 end += 4
00533 (length,) = _struct_I.unpack(str[start:end])
00534 start = end
00535 end += length
00536 if python3:
00537 self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00538 else:
00539 self.action_goal.header.frame_id = str[start:end]
00540 _x = self
00541 start = end
00542 end += 8
00543 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00544 start = end
00545 end += 4
00546 (length,) = _struct_I.unpack(str[start:end])
00547 start = end
00548 end += length
00549 if python3:
00550 self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00551 else:
00552 self.action_goal.goal_id.id = str[start:end]
00553 _x = self
00554 start = end
00555 end += 12
00556 (_x.action_goal.goal.starting_pose.header.seq, _x.action_goal.goal.starting_pose.header.stamp.secs, _x.action_goal.goal.starting_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00557 start = end
00558 end += 4
00559 (length,) = _struct_I.unpack(str[start:end])
00560 start = end
00561 end += length
00562 if python3:
00563 self.action_goal.goal.starting_pose.header.frame_id = str[start:end].decode('utf-8')
00564 else:
00565 self.action_goal.goal.starting_pose.header.frame_id = str[start:end]
00566 _x = self
00567 start = end
00568 end += 68
00569 (_x.action_goal.goal.starting_pose.pose.position.x, _x.action_goal.goal.starting_pose.pose.position.y, _x.action_goal.goal.starting_pose.pose.position.z, _x.action_goal.goal.starting_pose.pose.orientation.x, _x.action_goal.goal.starting_pose.pose.orientation.y, _x.action_goal.goal.starting_pose.pose.orientation.z, _x.action_goal.goal.starting_pose.pose.orientation.w, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_7d3I.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.header.frame_id = str[start:end].decode('utf-8')
00577 else:
00578 self.action_result.header.frame_id = str[start:end]
00579 _x = self
00580 start = end
00581 end += 8
00582 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00583 start = end
00584 end += 4
00585 (length,) = _struct_I.unpack(str[start:end])
00586 start = end
00587 end += length
00588 if python3:
00589 self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00590 else:
00591 self.action_result.status.goal_id.id = str[start:end]
00592 start = end
00593 end += 1
00594 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00595 start = end
00596 end += 4
00597 (length,) = _struct_I.unpack(str[start:end])
00598 start = end
00599 end += length
00600 if python3:
00601 self.action_result.status.text = str[start:end].decode('utf-8')
00602 else:
00603 self.action_result.status.text = str[start:end]
00604 _x = self
00605 start = end
00606 end += 12
00607 (_x.action_result.result.pose.header.seq, _x.action_result.result.pose.header.stamp.secs, _x.action_result.result.pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00608 start = end
00609 end += 4
00610 (length,) = _struct_I.unpack(str[start:end])
00611 start = end
00612 end += length
00613 if python3:
00614 self.action_result.result.pose.header.frame_id = str[start:end].decode('utf-8')
00615 else:
00616 self.action_result.result.pose.header.frame_id = str[start:end]
00617 _x = self
00618 start = end
00619 end += 68
00620 (_x.action_result.result.pose.pose.position.x, _x.action_result.result.pose.pose.position.y, _x.action_result.result.pose.pose.position.z, _x.action_result.result.pose.pose.orientation.x, _x.action_result.result.pose.pose.orientation.y, _x.action_result.result.pose.pose.orientation.z, _x.action_result.result.pose.pose.orientation.w, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_7d3I.unpack(str[start:end])
00621 start = end
00622 end += 4
00623 (length,) = _struct_I.unpack(str[start:end])
00624 start = end
00625 end += length
00626 if python3:
00627 self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00628 else:
00629 self.action_feedback.header.frame_id = str[start:end]
00630 _x = self
00631 start = end
00632 end += 8
00633 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00634 start = end
00635 end += 4
00636 (length,) = _struct_I.unpack(str[start:end])
00637 start = end
00638 end += length
00639 if python3:
00640 self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00641 else:
00642 self.action_feedback.status.goal_id.id = str[start:end]
00643 start = end
00644 end += 1
00645 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00646 start = end
00647 end += 4
00648 (length,) = _struct_I.unpack(str[start:end])
00649 start = end
00650 end += length
00651 if python3:
00652 self.action_feedback.status.text = str[start:end].decode('utf-8')
00653 else:
00654 self.action_feedback.status.text = str[start:end]
00655 return self
00656 except struct.error as e:
00657 raise genpy.DeserializationError(e)
00658
00659 _struct_I = genpy.struct_I
00660 _struct_3I = struct.Struct("<3I")
00661 _struct_B = struct.Struct("<B")
00662 _struct_2I = struct.Struct("<2I")
00663 _struct_7d3I = struct.Struct("<7d3I")