5 #include <std_msgs/Float64.h> 7 int main(
int argc,
char* argv[])
14 std::cerr <<
"Usage: " << argv[0] <<
" <host>" << std::endl;
15 #if !defined(BOOST_WINDOWS) 16 std::cerr <<
"(You may need to set permission to run this program as root.)\n$ chown root.root rosping; ls -al rosping; chmod 4755 rosping\n" << std::endl;
21 boost::asio::io_service io_service;
22 pinger p(io_service, argv[1]);
34 std_msgs::Float64 msg;
52 catch (std::exception& e)
54 std::cerr <<
"Exception: " << e.what() << std::endl;
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)
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
bool getParam(const std::string &key, std::string &s) const
ROSCPP_DECL void spinOnce()
int main(int argc, char *argv[])