#include <ros/ros.h>#include "laser_assembler/AssembleScans.h"#include "pr2_arm_navigation_perception/BuildCloudAngle.h"#include "pr2_msgs/SetPeriodicCmd.h"#include "sensor_msgs/PointCloud.h"#include "pr2_msgs/LaserScannerSignal.h"#include <boost/thread/mutex.hpp>
Go to the source code of this file.
Classes | |
| class | pr2_laser_snapshotter::PointCloudSrv |
Namespaces | |
| namespace | pr2_laser_snapshotter |
Functions | |
| int | main (int argc, char **argv) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 142 of file point_cloud_srv.cpp.