Interface to be implemented by feature trackers It derives from the RecursiveEstimator interface. More...
#include <FeatureTracker.h>
Public Member Functions | |
virtual void | correctState ()=0 |
Corrects the predicted state(s). First we track the features using both the prediction with the system model (copy of the previous feature locations) and if there is a prediction from the higher level (RBT) we track features using it too. We then decide which prediction is the "most likely" based on the quality measurement that the feature tracker returns and use the new location to update the belief state. | |
FeatureTracker (double loop_period_ns) | |
Default constructor. | |
virtual cv_bridge::CvImagePtr | getDepthEdgesImg () |
virtual cv_bridge::CvImagePtr | getDepthImg () |
virtual cv_bridge::CvImagePtr | getDetectingMaskImg () |
virtual cv_bridge::CvImagePtr | getPredictedAndLastFeaturesImg () |
virtual cv_bridge::CvImagePtr | getPredictingMaskImg () |
virtual cv_bridge::CvImagePtr | getRGBImg () |
virtual ft_state_t | getState () const =0 |
virtual cv_bridge::CvImagePtr | getTrackedFeaturesImg () |
virtual cv_bridge::CvImagePtr | getTrackedFeaturesWithPredictionMaskImg () |
virtual cv_bridge::CvImagePtr | getTrackingMaskImg () |
virtual void | predictState (double time_interval_ns)=0 |
First step when updating the filter. The next state is predicted from current state and system model (part of the RecursiveEstimatorInterace) In the FeatureTracker the system model is the most simple one: no change in the state. So the predicted state is just the current state. | |
virtual void | setCameraInfoMsg (const sensor_msgs::CameraInfo *camera_info) |
virtual void | setDynamicReconfigureValues (feature_tracker::FeatureTrackerDynReconfConfig &config)=0 |
virtual void | setFullRGBDPC (PointCloudPCL::ConstPtr full_rgb_pc) |
virtual void | setOcclusionMaskImg (cv_bridge::CvImagePtr occ_mask_img) |
virtual | ~FeatureTracker () |
Default destructor (empty) |
Interface to be implemented by feature trackers It derives from the RecursiveEstimator interface.
Definition at line 54 of file FeatureTracker.h.
omip::FeatureTracker::FeatureTracker | ( | double | loop_period_ns | ) | [inline] |
Default constructor.
Definition at line 62 of file FeatureTracker.h.
virtual omip::FeatureTracker::~FeatureTracker | ( | ) | [inline, virtual] |
Default destructor (empty)
Definition at line 71 of file FeatureTracker.h.
virtual void omip::FeatureTracker::correctState | ( | ) | [pure virtual] |
Corrects the predicted state(s). First we track the features using both the prediction with the system model (copy of the previous feature locations) and if there is a prediction from the higher level (RBT) we track features using it too. We then decide which prediction is the "most likely" based on the quality measurement that the feature tracker returns and use the new location to update the belief state.
Implements omip::RecursiveEstimatorFilterInterface< ft_state_t, ft_measurement_t >.
Implemented in omip::PointFeatureTracker.
virtual cv_bridge::CvImagePtr omip::FeatureTracker::getDepthEdgesImg | ( | ) | [inline, virtual] |
Get the image with the depth edges, used to reject Features that are on edges
Reimplemented in omip::PointFeatureTracker.
Definition at line 157 of file FeatureTracker.h.
virtual cv_bridge::CvImagePtr omip::FeatureTracker::getDepthImg | ( | ) | [inline, virtual] |
Reimplemented in omip::PointFeatureTracker.
Definition at line 129 of file FeatureTracker.h.
virtual cv_bridge::CvImagePtr omip::FeatureTracker::getDetectingMaskImg | ( | ) | [inline, virtual] |
Get the mask used to detect new features. Combines edges, max depth and mask of current features (to not detect them)
Reimplemented in omip::PointFeatureTracker.
Definition at line 184 of file FeatureTracker.h.
virtual cv_bridge::CvImagePtr omip::FeatureTracker::getPredictedAndLastFeaturesImg | ( | ) | [inline, virtual] |
Get the image with the last feature locations and the predicted feature locations
Reimplemented in omip::PointFeatureTracker.
Definition at line 193 of file FeatureTracker.h.
virtual cv_bridge::CvImagePtr omip::FeatureTracker::getPredictingMaskImg | ( | ) | [inline, virtual] |
Get the image with the depth edges, used to reject Features that are on edges
Reimplemented in omip::PointFeatureTracker.
Definition at line 166 of file FeatureTracker.h.
virtual cv_bridge::CvImagePtr omip::FeatureTracker::getRGBImg | ( | ) | [inline, virtual] |
Reimplemented in omip::PointFeatureTracker.
Definition at line 124 of file FeatureTracker.h.
virtual ft_state_t omip::FeatureTracker::getState | ( | ) | const [pure virtual] |
Get a point cloud with the 3D locations and the unique Feature Id (L value) of the last tracked features
Reimplemented from omip::RecursiveEstimatorFilterInterface< ft_state_t, ft_measurement_t >.
Implemented in omip::PointFeatureTracker.
virtual cv_bridge::CvImagePtr omip::FeatureTracker::getTrackedFeaturesImg | ( | ) | [inline, virtual] |
Get the last tracked Features as marks in the RGB image
Reimplemented in omip::PointFeatureTracker.
Definition at line 138 of file FeatureTracker.h.
virtual cv_bridge::CvImagePtr omip::FeatureTracker::getTrackedFeaturesWithPredictionMaskImg | ( | ) | [inline, virtual] |
Get a pointer to a RGB image with markers where the Features have been tracked in the last step and only showing the RGB area where the features are searched
Reimplemented in omip::PointFeatureTracker.
Definition at line 148 of file FeatureTracker.h.
virtual cv_bridge::CvImagePtr omip::FeatureTracker::getTrackingMaskImg | ( | ) | [inline, virtual] |
Get the mask used to track features. Combines edges, predictions mask and max depth
Reimplemented in omip::PointFeatureTracker.
Definition at line 175 of file FeatureTracker.h.
virtual void omip::FeatureTracker::predictState | ( | double | time_interval_ns | ) | [pure virtual] |
First step when updating the filter. The next state is predicted from current state and system model (part of the RecursiveEstimatorInterace) In the FeatureTracker the system model is the most simple one: no change in the state. So the predicted state is just the current state.
Implements omip::RecursiveEstimatorFilterInterface< ft_state_t, ft_measurement_t >.
Implemented in omip::PointFeatureTracker.
virtual void omip::FeatureTracker::setCameraInfoMsg | ( | const sensor_msgs::CameraInfo * | camera_info | ) | [inline, virtual] |
Set the parameters of the camera to project the predicted Feature locations to the image plane
camera_info | - Pointer to the CameraInfo message containing the camera parameters |
Reimplemented in omip::PointFeatureTracker.
Definition at line 118 of file FeatureTracker.h.
virtual void omip::FeatureTracker::setDynamicReconfigureValues | ( | feature_tracker::FeatureTrackerDynReconfConfig & | config | ) | [pure virtual] |
Implemented in omip::PointFeatureTracker.
virtual void omip::FeatureTracker::setFullRGBDPC | ( | PointCloudPCL::ConstPtr | full_rgb_pc | ) | [inline, virtual] |
Set the input RGB-D point cloud
full_rgb_pc | - Shared pointer to the input RGB-D point cloud |
Reimplemented in omip::PointFeatureTracker.
Definition at line 101 of file FeatureTracker.h.
virtual void omip::FeatureTracker::setOcclusionMaskImg | ( | cv_bridge::CvImagePtr | occ_mask_img | ) | [inline, virtual] |
Set the input occlusion mask image
rgb_img | - Shared pointer to the input occlusion mask image |
Reimplemented in omip::PointFeatureTracker.
Definition at line 109 of file FeatureTracker.h.