Public Member Functions | |
void | gotIntersection (const tf::Vector3 &pt) |
void | run (void) |
void | sendPoint (double x, double y, double z) |
TestSelfFilter (void) | |
~TestSelfFilter (void) | |
Protected Member Functions | |
double | uniform (double magnitude) |
Protected Attributes | |
int | id_ |
ros::NodeHandle | nodeHandle_ |
robot_self_filter::SelfMask * | sf_ |
tf::TransformListener | tf_ |
ros::Publisher | vmPub_ |
Definition at line 46 of file test_filter.cpp.
TestSelfFilter::TestSelfFilter | ( | void | ) | [inline] |
Definition at line 50 of file test_filter.cpp.
TestSelfFilter::~TestSelfFilter | ( | void | ) | [inline] |
Definition at line 63 of file test_filter.cpp.
void TestSelfFilter::gotIntersection | ( | const tf::Vector3 & | pt | ) | [inline] |
Definition at line 68 of file test_filter.cpp.
void TestSelfFilter::run | ( | void | ) | [inline] |
Definition at line 102 of file test_filter.cpp.
void TestSelfFilter::sendPoint | ( | double | x, |
double | y, | ||
double | z | ||
) | [inline] |
Definition at line 73 of file test_filter.cpp.
double TestSelfFilter::uniform | ( | double | magnitude | ) | [inline, protected] |
Definition at line 151 of file test_filter.cpp.
int TestSelfFilter::id_ [protected] |
Definition at line 160 of file test_filter.cpp.
ros::NodeHandle TestSelfFilter::nodeHandle_ [protected] |
Definition at line 159 of file test_filter.cpp.
robot_self_filter::SelfMask* TestSelfFilter::sf_ [protected] |
Definition at line 157 of file test_filter.cpp.
tf::TransformListener TestSelfFilter::tf_ [protected] |
Definition at line 156 of file test_filter.cpp.
ros::Publisher TestSelfFilter::vmPub_ [protected] |
Definition at line 158 of file test_filter.cpp.