This is the complete list of members for velodyne_pointcloud::OrganizedCloudXYZIR, including all inherited members.
addPoint(float x, float y, float z, const uint16_t ring, const uint16_t azimuth, const float distance, const float intensity, const float time) | velodyne_pointcloud::OrganizedCloudXYZIR | virtual |
cloud | velodyne_rawdata::DataContainerBase | |
computeTransformation(const ros::Time &time) | velodyne_rawdata::DataContainerBase | inline |
config_ | velodyne_rawdata::DataContainerBase | protected |
configure(const double max_range, const double min_range, const std::string fixed_frame, const std::string target_frame) | velodyne_rawdata::DataContainerBase | inline |
DataContainerBase(const double max_range, const double min_range, const std::string &target_frame, const std::string &fixed_frame, const unsigned int init_width, const unsigned int init_height, const bool is_dense, const unsigned int scans_per_packet, boost::shared_ptr< tf::TransformListener > &tf_ptr, int fields,...) | velodyne_rawdata::DataContainerBase | inline |
finishCloud() | velodyne_rawdata::DataContainerBase | inline |
iter_intensity | velodyne_pointcloud::OrganizedCloudXYZIR | private |
iter_ring | velodyne_pointcloud::OrganizedCloudXYZIR | private |
iter_time | velodyne_pointcloud::OrganizedCloudXYZIR | private |
iter_x | velodyne_pointcloud::OrganizedCloudXYZIR | private |
iter_y | velodyne_pointcloud::OrganizedCloudXYZIR | private |
iter_z | velodyne_pointcloud::OrganizedCloudXYZIR | private |
newLine() | velodyne_pointcloud::OrganizedCloudXYZIR | virtual |
OrganizedCloudXYZIR(const double max_range, const double min_range, const std::string &target_frame, const std::string &fixed_frame, const unsigned int num_lasers, const unsigned int scans_per_block, boost::shared_ptr< tf::TransformListener > tf_ptr=boost::shared_ptr< tf::TransformListener >()) | velodyne_pointcloud::OrganizedCloudXYZIR | |
pointInRange(float range) | velodyne_rawdata::DataContainerBase | inline |
setup(const velodyne_msgs::VelodyneScan::ConstPtr &scan_msg) | velodyne_pointcloud::OrganizedCloudXYZIR | virtual |
tf_ptr | velodyne_rawdata::DataContainerBase | protected |
transformation | velodyne_rawdata::DataContainerBase | protected |
transformPoint(float &x, float &y, float &z) | velodyne_rawdata::DataContainerBase | inline |
vectorTfToEigen(tf::Vector3 &tf_vec, Eigen::Vector3f &eigen_vec) | velodyne_rawdata::DataContainerBase | inline |