39 #include "laser_assembler/AssembleScans.h" 42 #include "sensor_msgs/PointCloud.h" 92 ROS_INFO(
"Published Cloud with %u points", (uint32_t)(srv.response.cloud.points.size())) ;
97 ROS_ERROR(
"Error making service call\n") ;
113 int main(
int argc,
char **argv)
115 ros::init(argc, argv,
"periodic_snapshotter");
117 ROS_INFO(
"Waiting for [build_cloud] to be advertised");
119 ROS_INFO(
"Found build_cloud! Starting the snapshotter");
ServiceClient serviceClient(const std::string &service_name, bool persistent=false, const M_string &header_values=M_string())
void publish(const boost::shared_ptr< M > &message) const
int main(int argc, char **argv)
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
bool call(MReq &req, MRes &res)
ROSCPP_DECL void spin(Spinner &spinner)
ros::ServiceClient client_
Timer createTimer(Rate r, Handler h, Obj o, bool oneshot=false, bool autostart=true) const
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
void timerCallback(const ros::TimerEvent &e)
ROSCPP_DECL bool waitForService(const std::string &service_name, int32_t timeout)