
Public Member Functions | |
| ObstaclesDetection () | |
| virtual | ~ObstaclesDetection () |
Private Member Functions | |
| void | callback (const sensor_msgs::PointCloud2ConstPtr &cloudMsg) |
| virtual void | onInit () |
| void | parameterMoved (ros::NodeHandle &nh, const std::string &rosName, const std::string ¶meterName, rtabmap::ParametersMap ¶meters) |
Private Attributes | |
| ros::Subscriber | cloudSub_ |
| std::string | frameId_ |
| rtabmap::OccupancyGrid | grid_ |
| ros::Publisher | groundPub_ |
| std::string | mapFrameId_ |
| bool | mapFrameProjection_ |
| ros::Publisher | obstaclesPub_ |
| ros::Publisher | projObstaclesPub_ |
| tf::TransformListener | tfListener_ |
| bool | waitForTransform_ |
Definition at line 49 of file obstacles_detection.cpp.
| rtabmap_ros::ObstaclesDetection::ObstaclesDetection | ( | ) | [inline] |
Definition at line 52 of file obstacles_detection.cpp.
| virtual rtabmap_ros::ObstaclesDetection::~ObstaclesDetection | ( | ) | [inline, virtual] |
Definition at line 58 of file obstacles_detection.cpp.
| void rtabmap_ros::ObstaclesDetection::callback | ( | const sensor_msgs::PointCloud2ConstPtr & | cloudMsg | ) | [inline, private] |
Definition at line 236 of file obstacles_detection.cpp.
| virtual void rtabmap_ros::ObstaclesDetection::onInit | ( | ) | [inline, private, virtual] |
Implements nodelet::Nodelet.
Definition at line 106 of file obstacles_detection.cpp.
| void rtabmap_ros::ObstaclesDetection::parameterMoved | ( | ros::NodeHandle & | nh, |
| const std::string & | rosName, | ||
| const std::string & | parameterName, | ||
| rtabmap::ParametersMap & | parameters | ||
| ) | [inline, private] |
Definition at line 63 of file obstacles_detection.cpp.
Definition at line 435 of file obstacles_detection.cpp.
std::string rtabmap_ros::ObstaclesDetection::frameId_ [private] |
Definition at line 422 of file obstacles_detection.cpp.
Definition at line 426 of file obstacles_detection.cpp.
Definition at line 431 of file obstacles_detection.cpp.
std::string rtabmap_ros::ObstaclesDetection::mapFrameId_ [private] |
Definition at line 423 of file obstacles_detection.cpp.
bool rtabmap_ros::ObstaclesDetection::mapFrameProjection_ [private] |
Definition at line 427 of file obstacles_detection.cpp.
Definition at line 432 of file obstacles_detection.cpp.
Definition at line 433 of file obstacles_detection.cpp.
Definition at line 429 of file obstacles_detection.cpp.
bool rtabmap_ros::ObstaclesDetection::waitForTransform_ [private] |
Definition at line 424 of file obstacles_detection.cpp.