#include <cloud_accum.h>
Public Member Functions | |
void | push (const std::string &key, const sensor_msgs::PointCloud2::ConstPtr &msg, std::function< void()> process, std::function< bool(const sensor_msgs::PointCloud2::ConstPtr &)> accumulate, std::function< void()> clear) final |
void | reset () final |
Additional Inherited Members | |
Public Types inherited from mcl_3dl::CloudAccumulationLogicBase | |
using | Ptr = std::shared_ptr< CloudAccumulationLogicBase > |
Definition at line 57 of file cloud_accum.h.
|
finalvirtual |
Implements mcl_3dl::CloudAccumulationLogicBase.
Definition at line 41 of file cloud_accum.cpp.
|
inlinefinalvirtual |
Implements mcl_3dl::CloudAccumulationLogicBase.
Definition at line 67 of file cloud_accum.h.