Public Member Functions | |
Pointcloud2ToMapNode () | |
Private Member Functions | |
void | cbCloud (const sensor_msgs::PointCloud2::ConstPtr &cloud, const bool singleshot) |
Private Attributes | |
std::vector< costmap_cspace::PointcloudAccumurator< sensor_msgs::PointCloud2 > > | accums_ |
std::string | global_frame_ |
unsigned int | height_ |
nav_msgs::OccupancyGrid | map_ |
ros::NodeHandle | nh_ |
float | origin_x_ |
float | origin_y_ |
ros::NodeHandle | pnh_ |
ros::Publisher | pub_map_ |
ros::Duration | publish_interval_ |
ros::Time | published_ |
std::string | robot_frame_ |
ros::Subscriber | sub_cloud_ |
ros::Subscriber | sub_cloud_single_ |
tf2_ros::Buffer | tfbuf_ |
tf2_ros::TransformListener | tfl_ |
unsigned int | width_ |
double | z_max_ |
double | z_min_ |
Definition at line 44 of file pointcloud2_to_map.cpp.
|
inline |
Definition at line 71 of file pointcloud2_to_map.cpp.
|
inlineprivate |
Definition at line 116 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 68 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 60 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 64 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 53 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 47 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 65 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 66 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 48 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 49 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 57 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 56 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 61 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 50 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 51 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 54 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 55 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 63 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 59 of file pointcloud2_to_map.cpp.
|
private |
Definition at line 59 of file pointcloud2_to_map.cpp.