#include <PluginInterface.h>
Definition at line 11 of file PluginInterface.h.
rtabmap_ros::PluginInterface::PluginInterface |
( |
| ) |
|
virtual rtabmap_ros::PluginInterface::~PluginInterface |
( |
| ) |
|
|
inlinevirtual |
virtual sensor_msgs::PointCloud2 rtabmap_ros::PluginInterface::filterPointCloud |
( |
const sensor_msgs::PointCloud2 |
msg | ) |
|
|
pure virtual |
const std::string rtabmap_ros::PluginInterface::getName |
( |
void |
| ) |
const |
|
inline |
void rtabmap_ros::PluginInterface::initialize |
( |
const std::string |
name, |
|
|
ros::NodeHandle & |
nh |
|
) |
| |
bool rtabmap_ros::PluginInterface::isEnabled |
( |
| ) |
|
|
inline |
virtual void rtabmap_ros::PluginInterface::onInitialize |
( |
| ) |
|
|
inlineprotectedvirtual |
bool rtabmap_ros::PluginInterface::enabled_ |
|
protected |
Currently this var is managed by subclasses. TODO: make this managed by this class and/or container class.
Definition at line 36 of file PluginInterface.h.
std::string rtabmap_ros::PluginInterface::name_ |
|
protected |
The documentation for this class was generated from the following files: