GraspAction.h
Go to the documentation of this file.
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-fuerte-srs_public/doc_stacks/2014-01-05_11-35-06.523601/srs_public/srs_knowledge/msg/GraspAction.msg */
00002 #ifndef SRS_KNOWLEDGE_MESSAGE_GRASPACTION_H
00003 #define SRS_KNOWLEDGE_MESSAGE_GRASPACTION_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 "geometry_msgs/Point32.h"
00018 
00019 namespace srs_knowledge
00020 {
00021 template <class ContainerAllocator>
00022 struct GraspAction_ {
00023   typedef GraspAction_<ContainerAllocator> Type;
00024 
00025   GraspAction_()
00026   : ifGrasp(false)
00027   , rough_center()
00028   , confidence_level(0.0)
00029   , radius_region(0.0)
00030   , object_id(0)
00031   , object_type()
00032   , class_id(0)
00033   {
00034   }
00035 
00036   GraspAction_(const ContainerAllocator& _alloc)
00037   : ifGrasp(false)
00038   , rough_center(_alloc)
00039   , confidence_level(0.0)
00040   , radius_region(0.0)
00041   , object_id(0)
00042   , object_type(_alloc)
00043   , class_id(0)
00044   {
00045   }
00046 
00047   typedef uint8_t _ifGrasp_type;
00048   uint8_t ifGrasp;
00049 
00050   typedef  ::geometry_msgs::Point32_<ContainerAllocator>  _rough_center_type;
00051    ::geometry_msgs::Point32_<ContainerAllocator>  rough_center;
00052 
00053   typedef float _confidence_level_type;
00054   float confidence_level;
00055 
00056   typedef float _radius_region_type;
00057   float radius_region;
00058 
00059   typedef int32_t _object_id_type;
00060   int32_t object_id;
00061 
00062   typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other >  _object_type_type;
00063   std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other >  object_type;
00064 
00065   typedef int32_t _class_id_type;
00066   int32_t class_id;
00067 
00068 
00069   typedef boost::shared_ptr< ::srs_knowledge::GraspAction_<ContainerAllocator> > Ptr;
00070   typedef boost::shared_ptr< ::srs_knowledge::GraspAction_<ContainerAllocator>  const> ConstPtr;
00071   boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00072 }; // struct GraspAction
00073 typedef  ::srs_knowledge::GraspAction_<std::allocator<void> > GraspAction;
00074 
00075 typedef boost::shared_ptr< ::srs_knowledge::GraspAction> GraspActionPtr;
00076 typedef boost::shared_ptr< ::srs_knowledge::GraspAction const> GraspActionConstPtr;
00077 
00078 
00079 template<typename ContainerAllocator>
00080 std::ostream& operator<<(std::ostream& s, const  ::srs_knowledge::GraspAction_<ContainerAllocator> & v)
00081 {
00082   ros::message_operations::Printer< ::srs_knowledge::GraspAction_<ContainerAllocator> >::stream(s, "", v);
00083   return s;}
00084 
00085 } // namespace srs_knowledge
00086 
00087 namespace ros
00088 {
00089 namespace message_traits
00090 {
00091 template<class ContainerAllocator> struct IsMessage< ::srs_knowledge::GraspAction_<ContainerAllocator> > : public TrueType {};
00092 template<class ContainerAllocator> struct IsMessage< ::srs_knowledge::GraspAction_<ContainerAllocator>  const> : public TrueType {};
00093 template<class ContainerAllocator>
00094 struct MD5Sum< ::srs_knowledge::GraspAction_<ContainerAllocator> > {
00095   static const char* value() 
00096   {
00097     return "a5b55b2bc3272273072fad2e424ffe38";
00098   }
00099 
00100   static const char* value(const  ::srs_knowledge::GraspAction_<ContainerAllocator> &) { return value(); } 
00101   static const uint64_t static_value1 = 0xa5b55b2bc3272273ULL;
00102   static const uint64_t static_value2 = 0x072fad2e424ffe38ULL;
00103 };
00104 
00105 template<class ContainerAllocator>
00106 struct DataType< ::srs_knowledge::GraspAction_<ContainerAllocator> > {
00107   static const char* value() 
00108   {
00109     return "srs_knowledge/GraspAction";
00110   }
00111 
00112   static const char* value(const  ::srs_knowledge::GraspAction_<ContainerAllocator> &) { return value(); } 
00113 };
00114 
00115 template<class ContainerAllocator>
00116 struct Definition< ::srs_knowledge::GraspAction_<ContainerAllocator> > {
00117   static const char* value() 
00118   {
00119     return "bool ifGrasp\n\
00120 \n\
00121 geometry_msgs/Point32 rough_center\n\
00122 float32 confidence_level\n\
00123 float32 radius_region\n\
00124 \n\
00125 int32 object_id\n\
00126 # geometry_msgs/Point32 grid_size\n\
00127 # geometry_msgs\n\
00128 string object_type\n\
00129 int32 class_id\n\
00130 \n\
00131 ================================================================================\n\
00132 MSG: geometry_msgs/Point32\n\
00133 # This contains the position of a point in free space(with 32 bits of precision).\n\
00134 # It is recommeded to use Point wherever possible instead of Point32.  \n\
00135 # \n\
00136 # This recommendation is to promote interoperability.  \n\
00137 #\n\
00138 # This message is designed to take up less space when sending\n\
00139 # lots of points at once, as in the case of a PointCloud.  \n\
00140 \n\
00141 float32 x\n\
00142 float32 y\n\
00143 float32 z\n\
00144 ";
00145   }
00146 
00147   static const char* value(const  ::srs_knowledge::GraspAction_<ContainerAllocator> &) { return value(); } 
00148 };
00149 
00150 } // namespace message_traits
00151 } // namespace ros
00152 
00153 namespace ros
00154 {
00155 namespace serialization
00156 {
00157 
00158 template<class ContainerAllocator> struct Serializer< ::srs_knowledge::GraspAction_<ContainerAllocator> >
00159 {
00160   template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00161   {
00162     stream.next(m.ifGrasp);
00163     stream.next(m.rough_center);
00164     stream.next(m.confidence_level);
00165     stream.next(m.radius_region);
00166     stream.next(m.object_id);
00167     stream.next(m.object_type);
00168     stream.next(m.class_id);
00169   }
00170 
00171   ROS_DECLARE_ALLINONE_SERIALIZER;
00172 }; // struct GraspAction_
00173 } // namespace serialization
00174 } // namespace ros
00175 
00176 namespace ros
00177 {
00178 namespace message_operations
00179 {
00180 
00181 template<class ContainerAllocator>
00182 struct Printer< ::srs_knowledge::GraspAction_<ContainerAllocator> >
00183 {
00184   template<typename Stream> static void stream(Stream& s, const std::string& indent, const  ::srs_knowledge::GraspAction_<ContainerAllocator> & v) 
00185   {
00186     s << indent << "ifGrasp: ";
00187     Printer<uint8_t>::stream(s, indent + "  ", v.ifGrasp);
00188     s << indent << "rough_center: ";
00189 s << std::endl;
00190     Printer< ::geometry_msgs::Point32_<ContainerAllocator> >::stream(s, indent + "  ", v.rough_center);
00191     s << indent << "confidence_level: ";
00192     Printer<float>::stream(s, indent + "  ", v.confidence_level);
00193     s << indent << "radius_region: ";
00194     Printer<float>::stream(s, indent + "  ", v.radius_region);
00195     s << indent << "object_id: ";
00196     Printer<int32_t>::stream(s, indent + "  ", v.object_id);
00197     s << indent << "object_type: ";
00198     Printer<std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > >::stream(s, indent + "  ", v.object_type);
00199     s << indent << "class_id: ";
00200     Printer<int32_t>::stream(s, indent + "  ", v.class_id);
00201   }
00202 };
00203 
00204 
00205 } // namespace message_operations
00206 } // namespace ros
00207 
00208 #endif // SRS_KNOWLEDGE_MESSAGE_GRASPACTION_H
00209 


srs_knowledge
Author(s): Ze Ji
autogenerated on Sun Jan 5 2014 12:03:28