Public Types | |
typedef pcl::PointXYZRGB | Point |
typedef pcl::PointCloud < pcl::PointXYZRGB > | PointCloud |
Public Member Functions | |
void | callback (const PointCloud::ConstPtr &cloud) |
PointCloud::Ptr | filter (PointCloud::Ptr cloud) |
PointCloudMapper () | |
void | publishCallback (const ros::TimerEvent &) |
Private Attributes | |
PointCloud | accumulated_cloud_ |
ros::Publisher | cloud_pub_ |
ros::Subscriber | cloud_sub_ |
bool | filter_map_ |
std::string | fixed_frame_ |
ros::NodeHandle | nh_ |
ros::NodeHandle | nh_priv_ |
ros::Timer | pub_timer_ |
tf::TransformListener | tf_listener_ |
double | voxel_size_ |
double | x_filter_max_ |
double | x_filter_min_ |
double | y_filter_max_ |
double | y_filter_min_ |
double | z_filter_max_ |
double | z_filter_min_ |
Stores incoming point clouds in a map transforming each cloud to a global fixed frame using tf.
Definition at line 13 of file pointcloud_mapper.cpp.
Definition at line 17 of file pointcloud_mapper.cpp.
Definition at line 18 of file pointcloud_mapper.cpp.
PointCloudMapper::PointCloudMapper | ( | ) | [inline] |
Definition at line 20 of file pointcloud_mapper.cpp.
void PointCloudMapper::callback | ( | const PointCloud::ConstPtr & | cloud | ) | [inline] |
Definition at line 40 of file pointcloud_mapper.cpp.
PointCloud::Ptr PointCloudMapper::filter | ( | PointCloud::Ptr | cloud | ) | [inline] |
Definition at line 71 of file pointcloud_mapper.cpp.
void PointCloudMapper::publishCallback | ( | const ros::TimerEvent & | ) | [inline] |
Definition at line 63 of file pointcloud_mapper.cpp.
Definition at line 134 of file pointcloud_mapper.cpp.
ros::Publisher PointCloudMapper::cloud_pub_ [private] |
Definition at line 128 of file pointcloud_mapper.cpp.
ros::Subscriber PointCloudMapper::cloud_sub_ [private] |
Definition at line 127 of file pointcloud_mapper.cpp.
bool PointCloudMapper::filter_map_ [private] |
Definition at line 122 of file pointcloud_mapper.cpp.
std::string PointCloudMapper::fixed_frame_ [private] |
Definition at line 132 of file pointcloud_mapper.cpp.
ros::NodeHandle PointCloudMapper::nh_ [private] |
Definition at line 124 of file pointcloud_mapper.cpp.
ros::NodeHandle PointCloudMapper::nh_priv_ [private] |
Definition at line 125 of file pointcloud_mapper.cpp.
ros::Timer PointCloudMapper::pub_timer_ [private] |
Definition at line 130 of file pointcloud_mapper.cpp.
Definition at line 133 of file pointcloud_mapper.cpp.
double PointCloudMapper::voxel_size_ [private] |
Definition at line 121 of file pointcloud_mapper.cpp.
double PointCloudMapper::x_filter_max_ [private] |
Definition at line 116 of file pointcloud_mapper.cpp.
double PointCloudMapper::x_filter_min_ [private] |
Definition at line 115 of file pointcloud_mapper.cpp.
double PointCloudMapper::y_filter_max_ [private] |
Definition at line 118 of file pointcloud_mapper.cpp.
double PointCloudMapper::y_filter_min_ [private] |
Definition at line 117 of file pointcloud_mapper.cpp.
double PointCloudMapper::z_filter_max_ [private] |
Definition at line 120 of file pointcloud_mapper.cpp.
double PointCloudMapper::z_filter_min_ [private] |
Definition at line 119 of file pointcloud_mapper.cpp.