_GetNavPoseAction.py
Go to the documentation of this file.
00001 """autogenerated by genpy from pr2_object_manipulation_msgs/GetNavPoseAction.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 GetNavPoseAction(genpy.Message):
00014   _md5sum = "3fe13630a063eaa45d146587a82676fe"
00015   _type = "pr2_object_manipulation_msgs/GetNavPoseAction"
00016   _has_header = False #flag to mark the presence of a Header object
00017   _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00018 
00019 GetNavPoseActionGoal action_goal
00020 GetNavPoseActionResult action_result
00021 GetNavPoseActionFeedback action_feedback
00022 
00023 ================================================================================
00024 MSG: pr2_object_manipulation_msgs/GetNavPoseActionGoal
00025 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00026 
00027 Header header
00028 actionlib_msgs/GoalID goal_id
00029 GetNavPoseGoal 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/GetNavPoseGoal
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 # The maximum in-plane distance that the action will allow
00071 float32 max_distance
00072 
00073 ================================================================================
00074 MSG: geometry_msgs/PoseStamped
00075 # A Pose with reference coordinate frame and timestamp
00076 Header header
00077 Pose pose
00078 
00079 ================================================================================
00080 MSG: geometry_msgs/Pose
00081 # A representation of pose in free space, composed of postion and orientation. 
00082 Point position
00083 Quaternion orientation
00084 
00085 ================================================================================
00086 MSG: geometry_msgs/Point
00087 # This contains the position of a point in free space
00088 float64 x
00089 float64 y
00090 float64 z
00091 
00092 ================================================================================
00093 MSG: geometry_msgs/Quaternion
00094 # This represents an orientation in free space in quaternion form.
00095 
00096 float64 x
00097 float64 y
00098 float64 z
00099 float64 w
00100 
00101 ================================================================================
00102 MSG: pr2_object_manipulation_msgs/GetNavPoseActionResult
00103 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00104 
00105 Header header
00106 actionlib_msgs/GoalStatus status
00107 GetNavPoseResult result
00108 
00109 ================================================================================
00110 MSG: actionlib_msgs/GoalStatus
00111 GoalID goal_id
00112 uint8 status
00113 uint8 PENDING         = 0   # The goal has yet to be processed by the action server
00114 uint8 ACTIVE          = 1   # The goal is currently being processed by the action server
00115 uint8 PREEMPTED       = 2   # The goal received a cancel request after it started executing
00116                             #   and has since completed its execution (Terminal State)
00117 uint8 SUCCEEDED       = 3   # The goal was achieved successfully by the action server (Terminal State)
00118 uint8 ABORTED         = 4   # The goal was aborted during execution by the action server due
00119                             #    to some failure (Terminal State)
00120 uint8 REJECTED        = 5   # The goal was rejected by the action server without being processed,
00121                             #    because the goal was unattainable or invalid (Terminal State)
00122 uint8 PREEMPTING      = 6   # The goal received a cancel request after it started executing
00123                             #    and has not yet completed execution
00124 uint8 RECALLING       = 7   # The goal received a cancel request before it started executing,
00125                             #    but the action server has not yet confirmed that the goal is canceled
00126 uint8 RECALLED        = 8   # The goal received a cancel request before it started executing
00127                             #    and was successfully cancelled (Terminal State)
00128 uint8 LOST            = 9   # An action client can determine that a goal is LOST. This should not be
00129                             #    sent over the wire by an action server
00130 
00131 #Allow for the user to associate a string with GoalStatus for debugging
00132 string text
00133 
00134 
00135 ================================================================================
00136 MSG: pr2_object_manipulation_msgs/GetNavPoseResult
00137 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00138 # the returned pose, assuming the user has clicked "accept"
00139 # if the user clicks "cancel" the action aborts
00140 geometry_msgs/PoseStamped pose
00141 
00142 
00143 ================================================================================
00144 MSG: pr2_object_manipulation_msgs/GetNavPoseActionFeedback
00145 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00146 
00147 Header header
00148 actionlib_msgs/GoalStatus status
00149 GetNavPoseFeedback feedback
00150 
00151 ================================================================================
00152 MSG: pr2_object_manipulation_msgs/GetNavPoseFeedback
00153 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00154 
00155 
00156 """
00157   __slots__ = ['action_goal','action_result','action_feedback']
00158   _slot_types = ['pr2_object_manipulation_msgs/GetNavPoseActionGoal','pr2_object_manipulation_msgs/GetNavPoseActionResult','pr2_object_manipulation_msgs/GetNavPoseActionFeedback']
00159 
00160   def __init__(self, *args, **kwds):
00161     """
00162     Constructor. Any message fields that are implicitly/explicitly
00163     set to None will be assigned a default value. The recommend
00164     use is keyword arguments as this is more robust to future message
00165     changes.  You cannot mix in-order arguments and keyword arguments.
00166 
00167     The available fields are:
00168        action_goal,action_result,action_feedback
00169 
00170     :param args: complete set of field values, in .msg order
00171     :param kwds: use keyword arguments corresponding to message field names
00172     to set specific fields.
00173     """
00174     if args or kwds:
00175       super(GetNavPoseAction, self).__init__(*args, **kwds)
00176       #message fields cannot be None, assign default values for those that are
00177       if self.action_goal is None:
00178         self.action_goal = pr2_object_manipulation_msgs.msg.GetNavPoseActionGoal()
00179       if self.action_result is None:
00180         self.action_result = pr2_object_manipulation_msgs.msg.GetNavPoseActionResult()
00181       if self.action_feedback is None:
00182         self.action_feedback = pr2_object_manipulation_msgs.msg.GetNavPoseActionFeedback()
00183     else:
00184       self.action_goal = pr2_object_manipulation_msgs.msg.GetNavPoseActionGoal()
00185       self.action_result = pr2_object_manipulation_msgs.msg.GetNavPoseActionResult()
00186       self.action_feedback = pr2_object_manipulation_msgs.msg.GetNavPoseActionFeedback()
00187 
00188   def _get_types(self):
00189     """
00190     internal API method
00191     """
00192     return self._slot_types
00193 
00194   def serialize(self, buff):
00195     """
00196     serialize message into buffer
00197     :param buff: buffer, ``StringIO``
00198     """
00199     try:
00200       _x = self
00201       buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00202       _x = self.action_goal.header.frame_id
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_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00210       _x = self.action_goal.goal_id.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_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))
00218       _x = self.action_goal.goal.starting_pose.header.frame_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       _x = self
00225       buff.write(_struct_7df3I.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_goal.goal.max_distance, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00226       _x = self.action_result.header.frame_id
00227       length = len(_x)
00228       if python3 or type(_x) == unicode:
00229         _x = _x.encode('utf-8')
00230         length = len(_x)
00231       buff.write(struct.pack('<I%ss'%length, length, _x))
00232       _x = self
00233       buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00234       _x = self.action_result.status.goal_id.id
00235       length = len(_x)
00236       if python3 or type(_x) == unicode:
00237         _x = _x.encode('utf-8')
00238         length = len(_x)
00239       buff.write(struct.pack('<I%ss'%length, length, _x))
00240       buff.write(_struct_B.pack(self.action_result.status.status))
00241       _x = self.action_result.status.text
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       _x = self
00248       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))
00249       _x = self.action_result.result.pose.header.frame_id
00250       length = len(_x)
00251       if python3 or type(_x) == unicode:
00252         _x = _x.encode('utf-8')
00253         length = len(_x)
00254       buff.write(struct.pack('<I%ss'%length, length, _x))
00255       _x = self
00256       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))
00257       _x = self.action_feedback.header.frame_id
00258       length = len(_x)
00259       if python3 or type(_x) == unicode:
00260         _x = _x.encode('utf-8')
00261         length = len(_x)
00262       buff.write(struct.pack('<I%ss'%length, length, _x))
00263       _x = self
00264       buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00265       _x = self.action_feedback.status.goal_id.id
00266       length = len(_x)
00267       if python3 or type(_x) == unicode:
00268         _x = _x.encode('utf-8')
00269         length = len(_x)
00270       buff.write(struct.pack('<I%ss'%length, length, _x))
00271       buff.write(_struct_B.pack(self.action_feedback.status.status))
00272       _x = self.action_feedback.status.text
00273       length = len(_x)
00274       if python3 or type(_x) == unicode:
00275         _x = _x.encode('utf-8')
00276         length = len(_x)
00277       buff.write(struct.pack('<I%ss'%length, length, _x))
00278     except struct.error as se: self._check_types(struct.error("%s: '%s' when writing '%s'" % (type(se), str(se), str(_x))))
00279     except TypeError as te: self._check_types(ValueError("%s: '%s' when writing '%s'" % (type(te), str(te), str(_x))))
00280 
00281   def deserialize(self, str):
00282     """
00283     unpack serialized message in str into this message instance
00284     :param str: byte array of serialized message, ``str``
00285     """
00286     try:
00287       if self.action_goal is None:
00288         self.action_goal = pr2_object_manipulation_msgs.msg.GetNavPoseActionGoal()
00289       if self.action_result is None:
00290         self.action_result = pr2_object_manipulation_msgs.msg.GetNavPoseActionResult()
00291       if self.action_feedback is None:
00292         self.action_feedback = pr2_object_manipulation_msgs.msg.GetNavPoseActionFeedback()
00293       end = 0
00294       _x = self
00295       start = end
00296       end += 12
00297       (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.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.header.frame_id = str[start:end].decode('utf-8')
00305       else:
00306         self.action_goal.header.frame_id = str[start:end]
00307       _x = self
00308       start = end
00309       end += 8
00310       (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.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_id.id = str[start:end].decode('utf-8')
00318       else:
00319         self.action_goal.goal_id.id = str[start:end]
00320       _x = self
00321       start = end
00322       end += 12
00323       (_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])
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.starting_pose.header.frame_id = str[start:end].decode('utf-8')
00331       else:
00332         self.action_goal.goal.starting_pose.header.frame_id = str[start:end]
00333       _x = self
00334       start = end
00335       end += 72
00336       (_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_goal.goal.max_distance, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_7df3I.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_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])
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_result.result.pose.header.frame_id = str[start:end].decode('utf-8')
00382       else:
00383         self.action_result.result.pose.header.frame_id = str[start:end]
00384       _x = self
00385       start = end
00386       end += 68
00387       (_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])
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.header.frame_id = str[start:end].decode('utf-8')
00395       else:
00396         self.action_feedback.header.frame_id = str[start:end]
00397       _x = self
00398       start = end
00399       end += 8
00400       (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00401       start = end
00402       end += 4
00403       (length,) = _struct_I.unpack(str[start:end])
00404       start = end
00405       end += length
00406       if python3:
00407         self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00408       else:
00409         self.action_feedback.status.goal_id.id = str[start:end]
00410       start = end
00411       end += 1
00412       (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00413       start = end
00414       end += 4
00415       (length,) = _struct_I.unpack(str[start:end])
00416       start = end
00417       end += length
00418       if python3:
00419         self.action_feedback.status.text = str[start:end].decode('utf-8')
00420       else:
00421         self.action_feedback.status.text = str[start:end]
00422       return self
00423     except struct.error as e:
00424       raise genpy.DeserializationError(e) #most likely buffer underfill
00425 
00426 
00427   def serialize_numpy(self, buff, numpy):
00428     """
00429     serialize message with numpy array types into buffer
00430     :param buff: buffer, ``StringIO``
00431     :param numpy: numpy python module
00432     """
00433     try:
00434       _x = self
00435       buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00436       _x = self.action_goal.header.frame_id
00437       length = len(_x)
00438       if python3 or type(_x) == unicode:
00439         _x = _x.encode('utf-8')
00440         length = len(_x)
00441       buff.write(struct.pack('<I%ss'%length, length, _x))
00442       _x = self
00443       buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00444       _x = self.action_goal.goal_id.id
00445       length = len(_x)
00446       if python3 or type(_x) == unicode:
00447         _x = _x.encode('utf-8')
00448         length = len(_x)
00449       buff.write(struct.pack('<I%ss'%length, length, _x))
00450       _x = self
00451       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))
00452       _x = self.action_goal.goal.starting_pose.header.frame_id
00453       length = len(_x)
00454       if python3 or type(_x) == unicode:
00455         _x = _x.encode('utf-8')
00456         length = len(_x)
00457       buff.write(struct.pack('<I%ss'%length, length, _x))
00458       _x = self
00459       buff.write(_struct_7df3I.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_goal.goal.max_distance, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00460       _x = self.action_result.header.frame_id
00461       length = len(_x)
00462       if python3 or type(_x) == unicode:
00463         _x = _x.encode('utf-8')
00464         length = len(_x)
00465       buff.write(struct.pack('<I%ss'%length, length, _x))
00466       _x = self
00467       buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00468       _x = self.action_result.status.goal_id.id
00469       length = len(_x)
00470       if python3 or type(_x) == unicode:
00471         _x = _x.encode('utf-8')
00472         length = len(_x)
00473       buff.write(struct.pack('<I%ss'%length, length, _x))
00474       buff.write(_struct_B.pack(self.action_result.status.status))
00475       _x = self.action_result.status.text
00476       length = len(_x)
00477       if python3 or type(_x) == unicode:
00478         _x = _x.encode('utf-8')
00479         length = len(_x)
00480       buff.write(struct.pack('<I%ss'%length, length, _x))
00481       _x = self
00482       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))
00483       _x = self.action_result.result.pose.header.frame_id
00484       length = len(_x)
00485       if python3 or type(_x) == unicode:
00486         _x = _x.encode('utf-8')
00487         length = len(_x)
00488       buff.write(struct.pack('<I%ss'%length, length, _x))
00489       _x = self
00490       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))
00491       _x = self.action_feedback.header.frame_id
00492       length = len(_x)
00493       if python3 or type(_x) == unicode:
00494         _x = _x.encode('utf-8')
00495         length = len(_x)
00496       buff.write(struct.pack('<I%ss'%length, length, _x))
00497       _x = self
00498       buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00499       _x = self.action_feedback.status.goal_id.id
00500       length = len(_x)
00501       if python3 or type(_x) == unicode:
00502         _x = _x.encode('utf-8')
00503         length = len(_x)
00504       buff.write(struct.pack('<I%ss'%length, length, _x))
00505       buff.write(_struct_B.pack(self.action_feedback.status.status))
00506       _x = self.action_feedback.status.text
00507       length = len(_x)
00508       if python3 or type(_x) == unicode:
00509         _x = _x.encode('utf-8')
00510         length = len(_x)
00511       buff.write(struct.pack('<I%ss'%length, length, _x))
00512     except struct.error as se: self._check_types(struct.error("%s: '%s' when writing '%s'" % (type(se), str(se), str(_x))))
00513     except TypeError as te: self._check_types(ValueError("%s: '%s' when writing '%s'" % (type(te), str(te), str(_x))))
00514 
00515   def deserialize_numpy(self, str, numpy):
00516     """
00517     unpack serialized message in str into this message instance using numpy for array types
00518     :param str: byte array of serialized message, ``str``
00519     :param numpy: numpy python module
00520     """
00521     try:
00522       if self.action_goal is None:
00523         self.action_goal = pr2_object_manipulation_msgs.msg.GetNavPoseActionGoal()
00524       if self.action_result is None:
00525         self.action_result = pr2_object_manipulation_msgs.msg.GetNavPoseActionResult()
00526       if self.action_feedback is None:
00527         self.action_feedback = pr2_object_manipulation_msgs.msg.GetNavPoseActionFeedback()
00528       end = 0
00529       _x = self
00530       start = end
00531       end += 12
00532       (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00533       start = end
00534       end += 4
00535       (length,) = _struct_I.unpack(str[start:end])
00536       start = end
00537       end += length
00538       if python3:
00539         self.action_goal.header.frame_id = str[start:end].decode('utf-8')
00540       else:
00541         self.action_goal.header.frame_id = str[start:end]
00542       _x = self
00543       start = end
00544       end += 8
00545       (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00546       start = end
00547       end += 4
00548       (length,) = _struct_I.unpack(str[start:end])
00549       start = end
00550       end += length
00551       if python3:
00552         self.action_goal.goal_id.id = str[start:end].decode('utf-8')
00553       else:
00554         self.action_goal.goal_id.id = str[start:end]
00555       _x = self
00556       start = end
00557       end += 12
00558       (_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])
00559       start = end
00560       end += 4
00561       (length,) = _struct_I.unpack(str[start:end])
00562       start = end
00563       end += length
00564       if python3:
00565         self.action_goal.goal.starting_pose.header.frame_id = str[start:end].decode('utf-8')
00566       else:
00567         self.action_goal.goal.starting_pose.header.frame_id = str[start:end]
00568       _x = self
00569       start = end
00570       end += 72
00571       (_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_goal.goal.max_distance, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_7df3I.unpack(str[start:end])
00572       start = end
00573       end += 4
00574       (length,) = _struct_I.unpack(str[start:end])
00575       start = end
00576       end += length
00577       if python3:
00578         self.action_result.header.frame_id = str[start:end].decode('utf-8')
00579       else:
00580         self.action_result.header.frame_id = str[start:end]
00581       _x = self
00582       start = end
00583       end += 8
00584       (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00585       start = end
00586       end += 4
00587       (length,) = _struct_I.unpack(str[start:end])
00588       start = end
00589       end += length
00590       if python3:
00591         self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00592       else:
00593         self.action_result.status.goal_id.id = str[start:end]
00594       start = end
00595       end += 1
00596       (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00597       start = end
00598       end += 4
00599       (length,) = _struct_I.unpack(str[start:end])
00600       start = end
00601       end += length
00602       if python3:
00603         self.action_result.status.text = str[start:end].decode('utf-8')
00604       else:
00605         self.action_result.status.text = str[start:end]
00606       _x = self
00607       start = end
00608       end += 12
00609       (_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])
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_result.result.pose.header.frame_id = str[start:end].decode('utf-8')
00617       else:
00618         self.action_result.result.pose.header.frame_id = str[start:end]
00619       _x = self
00620       start = end
00621       end += 68
00622       (_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])
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_feedback.header.frame_id = str[start:end].decode('utf-8')
00630       else:
00631         self.action_feedback.header.frame_id = str[start:end]
00632       _x = self
00633       start = end
00634       end += 8
00635       (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.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_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00643       else:
00644         self.action_feedback.status.goal_id.id = str[start:end]
00645       start = end
00646       end += 1
00647       (self.action_feedback.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_feedback.status.text = str[start:end].decode('utf-8')
00655       else:
00656         self.action_feedback.status.text = str[start:end]
00657       return self
00658     except struct.error as e:
00659       raise genpy.DeserializationError(e) #most likely buffer underfill
00660 
00661 _struct_I = genpy.struct_I
00662 _struct_7df3I = struct.Struct("<7df3I")
00663 _struct_3I = struct.Struct("<3I")
00664 _struct_B = struct.Struct("<B")
00665 _struct_2I = struct.Struct("<2I")
00666 _struct_7d3I = struct.Struct("<7d3I")


pr2_object_manipulation_msgs
Author(s): Matei Ciocarlie
autogenerated on Mon Oct 6 2014 11:55:20