32 #include <geometry_msgs/PoseWithCovarianceStamped.h> 47 new StringProperty(
"Topic",
"initialpose",
"The topic on which to publish initial pose estimates.",
83 geometry_msgs::PoseWithCovarianceStamped pose;
84 pose.header.frame_id = fixed_frame;
86 pose.pose.pose.position.x = x;
87 pose.pose.pose.position.y = y;
90 quat.
setRPY(0.0, 0.0, theta);
95 ROS_INFO(
"Setting pose: %.3f %.3f %.3f [frame=%s]", x, y, theta, fixed_frame.c_str());
#define ROS_ERROR_STREAM_NAMED(name, args)
Property specialized to enforce floating point max/min.
std::string getStdString()
void publish(const boost::shared_ptr< M > &message) const
void setRPY(const tfScalar &roll, const tfScalar &pitch, const tfScalar &yaw)
static void quaternionTFToMsg(const Quaternion &bt, geometry_msgs::Quaternion &msg)
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
Property specialized for string values.
virtual QString getFixedFrame() const =0
Return the fixed frame name.
virtual float getFloat() const
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)