DeleteTF.h
Go to the documentation of this file.
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-fuerte-jsk-ros-pkg/doc_stacks/2013-03-23_12-16-27.483192/jsk-ros-pkg/jsk_coordination_system/dynamic_tf_publisher/srv/DeleteTF.srv */
00002 #ifndef DYNAMIC_TF_PUBLISHER_SERVICE_DELETETF_H
00003 #define DYNAMIC_TF_PUBLISHER_SERVICE_DELETETF_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 "std_msgs/Header.h"
00020 
00021 
00022 
00023 namespace dynamic_tf_publisher
00024 {
00025 template <class ContainerAllocator>
00026 struct DeleteTFRequest_ {
00027   typedef DeleteTFRequest_<ContainerAllocator> Type;
00028 
00029   DeleteTFRequest_()
00030   : header()
00031   {
00032   }
00033 
00034   DeleteTFRequest_(const ContainerAllocator& _alloc)
00035   : header(_alloc)
00036   {
00037   }
00038 
00039   typedef  ::std_msgs::Header_<ContainerAllocator>  _header_type;
00040    ::std_msgs::Header_<ContainerAllocator>  header;
00041 
00042 
00043   typedef boost::shared_ptr< ::dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> > Ptr;
00044   typedef boost::shared_ptr< ::dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator>  const> ConstPtr;
00045   boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00046 }; // struct DeleteTFRequest
00047 typedef  ::dynamic_tf_publisher::DeleteTFRequest_<std::allocator<void> > DeleteTFRequest;
00048 
00049 typedef boost::shared_ptr< ::dynamic_tf_publisher::DeleteTFRequest> DeleteTFRequestPtr;
00050 typedef boost::shared_ptr< ::dynamic_tf_publisher::DeleteTFRequest const> DeleteTFRequestConstPtr;
00051 
00052 
00053 template <class ContainerAllocator>
00054 struct DeleteTFResponse_ {
00055   typedef DeleteTFResponse_<ContainerAllocator> Type;
00056 
00057   DeleteTFResponse_()
00058   {
00059   }
00060 
00061   DeleteTFResponse_(const ContainerAllocator& _alloc)
00062   {
00063   }
00064 
00065 
00066   typedef boost::shared_ptr< ::dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator> > Ptr;
00067   typedef boost::shared_ptr< ::dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator>  const> ConstPtr;
00068   boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00069 }; // struct DeleteTFResponse
00070 typedef  ::dynamic_tf_publisher::DeleteTFResponse_<std::allocator<void> > DeleteTFResponse;
00071 
00072 typedef boost::shared_ptr< ::dynamic_tf_publisher::DeleteTFResponse> DeleteTFResponsePtr;
00073 typedef boost::shared_ptr< ::dynamic_tf_publisher::DeleteTFResponse const> DeleteTFResponseConstPtr;
00074 
00075 struct DeleteTF
00076 {
00077 
00078 typedef DeleteTFRequest Request;
00079 typedef DeleteTFResponse Response;
00080 Request request;
00081 Response response;
00082 
00083 typedef Request RequestType;
00084 typedef Response ResponseType;
00085 }; // struct DeleteTF
00086 } // namespace dynamic_tf_publisher
00087 
00088 namespace ros
00089 {
00090 namespace message_traits
00091 {
00092 template<class ContainerAllocator> struct IsMessage< ::dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> > : public TrueType {};
00093 template<class ContainerAllocator> struct IsMessage< ::dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator>  const> : public TrueType {};
00094 template<class ContainerAllocator>
00095 struct MD5Sum< ::dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> > {
00096   static const char* value() 
00097   {
00098     return "d7be0bb39af8fb9129d5a76e6b63a290";
00099   }
00100 
00101   static const char* value(const  ::dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> &) { return value(); } 
00102   static const uint64_t static_value1 = 0xd7be0bb39af8fb91ULL;
00103   static const uint64_t static_value2 = 0x29d5a76e6b63a290ULL;
00104 };
00105 
00106 template<class ContainerAllocator>
00107 struct DataType< ::dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> > {
00108   static const char* value() 
00109   {
00110     return "dynamic_tf_publisher/DeleteTFRequest";
00111   }
00112 
00113   static const char* value(const  ::dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> &) { return value(); } 
00114 };
00115 
00116 template<class ContainerAllocator>
00117 struct Definition< ::dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> > {
00118   static const char* value() 
00119   {
00120     return "Header  header\n\
00121 \n\
00122 ================================================================================\n\
00123 MSG: std_msgs/Header\n\
00124 # Standard metadata for higher-level stamped data types.\n\
00125 # This is generally used to communicate timestamped data \n\
00126 # in a particular coordinate frame.\n\
00127 # \n\
00128 # sequence ID: consecutively increasing ID \n\
00129 uint32 seq\n\
00130 #Two-integer timestamp that is expressed as:\n\
00131 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00132 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00133 # time-handling sugar is provided by the client library\n\
00134 time stamp\n\
00135 #Frame this data is associated with\n\
00136 # 0: no frame\n\
00137 # 1: global frame\n\
00138 string frame_id\n\
00139 \n\
00140 ";
00141   }
00142 
00143   static const char* value(const  ::dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> &) { return value(); } 
00144 };
00145 
00146 template<class ContainerAllocator> struct HasHeader< ::dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> > : public TrueType {};
00147 template<class ContainerAllocator> struct HasHeader< const ::dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> > : public TrueType {};
00148 } // namespace message_traits
00149 } // namespace ros
00150 
00151 
00152 namespace ros
00153 {
00154 namespace message_traits
00155 {
00156 template<class ContainerAllocator> struct IsMessage< ::dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator> > : public TrueType {};
00157 template<class ContainerAllocator> struct IsMessage< ::dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator>  const> : public TrueType {};
00158 template<class ContainerAllocator>
00159 struct MD5Sum< ::dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator> > {
00160   static const char* value() 
00161   {
00162     return "d41d8cd98f00b204e9800998ecf8427e";
00163   }
00164 
00165   static const char* value(const  ::dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator> &) { return value(); } 
00166   static const uint64_t static_value1 = 0xd41d8cd98f00b204ULL;
00167   static const uint64_t static_value2 = 0xe9800998ecf8427eULL;
00168 };
00169 
00170 template<class ContainerAllocator>
00171 struct DataType< ::dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator> > {
00172   static const char* value() 
00173   {
00174     return "dynamic_tf_publisher/DeleteTFResponse";
00175   }
00176 
00177   static const char* value(const  ::dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator> &) { return value(); } 
00178 };
00179 
00180 template<class ContainerAllocator>
00181 struct Definition< ::dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator> > {
00182   static const char* value() 
00183   {
00184     return "\n\
00185 \n\
00186 ";
00187   }
00188 
00189   static const char* value(const  ::dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator> &) { return value(); } 
00190 };
00191 
00192 template<class ContainerAllocator> struct IsFixedSize< ::dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator> > : public TrueType {};
00193 } // namespace message_traits
00194 } // namespace ros
00195 
00196 namespace ros
00197 {
00198 namespace serialization
00199 {
00200 
00201 template<class ContainerAllocator> struct Serializer< ::dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> >
00202 {
00203   template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00204   {
00205     stream.next(m.header);
00206   }
00207 
00208   ROS_DECLARE_ALLINONE_SERIALIZER;
00209 }; // struct DeleteTFRequest_
00210 } // namespace serialization
00211 } // namespace ros
00212 
00213 
00214 namespace ros
00215 {
00216 namespace serialization
00217 {
00218 
00219 template<class ContainerAllocator> struct Serializer< ::dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator> >
00220 {
00221   template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00222   {
00223   }
00224 
00225   ROS_DECLARE_ALLINONE_SERIALIZER;
00226 }; // struct DeleteTFResponse_
00227 } // namespace serialization
00228 } // namespace ros
00229 
00230 namespace ros
00231 {
00232 namespace service_traits
00233 {
00234 template<>
00235 struct MD5Sum<dynamic_tf_publisher::DeleteTF> {
00236   static const char* value() 
00237   {
00238     return "d7be0bb39af8fb9129d5a76e6b63a290";
00239   }
00240 
00241   static const char* value(const dynamic_tf_publisher::DeleteTF&) { return value(); } 
00242 };
00243 
00244 template<>
00245 struct DataType<dynamic_tf_publisher::DeleteTF> {
00246   static const char* value() 
00247   {
00248     return "dynamic_tf_publisher/DeleteTF";
00249   }
00250 
00251   static const char* value(const dynamic_tf_publisher::DeleteTF&) { return value(); } 
00252 };
00253 
00254 template<class ContainerAllocator>
00255 struct MD5Sum<dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> > {
00256   static const char* value() 
00257   {
00258     return "d7be0bb39af8fb9129d5a76e6b63a290";
00259   }
00260 
00261   static const char* value(const dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> &) { return value(); } 
00262 };
00263 
00264 template<class ContainerAllocator>
00265 struct DataType<dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> > {
00266   static const char* value() 
00267   {
00268     return "dynamic_tf_publisher/DeleteTF";
00269   }
00270 
00271   static const char* value(const dynamic_tf_publisher::DeleteTFRequest_<ContainerAllocator> &) { return value(); } 
00272 };
00273 
00274 template<class ContainerAllocator>
00275 struct MD5Sum<dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator> > {
00276   static const char* value() 
00277   {
00278     return "d7be0bb39af8fb9129d5a76e6b63a290";
00279   }
00280 
00281   static const char* value(const dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator> &) { return value(); } 
00282 };
00283 
00284 template<class ContainerAllocator>
00285 struct DataType<dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator> > {
00286   static const char* value() 
00287   {
00288     return "dynamic_tf_publisher/DeleteTF";
00289   }
00290 
00291   static const char* value(const dynamic_tf_publisher::DeleteTFResponse_<ContainerAllocator> &) { return value(); } 
00292 };
00293 
00294 } // namespace service_traits
00295 } // namespace ros
00296 
00297 #endif // DYNAMIC_TF_PUBLISHER_SERVICE_DELETETF_H
00298 
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


dynamic_tf_publisher
Author(s): Manabu Saito
autogenerated on Sat Mar 23 2013 16:00:56