Go to the documentation of this file. 1 #ifndef VISP_TRACKER_TRACKER_HH
2 # define VISP_TRACKER_TRACKER_HH
3 # include <boost/filesystem/path.hpp>
4 # include <boost/thread/recursive_mutex.hpp>
6 # include <dynamic_reconfigure/server.h>
12 # include <geometry_msgs/TwistStamped.h>
14 # include <sensor_msgs/Image.h>
15 # include <sensor_msgs/CameraInfo.h>
20 # include <visp_tracker/Init.h>
21 # include <visp_tracker/ModelBasedSettingsConfig.h>
22 # include <visp_tracker/ModelBasedSettingsKltConfig.h>
23 # include <visp_tracker/ModelBasedSettingsEdgeConfig.h>
24 # include <visp_tracker/MovingEdgeSites.h>
25 # include <visp_tracker/KltPoints.h>
27 # include <visp3/core/vpCameraParameters.h>
28 # include <visp3/core/vpHomogeneousMatrix.h>
29 # include <visp3/core/vpImage.h>
30 # include <visp3/mbt/vpMbGenericTracker.h>
31 # include <visp3/me/vpMe.h>
42 typedef boost::function<bool (visp_tracker::Init::Request&,
43 visp_tracker::Init::Response& res)>
46 template<
class ConfigType>
62 unsigned queueSize = 5u);
69 visp_tracker::Init::Response& res);
78 (
const geometry_msgs::TransformStampedConstPtr&);
126 sensor_msgs::CameraInfoConstPtr
info_;
ros::Publisher kltPointsPublisher_
std::string rectifiedImageTopic_
ros::Subscriber objectPositionHintSubscriber_
ros::ServiceServer initService_
reconfigureSrvStruct< visp_tracker::ModelBasedSettingsEdgeConfig >::reconfigureSrv_t * reconfigureEdgeSrv_
tf::TransformBroadcaster transformBroadcaster_
ros::NodeHandle & nodeHandlePrivate_
bool initCallback(visp_tracker::Init::Request &req, visp_tracker::Init::Response &res)
ROSCPP_DECL void spinOnce()
ros::Publisher resultPublisher_
std::string childFrameId_
unsigned lastTrackedImage_
void updateMovingEdgeSites(visp_tracker::MovingEdgeSitesPtr sites)
reconfigureSrvStruct< visp_tracker::ModelBasedSettingsConfig >::reconfigureSrv_t * reconfigureSrv_
boost::function< bool(visp_tracker::Init::Request &, visp_tracker::Init::Response &res)> initCallback_t
boost::filesystem::path modelPath_
geometry_msgs::TransformStamped objectPositionHint_
image_proc::AdvertisementChecker checkInputs_
Helper used to check that subscribed topics exist.
std::string cameraInfoTopic_
vpMbGenericTracker tracker_
tf::TransformBroadcaster tfBroadcaster_
void objectPositionHintCallback(const geometry_msgs::TransformStampedConstPtr &)
ros::Publisher transformationPublisher_
sensor_msgs::CameraInfoConstPtr info_
bool compensateRobotMotion_
Tracker(ros::NodeHandle &nh, ros::NodeHandle &privateNh, volatile bool &exiting, unsigned queueSize=5u)
boost::recursive_mutex mutex_
image_transport::ImageTransport imageTransport_
ros::NodeHandle & nodeHandle_
std::string cameraPrefix_
void updateKltPoints(visp_tracker::KltPointsPtr klt)
image_transport::CameraSubscriber cameraSubscriber_
vpCameraParameters cameraParameters_
tf::TransformListener listener_
reconfigureSrvStruct< visp_tracker::ModelBasedSettingsKltConfig >::reconfigureSrv_t * reconfigureKltSrv_
ros::Publisher movingEdgeSitesPublisher_
vpImage< unsigned char > image_t
@ WAITING_FOR_INITIALIZATION
std::string worldFrameId_
visp_tracker
Author(s): Thomas Moulard
autogenerated on Sat Aug 24 2024 02:54:56