_GetGraspingPointAction.py
Go to the documentation of this file.
00001 """autogenerated by genpy from iri_bow_object_detector/GetGraspingPointAction.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 actionlib_msgs.msg
00008 import geometry_msgs.msg
00009 import sensor_msgs.msg
00010 import iri_bow_object_detector.msg
00011 import genpy
00012 import std_msgs.msg
00013 
00014 class GetGraspingPointAction(genpy.Message):
00015   _md5sum = "06042548d4cbeff4079ce48607938720"
00016   _type = "iri_bow_object_detector/GetGraspingPointAction"
00017   _has_header = False #flag to mark the presence of a Header object
00018   _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00019 
00020 GetGraspingPointActionGoal action_goal
00021 GetGraspingPointActionResult action_result
00022 GetGraspingPointActionFeedback action_feedback
00023 
00024 ================================================================================
00025 MSG: iri_bow_object_detector/GetGraspingPointActionGoal
00026 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00027 
00028 Header header
00029 actionlib_msgs/GoalID goal_id
00030 GetGraspingPointGoal goal
00031 
00032 ================================================================================
00033 MSG: std_msgs/Header
00034 # Standard metadata for higher-level stamped data types.
00035 # This is generally used to communicate timestamped data 
00036 # in a particular coordinate frame.
00037 # 
00038 # sequence ID: consecutively increasing ID 
00039 uint32 seq
00040 #Two-integer timestamp that is expressed as:
00041 # * stamp.secs: seconds (stamp_secs) since epoch
00042 # * stamp.nsecs: nanoseconds since stamp_secs
00043 # time-handling sugar is provided by the client library
00044 time stamp
00045 #Frame this data is associated with
00046 # 0: no frame
00047 # 1: global frame
00048 string frame_id
00049 
00050 ================================================================================
00051 MSG: actionlib_msgs/GoalID
00052 # The stamp should store the time at which this goal was requested.
00053 # It is used by an action server when it tries to preempt all
00054 # goals that were requested before a certain time
00055 time stamp
00056 
00057 # The id provides a way to associate feedback and
00058 # result message with specific goal requests. The id
00059 # specified must be unique.
00060 string id
00061 
00062 
00063 ================================================================================
00064 MSG: iri_bow_object_detector/GetGraspingPointGoal
00065 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00066 # Define the goal
00067 sensor_msgs/PointCloud2 pointcloud
00068 
00069 ================================================================================
00070 MSG: sensor_msgs/PointCloud2
00071 # This message holds a collection of N-dimensional points, which may
00072 # contain additional information such as normals, intensity, etc. The
00073 # point data is stored as a binary blob, its layout described by the
00074 # contents of the "fields" array.
00075 
00076 # The point cloud data may be organized 2d (image-like) or 1d
00077 # (unordered). Point clouds organized as 2d images may be produced by
00078 # camera depth sensors such as stereo or time-of-flight.
00079 
00080 # Time of sensor data acquisition, and the coordinate frame ID (for 3d
00081 # points).
00082 Header header
00083 
00084 # 2D structure of the point cloud. If the cloud is unordered, height is
00085 # 1 and width is the length of the point cloud.
00086 uint32 height
00087 uint32 width
00088 
00089 # Describes the channels and their layout in the binary data blob.
00090 PointField[] fields
00091 
00092 bool    is_bigendian # Is this data bigendian?
00093 uint32  point_step   # Length of a point in bytes
00094 uint32  row_step     # Length of a row in bytes
00095 uint8[] data         # Actual point data, size is (row_step*height)
00096 
00097 bool is_dense        # True if there are no invalid points
00098 
00099 ================================================================================
00100 MSG: sensor_msgs/PointField
00101 # This message holds the description of one point entry in the
00102 # PointCloud2 message format.
00103 uint8 INT8    = 1
00104 uint8 UINT8   = 2
00105 uint8 INT16   = 3
00106 uint8 UINT16  = 4
00107 uint8 INT32   = 5
00108 uint8 UINT32  = 6
00109 uint8 FLOAT32 = 7
00110 uint8 FLOAT64 = 8
00111 
00112 string name      # Name of field
00113 uint32 offset    # Offset from start of point struct
00114 uint8  datatype  # Datatype enumeration, see above
00115 uint32 count     # How many elements in the field
00116 
00117 ================================================================================
00118 MSG: iri_bow_object_detector/GetGraspingPointActionResult
00119 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00120 
00121 Header header
00122 actionlib_msgs/GoalStatus status
00123 GetGraspingPointResult result
00124 
00125 ================================================================================
00126 MSG: actionlib_msgs/GoalStatus
00127 GoalID goal_id
00128 uint8 status
00129 uint8 PENDING         = 0   # The goal has yet to be processed by the action server
00130 uint8 ACTIVE          = 1   # The goal is currently being processed by the action server
00131 uint8 PREEMPTED       = 2   # The goal received a cancel request after it started executing
00132                             #   and has since completed its execution (Terminal State)
00133 uint8 SUCCEEDED       = 3   # The goal was achieved successfully by the action server (Terminal State)
00134 uint8 ABORTED         = 4   # The goal was aborted during execution by the action server due
00135                             #    to some failure (Terminal State)
00136 uint8 REJECTED        = 5   # The goal was rejected by the action server without being processed,
00137                             #    because the goal was unattainable or invalid (Terminal State)
00138 uint8 PREEMPTING      = 6   # The goal received a cancel request after it started executing
00139                             #    and has not yet completed execution
00140 uint8 RECALLING       = 7   # The goal received a cancel request before it started executing,
00141                             #    but the action server has not yet confirmed that the goal is canceled
00142 uint8 RECALLED        = 8   # The goal received a cancel request before it started executing
00143                             #    and was successfully cancelled (Terminal State)
00144 uint8 LOST            = 9   # An action client can determine that a goal is LOST. This should not be
00145                             #    sent over the wire by an action server
00146 
00147 #Allow for the user to associate a string with GoalStatus for debugging
00148 string text
00149 
00150 
00151 ================================================================================
00152 MSG: iri_bow_object_detector/GetGraspingPointResult
00153 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00154 # Define the result
00155 geometry_msgs/Point grasping_point
00156 
00157 ================================================================================
00158 MSG: geometry_msgs/Point
00159 # This contains the position of a point in free space
00160 float64 x
00161 float64 y
00162 float64 z
00163 
00164 ================================================================================
00165 MSG: iri_bow_object_detector/GetGraspingPointActionFeedback
00166 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00167 
00168 Header header
00169 actionlib_msgs/GoalStatus status
00170 GetGraspingPointFeedback feedback
00171 
00172 ================================================================================
00173 MSG: iri_bow_object_detector/GetGraspingPointFeedback
00174 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00175 # Define a feedback message
00176 float32 percent_complete
00177 
00178 """
00179   __slots__ = ['action_goal','action_result','action_feedback']
00180   _slot_types = ['iri_bow_object_detector/GetGraspingPointActionGoal','iri_bow_object_detector/GetGraspingPointActionResult','iri_bow_object_detector/GetGraspingPointActionFeedback']
00181 
00182   def __init__(self, *args, **kwds):
00183     """
00184     Constructor. Any message fields that are implicitly/explicitly
00185     set to None will be assigned a default value. The recommend
00186     use is keyword arguments as this is more robust to future message
00187     changes.  You cannot mix in-order arguments and keyword arguments.
00188 
00189     The available fields are:
00190        action_goal,action_result,action_feedback
00191 
00192     :param args: complete set of field values, in .msg order
00193     :param kwds: use keyword arguments corresponding to message field names
00194     to set specific fields.
00195     """
00196     if args or kwds:
00197       super(GetGraspingPointAction, self).__init__(*args, **kwds)
00198       #message fields cannot be None, assign default values for those that are
00199       if self.action_goal is None:
00200         self.action_goal = iri_bow_object_detector.msg.GetGraspingPointActionGoal()
00201       if self.action_result is None:
00202         self.action_result = iri_bow_object_detector.msg.GetGraspingPointActionResult()
00203       if self.action_feedback is None:
00204         self.action_feedback = iri_bow_object_detector.msg.GetGraspingPointActionFeedback()
00205     else:
00206       self.action_goal = iri_bow_object_detector.msg.GetGraspingPointActionGoal()
00207       self.action_result = iri_bow_object_detector.msg.GetGraspingPointActionResult()
00208       self.action_feedback = iri_bow_object_detector.msg.GetGraspingPointActionFeedback()
00209 
00210   def _get_types(self):
00211     """
00212     internal API method
00213     """
00214     return self._slot_types
00215 
00216   def serialize(self, buff):
00217     """
00218     serialize message into buffer
00219     :param buff: buffer, ``StringIO``
00220     """
00221     try:
00222       _x = self
00223       buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00224       _x = self.action_goal.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_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00232       _x = self.action_goal.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       _x = self
00239       buff.write(_struct_3I.pack(_x.action_goal.goal.pointcloud.header.seq, _x.action_goal.goal.pointcloud.header.stamp.secs, _x.action_goal.goal.pointcloud.header.stamp.nsecs))
00240       _x = self.action_goal.goal.pointcloud.header.frame_id
00241       length = len(_x)
00242       if python3 or type(_x) == unicode:
00243         _x = _x.encode('utf-8')
00244         length = len(_x)
00245       buff.write(struct.pack('<I%ss'%length, length, _x))
00246       _x = self
00247       buff.write(_struct_2I.pack(_x.action_goal.goal.pointcloud.height, _x.action_goal.goal.pointcloud.width))
00248       length = len(self.action_goal.goal.pointcloud.fields)
00249       buff.write(_struct_I.pack(length))
00250       for val1 in self.action_goal.goal.pointcloud.fields:
00251         _x = val1.name
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         _x = val1
00258         buff.write(_struct_IBI.pack(_x.offset, _x.datatype, _x.count))
00259       _x = self
00260       buff.write(_struct_B2I.pack(_x.action_goal.goal.pointcloud.is_bigendian, _x.action_goal.goal.pointcloud.point_step, _x.action_goal.goal.pointcloud.row_step))
00261       _x = self.action_goal.goal.pointcloud.data
00262       length = len(_x)
00263       # - if encoded as a list instead, serialize as bytes instead of string
00264       if type(_x) in [list, tuple]:
00265         buff.write(struct.pack('<I%sB'%length, length, *_x))
00266       else:
00267         buff.write(struct.pack('<I%ss'%length, length, _x))
00268       _x = self
00269       buff.write(_struct_B3I.pack(_x.action_goal.goal.pointcloud.is_dense, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00270       _x = self.action_result.header.frame_id
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       _x = self
00277       buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00278       _x = self.action_result.status.goal_id.id
00279       length = len(_x)
00280       if python3 or type(_x) == unicode:
00281         _x = _x.encode('utf-8')
00282         length = len(_x)
00283       buff.write(struct.pack('<I%ss'%length, length, _x))
00284       buff.write(_struct_B.pack(self.action_result.status.status))
00285       _x = self.action_result.status.text
00286       length = len(_x)
00287       if python3 or type(_x) == unicode:
00288         _x = _x.encode('utf-8')
00289         length = len(_x)
00290       buff.write(struct.pack('<I%ss'%length, length, _x))
00291       _x = self
00292       buff.write(_struct_3d3I.pack(_x.action_result.result.grasping_point.x, _x.action_result.result.grasping_point.y, _x.action_result.result.grasping_point.z, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00293       _x = self.action_feedback.header.frame_id
00294       length = len(_x)
00295       if python3 or type(_x) == unicode:
00296         _x = _x.encode('utf-8')
00297         length = len(_x)
00298       buff.write(struct.pack('<I%ss'%length, length, _x))
00299       _x = self
00300       buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00301       _x = self.action_feedback.status.goal_id.id
00302       length = len(_x)
00303       if python3 or type(_x) == unicode:
00304         _x = _x.encode('utf-8')
00305         length = len(_x)
00306       buff.write(struct.pack('<I%ss'%length, length, _x))
00307       buff.write(_struct_B.pack(self.action_feedback.status.status))
00308       _x = self.action_feedback.status.text
00309       length = len(_x)
00310       if python3 or type(_x) == unicode:
00311         _x = _x.encode('utf-8')
00312         length = len(_x)
00313       buff.write(struct.pack('<I%ss'%length, length, _x))
00314       buff.write(_struct_f.pack(self.action_feedback.feedback.percent_complete))
00315     except struct.error as se: self._check_types(se)
00316     except TypeError as te: self._check_types(te)
00317 
00318   def deserialize(self, str):
00319     """
00320     unpack serialized message in str into this message instance
00321     :param str: byte array of serialized message, ``str``
00322     """
00323     try:
00324       if self.action_goal is None:
00325         self.action_goal = iri_bow_object_detector.msg.GetGraspingPointActionGoal()
00326       if self.action_result is None:
00327         self.action_result = iri_bow_object_detector.msg.GetGraspingPointActionResult()
00328       if self.action_feedback is None:
00329         self.action_feedback = iri_bow_object_detector.msg.GetGraspingPointActionFeedback()
00330       end = 0
00331       _x = self
00332       start = end
00333       end += 12
00334       (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.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_goal.header.frame_id = str[start:end].decode('utf-8')
00342       else:
00343         self.action_goal.header.frame_id = str[start:end]
00344       _x = self
00345       start = end
00346       end += 8
00347       (_x.action_goal.goal_id.stamp.secs, _x.action_goal.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_goal.goal_id.id = str[start:end].decode('utf-8')
00355       else:
00356         self.action_goal.goal_id.id = str[start:end]
00357       _x = self
00358       start = end
00359       end += 12
00360       (_x.action_goal.goal.pointcloud.header.seq, _x.action_goal.goal.pointcloud.header.stamp.secs, _x.action_goal.goal.pointcloud.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00361       start = end
00362       end += 4
00363       (length,) = _struct_I.unpack(str[start:end])
00364       start = end
00365       end += length
00366       if python3:
00367         self.action_goal.goal.pointcloud.header.frame_id = str[start:end].decode('utf-8')
00368       else:
00369         self.action_goal.goal.pointcloud.header.frame_id = str[start:end]
00370       _x = self
00371       start = end
00372       end += 8
00373       (_x.action_goal.goal.pointcloud.height, _x.action_goal.goal.pointcloud.width,) = _struct_2I.unpack(str[start:end])
00374       start = end
00375       end += 4
00376       (length,) = _struct_I.unpack(str[start:end])
00377       self.action_goal.goal.pointcloud.fields = []
00378       for i in range(0, length):
00379         val1 = sensor_msgs.msg.PointField()
00380         start = end
00381         end += 4
00382         (length,) = _struct_I.unpack(str[start:end])
00383         start = end
00384         end += length
00385         if python3:
00386           val1.name = str[start:end].decode('utf-8')
00387         else:
00388           val1.name = str[start:end]
00389         _x = val1
00390         start = end
00391         end += 9
00392         (_x.offset, _x.datatype, _x.count,) = _struct_IBI.unpack(str[start:end])
00393         self.action_goal.goal.pointcloud.fields.append(val1)
00394       _x = self
00395       start = end
00396       end += 9
00397       (_x.action_goal.goal.pointcloud.is_bigendian, _x.action_goal.goal.pointcloud.point_step, _x.action_goal.goal.pointcloud.row_step,) = _struct_B2I.unpack(str[start:end])
00398       self.action_goal.goal.pointcloud.is_bigendian = bool(self.action_goal.goal.pointcloud.is_bigendian)
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_goal.goal.pointcloud.data = str[start:end].decode('utf-8')
00406       else:
00407         self.action_goal.goal.pointcloud.data = str[start:end]
00408       _x = self
00409       start = end
00410       end += 13
00411       (_x.action_goal.goal.pointcloud.is_dense, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_B3I.unpack(str[start:end])
00412       self.action_goal.goal.pointcloud.is_dense = bool(self.action_goal.goal.pointcloud.is_dense)
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_result.header.frame_id = str[start:end].decode('utf-8')
00420       else:
00421         self.action_result.header.frame_id = str[start:end]
00422       _x = self
00423       start = end
00424       end += 8
00425       (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00426       start = end
00427       end += 4
00428       (length,) = _struct_I.unpack(str[start:end])
00429       start = end
00430       end += length
00431       if python3:
00432         self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00433       else:
00434         self.action_result.status.goal_id.id = str[start:end]
00435       start = end
00436       end += 1
00437       (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00438       start = end
00439       end += 4
00440       (length,) = _struct_I.unpack(str[start:end])
00441       start = end
00442       end += length
00443       if python3:
00444         self.action_result.status.text = str[start:end].decode('utf-8')
00445       else:
00446         self.action_result.status.text = str[start:end]
00447       _x = self
00448       start = end
00449       end += 36
00450       (_x.action_result.result.grasping_point.x, _x.action_result.result.grasping_point.y, _x.action_result.result.grasping_point.z, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3d3I.unpack(str[start:end])
00451       start = end
00452       end += 4
00453       (length,) = _struct_I.unpack(str[start:end])
00454       start = end
00455       end += length
00456       if python3:
00457         self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00458       else:
00459         self.action_feedback.header.frame_id = str[start:end]
00460       _x = self
00461       start = end
00462       end += 8
00463       (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00464       start = end
00465       end += 4
00466       (length,) = _struct_I.unpack(str[start:end])
00467       start = end
00468       end += length
00469       if python3:
00470         self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00471       else:
00472         self.action_feedback.status.goal_id.id = str[start:end]
00473       start = end
00474       end += 1
00475       (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00476       start = end
00477       end += 4
00478       (length,) = _struct_I.unpack(str[start:end])
00479       start = end
00480       end += length
00481       if python3:
00482         self.action_feedback.status.text = str[start:end].decode('utf-8')
00483       else:
00484         self.action_feedback.status.text = str[start:end]
00485       start = end
00486       end += 4
00487       (self.action_feedback.feedback.percent_complete,) = _struct_f.unpack(str[start:end])
00488       return self
00489     except struct.error as e:
00490       raise genpy.DeserializationError(e) #most likely buffer underfill
00491 
00492 
00493   def serialize_numpy(self, buff, numpy):
00494     """
00495     serialize message with numpy array types into buffer
00496     :param buff: buffer, ``StringIO``
00497     :param numpy: numpy python module
00498     """
00499     try:
00500       _x = self
00501       buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00502       _x = self.action_goal.header.frame_id
00503       length = len(_x)
00504       if python3 or type(_x) == unicode:
00505         _x = _x.encode('utf-8')
00506         length = len(_x)
00507       buff.write(struct.pack('<I%ss'%length, length, _x))
00508       _x = self
00509       buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00510       _x = self.action_goal.goal_id.id
00511       length = len(_x)
00512       if python3 or type(_x) == unicode:
00513         _x = _x.encode('utf-8')
00514         length = len(_x)
00515       buff.write(struct.pack('<I%ss'%length, length, _x))
00516       _x = self
00517       buff.write(_struct_3I.pack(_x.action_goal.goal.pointcloud.header.seq, _x.action_goal.goal.pointcloud.header.stamp.secs, _x.action_goal.goal.pointcloud.header.stamp.nsecs))
00518       _x = self.action_goal.goal.pointcloud.header.frame_id
00519       length = len(_x)
00520       if python3 or type(_x) == unicode:
00521         _x = _x.encode('utf-8')
00522         length = len(_x)
00523       buff.write(struct.pack('<I%ss'%length, length, _x))
00524       _x = self
00525       buff.write(_struct_2I.pack(_x.action_goal.goal.pointcloud.height, _x.action_goal.goal.pointcloud.width))
00526       length = len(self.action_goal.goal.pointcloud.fields)
00527       buff.write(_struct_I.pack(length))
00528       for val1 in self.action_goal.goal.pointcloud.fields:
00529         _x = val1.name
00530         length = len(_x)
00531         if python3 or type(_x) == unicode:
00532           _x = _x.encode('utf-8')
00533           length = len(_x)
00534         buff.write(struct.pack('<I%ss'%length, length, _x))
00535         _x = val1
00536         buff.write(_struct_IBI.pack(_x.offset, _x.datatype, _x.count))
00537       _x = self
00538       buff.write(_struct_B2I.pack(_x.action_goal.goal.pointcloud.is_bigendian, _x.action_goal.goal.pointcloud.point_step, _x.action_goal.goal.pointcloud.row_step))
00539       _x = self.action_goal.goal.pointcloud.data
00540       length = len(_x)
00541       # - if encoded as a list instead, serialize as bytes instead of string
00542       if type(_x) in [list, tuple]:
00543         buff.write(struct.pack('<I%sB'%length, length, *_x))
00544       else:
00545         buff.write(struct.pack('<I%ss'%length, length, _x))
00546       _x = self
00547       buff.write(_struct_B3I.pack(_x.action_goal.goal.pointcloud.is_dense, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00548       _x = self.action_result.header.frame_id
00549       length = len(_x)
00550       if python3 or type(_x) == unicode:
00551         _x = _x.encode('utf-8')
00552         length = len(_x)
00553       buff.write(struct.pack('<I%ss'%length, length, _x))
00554       _x = self
00555       buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00556       _x = self.action_result.status.goal_id.id
00557       length = len(_x)
00558       if python3 or type(_x) == unicode:
00559         _x = _x.encode('utf-8')
00560         length = len(_x)
00561       buff.write(struct.pack('<I%ss'%length, length, _x))
00562       buff.write(_struct_B.pack(self.action_result.status.status))
00563       _x = self.action_result.status.text
00564       length = len(_x)
00565       if python3 or type(_x) == unicode:
00566         _x = _x.encode('utf-8')
00567         length = len(_x)
00568       buff.write(struct.pack('<I%ss'%length, length, _x))
00569       _x = self
00570       buff.write(_struct_3d3I.pack(_x.action_result.result.grasping_point.x, _x.action_result.result.grasping_point.y, _x.action_result.result.grasping_point.z, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00571       _x = self.action_feedback.header.frame_id
00572       length = len(_x)
00573       if python3 or type(_x) == unicode:
00574         _x = _x.encode('utf-8')
00575         length = len(_x)
00576       buff.write(struct.pack('<I%ss'%length, length, _x))
00577       _x = self
00578       buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00579       _x = self.action_feedback.status.goal_id.id
00580       length = len(_x)
00581       if python3 or type(_x) == unicode:
00582         _x = _x.encode('utf-8')
00583         length = len(_x)
00584       buff.write(struct.pack('<I%ss'%length, length, _x))
00585       buff.write(_struct_B.pack(self.action_feedback.status.status))
00586       _x = self.action_feedback.status.text
00587       length = len(_x)
00588       if python3 or type(_x) == unicode:
00589         _x = _x.encode('utf-8')
00590         length = len(_x)
00591       buff.write(struct.pack('<I%ss'%length, length, _x))
00592       buff.write(_struct_f.pack(self.action_feedback.feedback.percent_complete))
00593     except struct.error as se: self._check_types(se)
00594     except TypeError as te: self._check_types(te)
00595 
00596   def deserialize_numpy(self, str, numpy):
00597     """
00598     unpack serialized message in str into this message instance using numpy for array types
00599     :param str: byte array of serialized message, ``str``
00600     :param numpy: numpy python module
00601     """
00602     try:
00603       if self.action_goal is None:
00604         self.action_goal = iri_bow_object_detector.msg.GetGraspingPointActionGoal()
00605       if self.action_result is None:
00606         self.action_result = iri_bow_object_detector.msg.GetGraspingPointActionResult()
00607       if self.action_feedback is None:
00608         self.action_feedback = iri_bow_object_detector.msg.GetGraspingPointActionFeedback()
00609       end = 0
00610       _x = self
00611       start = end
00612       end += 12
00613       (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.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_goal.header.frame_id = str[start:end].decode('utf-8')
00621       else:
00622         self.action_goal.header.frame_id = str[start:end]
00623       _x = self
00624       start = end
00625       end += 8
00626       (_x.action_goal.goal_id.stamp.secs, _x.action_goal.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_goal.goal_id.id = str[start:end].decode('utf-8')
00634       else:
00635         self.action_goal.goal_id.id = str[start:end]
00636       _x = self
00637       start = end
00638       end += 12
00639       (_x.action_goal.goal.pointcloud.header.seq, _x.action_goal.goal.pointcloud.header.stamp.secs, _x.action_goal.goal.pointcloud.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00640       start = end
00641       end += 4
00642       (length,) = _struct_I.unpack(str[start:end])
00643       start = end
00644       end += length
00645       if python3:
00646         self.action_goal.goal.pointcloud.header.frame_id = str[start:end].decode('utf-8')
00647       else:
00648         self.action_goal.goal.pointcloud.header.frame_id = str[start:end]
00649       _x = self
00650       start = end
00651       end += 8
00652       (_x.action_goal.goal.pointcloud.height, _x.action_goal.goal.pointcloud.width,) = _struct_2I.unpack(str[start:end])
00653       start = end
00654       end += 4
00655       (length,) = _struct_I.unpack(str[start:end])
00656       self.action_goal.goal.pointcloud.fields = []
00657       for i in range(0, length):
00658         val1 = sensor_msgs.msg.PointField()
00659         start = end
00660         end += 4
00661         (length,) = _struct_I.unpack(str[start:end])
00662         start = end
00663         end += length
00664         if python3:
00665           val1.name = str[start:end].decode('utf-8')
00666         else:
00667           val1.name = str[start:end]
00668         _x = val1
00669         start = end
00670         end += 9
00671         (_x.offset, _x.datatype, _x.count,) = _struct_IBI.unpack(str[start:end])
00672         self.action_goal.goal.pointcloud.fields.append(val1)
00673       _x = self
00674       start = end
00675       end += 9
00676       (_x.action_goal.goal.pointcloud.is_bigendian, _x.action_goal.goal.pointcloud.point_step, _x.action_goal.goal.pointcloud.row_step,) = _struct_B2I.unpack(str[start:end])
00677       self.action_goal.goal.pointcloud.is_bigendian = bool(self.action_goal.goal.pointcloud.is_bigendian)
00678       start = end
00679       end += 4
00680       (length,) = _struct_I.unpack(str[start:end])
00681       start = end
00682       end += length
00683       if python3:
00684         self.action_goal.goal.pointcloud.data = str[start:end].decode('utf-8')
00685       else:
00686         self.action_goal.goal.pointcloud.data = str[start:end]
00687       _x = self
00688       start = end
00689       end += 13
00690       (_x.action_goal.goal.pointcloud.is_dense, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_B3I.unpack(str[start:end])
00691       self.action_goal.goal.pointcloud.is_dense = bool(self.action_goal.goal.pointcloud.is_dense)
00692       start = end
00693       end += 4
00694       (length,) = _struct_I.unpack(str[start:end])
00695       start = end
00696       end += length
00697       if python3:
00698         self.action_result.header.frame_id = str[start:end].decode('utf-8')
00699       else:
00700         self.action_result.header.frame_id = str[start:end]
00701       _x = self
00702       start = end
00703       end += 8
00704       (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00705       start = end
00706       end += 4
00707       (length,) = _struct_I.unpack(str[start:end])
00708       start = end
00709       end += length
00710       if python3:
00711         self.action_result.status.goal_id.id = str[start:end].decode('utf-8')
00712       else:
00713         self.action_result.status.goal_id.id = str[start:end]
00714       start = end
00715       end += 1
00716       (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00717       start = end
00718       end += 4
00719       (length,) = _struct_I.unpack(str[start:end])
00720       start = end
00721       end += length
00722       if python3:
00723         self.action_result.status.text = str[start:end].decode('utf-8')
00724       else:
00725         self.action_result.status.text = str[start:end]
00726       _x = self
00727       start = end
00728       end += 36
00729       (_x.action_result.result.grasping_point.x, _x.action_result.result.grasping_point.y, _x.action_result.result.grasping_point.z, _x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3d3I.unpack(str[start:end])
00730       start = end
00731       end += 4
00732       (length,) = _struct_I.unpack(str[start:end])
00733       start = end
00734       end += length
00735       if python3:
00736         self.action_feedback.header.frame_id = str[start:end].decode('utf-8')
00737       else:
00738         self.action_feedback.header.frame_id = str[start:end]
00739       _x = self
00740       start = end
00741       end += 8
00742       (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00743       start = end
00744       end += 4
00745       (length,) = _struct_I.unpack(str[start:end])
00746       start = end
00747       end += length
00748       if python3:
00749         self.action_feedback.status.goal_id.id = str[start:end].decode('utf-8')
00750       else:
00751         self.action_feedback.status.goal_id.id = str[start:end]
00752       start = end
00753       end += 1
00754       (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00755       start = end
00756       end += 4
00757       (length,) = _struct_I.unpack(str[start:end])
00758       start = end
00759       end += length
00760       if python3:
00761         self.action_feedback.status.text = str[start:end].decode('utf-8')
00762       else:
00763         self.action_feedback.status.text = str[start:end]
00764       start = end
00765       end += 4
00766       (self.action_feedback.feedback.percent_complete,) = _struct_f.unpack(str[start:end])
00767       return self
00768     except struct.error as e:
00769       raise genpy.DeserializationError(e) #most likely buffer underfill
00770 
00771 _struct_I = genpy.struct_I
00772 _struct_IBI = struct.Struct("<IBI")
00773 _struct_B = struct.Struct("<B")
00774 _struct_3d3I = struct.Struct("<3d3I")
00775 _struct_f = struct.Struct("<f")
00776 _struct_3I = struct.Struct("<3I")
00777 _struct_B3I = struct.Struct("<B3I")
00778 _struct_B2I = struct.Struct("<B2I")
00779 _struct_2I = struct.Struct("<2I")


iri_bow_object_detector
Author(s): dmartinez
autogenerated on Fri Dec 6 2013 22:45:45