Class IntensityServer

Inheritance Relationships

Base Type

Class Documentation

class IntensityServer : public voxblox::TsdfServer

Public Functions

IntensityServer(const ros::NodeHandle &nh, const ros::NodeHandle &nh_private)
virtual ~IntensityServer()
virtual void updateMesh()

Incremental update.

virtual void publishPointclouds()
void intensityImageCallback(const sensor_msgs::ImageConstPtr &image)

Protected Attributes

ros::Subscriber intensity_image_sub_

Subscriber for intensity images.

ros::Publisher intensity_pointcloud_pub_
ros::Publisher intensity_mesh_pub_
double focal_length_px_

Parameters of the incoming UNDISTORTED intensity images.

int subsample_factor_

How much to subsample the image by (not proper downsampling, just subsampling).

std::shared_ptr<Layer<IntensityVoxel>> intensity_layer_
std::unique_ptr<IntensityIntegrator> intensity_integrator_
std::shared_ptr<ColorMap> color_map_