bufferCloud(const sensor_msgs::PointCloud2 &cloud) | costmap_2d::ObservationBuffer | |
bufferCloud(const pcl::PointCloud< pcl::PointXYZ > &cloud) | costmap_2d::ObservationBuffer | |
expected_update_rate_ | costmap_2d::ObservationBuffer | private |
getObservations(std::vector< Observation > &observations) | costmap_2d::ObservationBuffer | |
global_frame_ | costmap_2d::ObservationBuffer | private |
isCurrent() const | costmap_2d::ObservationBuffer | |
last_updated_ | costmap_2d::ObservationBuffer | private |
lock() | costmap_2d::ObservationBuffer | inline |
lock_ | costmap_2d::ObservationBuffer | private |
max_obstacle_height_ | costmap_2d::ObservationBuffer | private |
min_obstacle_height_ | costmap_2d::ObservationBuffer | private |
observation_keep_time_ | costmap_2d::ObservationBuffer | private |
observation_list_ | costmap_2d::ObservationBuffer | private |
ObservationBuffer(std::string topic_name, double observation_keep_time, double expected_update_rate, double min_obstacle_height, double max_obstacle_height, double obstacle_range, double raytrace_range, tf::TransformListener &tf, std::string global_frame, std::string sensor_frame, double tf_tolerance) | costmap_2d::ObservationBuffer | |
obstacle_range_ | costmap_2d::ObservationBuffer | private |
purgeStaleObservations() | costmap_2d::ObservationBuffer | private |
raytrace_range_ | costmap_2d::ObservationBuffer | private |
resetLastUpdated() | costmap_2d::ObservationBuffer | |
sensor_frame_ | costmap_2d::ObservationBuffer | private |
setGlobalFrame(const std::string new_global_frame) | costmap_2d::ObservationBuffer | |
tf_ | costmap_2d::ObservationBuffer | private |
tf_tolerance_ | costmap_2d::ObservationBuffer | private |
topic_name_ | costmap_2d::ObservationBuffer | private |
unlock() | costmap_2d::ObservationBuffer | inline |
~ObservationBuffer() | costmap_2d::ObservationBuffer | |