
Public Member Functions | |
| ObstaclesDetection () | |
| virtual | ~ObstaclesDetection () |
Private Member Functions | |
| void | callback (const sensor_msgs::PointCloud2ConstPtr &cloudMsg) |
| virtual void | onInit () |
Private Attributes | |
| ros::Subscriber | cloudSub_ |
| std::string | frameId_ |
| double | groundNormalAngle_ |
| ros::Publisher | groundPub_ |
| double | maxObstaclesHeight_ |
| int | minClusterSize_ |
| double | normalEstimationRadius_ |
| ros::Publisher | obstaclesPub_ |
| tf::TransformListener | tfListener_ |
| bool | waitForTransform_ |
Definition at line 63 of file obstacles_detection.cpp.
| rtabmap_ros::ObstaclesDetection::ObstaclesDetection | ( | ) | [inline] |
Definition at line 66 of file obstacles_detection.cpp.
| virtual rtabmap_ros::ObstaclesDetection::~ObstaclesDetection | ( | ) | [inline, virtual] |
Definition at line 75 of file obstacles_detection.cpp.
| void rtabmap_ros::ObstaclesDetection::callback | ( | const sensor_msgs::PointCloud2ConstPtr & | cloudMsg | ) | [inline, private] |
Definition at line 101 of file obstacles_detection.cpp.
| virtual void rtabmap_ros::ObstaclesDetection::onInit | ( | ) | [inline, private, virtual] |
Implements nodelet::Nodelet.
Definition at line 79 of file obstacles_detection.cpp.
Definition at line 192 of file obstacles_detection.cpp.
std::string rtabmap_ros::ObstaclesDetection::frameId_ [private] |
Definition at line 180 of file obstacles_detection.cpp.
double rtabmap_ros::ObstaclesDetection::groundNormalAngle_ [private] |
Definition at line 182 of file obstacles_detection.cpp.
Definition at line 189 of file obstacles_detection.cpp.
double rtabmap_ros::ObstaclesDetection::maxObstaclesHeight_ [private] |
Definition at line 184 of file obstacles_detection.cpp.
int rtabmap_ros::ObstaclesDetection::minClusterSize_ [private] |
Definition at line 183 of file obstacles_detection.cpp.
double rtabmap_ros::ObstaclesDetection::normalEstimationRadius_ [private] |
Definition at line 181 of file obstacles_detection.cpp.
Definition at line 190 of file obstacles_detection.cpp.
Definition at line 187 of file obstacles_detection.cpp.
bool rtabmap_ros::ObstaclesDetection::waitForTransform_ [private] |
Definition at line 185 of file obstacles_detection.cpp.