#include "ros/ros.h"#include "sensor_msgs/PointCloud.h"#include "geometry_msgs/Pose.h"#include "move_base_msgs/MoveBaseAction.h"#include "actionlib/client/simple_action_client.h"#include "pcl/common/angles.h"#include "LinearMath/btQuaternion.h"#include <pr2_controllers_msgs/SingleJointPositionAction.h>#include <pr2_msgs/SetPeriodicCmd.h>#include <pr2_msgs/PeriodicCmd.h>#include <pr2_msgs/LaserTrajCmd.h>#include <pr2_msgs/SetLaserTrajCmd.h>#include "pr2_msgs/LaserScannerSignal.h"
Go to the source code of this file.
Classes | |
| class | AutonomousExploration |
Functions | |
| int | main (int argc, char **argv) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 275 of file autonomous_exploration.cpp.