$search
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-electric-humanoid_walk/doc_stacks/2013-03-01_15-40-38.607083/humanoid_walk/walk_msgs/srv/GetPath.srv */ 00002 #ifndef WALK_MSGS_SERVICE_GETPATH_H 00003 #define WALK_MSGS_SERVICE_GETPATH_H 00004 #include <string> 00005 #include <vector> 00006 #include <map> 00007 #include <ostream> 00008 #include "ros/serialization.h" 00009 #include "ros/builtin_message_traits.h" 00010 #include "ros/message_operations.h" 00011 #include "ros/time.h" 00012 00013 #include "ros/macros.h" 00014 00015 #include "ros/assert.h" 00016 00017 #include "ros/service_traits.h" 00018 00019 #include "geometry_msgs/Pose.h" 00020 #include "geometry_msgs/Pose.h" 00021 #include "geometry_msgs/Point.h" 00022 #include "geometry_msgs/Pose.h" 00023 #include "geometry_msgs/Pose.h" 00024 #include "geometry_msgs/Point.h" 00025 #include "walk_msgs/Footprint2d.h" 00026 00027 00028 #include "walk_msgs/WalkPath.h" 00029 00030 namespace walk_msgs 00031 { 00032 template <class ContainerAllocator> 00033 struct GetPathRequest_ { 00034 typedef GetPathRequest_<ContainerAllocator> Type; 00035 00036 GetPathRequest_() 00037 : initial_left_foot_position() 00038 , initial_right_foot_position() 00039 , initial_center_of_mass_position() 00040 , final_left_foot_position() 00041 , final_right_foot_position() 00042 , final_center_of_mass_position() 00043 , start_with_left_foot(false) 00044 , footprints() 00045 { 00046 } 00047 00048 GetPathRequest_(const ContainerAllocator& _alloc) 00049 : initial_left_foot_position(_alloc) 00050 , initial_right_foot_position(_alloc) 00051 , initial_center_of_mass_position(_alloc) 00052 , final_left_foot_position(_alloc) 00053 , final_right_foot_position(_alloc) 00054 , final_center_of_mass_position(_alloc) 00055 , start_with_left_foot(false) 00056 , footprints(_alloc) 00057 { 00058 } 00059 00060 typedef ::geometry_msgs::Pose_<ContainerAllocator> _initial_left_foot_position_type; 00061 ::geometry_msgs::Pose_<ContainerAllocator> initial_left_foot_position; 00062 00063 typedef ::geometry_msgs::Pose_<ContainerAllocator> _initial_right_foot_position_type; 00064 ::geometry_msgs::Pose_<ContainerAllocator> initial_right_foot_position; 00065 00066 typedef ::geometry_msgs::Point_<ContainerAllocator> _initial_center_of_mass_position_type; 00067 ::geometry_msgs::Point_<ContainerAllocator> initial_center_of_mass_position; 00068 00069 typedef ::geometry_msgs::Pose_<ContainerAllocator> _final_left_foot_position_type; 00070 ::geometry_msgs::Pose_<ContainerAllocator> final_left_foot_position; 00071 00072 typedef ::geometry_msgs::Pose_<ContainerAllocator> _final_right_foot_position_type; 00073 ::geometry_msgs::Pose_<ContainerAllocator> final_right_foot_position; 00074 00075 typedef ::geometry_msgs::Point_<ContainerAllocator> _final_center_of_mass_position_type; 00076 ::geometry_msgs::Point_<ContainerAllocator> final_center_of_mass_position; 00077 00078 typedef uint8_t _start_with_left_foot_type; 00079 uint8_t start_with_left_foot; 00080 00081 typedef std::vector< ::walk_msgs::Footprint2d_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::walk_msgs::Footprint2d_<ContainerAllocator> >::other > _footprints_type; 00082 std::vector< ::walk_msgs::Footprint2d_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::walk_msgs::Footprint2d_<ContainerAllocator> >::other > footprints; 00083 00084 00085 ROS_DEPRECATED uint32_t get_footprints_size() const { return (uint32_t)footprints.size(); } 00086 ROS_DEPRECATED void set_footprints_size(uint32_t size) { footprints.resize((size_t)size); } 00087 ROS_DEPRECATED void get_footprints_vec(std::vector< ::walk_msgs::Footprint2d_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::walk_msgs::Footprint2d_<ContainerAllocator> >::other > & vec) const { vec = this->footprints; } 00088 ROS_DEPRECATED void set_footprints_vec(const std::vector< ::walk_msgs::Footprint2d_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::walk_msgs::Footprint2d_<ContainerAllocator> >::other > & vec) { this->footprints = vec; } 00089 private: 00090 static const char* __s_getDataType_() { return "walk_msgs/GetPathRequest"; } 00091 public: 00092 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00093 00094 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00095 00096 private: 00097 static const char* __s_getMD5Sum_() { return "9325cbcfc330e3e7667ffad5cb6d4c50"; } 00098 public: 00099 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00100 00101 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00102 00103 private: 00104 static const char* __s_getServerMD5Sum_() { return "2b6fd7b841642a7520d3b2fd459370d2"; } 00105 public: 00106 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00107 00108 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00109 00110 private: 00111 static const char* __s_getMessageDefinition_() { return "geometry_msgs/Pose initial_left_foot_position\n\ 00112 geometry_msgs/Pose initial_right_foot_position\n\ 00113 geometry_msgs/Point initial_center_of_mass_position\n\ 00114 \n\ 00115 geometry_msgs/Pose final_left_foot_position\n\ 00116 geometry_msgs/Pose final_right_foot_position\n\ 00117 geometry_msgs/Point final_center_of_mass_position\n\ 00118 \n\ 00119 bool start_with_left_foot\n\ 00120 \n\ 00121 walk_msgs/Footprint2d[] footprints\n\ 00122 \n\ 00123 ================================================================================\n\ 00124 MSG: geometry_msgs/Pose\n\ 00125 # A representation of pose in free space, composed of postion and orientation. \n\ 00126 Point position\n\ 00127 Quaternion orientation\n\ 00128 \n\ 00129 ================================================================================\n\ 00130 MSG: geometry_msgs/Point\n\ 00131 # This contains the position of a point in free space\n\ 00132 float64 x\n\ 00133 float64 y\n\ 00134 float64 z\n\ 00135 \n\ 00136 ================================================================================\n\ 00137 MSG: geometry_msgs/Quaternion\n\ 00138 # This represents an orientation in free space in quaternion form.\n\ 00139 \n\ 00140 float64 x\n\ 00141 float64 y\n\ 00142 float64 z\n\ 00143 float64 w\n\ 00144 \n\ 00145 ================================================================================\n\ 00146 MSG: walk_msgs/Footprint2d\n\ 00147 time beginTime\n\ 00148 duration duration\n\ 00149 float64 x\n\ 00150 float64 y\n\ 00151 float64 theta\n\ 00152 \n\ 00153 "; } 00154 public: 00155 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00156 00157 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00158 00159 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00160 { 00161 ros::serialization::OStream stream(write_ptr, 1000000000); 00162 ros::serialization::serialize(stream, initial_left_foot_position); 00163 ros::serialization::serialize(stream, initial_right_foot_position); 00164 ros::serialization::serialize(stream, initial_center_of_mass_position); 00165 ros::serialization::serialize(stream, final_left_foot_position); 00166 ros::serialization::serialize(stream, final_right_foot_position); 00167 ros::serialization::serialize(stream, final_center_of_mass_position); 00168 ros::serialization::serialize(stream, start_with_left_foot); 00169 ros::serialization::serialize(stream, footprints); 00170 return stream.getData(); 00171 } 00172 00173 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00174 { 00175 ros::serialization::IStream stream(read_ptr, 1000000000); 00176 ros::serialization::deserialize(stream, initial_left_foot_position); 00177 ros::serialization::deserialize(stream, initial_right_foot_position); 00178 ros::serialization::deserialize(stream, initial_center_of_mass_position); 00179 ros::serialization::deserialize(stream, final_left_foot_position); 00180 ros::serialization::deserialize(stream, final_right_foot_position); 00181 ros::serialization::deserialize(stream, final_center_of_mass_position); 00182 ros::serialization::deserialize(stream, start_with_left_foot); 00183 ros::serialization::deserialize(stream, footprints); 00184 return stream.getData(); 00185 } 00186 00187 ROS_DEPRECATED virtual uint32_t serializationLength() const 00188 { 00189 uint32_t size = 0; 00190 size += ros::serialization::serializationLength(initial_left_foot_position); 00191 size += ros::serialization::serializationLength(initial_right_foot_position); 00192 size += ros::serialization::serializationLength(initial_center_of_mass_position); 00193 size += ros::serialization::serializationLength(final_left_foot_position); 00194 size += ros::serialization::serializationLength(final_right_foot_position); 00195 size += ros::serialization::serializationLength(final_center_of_mass_position); 00196 size += ros::serialization::serializationLength(start_with_left_foot); 00197 size += ros::serialization::serializationLength(footprints); 00198 return size; 00199 } 00200 00201 typedef boost::shared_ptr< ::walk_msgs::GetPathRequest_<ContainerAllocator> > Ptr; 00202 typedef boost::shared_ptr< ::walk_msgs::GetPathRequest_<ContainerAllocator> const> ConstPtr; 00203 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00204 }; // struct GetPathRequest 00205 typedef ::walk_msgs::GetPathRequest_<std::allocator<void> > GetPathRequest; 00206 00207 typedef boost::shared_ptr< ::walk_msgs::GetPathRequest> GetPathRequestPtr; 00208 typedef boost::shared_ptr< ::walk_msgs::GetPathRequest const> GetPathRequestConstPtr; 00209 00210 00211 template <class ContainerAllocator> 00212 struct GetPathResponse_ { 00213 typedef GetPathResponse_<ContainerAllocator> Type; 00214 00215 GetPathResponse_() 00216 : path() 00217 { 00218 } 00219 00220 GetPathResponse_(const ContainerAllocator& _alloc) 00221 : path(_alloc) 00222 { 00223 } 00224 00225 typedef ::walk_msgs::WalkPath_<ContainerAllocator> _path_type; 00226 ::walk_msgs::WalkPath_<ContainerAllocator> path; 00227 00228 00229 private: 00230 static const char* __s_getDataType_() { return "walk_msgs/GetPathResponse"; } 00231 public: 00232 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00233 00234 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00235 00236 private: 00237 static const char* __s_getMD5Sum_() { return "76d3891998acfa84511d5b8b9e0f9b97"; } 00238 public: 00239 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00240 00241 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00242 00243 private: 00244 static const char* __s_getServerMD5Sum_() { return "2b6fd7b841642a7520d3b2fd459370d2"; } 00245 public: 00246 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00247 00248 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00249 00250 private: 00251 static const char* __s_getMessageDefinition_() { return "walk_msgs/WalkPath path\n\ 00252 \n\ 00253 \n\ 00254 ================================================================================\n\ 00255 MSG: walk_msgs/WalkPath\n\ 00256 nav_msgs/Path left_foot\n\ 00257 nav_msgs/Path right_foot\n\ 00258 walk_msgs/PathPoint3d center_of_mass\n\ 00259 walk_msgs/PathPoint2d zmp\n\ 00260 \n\ 00261 ================================================================================\n\ 00262 MSG: nav_msgs/Path\n\ 00263 #An array of poses that represents a Path for a robot to follow\n\ 00264 Header header\n\ 00265 geometry_msgs/PoseStamped[] poses\n\ 00266 \n\ 00267 ================================================================================\n\ 00268 MSG: std_msgs/Header\n\ 00269 # Standard metadata for higher-level stamped data types.\n\ 00270 # This is generally used to communicate timestamped data \n\ 00271 # in a particular coordinate frame.\n\ 00272 # \n\ 00273 # sequence ID: consecutively increasing ID \n\ 00274 uint32 seq\n\ 00275 #Two-integer timestamp that is expressed as:\n\ 00276 # * stamp.secs: seconds (stamp_secs) since epoch\n\ 00277 # * stamp.nsecs: nanoseconds since stamp_secs\n\ 00278 # time-handling sugar is provided by the client library\n\ 00279 time stamp\n\ 00280 #Frame this data is associated with\n\ 00281 # 0: no frame\n\ 00282 # 1: global frame\n\ 00283 string frame_id\n\ 00284 \n\ 00285 ================================================================================\n\ 00286 MSG: geometry_msgs/PoseStamped\n\ 00287 # A Pose with reference coordinate frame and timestamp\n\ 00288 Header header\n\ 00289 Pose pose\n\ 00290 \n\ 00291 ================================================================================\n\ 00292 MSG: geometry_msgs/Pose\n\ 00293 # A representation of pose in free space, composed of postion and orientation. \n\ 00294 Point position\n\ 00295 Quaternion orientation\n\ 00296 \n\ 00297 ================================================================================\n\ 00298 MSG: geometry_msgs/Point\n\ 00299 # This contains the position of a point in free space\n\ 00300 float64 x\n\ 00301 float64 y\n\ 00302 float64 z\n\ 00303 \n\ 00304 ================================================================================\n\ 00305 MSG: geometry_msgs/Quaternion\n\ 00306 # This represents an orientation in free space in quaternion form.\n\ 00307 \n\ 00308 float64 x\n\ 00309 float64 y\n\ 00310 float64 z\n\ 00311 float64 w\n\ 00312 \n\ 00313 ================================================================================\n\ 00314 MSG: walk_msgs/PathPoint3d\n\ 00315 Header header\n\ 00316 geometry_msgs/PointStamped[] points\n\ 00317 \n\ 00318 ================================================================================\n\ 00319 MSG: geometry_msgs/PointStamped\n\ 00320 # This represents a Point with reference coordinate frame and timestamp\n\ 00321 Header header\n\ 00322 Point point\n\ 00323 \n\ 00324 ================================================================================\n\ 00325 MSG: walk_msgs/PathPoint2d\n\ 00326 Header header\n\ 00327 walk_msgs/Point2dStamped[] points\n\ 00328 \n\ 00329 ================================================================================\n\ 00330 MSG: walk_msgs/Point2dStamped\n\ 00331 Header header\n\ 00332 Point2d point\n\ 00333 \n\ 00334 ================================================================================\n\ 00335 MSG: walk_msgs/Point2d\n\ 00336 float64 x\n\ 00337 float64 y\n\ 00338 \n\ 00339 "; } 00340 public: 00341 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00342 00343 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00344 00345 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00346 { 00347 ros::serialization::OStream stream(write_ptr, 1000000000); 00348 ros::serialization::serialize(stream, path); 00349 return stream.getData(); 00350 } 00351 00352 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00353 { 00354 ros::serialization::IStream stream(read_ptr, 1000000000); 00355 ros::serialization::deserialize(stream, path); 00356 return stream.getData(); 00357 } 00358 00359 ROS_DEPRECATED virtual uint32_t serializationLength() const 00360 { 00361 uint32_t size = 0; 00362 size += ros::serialization::serializationLength(path); 00363 return size; 00364 } 00365 00366 typedef boost::shared_ptr< ::walk_msgs::GetPathResponse_<ContainerAllocator> > Ptr; 00367 typedef boost::shared_ptr< ::walk_msgs::GetPathResponse_<ContainerAllocator> const> ConstPtr; 00368 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00369 }; // struct GetPathResponse 00370 typedef ::walk_msgs::GetPathResponse_<std::allocator<void> > GetPathResponse; 00371 00372 typedef boost::shared_ptr< ::walk_msgs::GetPathResponse> GetPathResponsePtr; 00373 typedef boost::shared_ptr< ::walk_msgs::GetPathResponse const> GetPathResponseConstPtr; 00374 00375 struct GetPath 00376 { 00377 00378 typedef GetPathRequest Request; 00379 typedef GetPathResponse Response; 00380 Request request; 00381 Response response; 00382 00383 typedef Request RequestType; 00384 typedef Response ResponseType; 00385 }; // struct GetPath 00386 } // namespace walk_msgs 00387 00388 namespace ros 00389 { 00390 namespace message_traits 00391 { 00392 template<class ContainerAllocator> struct IsMessage< ::walk_msgs::GetPathRequest_<ContainerAllocator> > : public TrueType {}; 00393 template<class ContainerAllocator> struct IsMessage< ::walk_msgs::GetPathRequest_<ContainerAllocator> const> : public TrueType {}; 00394 template<class ContainerAllocator> 00395 struct MD5Sum< ::walk_msgs::GetPathRequest_<ContainerAllocator> > { 00396 static const char* value() 00397 { 00398 return "9325cbcfc330e3e7667ffad5cb6d4c50"; 00399 } 00400 00401 static const char* value(const ::walk_msgs::GetPathRequest_<ContainerAllocator> &) { return value(); } 00402 static const uint64_t static_value1 = 0x9325cbcfc330e3e7ULL; 00403 static const uint64_t static_value2 = 0x667ffad5cb6d4c50ULL; 00404 }; 00405 00406 template<class ContainerAllocator> 00407 struct DataType< ::walk_msgs::GetPathRequest_<ContainerAllocator> > { 00408 static const char* value() 00409 { 00410 return "walk_msgs/GetPathRequest"; 00411 } 00412 00413 static const char* value(const ::walk_msgs::GetPathRequest_<ContainerAllocator> &) { return value(); } 00414 }; 00415 00416 template<class ContainerAllocator> 00417 struct Definition< ::walk_msgs::GetPathRequest_<ContainerAllocator> > { 00418 static const char* value() 00419 { 00420 return "geometry_msgs/Pose initial_left_foot_position\n\ 00421 geometry_msgs/Pose initial_right_foot_position\n\ 00422 geometry_msgs/Point initial_center_of_mass_position\n\ 00423 \n\ 00424 geometry_msgs/Pose final_left_foot_position\n\ 00425 geometry_msgs/Pose final_right_foot_position\n\ 00426 geometry_msgs/Point final_center_of_mass_position\n\ 00427 \n\ 00428 bool start_with_left_foot\n\ 00429 \n\ 00430 walk_msgs/Footprint2d[] footprints\n\ 00431 \n\ 00432 ================================================================================\n\ 00433 MSG: geometry_msgs/Pose\n\ 00434 # A representation of pose in free space, composed of postion and orientation. \n\ 00435 Point position\n\ 00436 Quaternion orientation\n\ 00437 \n\ 00438 ================================================================================\n\ 00439 MSG: geometry_msgs/Point\n\ 00440 # This contains the position of a point in free space\n\ 00441 float64 x\n\ 00442 float64 y\n\ 00443 float64 z\n\ 00444 \n\ 00445 ================================================================================\n\ 00446 MSG: geometry_msgs/Quaternion\n\ 00447 # This represents an orientation in free space in quaternion form.\n\ 00448 \n\ 00449 float64 x\n\ 00450 float64 y\n\ 00451 float64 z\n\ 00452 float64 w\n\ 00453 \n\ 00454 ================================================================================\n\ 00455 MSG: walk_msgs/Footprint2d\n\ 00456 time beginTime\n\ 00457 duration duration\n\ 00458 float64 x\n\ 00459 float64 y\n\ 00460 float64 theta\n\ 00461 \n\ 00462 "; 00463 } 00464 00465 static const char* value(const ::walk_msgs::GetPathRequest_<ContainerAllocator> &) { return value(); } 00466 }; 00467 00468 } // namespace message_traits 00469 } // namespace ros 00470 00471 00472 namespace ros 00473 { 00474 namespace message_traits 00475 { 00476 template<class ContainerAllocator> struct IsMessage< ::walk_msgs::GetPathResponse_<ContainerAllocator> > : public TrueType {}; 00477 template<class ContainerAllocator> struct IsMessage< ::walk_msgs::GetPathResponse_<ContainerAllocator> const> : public TrueType {}; 00478 template<class ContainerAllocator> 00479 struct MD5Sum< ::walk_msgs::GetPathResponse_<ContainerAllocator> > { 00480 static const char* value() 00481 { 00482 return "76d3891998acfa84511d5b8b9e0f9b97"; 00483 } 00484 00485 static const char* value(const ::walk_msgs::GetPathResponse_<ContainerAllocator> &) { return value(); } 00486 static const uint64_t static_value1 = 0x76d3891998acfa84ULL; 00487 static const uint64_t static_value2 = 0x511d5b8b9e0f9b97ULL; 00488 }; 00489 00490 template<class ContainerAllocator> 00491 struct DataType< ::walk_msgs::GetPathResponse_<ContainerAllocator> > { 00492 static const char* value() 00493 { 00494 return "walk_msgs/GetPathResponse"; 00495 } 00496 00497 static const char* value(const ::walk_msgs::GetPathResponse_<ContainerAllocator> &) { return value(); } 00498 }; 00499 00500 template<class ContainerAllocator> 00501 struct Definition< ::walk_msgs::GetPathResponse_<ContainerAllocator> > { 00502 static const char* value() 00503 { 00504 return "walk_msgs/WalkPath path\n\ 00505 \n\ 00506 \n\ 00507 ================================================================================\n\ 00508 MSG: walk_msgs/WalkPath\n\ 00509 nav_msgs/Path left_foot\n\ 00510 nav_msgs/Path right_foot\n\ 00511 walk_msgs/PathPoint3d center_of_mass\n\ 00512 walk_msgs/PathPoint2d zmp\n\ 00513 \n\ 00514 ================================================================================\n\ 00515 MSG: nav_msgs/Path\n\ 00516 #An array of poses that represents a Path for a robot to follow\n\ 00517 Header header\n\ 00518 geometry_msgs/PoseStamped[] poses\n\ 00519 \n\ 00520 ================================================================================\n\ 00521 MSG: std_msgs/Header\n\ 00522 # Standard metadata for higher-level stamped data types.\n\ 00523 # This is generally used to communicate timestamped data \n\ 00524 # in a particular coordinate frame.\n\ 00525 # \n\ 00526 # sequence ID: consecutively increasing ID \n\ 00527 uint32 seq\n\ 00528 #Two-integer timestamp that is expressed as:\n\ 00529 # * stamp.secs: seconds (stamp_secs) since epoch\n\ 00530 # * stamp.nsecs: nanoseconds since stamp_secs\n\ 00531 # time-handling sugar is provided by the client library\n\ 00532 time stamp\n\ 00533 #Frame this data is associated with\n\ 00534 # 0: no frame\n\ 00535 # 1: global frame\n\ 00536 string frame_id\n\ 00537 \n\ 00538 ================================================================================\n\ 00539 MSG: geometry_msgs/PoseStamped\n\ 00540 # A Pose with reference coordinate frame and timestamp\n\ 00541 Header header\n\ 00542 Pose pose\n\ 00543 \n\ 00544 ================================================================================\n\ 00545 MSG: geometry_msgs/Pose\n\ 00546 # A representation of pose in free space, composed of postion and orientation. \n\ 00547 Point position\n\ 00548 Quaternion orientation\n\ 00549 \n\ 00550 ================================================================================\n\ 00551 MSG: geometry_msgs/Point\n\ 00552 # This contains the position of a point in free space\n\ 00553 float64 x\n\ 00554 float64 y\n\ 00555 float64 z\n\ 00556 \n\ 00557 ================================================================================\n\ 00558 MSG: geometry_msgs/Quaternion\n\ 00559 # This represents an orientation in free space in quaternion form.\n\ 00560 \n\ 00561 float64 x\n\ 00562 float64 y\n\ 00563 float64 z\n\ 00564 float64 w\n\ 00565 \n\ 00566 ================================================================================\n\ 00567 MSG: walk_msgs/PathPoint3d\n\ 00568 Header header\n\ 00569 geometry_msgs/PointStamped[] points\n\ 00570 \n\ 00571 ================================================================================\n\ 00572 MSG: geometry_msgs/PointStamped\n\ 00573 # This represents a Point with reference coordinate frame and timestamp\n\ 00574 Header header\n\ 00575 Point point\n\ 00576 \n\ 00577 ================================================================================\n\ 00578 MSG: walk_msgs/PathPoint2d\n\ 00579 Header header\n\ 00580 walk_msgs/Point2dStamped[] points\n\ 00581 \n\ 00582 ================================================================================\n\ 00583 MSG: walk_msgs/Point2dStamped\n\ 00584 Header header\n\ 00585 Point2d point\n\ 00586 \n\ 00587 ================================================================================\n\ 00588 MSG: walk_msgs/Point2d\n\ 00589 float64 x\n\ 00590 float64 y\n\ 00591 \n\ 00592 "; 00593 } 00594 00595 static const char* value(const ::walk_msgs::GetPathResponse_<ContainerAllocator> &) { return value(); } 00596 }; 00597 00598 } // namespace message_traits 00599 } // namespace ros 00600 00601 namespace ros 00602 { 00603 namespace serialization 00604 { 00605 00606 template<class ContainerAllocator> struct Serializer< ::walk_msgs::GetPathRequest_<ContainerAllocator> > 00607 { 00608 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00609 { 00610 stream.next(m.initial_left_foot_position); 00611 stream.next(m.initial_right_foot_position); 00612 stream.next(m.initial_center_of_mass_position); 00613 stream.next(m.final_left_foot_position); 00614 stream.next(m.final_right_foot_position); 00615 stream.next(m.final_center_of_mass_position); 00616 stream.next(m.start_with_left_foot); 00617 stream.next(m.footprints); 00618 } 00619 00620 ROS_DECLARE_ALLINONE_SERIALIZER; 00621 }; // struct GetPathRequest_ 00622 } // namespace serialization 00623 } // namespace ros 00624 00625 00626 namespace ros 00627 { 00628 namespace serialization 00629 { 00630 00631 template<class ContainerAllocator> struct Serializer< ::walk_msgs::GetPathResponse_<ContainerAllocator> > 00632 { 00633 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00634 { 00635 stream.next(m.path); 00636 } 00637 00638 ROS_DECLARE_ALLINONE_SERIALIZER; 00639 }; // struct GetPathResponse_ 00640 } // namespace serialization 00641 } // namespace ros 00642 00643 namespace ros 00644 { 00645 namespace service_traits 00646 { 00647 template<> 00648 struct MD5Sum<walk_msgs::GetPath> { 00649 static const char* value() 00650 { 00651 return "2b6fd7b841642a7520d3b2fd459370d2"; 00652 } 00653 00654 static const char* value(const walk_msgs::GetPath&) { return value(); } 00655 }; 00656 00657 template<> 00658 struct DataType<walk_msgs::GetPath> { 00659 static const char* value() 00660 { 00661 return "walk_msgs/GetPath"; 00662 } 00663 00664 static const char* value(const walk_msgs::GetPath&) { return value(); } 00665 }; 00666 00667 template<class ContainerAllocator> 00668 struct MD5Sum<walk_msgs::GetPathRequest_<ContainerAllocator> > { 00669 static const char* value() 00670 { 00671 return "2b6fd7b841642a7520d3b2fd459370d2"; 00672 } 00673 00674 static const char* value(const walk_msgs::GetPathRequest_<ContainerAllocator> &) { return value(); } 00675 }; 00676 00677 template<class ContainerAllocator> 00678 struct DataType<walk_msgs::GetPathRequest_<ContainerAllocator> > { 00679 static const char* value() 00680 { 00681 return "walk_msgs/GetPath"; 00682 } 00683 00684 static const char* value(const walk_msgs::GetPathRequest_<ContainerAllocator> &) { return value(); } 00685 }; 00686 00687 template<class ContainerAllocator> 00688 struct MD5Sum<walk_msgs::GetPathResponse_<ContainerAllocator> > { 00689 static const char* value() 00690 { 00691 return "2b6fd7b841642a7520d3b2fd459370d2"; 00692 } 00693 00694 static const char* value(const walk_msgs::GetPathResponse_<ContainerAllocator> &) { return value(); } 00695 }; 00696 00697 template<class ContainerAllocator> 00698 struct DataType<walk_msgs::GetPathResponse_<ContainerAllocator> > { 00699 static const char* value() 00700 { 00701 return "walk_msgs/GetPath"; 00702 } 00703 00704 static const char* value(const walk_msgs::GetPathResponse_<ContainerAllocator> &) { return value(); } 00705 }; 00706 00707 } // namespace service_traits 00708 } // namespace ros 00709 00710 #endif // WALK_MSGS_SERVICE_GETPATH_H 00711