$search
Public Member Functions | |
| void | dynReconfCallback (cob_3d_mapping_common::keyframe_detectorConfig &config, uint32_t level) |
| KeyframeDetector () | |
| void | pointCloudSubCallback (sensor_msgs::CameraInfo::ConstPtr pc_in) |
| void | transformSubCallback (const tf::tfMessageConstPtr &msg) |
| bool | triggerKeyFrame () |
| ~KeyframeDetector () | |
Public Attributes | |
| ros::NodeHandle | n_ |
| ros::Time | stamp_ |
Protected Attributes | |
| dynamic_reconfigure::Server < cob_3d_mapping_common::keyframe_detectorConfig > | config_server_ |
| double | distance_limit_ |
| bool | first_ |
| std::string | frame_id_ |
| ros::ServiceClient | keyframe_trigger_client_ |
| boost::mutex | m_mutex_pointCloudSubCallback |
| double | p_limit_ |
| ros::Subscriber | point_cloud_sub_ |
| double | r_limit_ |
| TransformListener | tf_listener_ |
| StampedTransform | transform_old_ |
| ros::Subscriber | transform_sub_ |
| bool | trigger_always_ |
| double | y_limit_ |
Definition at line 89 of file keyframe_detector.cpp.
| KeyframeDetector::KeyframeDetector | ( | ) | [inline] |
Definition at line 94 of file keyframe_detector.cpp.
| KeyframeDetector::~KeyframeDetector | ( | ) | [inline] |
void
Definition at line 113 of file keyframe_detector.cpp.
| void KeyframeDetector::dynReconfCallback | ( | cob_3d_mapping_common::keyframe_detectorConfig & | config, | |
| uint32_t | level | |||
| ) | [inline] |
Definition at line 118 of file keyframe_detector.cpp.
| void KeyframeDetector::pointCloudSubCallback | ( | sensor_msgs::CameraInfo::ConstPtr | pc_in | ) | [inline] |
Definition at line 144 of file keyframe_detector.cpp.
| void KeyframeDetector::transformSubCallback | ( | const tf::tfMessageConstPtr & | msg | ) | [inline] |
Definition at line 151 of file keyframe_detector.cpp.
| bool KeyframeDetector::triggerKeyFrame | ( | ) | [inline] |
Definition at line 208 of file keyframe_detector.cpp.
dynamic_reconfigure::Server<cob_3d_mapping_common::keyframe_detectorConfig> KeyframeDetector::config_server_ [protected] |
Definition at line 229 of file keyframe_detector.cpp.
double KeyframeDetector::distance_limit_ [protected] |
Definition at line 240 of file keyframe_detector.cpp.
bool KeyframeDetector::first_ [protected] |
Definition at line 231 of file keyframe_detector.cpp.
std::string KeyframeDetector::frame_id_ [protected] |
Definition at line 236 of file keyframe_detector.cpp.
Definition at line 228 of file keyframe_detector.cpp.
boost::mutex KeyframeDetector::m_mutex_pointCloudSubCallback [protected] |
Definition at line 244 of file keyframe_detector.cpp.
Definition at line 205 of file keyframe_detector.cpp.
double KeyframeDetector::p_limit_ [protected] |
Definition at line 242 of file keyframe_detector.cpp.
ros::Subscriber KeyframeDetector::point_cloud_sub_ [protected] |
Definition at line 226 of file keyframe_detector.cpp.
double KeyframeDetector::r_limit_ [protected] |
Definition at line 241 of file keyframe_detector.cpp.
Definition at line 206 of file keyframe_detector.cpp.
TransformListener KeyframeDetector::tf_listener_ [protected] |
Definition at line 227 of file keyframe_detector.cpp.
StampedTransform KeyframeDetector::transform_old_ [protected] |
Definition at line 234 of file keyframe_detector.cpp.
ros::Subscriber KeyframeDetector::transform_sub_ [protected] |
Definition at line 226 of file keyframe_detector.cpp.
bool KeyframeDetector::trigger_always_ [protected] |
Definition at line 232 of file keyframe_detector.cpp.
double KeyframeDetector::y_limit_ [protected] |
Definition at line 239 of file keyframe_detector.cpp.