, including all inherited members.
alpha_ | fast_plane_detection::PlaneDetection | [private] |
beta_ | fast_plane_detection::PlaneDetection | [private] |
disp_ | fast_plane_detection::PlaneDetection | [private] |
drange_ | fast_plane_detection::PlaneDetection | [private] |
err_ | fast_plane_detection::PlaneDetection | [private] |
find_table_ | fast_plane_detection::PlaneDetection | [private] |
GetHistX(sensor_msgs::Image &image, float &beta, float &disp) | fast_plane_detection::PlaneDetection | |
GetHistY(sensor_msgs::Image &image, float &beta, float &disp) | fast_plane_detection::PlaneDetection | |
GetLabels(sensor_msgs::Image &image) | fast_plane_detection::PlaneDetection | |
GetMeanSquaredError(float &mean_error) | fast_plane_detection::PlaneDetection | |
GetNDisp(int &n_disp) | fast_plane_detection::PlaneDetection | |
GetNInliers(int &n_inliers) | fast_plane_detection::PlaneDetection | |
GetPlaneParameters(float &alpha, float &beta, float &d, int &min_x, int &max_x, int &min_y, int &max_y) | fast_plane_detection::PlaneDetection | |
GetSpreadX() | fast_plane_detection::PlaneDetection | |
GetSpreadY() | fast_plane_detection::PlaneDetection | |
GetSumOfSquaredError(float &error) | fast_plane_detection::PlaneDetection | |
height_ | fast_plane_detection::PlaneDetection | [private] |
hist_x_ | fast_plane_detection::PlaneDetection | [private] |
hist_y_ | fast_plane_detection::PlaneDetection | [private] |
labels_ | fast_plane_detection::PlaneDetection | [private] |
max_x_ | fast_plane_detection::PlaneDetection | [private] |
max_y_ | fast_plane_detection::PlaneDetection | [private] |
min_beta_ | fast_plane_detection::PlaneDetection | [private] |
min_x_ | fast_plane_detection::PlaneDetection | [private] |
min_y_ | fast_plane_detection::PlaneDetection | [private] |
n_disps_ | fast_plane_detection::PlaneDetection | [private] |
n_inliers_ | fast_plane_detection::PlaneDetection | [private] |
PlaneDetection(int drange, int w, int h, bool find_table, std_msgs::Header img_header, bool search_y=true) | fast_plane_detection::PlaneDetection | |
search_y_ | fast_plane_detection::PlaneDetection | [private] |
spread_d_x_ | fast_plane_detection::PlaneDetection | [private] |
spread_d_y_ | fast_plane_detection::PlaneDetection | [private] |
tmp_beta_ | fast_plane_detection::PlaneDetection | [private] |
tmp_beta_x_ | fast_plane_detection::PlaneDetection | [private] |
tmp_disp_ | fast_plane_detection::PlaneDetection | [private] |
tmp_disp_x_ | fast_plane_detection::PlaneDetection | [private] |
Update(const stereo_msgs::DisparityImage::ConstPtr &disparity_image) | fast_plane_detection::PlaneDetection | |
Update_X(const stereo_msgs::DisparityImage::ConstPtr &disparity_image) | fast_plane_detection::PlaneDetection | [private] |
Update_Y(const stereo_msgs::DisparityImage::ConstPtr &disparity_image) | fast_plane_detection::PlaneDetection | [private] |
width_ | fast_plane_detection::PlaneDetection | [private] |
~PlaneDetection() | fast_plane_detection::PlaneDetection | |