auto_launch.cpp
Go to the documentation of this file.
1 #include "ros/ros.h"
2 #include "std_msgs/UInt32.h"
3 
4 int main(int argc, char **argv)
5 {
6  ros::init(argc, argv, "auto_launch");
8 
9  ros::Publisher auto_launch_pub = nh.advertise<std_msgs::UInt32>("/office/next_loop", 1000);
10 
11  ros::Rate loop_rate(1);
12  int wait_time = 255+60;
13  while (wait_time >254)
14  {
15  std_msgs::UInt32 msg;
16  msg.data = wait_time;
17  auto_launch_pub.publish(msg);
18  ros::spinOnce();
19  wait_time--;
20 
21  loop_rate.sleep();
22  }
23 
24  return 0;
25 }
void publish(const boost::shared_ptr< M > &message) const
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
int main(int argc, char **argv)
Definition: auto_launch.cpp:4
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
ROSCPP_DECL void spinOnce()


xbot_navi
Author(s):
autogenerated on Sat Oct 10 2020 03:27:50