Public Member Functions | |
| bool | compareDoorMsgs (door_msgs::Door msg_1, door_msgs::Door msg_2, std::string &print_string) |
| bool | detectDoor (const door_msgs::Door &door_estimate, door_msgs::Door &door_detection) |
| bool | detectDoorCheckerboard (const door_msgs::Door &door_estimate, door_msgs::Door &door_detection) |
| double | distancePoints (geometry_msgs::Point32 p1, geometry_msgs::Point32 p2) |
| double | distancePointsXY (geometry_msgs::Point32 p1, geometry_msgs::Point32 p2) |
| void | joyCallback () |
| void | pointTFToMsg32 (const tf::Vector3 &in, geometry_msgs::Point32 &out) |
| TestDoorDetectionNode (std::string node_name) | |
| void | transformTFPoint (const std::string &frame, const Stamped< tf::Point > &in, Stamped< tf::Point > &out) |
| ~TestDoorDetectionNode () | |
Public Attributes | |
| door_msgs::Door | door_msg_from_checkerboard_ |
| door_msgs::Door | door_msg_from_detector_ |
| door_msgs::Door | door_msg_to_detector_ |
| double | door_width_ |
| std::string | frame_id_ |
| std_msgs::String | joy_msg_ |
| std::string | joy_topic_ |
| tf::TransformListener | tf_ |
Definition at line 52 of file test_door_detection.cpp.
| TestDoorDetectionNode::TestDoorDetectionNode | ( | std::string | node_name | ) | [inline] |
Definition at line 64 of file test_door_detection.cpp.
| TestDoorDetectionNode::~TestDoorDetectionNode | ( | ) | [inline] |
Definition at line 81 of file test_door_detection.cpp.
| bool TestDoorDetectionNode::compareDoorMsgs | ( | door_msgs::Door | msg_1, | |
| door_msgs::Door | msg_2, | |||
| std::string & | print_string | |||
| ) | [inline] |
Definition at line 158 of file test_door_detection.cpp.
| bool TestDoorDetectionNode::detectDoor | ( | const door_msgs::Door & | door_estimate, | |
| door_msgs::Door & | door_detection | |||
| ) | [inline] |
Definition at line 215 of file test_door_detection.cpp.
| bool TestDoorDetectionNode::detectDoorCheckerboard | ( | const door_msgs::Door & | door_estimate, | |
| door_msgs::Door & | door_detection | |||
| ) | [inline] |
Definition at line 228 of file test_door_detection.cpp.
| double TestDoorDetectionNode::distancePoints | ( | geometry_msgs::Point32 | p1, | |
| geometry_msgs::Point32 | p2 | |||
| ) | [inline] |
Definition at line 149 of file test_door_detection.cpp.
| double TestDoorDetectionNode::distancePointsXY | ( | geometry_msgs::Point32 | p1, | |
| geometry_msgs::Point32 | p2 | |||
| ) | [inline] |
Definition at line 153 of file test_door_detection.cpp.
| void TestDoorDetectionNode::joyCallback | ( | ) | [inline] |
Definition at line 115 of file test_door_detection.cpp.
| void TestDoorDetectionNode::pointTFToMsg32 | ( | const tf::Vector3 & | in, | |
| geometry_msgs::Point32 & | out | |||
| ) | [inline] |
Definition at line 108 of file test_door_detection.cpp.
| void TestDoorDetectionNode::transformTFPoint | ( | const std::string & | frame, | |
| const Stamped< tf::Point > & | in, | |||
| Stamped< tf::Point > & | out | |||
| ) | [inline] |
Definition at line 86 of file test_door_detection.cpp.
| door_msgs::Door TestDoorDetectionNode::door_msg_from_checkerboard_ |
Definition at line 60 of file test_door_detection.cpp.
| door_msgs::Door TestDoorDetectionNode::door_msg_from_detector_ |
Definition at line 61 of file test_door_detection.cpp.
| door_msgs::Door TestDoorDetectionNode::door_msg_to_detector_ |
Definition at line 62 of file test_door_detection.cpp.
Definition at line 57 of file test_door_detection.cpp.
| std::string TestDoorDetectionNode::frame_id_ |
Definition at line 55 of file test_door_detection.cpp.
| std_msgs::String TestDoorDetectionNode::joy_msg_ |
Definition at line 56 of file test_door_detection.cpp.
| std::string TestDoorDetectionNode::joy_topic_ |
Definition at line 55 of file test_door_detection.cpp.
| tf::TransformListener TestDoorDetectionNode::tf_ |
Used to do transforms
Definition at line 58 of file test_door_detection.cpp.