_GetFreePath.py
Go to the documentation of this file.
00001 """autogenerated by genpy from collision_proximity_planner/GetFreePathRequest.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 arm_navigation_msgs.msg
00008 import geometry_msgs.msg
00009 import std_msgs.msg
00010 import genpy
00011 import sensor_msgs.msg
00012 
00013 class GetFreePathRequest(genpy.Message):
00014   _md5sum = "23e0e254ce49bb298446221648a76af8"
00015   _type = "collision_proximity_planner/GetFreePathRequest"
00016   _has_header = False #flag to mark the presence of a Header object
00017   _full_text = """
00018 arm_navigation_msgs/RobotState robot_state
00019 
00020 ================================================================================
00021 MSG: arm_navigation_msgs/RobotState
00022 # This message contains information about the robot state, i.e. the positions of its joints and links
00023 sensor_msgs/JointState joint_state
00024 arm_navigation_msgs/MultiDOFJointState multi_dof_joint_state
00025 
00026 ================================================================================
00027 MSG: sensor_msgs/JointState
00028 # This is a message that holds data to describe the state of a set of torque controlled joints. 
00029 #
00030 # The state of each joint (revolute or prismatic) is defined by:
00031 #  * the position of the joint (rad or m),
00032 #  * the velocity of the joint (rad/s or m/s) and 
00033 #  * the effort that is applied in the joint (Nm or N).
00034 #
00035 # Each joint is uniquely identified by its name
00036 # The header specifies the time at which the joint states were recorded. All the joint states
00037 # in one message have to be recorded at the same time.
00038 #
00039 # This message consists of a multiple arrays, one for each part of the joint state. 
00040 # The goal is to make each of the fields optional. When e.g. your joints have no
00041 # effort associated with them, you can leave the effort array empty. 
00042 #
00043 # All arrays in this message should have the same size, or be empty.
00044 # This is the only way to uniquely associate the joint name with the correct
00045 # states.
00046 
00047 
00048 Header header
00049 
00050 string[] name
00051 float64[] position
00052 float64[] velocity
00053 float64[] effort
00054 
00055 ================================================================================
00056 MSG: std_msgs/Header
00057 # Standard metadata for higher-level stamped data types.
00058 # This is generally used to communicate timestamped data 
00059 # in a particular coordinate frame.
00060 # 
00061 # sequence ID: consecutively increasing ID 
00062 uint32 seq
00063 #Two-integer timestamp that is expressed as:
00064 # * stamp.secs: seconds (stamp_secs) since epoch
00065 # * stamp.nsecs: nanoseconds since stamp_secs
00066 # time-handling sugar is provided by the client library
00067 time stamp
00068 #Frame this data is associated with
00069 # 0: no frame
00070 # 1: global frame
00071 string frame_id
00072 
00073 ================================================================================
00074 MSG: arm_navigation_msgs/MultiDOFJointState
00075 #A representation of a multi-dof joint state
00076 time stamp
00077 string[] joint_names
00078 string[] frame_ids
00079 string[] child_frame_ids
00080 geometry_msgs/Pose[] poses
00081 
00082 ================================================================================
00083 MSG: geometry_msgs/Pose
00084 # A representation of pose in free space, composed of postion and orientation. 
00085 Point position
00086 Quaternion orientation
00087 
00088 ================================================================================
00089 MSG: geometry_msgs/Point
00090 # This contains the position of a point in free space
00091 float64 x
00092 float64 y
00093 float64 z
00094 
00095 ================================================================================
00096 MSG: geometry_msgs/Quaternion
00097 # This represents an orientation in free space in quaternion form.
00098 
00099 float64 x
00100 float64 y
00101 float64 z
00102 float64 w
00103 
00104 """
00105   __slots__ = ['robot_state']
00106   _slot_types = ['arm_navigation_msgs/RobotState']
00107 
00108   def __init__(self, *args, **kwds):
00109     """
00110     Constructor. Any message fields that are implicitly/explicitly
00111     set to None will be assigned a default value. The recommend
00112     use is keyword arguments as this is more robust to future message
00113     changes.  You cannot mix in-order arguments and keyword arguments.
00114 
00115     The available fields are:
00116        robot_state
00117 
00118     :param args: complete set of field values, in .msg order
00119     :param kwds: use keyword arguments corresponding to message field names
00120     to set specific fields.
00121     """
00122     if args or kwds:
00123       super(GetFreePathRequest, self).__init__(*args, **kwds)
00124       #message fields cannot be None, assign default values for those that are
00125       if self.robot_state is None:
00126         self.robot_state = arm_navigation_msgs.msg.RobotState()
00127     else:
00128       self.robot_state = arm_navigation_msgs.msg.RobotState()
00129 
00130   def _get_types(self):
00131     """
00132     internal API method
00133     """
00134     return self._slot_types
00135 
00136   def serialize(self, buff):
00137     """
00138     serialize message into buffer
00139     :param buff: buffer, ``StringIO``
00140     """
00141     try:
00142       _x = self
00143       buff.write(_struct_3I.pack(_x.robot_state.joint_state.header.seq, _x.robot_state.joint_state.header.stamp.secs, _x.robot_state.joint_state.header.stamp.nsecs))
00144       _x = self.robot_state.joint_state.header.frame_id
00145       length = len(_x)
00146       if python3 or type(_x) == unicode:
00147         _x = _x.encode('utf-8')
00148         length = len(_x)
00149       buff.write(struct.pack('<I%ss'%length, length, _x))
00150       length = len(self.robot_state.joint_state.name)
00151       buff.write(_struct_I.pack(length))
00152       for val1 in self.robot_state.joint_state.name:
00153         length = len(val1)
00154         if python3 or type(val1) == unicode:
00155           val1 = val1.encode('utf-8')
00156           length = len(val1)
00157         buff.write(struct.pack('<I%ss'%length, length, val1))
00158       length = len(self.robot_state.joint_state.position)
00159       buff.write(_struct_I.pack(length))
00160       pattern = '<%sd'%length
00161       buff.write(struct.pack(pattern, *self.robot_state.joint_state.position))
00162       length = len(self.robot_state.joint_state.velocity)
00163       buff.write(_struct_I.pack(length))
00164       pattern = '<%sd'%length
00165       buff.write(struct.pack(pattern, *self.robot_state.joint_state.velocity))
00166       length = len(self.robot_state.joint_state.effort)
00167       buff.write(_struct_I.pack(length))
00168       pattern = '<%sd'%length
00169       buff.write(struct.pack(pattern, *self.robot_state.joint_state.effort))
00170       _x = self
00171       buff.write(_struct_2I.pack(_x.robot_state.multi_dof_joint_state.stamp.secs, _x.robot_state.multi_dof_joint_state.stamp.nsecs))
00172       length = len(self.robot_state.multi_dof_joint_state.joint_names)
00173       buff.write(_struct_I.pack(length))
00174       for val1 in self.robot_state.multi_dof_joint_state.joint_names:
00175         length = len(val1)
00176         if python3 or type(val1) == unicode:
00177           val1 = val1.encode('utf-8')
00178           length = len(val1)
00179         buff.write(struct.pack('<I%ss'%length, length, val1))
00180       length = len(self.robot_state.multi_dof_joint_state.frame_ids)
00181       buff.write(_struct_I.pack(length))
00182       for val1 in self.robot_state.multi_dof_joint_state.frame_ids:
00183         length = len(val1)
00184         if python3 or type(val1) == unicode:
00185           val1 = val1.encode('utf-8')
00186           length = len(val1)
00187         buff.write(struct.pack('<I%ss'%length, length, val1))
00188       length = len(self.robot_state.multi_dof_joint_state.child_frame_ids)
00189       buff.write(_struct_I.pack(length))
00190       for val1 in self.robot_state.multi_dof_joint_state.child_frame_ids:
00191         length = len(val1)
00192         if python3 or type(val1) == unicode:
00193           val1 = val1.encode('utf-8')
00194           length = len(val1)
00195         buff.write(struct.pack('<I%ss'%length, length, val1))
00196       length = len(self.robot_state.multi_dof_joint_state.poses)
00197       buff.write(_struct_I.pack(length))
00198       for val1 in self.robot_state.multi_dof_joint_state.poses:
00199         _v1 = val1.position
00200         _x = _v1
00201         buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00202         _v2 = val1.orientation
00203         _x = _v2
00204         buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00205     except struct.error as se: self._check_types(se)
00206     except TypeError as te: self._check_types(te)
00207 
00208   def deserialize(self, str):
00209     """
00210     unpack serialized message in str into this message instance
00211     :param str: byte array of serialized message, ``str``
00212     """
00213     try:
00214       if self.robot_state is None:
00215         self.robot_state = arm_navigation_msgs.msg.RobotState()
00216       end = 0
00217       _x = self
00218       start = end
00219       end += 12
00220       (_x.robot_state.joint_state.header.seq, _x.robot_state.joint_state.header.stamp.secs, _x.robot_state.joint_state.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00221       start = end
00222       end += 4
00223       (length,) = _struct_I.unpack(str[start:end])
00224       start = end
00225       end += length
00226       if python3:
00227         self.robot_state.joint_state.header.frame_id = str[start:end].decode('utf-8')
00228       else:
00229         self.robot_state.joint_state.header.frame_id = str[start:end]
00230       start = end
00231       end += 4
00232       (length,) = _struct_I.unpack(str[start:end])
00233       self.robot_state.joint_state.name = []
00234       for i in range(0, length):
00235         start = end
00236         end += 4
00237         (length,) = _struct_I.unpack(str[start:end])
00238         start = end
00239         end += length
00240         if python3:
00241           val1 = str[start:end].decode('utf-8')
00242         else:
00243           val1 = str[start:end]
00244         self.robot_state.joint_state.name.append(val1)
00245       start = end
00246       end += 4
00247       (length,) = _struct_I.unpack(str[start:end])
00248       pattern = '<%sd'%length
00249       start = end
00250       end += struct.calcsize(pattern)
00251       self.robot_state.joint_state.position = struct.unpack(pattern, str[start:end])
00252       start = end
00253       end += 4
00254       (length,) = _struct_I.unpack(str[start:end])
00255       pattern = '<%sd'%length
00256       start = end
00257       end += struct.calcsize(pattern)
00258       self.robot_state.joint_state.velocity = struct.unpack(pattern, str[start:end])
00259       start = end
00260       end += 4
00261       (length,) = _struct_I.unpack(str[start:end])
00262       pattern = '<%sd'%length
00263       start = end
00264       end += struct.calcsize(pattern)
00265       self.robot_state.joint_state.effort = struct.unpack(pattern, str[start:end])
00266       _x = self
00267       start = end
00268       end += 8
00269       (_x.robot_state.multi_dof_joint_state.stamp.secs, _x.robot_state.multi_dof_joint_state.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00270       start = end
00271       end += 4
00272       (length,) = _struct_I.unpack(str[start:end])
00273       self.robot_state.multi_dof_joint_state.joint_names = []
00274       for i in range(0, length):
00275         start = end
00276         end += 4
00277         (length,) = _struct_I.unpack(str[start:end])
00278         start = end
00279         end += length
00280         if python3:
00281           val1 = str[start:end].decode('utf-8')
00282         else:
00283           val1 = str[start:end]
00284         self.robot_state.multi_dof_joint_state.joint_names.append(val1)
00285       start = end
00286       end += 4
00287       (length,) = _struct_I.unpack(str[start:end])
00288       self.robot_state.multi_dof_joint_state.frame_ids = []
00289       for i in range(0, length):
00290         start = end
00291         end += 4
00292         (length,) = _struct_I.unpack(str[start:end])
00293         start = end
00294         end += length
00295         if python3:
00296           val1 = str[start:end].decode('utf-8')
00297         else:
00298           val1 = str[start:end]
00299         self.robot_state.multi_dof_joint_state.frame_ids.append(val1)
00300       start = end
00301       end += 4
00302       (length,) = _struct_I.unpack(str[start:end])
00303       self.robot_state.multi_dof_joint_state.child_frame_ids = []
00304       for i in range(0, length):
00305         start = end
00306         end += 4
00307         (length,) = _struct_I.unpack(str[start:end])
00308         start = end
00309         end += length
00310         if python3:
00311           val1 = str[start:end].decode('utf-8')
00312         else:
00313           val1 = str[start:end]
00314         self.robot_state.multi_dof_joint_state.child_frame_ids.append(val1)
00315       start = end
00316       end += 4
00317       (length,) = _struct_I.unpack(str[start:end])
00318       self.robot_state.multi_dof_joint_state.poses = []
00319       for i in range(0, length):
00320         val1 = geometry_msgs.msg.Pose()
00321         _v3 = val1.position
00322         _x = _v3
00323         start = end
00324         end += 24
00325         (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00326         _v4 = val1.orientation
00327         _x = _v4
00328         start = end
00329         end += 32
00330         (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
00331         self.robot_state.multi_dof_joint_state.poses.append(val1)
00332       return self
00333     except struct.error as e:
00334       raise genpy.DeserializationError(e) #most likely buffer underfill
00335 
00336 
00337   def serialize_numpy(self, buff, numpy):
00338     """
00339     serialize message with numpy array types into buffer
00340     :param buff: buffer, ``StringIO``
00341     :param numpy: numpy python module
00342     """
00343     try:
00344       _x = self
00345       buff.write(_struct_3I.pack(_x.robot_state.joint_state.header.seq, _x.robot_state.joint_state.header.stamp.secs, _x.robot_state.joint_state.header.stamp.nsecs))
00346       _x = self.robot_state.joint_state.header.frame_id
00347       length = len(_x)
00348       if python3 or type(_x) == unicode:
00349         _x = _x.encode('utf-8')
00350         length = len(_x)
00351       buff.write(struct.pack('<I%ss'%length, length, _x))
00352       length = len(self.robot_state.joint_state.name)
00353       buff.write(_struct_I.pack(length))
00354       for val1 in self.robot_state.joint_state.name:
00355         length = len(val1)
00356         if python3 or type(val1) == unicode:
00357           val1 = val1.encode('utf-8')
00358           length = len(val1)
00359         buff.write(struct.pack('<I%ss'%length, length, val1))
00360       length = len(self.robot_state.joint_state.position)
00361       buff.write(_struct_I.pack(length))
00362       pattern = '<%sd'%length
00363       buff.write(self.robot_state.joint_state.position.tostring())
00364       length = len(self.robot_state.joint_state.velocity)
00365       buff.write(_struct_I.pack(length))
00366       pattern = '<%sd'%length
00367       buff.write(self.robot_state.joint_state.velocity.tostring())
00368       length = len(self.robot_state.joint_state.effort)
00369       buff.write(_struct_I.pack(length))
00370       pattern = '<%sd'%length
00371       buff.write(self.robot_state.joint_state.effort.tostring())
00372       _x = self
00373       buff.write(_struct_2I.pack(_x.robot_state.multi_dof_joint_state.stamp.secs, _x.robot_state.multi_dof_joint_state.stamp.nsecs))
00374       length = len(self.robot_state.multi_dof_joint_state.joint_names)
00375       buff.write(_struct_I.pack(length))
00376       for val1 in self.robot_state.multi_dof_joint_state.joint_names:
00377         length = len(val1)
00378         if python3 or type(val1) == unicode:
00379           val1 = val1.encode('utf-8')
00380           length = len(val1)
00381         buff.write(struct.pack('<I%ss'%length, length, val1))
00382       length = len(self.robot_state.multi_dof_joint_state.frame_ids)
00383       buff.write(_struct_I.pack(length))
00384       for val1 in self.robot_state.multi_dof_joint_state.frame_ids:
00385         length = len(val1)
00386         if python3 or type(val1) == unicode:
00387           val1 = val1.encode('utf-8')
00388           length = len(val1)
00389         buff.write(struct.pack('<I%ss'%length, length, val1))
00390       length = len(self.robot_state.multi_dof_joint_state.child_frame_ids)
00391       buff.write(_struct_I.pack(length))
00392       for val1 in self.robot_state.multi_dof_joint_state.child_frame_ids:
00393         length = len(val1)
00394         if python3 or type(val1) == unicode:
00395           val1 = val1.encode('utf-8')
00396           length = len(val1)
00397         buff.write(struct.pack('<I%ss'%length, length, val1))
00398       length = len(self.robot_state.multi_dof_joint_state.poses)
00399       buff.write(_struct_I.pack(length))
00400       for val1 in self.robot_state.multi_dof_joint_state.poses:
00401         _v5 = val1.position
00402         _x = _v5
00403         buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00404         _v6 = val1.orientation
00405         _x = _v6
00406         buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00407     except struct.error as se: self._check_types(se)
00408     except TypeError as te: self._check_types(te)
00409 
00410   def deserialize_numpy(self, str, numpy):
00411     """
00412     unpack serialized message in str into this message instance using numpy for array types
00413     :param str: byte array of serialized message, ``str``
00414     :param numpy: numpy python module
00415     """
00416     try:
00417       if self.robot_state is None:
00418         self.robot_state = arm_navigation_msgs.msg.RobotState()
00419       end = 0
00420       _x = self
00421       start = end
00422       end += 12
00423       (_x.robot_state.joint_state.header.seq, _x.robot_state.joint_state.header.stamp.secs, _x.robot_state.joint_state.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00424       start = end
00425       end += 4
00426       (length,) = _struct_I.unpack(str[start:end])
00427       start = end
00428       end += length
00429       if python3:
00430         self.robot_state.joint_state.header.frame_id = str[start:end].decode('utf-8')
00431       else:
00432         self.robot_state.joint_state.header.frame_id = str[start:end]
00433       start = end
00434       end += 4
00435       (length,) = _struct_I.unpack(str[start:end])
00436       self.robot_state.joint_state.name = []
00437       for i in range(0, length):
00438         start = end
00439         end += 4
00440         (length,) = _struct_I.unpack(str[start:end])
00441         start = end
00442         end += length
00443         if python3:
00444           val1 = str[start:end].decode('utf-8')
00445         else:
00446           val1 = str[start:end]
00447         self.robot_state.joint_state.name.append(val1)
00448       start = end
00449       end += 4
00450       (length,) = _struct_I.unpack(str[start:end])
00451       pattern = '<%sd'%length
00452       start = end
00453       end += struct.calcsize(pattern)
00454       self.robot_state.joint_state.position = numpy.frombuffer(str[start:end], dtype=numpy.float64, count=length)
00455       start = end
00456       end += 4
00457       (length,) = _struct_I.unpack(str[start:end])
00458       pattern = '<%sd'%length
00459       start = end
00460       end += struct.calcsize(pattern)
00461       self.robot_state.joint_state.velocity = numpy.frombuffer(str[start:end], dtype=numpy.float64, count=length)
00462       start = end
00463       end += 4
00464       (length,) = _struct_I.unpack(str[start:end])
00465       pattern = '<%sd'%length
00466       start = end
00467       end += struct.calcsize(pattern)
00468       self.robot_state.joint_state.effort = numpy.frombuffer(str[start:end], dtype=numpy.float64, count=length)
00469       _x = self
00470       start = end
00471       end += 8
00472       (_x.robot_state.multi_dof_joint_state.stamp.secs, _x.robot_state.multi_dof_joint_state.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00473       start = end
00474       end += 4
00475       (length,) = _struct_I.unpack(str[start:end])
00476       self.robot_state.multi_dof_joint_state.joint_names = []
00477       for i in range(0, length):
00478         start = end
00479         end += 4
00480         (length,) = _struct_I.unpack(str[start:end])
00481         start = end
00482         end += length
00483         if python3:
00484           val1 = str[start:end].decode('utf-8')
00485         else:
00486           val1 = str[start:end]
00487         self.robot_state.multi_dof_joint_state.joint_names.append(val1)
00488       start = end
00489       end += 4
00490       (length,) = _struct_I.unpack(str[start:end])
00491       self.robot_state.multi_dof_joint_state.frame_ids = []
00492       for i in range(0, length):
00493         start = end
00494         end += 4
00495         (length,) = _struct_I.unpack(str[start:end])
00496         start = end
00497         end += length
00498         if python3:
00499           val1 = str[start:end].decode('utf-8')
00500         else:
00501           val1 = str[start:end]
00502         self.robot_state.multi_dof_joint_state.frame_ids.append(val1)
00503       start = end
00504       end += 4
00505       (length,) = _struct_I.unpack(str[start:end])
00506       self.robot_state.multi_dof_joint_state.child_frame_ids = []
00507       for i in range(0, length):
00508         start = end
00509         end += 4
00510         (length,) = _struct_I.unpack(str[start:end])
00511         start = end
00512         end += length
00513         if python3:
00514           val1 = str[start:end].decode('utf-8')
00515         else:
00516           val1 = str[start:end]
00517         self.robot_state.multi_dof_joint_state.child_frame_ids.append(val1)
00518       start = end
00519       end += 4
00520       (length,) = _struct_I.unpack(str[start:end])
00521       self.robot_state.multi_dof_joint_state.poses = []
00522       for i in range(0, length):
00523         val1 = geometry_msgs.msg.Pose()
00524         _v7 = val1.position
00525         _x = _v7
00526         start = end
00527         end += 24
00528         (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00529         _v8 = val1.orientation
00530         _x = _v8
00531         start = end
00532         end += 32
00533         (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
00534         self.robot_state.multi_dof_joint_state.poses.append(val1)
00535       return self
00536     except struct.error as e:
00537       raise genpy.DeserializationError(e) #most likely buffer underfill
00538 
00539 _struct_I = genpy.struct_I
00540 _struct_4d = struct.Struct("<4d")
00541 _struct_3I = struct.Struct("<3I")
00542 _struct_2I = struct.Struct("<2I")
00543 _struct_3d = struct.Struct("<3d")
00544 """autogenerated by genpy from collision_proximity_planner/GetFreePathResponse.msg. Do not edit."""
00545 import sys
00546 python3 = True if sys.hexversion > 0x03000000 else False
00547 import genpy
00548 import struct
00549 
00550 import arm_navigation_msgs.msg
00551 import trajectory_msgs.msg
00552 import geometry_msgs.msg
00553 import genpy
00554 import std_msgs.msg
00555 
00556 class GetFreePathResponse(genpy.Message):
00557   _md5sum = "6366bd72f32fa5d9429f90aac9082227"
00558   _type = "collision_proximity_planner/GetFreePathResponse"
00559   _has_header = False #flag to mark the presence of a Header object
00560   _full_text = """arm_navigation_msgs/RobotTrajectory robot_trajectory
00561 
00562 
00563 ================================================================================
00564 MSG: arm_navigation_msgs/RobotTrajectory
00565 trajectory_msgs/JointTrajectory joint_trajectory
00566 arm_navigation_msgs/MultiDOFJointTrajectory multi_dof_joint_trajectory
00567 
00568 ================================================================================
00569 MSG: trajectory_msgs/JointTrajectory
00570 Header header
00571 string[] joint_names
00572 JointTrajectoryPoint[] points
00573 ================================================================================
00574 MSG: std_msgs/Header
00575 # Standard metadata for higher-level stamped data types.
00576 # This is generally used to communicate timestamped data 
00577 # in a particular coordinate frame.
00578 # 
00579 # sequence ID: consecutively increasing ID 
00580 uint32 seq
00581 #Two-integer timestamp that is expressed as:
00582 # * stamp.secs: seconds (stamp_secs) since epoch
00583 # * stamp.nsecs: nanoseconds since stamp_secs
00584 # time-handling sugar is provided by the client library
00585 time stamp
00586 #Frame this data is associated with
00587 # 0: no frame
00588 # 1: global frame
00589 string frame_id
00590 
00591 ================================================================================
00592 MSG: trajectory_msgs/JointTrajectoryPoint
00593 float64[] positions
00594 float64[] velocities
00595 float64[] accelerations
00596 duration time_from_start
00597 ================================================================================
00598 MSG: arm_navigation_msgs/MultiDOFJointTrajectory
00599 #A representation of a multi-dof joint trajectory
00600 duration stamp
00601 string[] joint_names
00602 string[] frame_ids
00603 string[] child_frame_ids
00604 MultiDOFJointTrajectoryPoint[] points
00605 
00606 ================================================================================
00607 MSG: arm_navigation_msgs/MultiDOFJointTrajectoryPoint
00608 geometry_msgs/Pose[] poses
00609 duration time_from_start
00610 ================================================================================
00611 MSG: geometry_msgs/Pose
00612 # A representation of pose in free space, composed of postion and orientation. 
00613 Point position
00614 Quaternion orientation
00615 
00616 ================================================================================
00617 MSG: geometry_msgs/Point
00618 # This contains the position of a point in free space
00619 float64 x
00620 float64 y
00621 float64 z
00622 
00623 ================================================================================
00624 MSG: geometry_msgs/Quaternion
00625 # This represents an orientation in free space in quaternion form.
00626 
00627 float64 x
00628 float64 y
00629 float64 z
00630 float64 w
00631 
00632 """
00633   __slots__ = ['robot_trajectory']
00634   _slot_types = ['arm_navigation_msgs/RobotTrajectory']
00635 
00636   def __init__(self, *args, **kwds):
00637     """
00638     Constructor. Any message fields that are implicitly/explicitly
00639     set to None will be assigned a default value. The recommend
00640     use is keyword arguments as this is more robust to future message
00641     changes.  You cannot mix in-order arguments and keyword arguments.
00642 
00643     The available fields are:
00644        robot_trajectory
00645 
00646     :param args: complete set of field values, in .msg order
00647     :param kwds: use keyword arguments corresponding to message field names
00648     to set specific fields.
00649     """
00650     if args or kwds:
00651       super(GetFreePathResponse, self).__init__(*args, **kwds)
00652       #message fields cannot be None, assign default values for those that are
00653       if self.robot_trajectory is None:
00654         self.robot_trajectory = arm_navigation_msgs.msg.RobotTrajectory()
00655     else:
00656       self.robot_trajectory = arm_navigation_msgs.msg.RobotTrajectory()
00657 
00658   def _get_types(self):
00659     """
00660     internal API method
00661     """
00662     return self._slot_types
00663 
00664   def serialize(self, buff):
00665     """
00666     serialize message into buffer
00667     :param buff: buffer, ``StringIO``
00668     """
00669     try:
00670       _x = self
00671       buff.write(_struct_3I.pack(_x.robot_trajectory.joint_trajectory.header.seq, _x.robot_trajectory.joint_trajectory.header.stamp.secs, _x.robot_trajectory.joint_trajectory.header.stamp.nsecs))
00672       _x = self.robot_trajectory.joint_trajectory.header.frame_id
00673       length = len(_x)
00674       if python3 or type(_x) == unicode:
00675         _x = _x.encode('utf-8')
00676         length = len(_x)
00677       buff.write(struct.pack('<I%ss'%length, length, _x))
00678       length = len(self.robot_trajectory.joint_trajectory.joint_names)
00679       buff.write(_struct_I.pack(length))
00680       for val1 in self.robot_trajectory.joint_trajectory.joint_names:
00681         length = len(val1)
00682         if python3 or type(val1) == unicode:
00683           val1 = val1.encode('utf-8')
00684           length = len(val1)
00685         buff.write(struct.pack('<I%ss'%length, length, val1))
00686       length = len(self.robot_trajectory.joint_trajectory.points)
00687       buff.write(_struct_I.pack(length))
00688       for val1 in self.robot_trajectory.joint_trajectory.points:
00689         length = len(val1.positions)
00690         buff.write(_struct_I.pack(length))
00691         pattern = '<%sd'%length
00692         buff.write(struct.pack(pattern, *val1.positions))
00693         length = len(val1.velocities)
00694         buff.write(_struct_I.pack(length))
00695         pattern = '<%sd'%length
00696         buff.write(struct.pack(pattern, *val1.velocities))
00697         length = len(val1.accelerations)
00698         buff.write(_struct_I.pack(length))
00699         pattern = '<%sd'%length
00700         buff.write(struct.pack(pattern, *val1.accelerations))
00701         _v9 = val1.time_from_start
00702         _x = _v9
00703         buff.write(_struct_2i.pack(_x.secs, _x.nsecs))
00704       _x = self
00705       buff.write(_struct_2i.pack(_x.robot_trajectory.multi_dof_joint_trajectory.stamp.secs, _x.robot_trajectory.multi_dof_joint_trajectory.stamp.nsecs))
00706       length = len(self.robot_trajectory.multi_dof_joint_trajectory.joint_names)
00707       buff.write(_struct_I.pack(length))
00708       for val1 in self.robot_trajectory.multi_dof_joint_trajectory.joint_names:
00709         length = len(val1)
00710         if python3 or type(val1) == unicode:
00711           val1 = val1.encode('utf-8')
00712           length = len(val1)
00713         buff.write(struct.pack('<I%ss'%length, length, val1))
00714       length = len(self.robot_trajectory.multi_dof_joint_trajectory.frame_ids)
00715       buff.write(_struct_I.pack(length))
00716       for val1 in self.robot_trajectory.multi_dof_joint_trajectory.frame_ids:
00717         length = len(val1)
00718         if python3 or type(val1) == unicode:
00719           val1 = val1.encode('utf-8')
00720           length = len(val1)
00721         buff.write(struct.pack('<I%ss'%length, length, val1))
00722       length = len(self.robot_trajectory.multi_dof_joint_trajectory.child_frame_ids)
00723       buff.write(_struct_I.pack(length))
00724       for val1 in self.robot_trajectory.multi_dof_joint_trajectory.child_frame_ids:
00725         length = len(val1)
00726         if python3 or type(val1) == unicode:
00727           val1 = val1.encode('utf-8')
00728           length = len(val1)
00729         buff.write(struct.pack('<I%ss'%length, length, val1))
00730       length = len(self.robot_trajectory.multi_dof_joint_trajectory.points)
00731       buff.write(_struct_I.pack(length))
00732       for val1 in self.robot_trajectory.multi_dof_joint_trajectory.points:
00733         length = len(val1.poses)
00734         buff.write(_struct_I.pack(length))
00735         for val2 in val1.poses:
00736           _v10 = val2.position
00737           _x = _v10
00738           buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00739           _v11 = val2.orientation
00740           _x = _v11
00741           buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00742         _v12 = val1.time_from_start
00743         _x = _v12
00744         buff.write(_struct_2i.pack(_x.secs, _x.nsecs))
00745     except struct.error as se: self._check_types(se)
00746     except TypeError as te: self._check_types(te)
00747 
00748   def deserialize(self, str):
00749     """
00750     unpack serialized message in str into this message instance
00751     :param str: byte array of serialized message, ``str``
00752     """
00753     try:
00754       if self.robot_trajectory is None:
00755         self.robot_trajectory = arm_navigation_msgs.msg.RobotTrajectory()
00756       end = 0
00757       _x = self
00758       start = end
00759       end += 12
00760       (_x.robot_trajectory.joint_trajectory.header.seq, _x.robot_trajectory.joint_trajectory.header.stamp.secs, _x.robot_trajectory.joint_trajectory.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00761       start = end
00762       end += 4
00763       (length,) = _struct_I.unpack(str[start:end])
00764       start = end
00765       end += length
00766       if python3:
00767         self.robot_trajectory.joint_trajectory.header.frame_id = str[start:end].decode('utf-8')
00768       else:
00769         self.robot_trajectory.joint_trajectory.header.frame_id = str[start:end]
00770       start = end
00771       end += 4
00772       (length,) = _struct_I.unpack(str[start:end])
00773       self.robot_trajectory.joint_trajectory.joint_names = []
00774       for i in range(0, length):
00775         start = end
00776         end += 4
00777         (length,) = _struct_I.unpack(str[start:end])
00778         start = end
00779         end += length
00780         if python3:
00781           val1 = str[start:end].decode('utf-8')
00782         else:
00783           val1 = str[start:end]
00784         self.robot_trajectory.joint_trajectory.joint_names.append(val1)
00785       start = end
00786       end += 4
00787       (length,) = _struct_I.unpack(str[start:end])
00788       self.robot_trajectory.joint_trajectory.points = []
00789       for i in range(0, length):
00790         val1 = trajectory_msgs.msg.JointTrajectoryPoint()
00791         start = end
00792         end += 4
00793         (length,) = _struct_I.unpack(str[start:end])
00794         pattern = '<%sd'%length
00795         start = end
00796         end += struct.calcsize(pattern)
00797         val1.positions = struct.unpack(pattern, str[start:end])
00798         start = end
00799         end += 4
00800         (length,) = _struct_I.unpack(str[start:end])
00801         pattern = '<%sd'%length
00802         start = end
00803         end += struct.calcsize(pattern)
00804         val1.velocities = struct.unpack(pattern, str[start:end])
00805         start = end
00806         end += 4
00807         (length,) = _struct_I.unpack(str[start:end])
00808         pattern = '<%sd'%length
00809         start = end
00810         end += struct.calcsize(pattern)
00811         val1.accelerations = struct.unpack(pattern, str[start:end])
00812         _v13 = val1.time_from_start
00813         _x = _v13
00814         start = end
00815         end += 8
00816         (_x.secs, _x.nsecs,) = _struct_2i.unpack(str[start:end])
00817         self.robot_trajectory.joint_trajectory.points.append(val1)
00818       _x = self
00819       start = end
00820       end += 8
00821       (_x.robot_trajectory.multi_dof_joint_trajectory.stamp.secs, _x.robot_trajectory.multi_dof_joint_trajectory.stamp.nsecs,) = _struct_2i.unpack(str[start:end])
00822       start = end
00823       end += 4
00824       (length,) = _struct_I.unpack(str[start:end])
00825       self.robot_trajectory.multi_dof_joint_trajectory.joint_names = []
00826       for i in range(0, length):
00827         start = end
00828         end += 4
00829         (length,) = _struct_I.unpack(str[start:end])
00830         start = end
00831         end += length
00832         if python3:
00833           val1 = str[start:end].decode('utf-8')
00834         else:
00835           val1 = str[start:end]
00836         self.robot_trajectory.multi_dof_joint_trajectory.joint_names.append(val1)
00837       start = end
00838       end += 4
00839       (length,) = _struct_I.unpack(str[start:end])
00840       self.robot_trajectory.multi_dof_joint_trajectory.frame_ids = []
00841       for i in range(0, length):
00842         start = end
00843         end += 4
00844         (length,) = _struct_I.unpack(str[start:end])
00845         start = end
00846         end += length
00847         if python3:
00848           val1 = str[start:end].decode('utf-8')
00849         else:
00850           val1 = str[start:end]
00851         self.robot_trajectory.multi_dof_joint_trajectory.frame_ids.append(val1)
00852       start = end
00853       end += 4
00854       (length,) = _struct_I.unpack(str[start:end])
00855       self.robot_trajectory.multi_dof_joint_trajectory.child_frame_ids = []
00856       for i in range(0, length):
00857         start = end
00858         end += 4
00859         (length,) = _struct_I.unpack(str[start:end])
00860         start = end
00861         end += length
00862         if python3:
00863           val1 = str[start:end].decode('utf-8')
00864         else:
00865           val1 = str[start:end]
00866         self.robot_trajectory.multi_dof_joint_trajectory.child_frame_ids.append(val1)
00867       start = end
00868       end += 4
00869       (length,) = _struct_I.unpack(str[start:end])
00870       self.robot_trajectory.multi_dof_joint_trajectory.points = []
00871       for i in range(0, length):
00872         val1 = arm_navigation_msgs.msg.MultiDOFJointTrajectoryPoint()
00873         start = end
00874         end += 4
00875         (length,) = _struct_I.unpack(str[start:end])
00876         val1.poses = []
00877         for i in range(0, length):
00878           val2 = geometry_msgs.msg.Pose()
00879           _v14 = val2.position
00880           _x = _v14
00881           start = end
00882           end += 24
00883           (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00884           _v15 = val2.orientation
00885           _x = _v15
00886           start = end
00887           end += 32
00888           (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
00889           val1.poses.append(val2)
00890         _v16 = val1.time_from_start
00891         _x = _v16
00892         start = end
00893         end += 8
00894         (_x.secs, _x.nsecs,) = _struct_2i.unpack(str[start:end])
00895         self.robot_trajectory.multi_dof_joint_trajectory.points.append(val1)
00896       return self
00897     except struct.error as e:
00898       raise genpy.DeserializationError(e) #most likely buffer underfill
00899 
00900 
00901   def serialize_numpy(self, buff, numpy):
00902     """
00903     serialize message with numpy array types into buffer
00904     :param buff: buffer, ``StringIO``
00905     :param numpy: numpy python module
00906     """
00907     try:
00908       _x = self
00909       buff.write(_struct_3I.pack(_x.robot_trajectory.joint_trajectory.header.seq, _x.robot_trajectory.joint_trajectory.header.stamp.secs, _x.robot_trajectory.joint_trajectory.header.stamp.nsecs))
00910       _x = self.robot_trajectory.joint_trajectory.header.frame_id
00911       length = len(_x)
00912       if python3 or type(_x) == unicode:
00913         _x = _x.encode('utf-8')
00914         length = len(_x)
00915       buff.write(struct.pack('<I%ss'%length, length, _x))
00916       length = len(self.robot_trajectory.joint_trajectory.joint_names)
00917       buff.write(_struct_I.pack(length))
00918       for val1 in self.robot_trajectory.joint_trajectory.joint_names:
00919         length = len(val1)
00920         if python3 or type(val1) == unicode:
00921           val1 = val1.encode('utf-8')
00922           length = len(val1)
00923         buff.write(struct.pack('<I%ss'%length, length, val1))
00924       length = len(self.robot_trajectory.joint_trajectory.points)
00925       buff.write(_struct_I.pack(length))
00926       for val1 in self.robot_trajectory.joint_trajectory.points:
00927         length = len(val1.positions)
00928         buff.write(_struct_I.pack(length))
00929         pattern = '<%sd'%length
00930         buff.write(val1.positions.tostring())
00931         length = len(val1.velocities)
00932         buff.write(_struct_I.pack(length))
00933         pattern = '<%sd'%length
00934         buff.write(val1.velocities.tostring())
00935         length = len(val1.accelerations)
00936         buff.write(_struct_I.pack(length))
00937         pattern = '<%sd'%length
00938         buff.write(val1.accelerations.tostring())
00939         _v17 = val1.time_from_start
00940         _x = _v17
00941         buff.write(_struct_2i.pack(_x.secs, _x.nsecs))
00942       _x = self
00943       buff.write(_struct_2i.pack(_x.robot_trajectory.multi_dof_joint_trajectory.stamp.secs, _x.robot_trajectory.multi_dof_joint_trajectory.stamp.nsecs))
00944       length = len(self.robot_trajectory.multi_dof_joint_trajectory.joint_names)
00945       buff.write(_struct_I.pack(length))
00946       for val1 in self.robot_trajectory.multi_dof_joint_trajectory.joint_names:
00947         length = len(val1)
00948         if python3 or type(val1) == unicode:
00949           val1 = val1.encode('utf-8')
00950           length = len(val1)
00951         buff.write(struct.pack('<I%ss'%length, length, val1))
00952       length = len(self.robot_trajectory.multi_dof_joint_trajectory.frame_ids)
00953       buff.write(_struct_I.pack(length))
00954       for val1 in self.robot_trajectory.multi_dof_joint_trajectory.frame_ids:
00955         length = len(val1)
00956         if python3 or type(val1) == unicode:
00957           val1 = val1.encode('utf-8')
00958           length = len(val1)
00959         buff.write(struct.pack('<I%ss'%length, length, val1))
00960       length = len(self.robot_trajectory.multi_dof_joint_trajectory.child_frame_ids)
00961       buff.write(_struct_I.pack(length))
00962       for val1 in self.robot_trajectory.multi_dof_joint_trajectory.child_frame_ids:
00963         length = len(val1)
00964         if python3 or type(val1) == unicode:
00965           val1 = val1.encode('utf-8')
00966           length = len(val1)
00967         buff.write(struct.pack('<I%ss'%length, length, val1))
00968       length = len(self.robot_trajectory.multi_dof_joint_trajectory.points)
00969       buff.write(_struct_I.pack(length))
00970       for val1 in self.robot_trajectory.multi_dof_joint_trajectory.points:
00971         length = len(val1.poses)
00972         buff.write(_struct_I.pack(length))
00973         for val2 in val1.poses:
00974           _v18 = val2.position
00975           _x = _v18
00976           buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00977           _v19 = val2.orientation
00978           _x = _v19
00979           buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00980         _v20 = val1.time_from_start
00981         _x = _v20
00982         buff.write(_struct_2i.pack(_x.secs, _x.nsecs))
00983     except struct.error as se: self._check_types(se)
00984     except TypeError as te: self._check_types(te)
00985 
00986   def deserialize_numpy(self, str, numpy):
00987     """
00988     unpack serialized message in str into this message instance using numpy for array types
00989     :param str: byte array of serialized message, ``str``
00990     :param numpy: numpy python module
00991     """
00992     try:
00993       if self.robot_trajectory is None:
00994         self.robot_trajectory = arm_navigation_msgs.msg.RobotTrajectory()
00995       end = 0
00996       _x = self
00997       start = end
00998       end += 12
00999       (_x.robot_trajectory.joint_trajectory.header.seq, _x.robot_trajectory.joint_trajectory.header.stamp.secs, _x.robot_trajectory.joint_trajectory.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
01000       start = end
01001       end += 4
01002       (length,) = _struct_I.unpack(str[start:end])
01003       start = end
01004       end += length
01005       if python3:
01006         self.robot_trajectory.joint_trajectory.header.frame_id = str[start:end].decode('utf-8')
01007       else:
01008         self.robot_trajectory.joint_trajectory.header.frame_id = str[start:end]
01009       start = end
01010       end += 4
01011       (length,) = _struct_I.unpack(str[start:end])
01012       self.robot_trajectory.joint_trajectory.joint_names = []
01013       for i in range(0, length):
01014         start = end
01015         end += 4
01016         (length,) = _struct_I.unpack(str[start:end])
01017         start = end
01018         end += length
01019         if python3:
01020           val1 = str[start:end].decode('utf-8')
01021         else:
01022           val1 = str[start:end]
01023         self.robot_trajectory.joint_trajectory.joint_names.append(val1)
01024       start = end
01025       end += 4
01026       (length,) = _struct_I.unpack(str[start:end])
01027       self.robot_trajectory.joint_trajectory.points = []
01028       for i in range(0, length):
01029         val1 = trajectory_msgs.msg.JointTrajectoryPoint()
01030         start = end
01031         end += 4
01032         (length,) = _struct_I.unpack(str[start:end])
01033         pattern = '<%sd'%length
01034         start = end
01035         end += struct.calcsize(pattern)
01036         val1.positions = numpy.frombuffer(str[start:end], dtype=numpy.float64, count=length)
01037         start = end
01038         end += 4
01039         (length,) = _struct_I.unpack(str[start:end])
01040         pattern = '<%sd'%length
01041         start = end
01042         end += struct.calcsize(pattern)
01043         val1.velocities = numpy.frombuffer(str[start:end], dtype=numpy.float64, count=length)
01044         start = end
01045         end += 4
01046         (length,) = _struct_I.unpack(str[start:end])
01047         pattern = '<%sd'%length
01048         start = end
01049         end += struct.calcsize(pattern)
01050         val1.accelerations = numpy.frombuffer(str[start:end], dtype=numpy.float64, count=length)
01051         _v21 = val1.time_from_start
01052         _x = _v21
01053         start = end
01054         end += 8
01055         (_x.secs, _x.nsecs,) = _struct_2i.unpack(str[start:end])
01056         self.robot_trajectory.joint_trajectory.points.append(val1)
01057       _x = self
01058       start = end
01059       end += 8
01060       (_x.robot_trajectory.multi_dof_joint_trajectory.stamp.secs, _x.robot_trajectory.multi_dof_joint_trajectory.stamp.nsecs,) = _struct_2i.unpack(str[start:end])
01061       start = end
01062       end += 4
01063       (length,) = _struct_I.unpack(str[start:end])
01064       self.robot_trajectory.multi_dof_joint_trajectory.joint_names = []
01065       for i in range(0, length):
01066         start = end
01067         end += 4
01068         (length,) = _struct_I.unpack(str[start:end])
01069         start = end
01070         end += length
01071         if python3:
01072           val1 = str[start:end].decode('utf-8')
01073         else:
01074           val1 = str[start:end]
01075         self.robot_trajectory.multi_dof_joint_trajectory.joint_names.append(val1)
01076       start = end
01077       end += 4
01078       (length,) = _struct_I.unpack(str[start:end])
01079       self.robot_trajectory.multi_dof_joint_trajectory.frame_ids = []
01080       for i in range(0, length):
01081         start = end
01082         end += 4
01083         (length,) = _struct_I.unpack(str[start:end])
01084         start = end
01085         end += length
01086         if python3:
01087           val1 = str[start:end].decode('utf-8')
01088         else:
01089           val1 = str[start:end]
01090         self.robot_trajectory.multi_dof_joint_trajectory.frame_ids.append(val1)
01091       start = end
01092       end += 4
01093       (length,) = _struct_I.unpack(str[start:end])
01094       self.robot_trajectory.multi_dof_joint_trajectory.child_frame_ids = []
01095       for i in range(0, length):
01096         start = end
01097         end += 4
01098         (length,) = _struct_I.unpack(str[start:end])
01099         start = end
01100         end += length
01101         if python3:
01102           val1 = str[start:end].decode('utf-8')
01103         else:
01104           val1 = str[start:end]
01105         self.robot_trajectory.multi_dof_joint_trajectory.child_frame_ids.append(val1)
01106       start = end
01107       end += 4
01108       (length,) = _struct_I.unpack(str[start:end])
01109       self.robot_trajectory.multi_dof_joint_trajectory.points = []
01110       for i in range(0, length):
01111         val1 = arm_navigation_msgs.msg.MultiDOFJointTrajectoryPoint()
01112         start = end
01113         end += 4
01114         (length,) = _struct_I.unpack(str[start:end])
01115         val1.poses = []
01116         for i in range(0, length):
01117           val2 = geometry_msgs.msg.Pose()
01118           _v22 = val2.position
01119           _x = _v22
01120           start = end
01121           end += 24
01122           (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
01123           _v23 = val2.orientation
01124           _x = _v23
01125           start = end
01126           end += 32
01127           (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
01128           val1.poses.append(val2)
01129         _v24 = val1.time_from_start
01130         _x = _v24
01131         start = end
01132         end += 8
01133         (_x.secs, _x.nsecs,) = _struct_2i.unpack(str[start:end])
01134         self.robot_trajectory.multi_dof_joint_trajectory.points.append(val1)
01135       return self
01136     except struct.error as e:
01137       raise genpy.DeserializationError(e) #most likely buffer underfill
01138 
01139 _struct_I = genpy.struct_I
01140 _struct_4d = struct.Struct("<4d")
01141 _struct_3I = struct.Struct("<3I")
01142 _struct_2i = struct.Struct("<2i")
01143 _struct_3d = struct.Struct("<3d")
01144 class GetFreePath(object):
01145   _type          = 'collision_proximity_planner/GetFreePath'
01146   _md5sum = 'e5d8e6731173ba0b633eb5320faf8538'
01147   _request_class  = GetFreePathRequest
01148   _response_class = GetFreePathResponse


collision_proximity_planner
Author(s): Sachin Chitta
autogenerated on Thu Dec 12 2013 11:09:37