Public Member Functions | |
| void | run () | 
| void | sendPoint (double x, double y, double z) | 
| void | setShapeTransformAndMarker (bodies::Body *s, visualization_msgs::Marker &mk) | 
| void | testBox (void) | 
| void | testConvexMesh (void) | 
| void | testCylinder (void) | 
| void | testShape (bodies::Body *s) | 
| void | testSphere (void) | 
| TestVM (void) | |
| virtual | ~TestVM (void) | 
Protected Member Functions | |
| double | uniform (double magnitude) | 
Protected Attributes | |
| int | m_id | 
| ros::NodeHandle | m_nodeHandle | 
| ros::Time | m_tm | 
| ros::Publisher | m_vmPub | 
Definition at line 48 of file test_cs_point_inclusion.cpp.
| TestVM::TestVM | ( | void | ) |  [inline] | 
        
Definition at line 52 of file test_cs_point_inclusion.cpp.
| virtual TestVM::~TestVM | ( | void | ) |  [inline, virtual] | 
        
Definition at line 58 of file test_cs_point_inclusion.cpp.
| void TestVM::run | ( | void | ) |  [inline] | 
        
Definition at line 275 of file test_cs_point_inclusion.cpp.
| void TestVM::sendPoint | ( | double | x, | 
| double | y, | ||
| double | z | ||
| ) |  [inline] | 
        
Definition at line 62 of file test_cs_point_inclusion.cpp.
| void TestVM::setShapeTransformAndMarker | ( | bodies::Body * | s, | 
| visualization_msgs::Marker & | mk | ||
| ) |  [inline] | 
        
Definition at line 102 of file test_cs_point_inclusion.cpp.
| void TestVM::testBox | ( | void | ) |  [inline] | 
        
Definition at line 172 of file test_cs_point_inclusion.cpp.
| void TestVM::testConvexMesh | ( | void | ) |  [inline] | 
        
Definition at line 230 of file test_cs_point_inclusion.cpp.
| void TestVM::testCylinder | ( | void | ) |  [inline] | 
        
Definition at line 201 of file test_cs_point_inclusion.cpp.
| void TestVM::testShape | ( | bodies::Body * | s | ) |  [inline] | 
        
Definition at line 89 of file test_cs_point_inclusion.cpp.
| void TestVM::testSphere | ( | void | ) |  [inline] | 
        
Definition at line 144 of file test_cs_point_inclusion.cpp.
| double TestVM::uniform | ( | double | magnitude | ) |  [inline, protected] | 
        
Definition at line 296 of file test_cs_point_inclusion.cpp.
int TestVM::m_id [protected] | 
        
Definition at line 304 of file test_cs_point_inclusion.cpp.
ros::NodeHandle TestVM::m_nodeHandle [protected] | 
        
Definition at line 301 of file test_cs_point_inclusion.cpp.
ros::Time TestVM::m_tm [protected] | 
        
Definition at line 303 of file test_cs_point_inclusion.cpp.
ros::Publisher TestVM::m_vmPub [protected] | 
        
Definition at line 302 of file test_cs_point_inclusion.cpp.