angleBetweenRays(const cv::Point3d &ray1, const cv::Point3d &ray2) const | depth_sensor_pose::DepthSensorPose | protected |
calcDeltaAngleForImgRows(double vertical_fov) | depth_sensor_pose::DepthSensorPose | protected |
calcGroundDistancesForImgRows(double mount_height, double tilt_angle, std::vector< double > &distances) | depth_sensor_pose::DepthSensorPose | protected |
DepthSensorPose()=default | depth_sensor_pose::DepthSensorPose | |
DepthSensorPose(const DepthSensorPose &)=delete | depth_sensor_pose::DepthSensorPose | |
estimateParams(const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::CameraInfoConstPtr &info_msg) | depth_sensor_pose::DepthSensorPose | |
fieldOfView(double &min, double &max, double x1, double y1, double xc, double yc, double x2, double y2) | depth_sensor_pose::DepthSensorPose | protected |
getDbgImage() const | depth_sensor_pose::DepthSensorPose | |
getGroundPoints(const sensor_msgs::ImageConstPtr &depth_msg, pcl::PointCloud< pcl::PointXYZ >::Ptr &points, std::list< std::pair< unsigned, unsigned >> &points_indices) | depth_sensor_pose::DepthSensorPose | protected |
getPublishDepthEnable() const | depth_sensor_pose::DepthSensorPose | inline |
getSensorMountHeight() const | depth_sensor_pose::DepthSensorPose | inline |
getSensorTiltAngle() const | depth_sensor_pose::DepthSensorPose | inline |
lengthOfVector(const cv::Point3d &vec) const | depth_sensor_pose::DepthSensorPose | protected |
operator=(const DepthSensorPose &)=delete | depth_sensor_pose::DepthSensorPose | |
prepareDbgImage(const sensor_msgs::ImageConstPtr &depth_msg, const std::list< std::pair< unsigned, unsigned >> &ground_points_indices) | depth_sensor_pose::DepthSensorPose | protected |
sensorPoseCalibration(const sensor_msgs::ImageConstPtr &depth_msg, double &tilt_angle, double &height) | depth_sensor_pose::DepthSensorPose | protected |
setCamModelUpdate(const bool u) | depth_sensor_pose::DepthSensorPose | inline |
setDepthImgStepCol(const int step) | depth_sensor_pose::DepthSensorPose | |
setDepthImgStepRow(const int step) | depth_sensor_pose::DepthSensorPose | |
setGroundMaxPoints(const unsigned u) | depth_sensor_pose::DepthSensorPose | inline |
setPublishDepthEnable(const bool enable) | depth_sensor_pose::DepthSensorPose | inline |
setRangeLimits(const float rmin, const float rmax) | depth_sensor_pose::DepthSensorPose | |
setRansacDistanceThresh(const float u) | depth_sensor_pose::DepthSensorPose | inline |
setRansacMaxIter(const unsigned u) | depth_sensor_pose::DepthSensorPose | inline |
setReconfParamsUpdated(bool updated) | depth_sensor_pose::DepthSensorPose | inline |
setSensorMountHeightMax(const float height) | depth_sensor_pose::DepthSensorPose | |
setSensorMountHeightMin(const float height) | depth_sensor_pose::DepthSensorPose | |
setSensorTiltAngleMax(const float angle) | depth_sensor_pose::DepthSensorPose | |
setSensorTiltAngleMin(const float angle) | depth_sensor_pose::DepthSensorPose | |
setUsedDepthHeight(const unsigned height) | depth_sensor_pose::DepthSensorPose | |
~DepthSensorPose()=default | depth_sensor_pose::DepthSensorPose | |