00001
00002 #ifndef CART_PUSHING_MSGS_MESSAGE_ROBOTCARTCONFIGURATION_H
00003 #define CART_PUSHING_MSGS_MESSAGE_ROBOTCARTCONFIGURATION_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/Pose.h"
00018 #include "geometry_msgs/Pose.h"
00019
00020 namespace cart_pushing_msgs
00021 {
00022 template <class ContainerAllocator>
00023 struct RobotCartConfiguration_ {
00024 typedef RobotCartConfiguration_<ContainerAllocator> Type;
00025
00026 RobotCartConfiguration_()
00027 : robot_pose()
00028 , cart_pose()
00029 {
00030 }
00031
00032 RobotCartConfiguration_(const ContainerAllocator& _alloc)
00033 : robot_pose(_alloc)
00034 , cart_pose(_alloc)
00035 {
00036 }
00037
00038 typedef ::geometry_msgs::Pose_<ContainerAllocator> _robot_pose_type;
00039 ::geometry_msgs::Pose_<ContainerAllocator> robot_pose;
00040
00041 typedef ::geometry_msgs::Pose_<ContainerAllocator> _cart_pose_type;
00042 ::geometry_msgs::Pose_<ContainerAllocator> cart_pose;
00043
00044
00045 private:
00046 static const char* __s_getDataType_() { return "cart_pushing_msgs/RobotCartConfiguration"; }
00047 public:
00048 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00049
00050 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00051
00052 private:
00053 static const char* __s_getMD5Sum_() { return "b6763adc7a4163e81b79c0de27053f06"; }
00054 public:
00055 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00056
00057 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00058
00059 private:
00060 static const char* __s_getMessageDefinition_() { return "# Robot's pose in reference frame\n\
00061 geometry_msgs/Pose robot_pose\n\
00062 \n\
00063 # Cart's pose in base frame\n\
00064 geometry_msgs/Pose cart_pose\n\
00065 ================================================================================\n\
00066 MSG: geometry_msgs/Pose\n\
00067 # A representation of pose in free space, composed of postion and orientation. \n\
00068 Point position\n\
00069 Quaternion orientation\n\
00070 \n\
00071 ================================================================================\n\
00072 MSG: geometry_msgs/Point\n\
00073 # This contains the position of a point in free space\n\
00074 float64 x\n\
00075 float64 y\n\
00076 float64 z\n\
00077 \n\
00078 ================================================================================\n\
00079 MSG: geometry_msgs/Quaternion\n\
00080 # This represents an orientation in free space in quaternion form.\n\
00081 \n\
00082 float64 x\n\
00083 float64 y\n\
00084 float64 z\n\
00085 float64 w\n\
00086 \n\
00087 "; }
00088 public:
00089 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00090
00091 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00092
00093 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00094 {
00095 ros::serialization::OStream stream(write_ptr, 1000000000);
00096 ros::serialization::serialize(stream, robot_pose);
00097 ros::serialization::serialize(stream, cart_pose);
00098 return stream.getData();
00099 }
00100
00101 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00102 {
00103 ros::serialization::IStream stream(read_ptr, 1000000000);
00104 ros::serialization::deserialize(stream, robot_pose);
00105 ros::serialization::deserialize(stream, cart_pose);
00106 return stream.getData();
00107 }
00108
00109 ROS_DEPRECATED virtual uint32_t serializationLength() const
00110 {
00111 uint32_t size = 0;
00112 size += ros::serialization::serializationLength(robot_pose);
00113 size += ros::serialization::serializationLength(cart_pose);
00114 return size;
00115 }
00116
00117 typedef boost::shared_ptr< ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> > Ptr;
00118 typedef boost::shared_ptr< ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> const> ConstPtr;
00119 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00120 };
00121 typedef ::cart_pushing_msgs::RobotCartConfiguration_<std::allocator<void> > RobotCartConfiguration;
00122
00123 typedef boost::shared_ptr< ::cart_pushing_msgs::RobotCartConfiguration> RobotCartConfigurationPtr;
00124 typedef boost::shared_ptr< ::cart_pushing_msgs::RobotCartConfiguration const> RobotCartConfigurationConstPtr;
00125
00126
00127 template<typename ContainerAllocator>
00128 std::ostream& operator<<(std::ostream& s, const ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> & v)
00129 {
00130 ros::message_operations::Printer< ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> >::stream(s, "", v);
00131 return s;}
00132
00133 }
00134
00135 namespace ros
00136 {
00137 namespace message_traits
00138 {
00139 template<class ContainerAllocator> struct IsMessage< ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> > : public TrueType {};
00140 template<class ContainerAllocator> struct IsMessage< ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> const> : public TrueType {};
00141 template<class ContainerAllocator>
00142 struct MD5Sum< ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> > {
00143 static const char* value()
00144 {
00145 return "b6763adc7a4163e81b79c0de27053f06";
00146 }
00147
00148 static const char* value(const ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> &) { return value(); }
00149 static const uint64_t static_value1 = 0xb6763adc7a4163e8ULL;
00150 static const uint64_t static_value2 = 0x1b79c0de27053f06ULL;
00151 };
00152
00153 template<class ContainerAllocator>
00154 struct DataType< ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> > {
00155 static const char* value()
00156 {
00157 return "cart_pushing_msgs/RobotCartConfiguration";
00158 }
00159
00160 static const char* value(const ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> &) { return value(); }
00161 };
00162
00163 template<class ContainerAllocator>
00164 struct Definition< ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> > {
00165 static const char* value()
00166 {
00167 return "# Robot's pose in reference frame\n\
00168 geometry_msgs/Pose robot_pose\n\
00169 \n\
00170 # Cart's pose in base frame\n\
00171 geometry_msgs/Pose cart_pose\n\
00172 ================================================================================\n\
00173 MSG: geometry_msgs/Pose\n\
00174 # A representation of pose in free space, composed of postion and orientation. \n\
00175 Point position\n\
00176 Quaternion orientation\n\
00177 \n\
00178 ================================================================================\n\
00179 MSG: geometry_msgs/Point\n\
00180 # This contains the position of a point in free space\n\
00181 float64 x\n\
00182 float64 y\n\
00183 float64 z\n\
00184 \n\
00185 ================================================================================\n\
00186 MSG: geometry_msgs/Quaternion\n\
00187 # This represents an orientation in free space in quaternion form.\n\
00188 \n\
00189 float64 x\n\
00190 float64 y\n\
00191 float64 z\n\
00192 float64 w\n\
00193 \n\
00194 ";
00195 }
00196
00197 static const char* value(const ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> &) { return value(); }
00198 };
00199
00200 template<class ContainerAllocator> struct IsFixedSize< ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> > : public TrueType {};
00201 }
00202 }
00203
00204 namespace ros
00205 {
00206 namespace serialization
00207 {
00208
00209 template<class ContainerAllocator> struct Serializer< ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> >
00210 {
00211 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00212 {
00213 stream.next(m.robot_pose);
00214 stream.next(m.cart_pose);
00215 }
00216
00217 ROS_DECLARE_ALLINONE_SERIALIZER;
00218 };
00219 }
00220 }
00221
00222 namespace ros
00223 {
00224 namespace message_operations
00225 {
00226
00227 template<class ContainerAllocator>
00228 struct Printer< ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> >
00229 {
00230 template<typename Stream> static void stream(Stream& s, const std::string& indent, const ::cart_pushing_msgs::RobotCartConfiguration_<ContainerAllocator> & v)
00231 {
00232 s << indent << "robot_pose: ";
00233 s << std::endl;
00234 Printer< ::geometry_msgs::Pose_<ContainerAllocator> >::stream(s, indent + " ", v.robot_pose);
00235 s << indent << "cart_pose: ";
00236 s << std::endl;
00237 Printer< ::geometry_msgs::Pose_<ContainerAllocator> >::stream(s, indent + " ", v.cart_pose);
00238 }
00239 };
00240
00241
00242 }
00243 }
00244
00245 #endif // CART_PUSHING_MSGS_MESSAGE_ROBOTCARTCONFIGURATION_H
00246