Protected Member Functions | |
geometry_msgs::Point | Point (float x, float y) |
virtual void | SetUp () |
void | testProcessing () |
Protected Attributes | |
calibration_msgs::CalibrationPattern | features_ |
LaserJointProcessor | processor_ |
calibration_msgs::JointStateCalibrationPattern | result_ |
calibration_msgs::DenseLaserSnapshot | snapshot_ |
Static Protected Attributes | |
static const unsigned int | P = 7 |
Definition at line 43 of file laser_joint_processor_unittest.cpp.
geometry_msgs::Point LaserJointProcessor_EasyTests::Point | ( | float | x, |
float | y | ||
) | [inline, protected] |
Definition at line 111 of file laser_joint_processor_unittest.cpp.
virtual void LaserJointProcessor_EasyTests::SetUp | ( | ) | [inline, protected, virtual] |
Definition at line 46 of file laser_joint_processor_unittest.cpp.
void LaserJointProcessor_EasyTests::testProcessing | ( | ) | [inline, protected] |
Definition at line 103 of file laser_joint_processor_unittest.cpp.
calibration_msgs::CalibrationPattern LaserJointProcessor_EasyTests::features_ [protected] |
Definition at line 121 of file laser_joint_processor_unittest.cpp.
const unsigned int LaserJointProcessor_EasyTests::P = 7 [static, protected] |
Definition at line 119 of file laser_joint_processor_unittest.cpp.
Definition at line 123 of file laser_joint_processor_unittest.cpp.
calibration_msgs::JointStateCalibrationPattern LaserJointProcessor_EasyTests::result_ [protected] |
Definition at line 120 of file laser_joint_processor_unittest.cpp.
calibration_msgs::DenseLaserSnapshot LaserJointProcessor_EasyTests::snapshot_ [protected] |
Definition at line 122 of file laser_joint_processor_unittest.cpp.