This is the complete list of members for fake_object_recognition::Rating, including all inherited members.
camera_orientation_ | fake_object_recognition::Rating | private |
fcp_ | fake_object_recognition::Rating | private |
fovx_ | fake_object_recognition::Rating | private |
fovy_ | fake_object_recognition::Rating | private |
getAngleRating(const geometry_msgs::Pose &object_pose, bool direction) | fake_object_recognition::Rating | private |
getBBRating(const std::array< geometry_msgs::Point, 8 > &bounding_box) | fake_object_recognition::Rating | private |
getDistanceRating(const geometry_msgs::Pose &object_pose) | fake_object_recognition::Rating | private |
getNormalRating(const geometry_msgs::Pose &object_pose, const std::vector< geometry_msgs::Point > &normals) | fake_object_recognition::Rating | private |
ncp_ | fake_object_recognition::Rating | private |
rateBBandNormal(const geometry_msgs::Pose &object_pose, const std::array< geometry_msgs::Point, 8 > &bounding_box, const std::vector< geometry_msgs::Point > &normals, double threshold) | fake_object_recognition::Rating | |
ratePose(const geometry_msgs::Pose &pose, double threshold_d, double threshold_x, double threshold_y) | fake_object_recognition::Rating | |
Rating(double fovx, double fovy, double ncp, double fcp) | fake_object_recognition::Rating |