30 #include <geometry_msgs/PoseWithCovarianceStamped.h> 37 printf (
"Received pose %f, %f, %f\n", pose.pose.pose.position.x,
38 pose.pose.pose.position.y, pose.pose.pose.position.z);
41 int _tmain (
int argc, _TCHAR * argv[])
44 char *ros_master =
"1.2.3.4";
46 printf (
"Connecting to server at %s\n", ros_master);
47 nh.initNode (ros_master);
53 printf (
"Waiting to receive messages\n");
60 printf (
"All done!\n");
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
void estimated_pose_callback(const geometry_msgs::PoseWithCovarianceStamped &pose)
int _tmain(int argc, _TCHAR *argv[])