1 #ifndef PLUGIN_INTERFACE_H_ 2 #define PLUGIN_INTERFACE_H_ 6 #include <sensor_msgs/PointCloud2.h> 28 virtual sensor_msgs::PointCloud2
filterPointCloud(
const sensor_msgs::PointCloud2 msg) = 0;
44 #endif // PLUGIN_INTERFACE_H_ virtual ~PluginInterface()
virtual sensor_msgs::PointCloud2 filterPointCloud(const sensor_msgs::PointCloud2 msg)=0
virtual void onInitialize()
This is called at the end of initialize(). Override to implement subclass-specific initialization...
bool enabled_
Currently this var is managed by subclasses. TODO: make this managed by this class and/or container c...
const std::string getName() const
void initialize(const std::string name, ros::NodeHandle &nh)