Quantcast
Channel: ROS Answers: Open Source Q&A Forum - RSS feed
Viewing all articles
Browse latest Browse all 2203

ROS publishing "/initialpose" topic in code

$
0
0
Hello, I'm trying to publishing the topic "initialpose" whose type is `geometry_msgs/PoseWithCovarianceStamped` to amcl node. I successfully made a node from following c++ source code (modified from rviz initial pose tool) The problem is that it does not publish any topic. What's the problem? #include #include double pose(int flag); void onPoseSet(double x, double y, double theta); void onPoseSet(double x, double y, double theta) { ros::NodeHandle nh_; ros::Publisher pub_ = nh_.advertise ("/initialpose", 1); ros::Rate loop_rate(10); // 10HZ = 0.1s ros::spinOnce(); std::string fixed_frame = "map"; geometry_msgs::PoseWithCovarianceStamped pose; pose.header.frame_id = fixed_frame; pose.header.stamp = ros::Time::now(); // set x,y coord pose.pose.pose.position.x = x; pose.pose.pose.position.y = y; pose.pose.pose.position.z = 0.0; // set theta tf::Quaternion quat; quat.setRPY(0.0, 0.0, theta); tf::quaternionTFToMsg(quat, pose.pose.pose.orientation); pose.pose.covariance[6*0+0] = 0.5 * 0.5; pose.pose.covariance[6*1+1] = 0.5 * 0.5; pose.pose.covariance[6*5+5] = M_PI/12.0 * M_PI/12.0; // publish ROS_INFO("x: %f, y: %f, z: 0.0, theta: %f",x,y,theta); pub_.publish(pose); } int main(int argc, char** argv) { // setting ros::init(argc, argv, "set_pose_node"); onPoseSet(0.968507917975, -4.61491396765, 1); return 0; }

Viewing all articles
Browse latest Browse all 2203

Trending Articles



<script src="https://jsc.adskeeper.com/r/s/rssing.com.1596347.js" async> </script>