#include <algorithm>#include <string>#include <vector>#include <sstream>#include <boost/python.hpp>#include <python2.7/Python.h>#include <ros/serialization.h>#include <sensor_msgs/LaserScan.h>#include <lama_msgs/Crossing.h>#include <lama_msgs/Frontier.h>#include <crossing_detector/laser_crossing_detector.h>#include <crossing_detector/wrapper_utils.h>
Go to the source code of this file.
Classes | |
| class | LaserCrossingDetectorWrapper |
Functions | |
| BOOST_PYTHON_MODULE (laser_crossing_detector_wrapper_cpp) | |
| BOOST_PYTHON_MODULE | ( | laser_crossing_detector_wrapper_cpp | ) |
Definition at line 68 of file laser_crossing_detector_wrapper.cpp.