32 #ifndef MULTI_RB_TRACKER_NODE_H 33 #define MULTI_RB_TRACKER_NODE_H 39 #include <dynamic_reconfigure/server.h> 40 #include <rb_tracker/RBTrackerDynReconfConfig.h> 42 #include <sensor_msgs/PointCloud2.h> 43 #include <geometry_msgs/Pose.h> 45 #include <visualization_msgs/MarkerArray.h> 51 #include <pcl/io/io.h> 52 #include <pcl/point_types.h> 54 #include <Eigen/StdVector> 55 #include <Eigen/Geometry> 60 #include "omip_msgs/RigidBodyPosesMsg.h" 61 #include "omip_msgs/RigidBodyPoseMsg.h" 63 #include "omip_msgs/RigidBodyPosesAndVelsMsg.h" 64 #include "omip_msgs/RigidBodyPoseAndVelMsg.h" 66 #include "omip_msgs/RigidBodyTwistsWithCovMsg.h" 67 #include "omip_msgs/RigidBodyTwistWithCovMsg.h" 72 #include <std_msgs/Float64.h> 74 #include "omip_msgs/ShapeTrackerStates.h" 104 void RGBDPCCallback(
const sensor_msgs::PointCloud2ConstPtr &full_pc_msg);
220 dynamic_reconfigure::Server<rb_tracker::RBTrackerDynReconfConfig>
_dr_srv;
221 dynamic_reconfigure::Server<rb_tracker::RBTrackerDynReconfConfig>::CallbackType
_dr_callback;
int _supporting_features_threshold
ros::Subscriber _matthias_refinements_subscriber
virtual void _PublishPosesWithCovariance()
void RGBDPCCallback(const sensor_msgs::PointCloud2ConstPtr &full_pc_msg)
ros::Publisher _rbposes_publisher
ros::Publisher _clustered_pc_publisher
virtual void _PublishClusteredFeatures()
Publish the tracked features clustered in RBs (the cluster id is written in the "label" field of the ...
void MeasurementFromShapeTrackerCallback(const boost::shared_ptr< omip_msgs::ShapeTrackerStates const > &shape_tracker_states)
ros::Publisher _atbirthfeats_pc_publisher
ros::Publisher _predictedfeats_pc_publisher
ros::Subscriber _meas_from_st_subscriber
virtual void _publishState() const
Publish the current state of this RE level.
omip_msgs::RigidBodyPosesAndVelsMsg rbt_state_t
std::map< RB_id_t, ros::Publisher * > _est_body_publishers
ros::Publisher _state_publisher2
virtual ~MultiRBTrackerNode()
virtual void _PrintResults() const
Print the results of the RB tracker on the terminal.
rbt_state_t _last_predictions_kh
dynamic_reconfigure::Server< rb_tracker::RBTrackerDynReconfConfig > _dr_srv
dynamic_reconfigure::Server< rb_tracker::RBTrackerDynReconfConfig >::CallbackType _dr_callback
static_environment_tracker_t _static_environment_tracker_type
double _max_error_to_reassign_feats
virtual void measurementCallback(const boost::shared_ptr< rbt_measurement_ros_t const > &features_pc)
Callback for the measurements for this RE level (3D features from the lower level, FT)
ros::Publisher _freefeats_pc_publisher
virtual void _PublishTF()
void MatthiasRefinementsCallback(const boost::shared_ptr< rbt_state_t const > &matthias_refinements)
double _static_motion_threshold
int _min_num_feats_for_new_rb
bool _publishing_clustered_pc
bool _publishing_rbposes_with_cov
virtual void statePredictionCallback(const boost::shared_ptr< rbt_state_t const > &predicted_next_state)
Callback for the predictions about the state of this RE level coming from the higher level of the hie...
bool _shape_tracker_received
double _new_rbm_error_threshold
omip_msgs::ShapeTrackerStates _shape_tracker_meas
static_environment_tracker_t
int _min_num_frames_for_new_rb
double _estimation_error_threshold
Eigen::Twistd _previous_twist
virtual void _publishPredictedMeasurement() const
Publish the prediction about the next measurement by this RE level.
void DynamicReconfigureCallback(rb_tracker::RBTrackerDynReconfConfig &config, uint32_t level)
Callback for the Dynamic Reconfigure parameters.