Public Member Functions | Private Member Functions | Private Attributes | List of all members
rtabmap_ros::ObstaclesDetectionOld Class Reference
Inheritance diagram for rtabmap_ros::ObstaclesDetectionOld:
Inheritance graph
[legend]

Public Member Functions

 ObstaclesDetectionOld ()
 
virtual ~ObstaclesDetectionOld ()
 
- Public Member Functions inherited from nodelet::Nodelet
void init (const std::string &name, const M_string &remapping_args, const V_string &my_argv, ros::CallbackQueueInterface *st_queue=NULL, ros::CallbackQueueInterface *mt_queue=NULL)
 
 Nodelet ()
 
virtual ~Nodelet ()
 

Private Member Functions

void callback (const sensor_msgs::PointCloud2ConstPtr &cloudMsg)
 
virtual void onInit ()
 

Private Attributes

ros::Subscriber cloudSub_
 
double clusterRadius_
 
std::string frameId_
 
double groundNormalAngle_
 
ros::Publisher groundPub_
 
double maxGroundHeight_
 
double maxObstaclesHeight_
 
int minClusterSize_
 
int normalKSearch_
 
ros::Publisher obstaclesPub_
 
bool optimizeForCloseObjects_
 
ros::Publisher projObstaclesPub_
 
double projVoxelSize_
 
bool segmentFlatObstacles_
 
tf::TransformListener tfListener_
 
bool waitForTransform_
 

Additional Inherited Members

- Protected Member Functions inherited from nodelet::Nodelet
ros::CallbackQueueInterfacegetMTCallbackQueue () const
 
ros::NodeHandlegetMTNodeHandle () const
 
ros::NodeHandlegetMTPrivateNodeHandle () const
 
const V_stringgetMyArgv () const
 
const std::stringgetName () const
 
ros::NodeHandlegetNodeHandle () const
 
ros::NodeHandlegetPrivateNodeHandle () const
 
const M_stringgetRemappingArgs () const
 
ros::CallbackQueueInterfacegetSTCallbackQueue () const
 
std::string getSuffixedName (const std::string &suffix) const
 

Detailed Description

Definition at line 50 of file obstacles_detection_old.cpp.

Constructor & Destructor Documentation

◆ ObstaclesDetectionOld()

rtabmap_ros::ObstaclesDetectionOld::ObstaclesDetectionOld ( )
inline

Definition at line 53 of file obstacles_detection_old.cpp.

◆ ~ObstaclesDetectionOld()

virtual rtabmap_ros::ObstaclesDetectionOld::~ObstaclesDetectionOld ( )
inlinevirtual

Definition at line 67 of file obstacles_detection_old.cpp.

Member Function Documentation

◆ callback()

void rtabmap_ros::ObstaclesDetectionOld::callback ( const sensor_msgs::PointCloud2ConstPtr &  cloudMsg)
inlineprivate

Definition at line 110 of file obstacles_detection_old.cpp.

◆ onInit()

virtual void rtabmap_ros::ObstaclesDetectionOld::onInit ( )
inlineprivatevirtual

Implements nodelet::Nodelet.

Definition at line 71 of file obstacles_detection_old.cpp.

Member Data Documentation

◆ cloudSub_

ros::Subscriber rtabmap_ros::ObstaclesDetectionOld::cloudSub_
private

Definition at line 351 of file obstacles_detection_old.cpp.

◆ clusterRadius_

double rtabmap_ros::ObstaclesDetectionOld::clusterRadius_
private

Definition at line 336 of file obstacles_detection_old.cpp.

◆ frameId_

std::string rtabmap_ros::ObstaclesDetectionOld::frameId_
private

Definition at line 333 of file obstacles_detection_old.cpp.

◆ groundNormalAngle_

double rtabmap_ros::ObstaclesDetectionOld::groundNormalAngle_
private

Definition at line 335 of file obstacles_detection_old.cpp.

◆ groundPub_

ros::Publisher rtabmap_ros::ObstaclesDetectionOld::groundPub_
private

Definition at line 347 of file obstacles_detection_old.cpp.

◆ maxGroundHeight_

double rtabmap_ros::ObstaclesDetectionOld::maxGroundHeight_
private

Definition at line 339 of file obstacles_detection_old.cpp.

◆ maxObstaclesHeight_

double rtabmap_ros::ObstaclesDetectionOld::maxObstaclesHeight_
private

Definition at line 338 of file obstacles_detection_old.cpp.

◆ minClusterSize_

int rtabmap_ros::ObstaclesDetectionOld::minClusterSize_
private

Definition at line 337 of file obstacles_detection_old.cpp.

◆ normalKSearch_

int rtabmap_ros::ObstaclesDetectionOld::normalKSearch_
private

Definition at line 334 of file obstacles_detection_old.cpp.

◆ obstaclesPub_

ros::Publisher rtabmap_ros::ObstaclesDetectionOld::obstaclesPub_
private

Definition at line 348 of file obstacles_detection_old.cpp.

◆ optimizeForCloseObjects_

bool rtabmap_ros::ObstaclesDetectionOld::optimizeForCloseObjects_
private

Definition at line 342 of file obstacles_detection_old.cpp.

◆ projObstaclesPub_

ros::Publisher rtabmap_ros::ObstaclesDetectionOld::projObstaclesPub_
private

Definition at line 349 of file obstacles_detection_old.cpp.

◆ projVoxelSize_

double rtabmap_ros::ObstaclesDetectionOld::projVoxelSize_
private

Definition at line 343 of file obstacles_detection_old.cpp.

◆ segmentFlatObstacles_

bool rtabmap_ros::ObstaclesDetectionOld::segmentFlatObstacles_
private

Definition at line 340 of file obstacles_detection_old.cpp.

◆ tfListener_

tf::TransformListener rtabmap_ros::ObstaclesDetectionOld::tfListener_
private

Definition at line 345 of file obstacles_detection_old.cpp.

◆ waitForTransform_

bool rtabmap_ros::ObstaclesDetectionOld::waitForTransform_
private

Definition at line 341 of file obstacles_detection_old.cpp.


The documentation for this class was generated from the following file:


rtabmap_ros
Author(s): Mathieu Labbe
autogenerated on Tue Jan 24 2023 04:04:40