Class PointcloudInputHandler

Inheritance Relationships

Base Type

Class Documentation

class PointcloudInputHandler : public wavemap::InputHandler

Public Functions

PointcloudInputHandler(const PointcloudInputHandlerConfig &config, const param::Value &params, std::string world_frame, VolumetricDataStructureBase::Ptr occupancy_map, std::shared_ptr<TfTransformer> transformer, std::shared_ptr<ThreadPool> thread_pool, ros::NodeHandle nh, ros::NodeHandle nh_private)
inline virtual InputHandlerType getType() const override
inline PointcloudTopicType getTopicType() const
void callback(const sensor_msgs::PointCloud2 &pointcloud_msg)

Public Static Functions

template<typename RegistrarT>
static bool registerCallback(PointcloudTopicType type, RegistrarT registrar)