$search
00001 """autogenerated by genmsg_py from ClipFootstepRequest.msg. Do not edit.""" 00002 import roslib.message 00003 import struct 00004 00005 import geometry_msgs.msg 00006 import humanoid_nav_msgs.msg 00007 00008 class ClipFootstepRequest(roslib.message.Message): 00009 _md5sum = "f22cfce442b381849d82602383b052c7" 00010 _type = "humanoid_nav_msgs/ClipFootstepRequest" 00011 _has_header = False #flag to mark the presence of a Header object 00012 _full_text = """StepTarget step 00013 00014 ================================================================================ 00015 MSG: humanoid_nav_msgs/StepTarget 00016 # Target for a single stepping motion of a humanoid's leg 00017 00018 geometry_msgs/Pose2D pose # step pose as relative offset to last leg 00019 uint8 leg # which leg to use (left/right, see below) 00020 00021 uint8 right=0 # right leg constant 00022 uint8 left=1 # left leg constant 00023 00024 ================================================================================ 00025 MSG: geometry_msgs/Pose2D 00026 # This expresses a position and orientation on a 2D manifold. 00027 00028 float64 x 00029 float64 y 00030 float64 theta 00031 """ 00032 __slots__ = ['step'] 00033 _slot_types = ['humanoid_nav_msgs/StepTarget'] 00034 00035 def __init__(self, *args, **kwds): 00036 """ 00037 Constructor. Any message fields that are implicitly/explicitly 00038 set to None will be assigned a default value. The recommend 00039 use is keyword arguments as this is more robust to future message 00040 changes. You cannot mix in-order arguments and keyword arguments. 00041 00042 The available fields are: 00043 step 00044 00045 @param args: complete set of field values, in .msg order 00046 @param kwds: use keyword arguments corresponding to message field names 00047 to set specific fields. 00048 """ 00049 if args or kwds: 00050 super(ClipFootstepRequest, self).__init__(*args, **kwds) 00051 #message fields cannot be None, assign default values for those that are 00052 if self.step is None: 00053 self.step = humanoid_nav_msgs.msg.StepTarget() 00054 else: 00055 self.step = humanoid_nav_msgs.msg.StepTarget() 00056 00057 def _get_types(self): 00058 """ 00059 internal API method 00060 """ 00061 return self._slot_types 00062 00063 def serialize(self, buff): 00064 """ 00065 serialize message into buffer 00066 @param buff: buffer 00067 @type buff: StringIO 00068 """ 00069 try: 00070 _x = self 00071 buff.write(_struct_3dB.pack(_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg)) 00072 except struct.error as se: self._check_types(se) 00073 except TypeError as te: self._check_types(te) 00074 00075 def deserialize(self, str): 00076 """ 00077 unpack serialized message in str into this message instance 00078 @param str: byte array of serialized message 00079 @type str: str 00080 """ 00081 try: 00082 if self.step is None: 00083 self.step = humanoid_nav_msgs.msg.StepTarget() 00084 end = 0 00085 _x = self 00086 start = end 00087 end += 25 00088 (_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg,) = _struct_3dB.unpack(str[start:end]) 00089 return self 00090 except struct.error as e: 00091 raise roslib.message.DeserializationError(e) #most likely buffer underfill 00092 00093 00094 def serialize_numpy(self, buff, numpy): 00095 """ 00096 serialize message with numpy array types into buffer 00097 @param buff: buffer 00098 @type buff: StringIO 00099 @param numpy: numpy python module 00100 @type numpy module 00101 """ 00102 try: 00103 _x = self 00104 buff.write(_struct_3dB.pack(_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg)) 00105 except struct.error as se: self._check_types(se) 00106 except TypeError as te: self._check_types(te) 00107 00108 def deserialize_numpy(self, str, numpy): 00109 """ 00110 unpack serialized message in str into this message instance using numpy for array types 00111 @param str: byte array of serialized message 00112 @type str: str 00113 @param numpy: numpy python module 00114 @type numpy: module 00115 """ 00116 try: 00117 if self.step is None: 00118 self.step = humanoid_nav_msgs.msg.StepTarget() 00119 end = 0 00120 _x = self 00121 start = end 00122 end += 25 00123 (_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg,) = _struct_3dB.unpack(str[start:end]) 00124 return self 00125 except struct.error as e: 00126 raise roslib.message.DeserializationError(e) #most likely buffer underfill 00127 00128 _struct_I = roslib.message.struct_I 00129 _struct_3dB = struct.Struct("<3dB") 00130 """autogenerated by genmsg_py from ClipFootstepResponse.msg. Do not edit.""" 00131 import roslib.message 00132 import struct 00133 00134 import geometry_msgs.msg 00135 import humanoid_nav_msgs.msg 00136 00137 class ClipFootstepResponse(roslib.message.Message): 00138 _md5sum = "f22cfce442b381849d82602383b052c7" 00139 _type = "humanoid_nav_msgs/ClipFootstepResponse" 00140 _has_header = False #flag to mark the presence of a Header object 00141 _full_text = """StepTarget step 00142 00143 00144 ================================================================================ 00145 MSG: humanoid_nav_msgs/StepTarget 00146 # Target for a single stepping motion of a humanoid's leg 00147 00148 geometry_msgs/Pose2D pose # step pose as relative offset to last leg 00149 uint8 leg # which leg to use (left/right, see below) 00150 00151 uint8 right=0 # right leg constant 00152 uint8 left=1 # left leg constant 00153 00154 ================================================================================ 00155 MSG: geometry_msgs/Pose2D 00156 # This expresses a position and orientation on a 2D manifold. 00157 00158 float64 x 00159 float64 y 00160 float64 theta 00161 """ 00162 __slots__ = ['step'] 00163 _slot_types = ['humanoid_nav_msgs/StepTarget'] 00164 00165 def __init__(self, *args, **kwds): 00166 """ 00167 Constructor. Any message fields that are implicitly/explicitly 00168 set to None will be assigned a default value. The recommend 00169 use is keyword arguments as this is more robust to future message 00170 changes. You cannot mix in-order arguments and keyword arguments. 00171 00172 The available fields are: 00173 step 00174 00175 @param args: complete set of field values, in .msg order 00176 @param kwds: use keyword arguments corresponding to message field names 00177 to set specific fields. 00178 """ 00179 if args or kwds: 00180 super(ClipFootstepResponse, self).__init__(*args, **kwds) 00181 #message fields cannot be None, assign default values for those that are 00182 if self.step is None: 00183 self.step = humanoid_nav_msgs.msg.StepTarget() 00184 else: 00185 self.step = humanoid_nav_msgs.msg.StepTarget() 00186 00187 def _get_types(self): 00188 """ 00189 internal API method 00190 """ 00191 return self._slot_types 00192 00193 def serialize(self, buff): 00194 """ 00195 serialize message into buffer 00196 @param buff: buffer 00197 @type buff: StringIO 00198 """ 00199 try: 00200 _x = self 00201 buff.write(_struct_3dB.pack(_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg)) 00202 except struct.error as se: self._check_types(se) 00203 except TypeError as te: self._check_types(te) 00204 00205 def deserialize(self, str): 00206 """ 00207 unpack serialized message in str into this message instance 00208 @param str: byte array of serialized message 00209 @type str: str 00210 """ 00211 try: 00212 if self.step is None: 00213 self.step = humanoid_nav_msgs.msg.StepTarget() 00214 end = 0 00215 _x = self 00216 start = end 00217 end += 25 00218 (_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg,) = _struct_3dB.unpack(str[start:end]) 00219 return self 00220 except struct.error as e: 00221 raise roslib.message.DeserializationError(e) #most likely buffer underfill 00222 00223 00224 def serialize_numpy(self, buff, numpy): 00225 """ 00226 serialize message with numpy array types into buffer 00227 @param buff: buffer 00228 @type buff: StringIO 00229 @param numpy: numpy python module 00230 @type numpy module 00231 """ 00232 try: 00233 _x = self 00234 buff.write(_struct_3dB.pack(_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg)) 00235 except struct.error as se: self._check_types(se) 00236 except TypeError as te: self._check_types(te) 00237 00238 def deserialize_numpy(self, str, numpy): 00239 """ 00240 unpack serialized message in str into this message instance using numpy for array types 00241 @param str: byte array of serialized message 00242 @type str: str 00243 @param numpy: numpy python module 00244 @type numpy: module 00245 """ 00246 try: 00247 if self.step is None: 00248 self.step = humanoid_nav_msgs.msg.StepTarget() 00249 end = 0 00250 _x = self 00251 start = end 00252 end += 25 00253 (_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg,) = _struct_3dB.unpack(str[start:end]) 00254 return self 00255 except struct.error as e: 00256 raise roslib.message.DeserializationError(e) #most likely buffer underfill 00257 00258 _struct_I = roslib.message.struct_I 00259 _struct_3dB = struct.Struct("<3dB") 00260 class ClipFootstep(roslib.message.ServiceDefinition): 00261 _type = 'humanoid_nav_msgs/ClipFootstep' 00262 _md5sum = '394ac576028f40af6569704f845b86a1' 00263 _request_class = ClipFootstepRequest 00264 _response_class = ClipFootstepResponse