Public Member Functions | |
void | cameraCallback (const sensor_msgs::CameraInfoConstPtr &camera_info) |
void | imageCallback (const sensor_msgs::ImageConstPtr &image) |
virtual void | reconf_callback (blort_ros::TrackerConfig &config, uint32_t level) |
virtual blort_ros::RecoveryCall | recovery (const sensor_msgs::ImageConstPtr &msg) |
SingleShotMode (TrackerNode *parent) | |
bool | singleShotService (blort_ros::EstimatePose::Request &req, blort_ros::EstimatePose::Response &resp) |
Private Attributes | |
ros::Subscriber | cam_info_sub |
ros::ServiceClient | detector_set_caminfo_service |
image_transport::Subscriber | image_sub |
bool | inServiceCall |
sensor_msgs::CameraInfoConstPtr | lastCameraInfo |
sensor_msgs::ImageConstPtr | lastImage |
TrackerNode * | parent_ |
std::list< geometry_msgs::Pose > | results |
ros::ServiceServer | singleshot_service |
double | time_to_run_singleshot |
Definition at line 262 of file tracker_node.cpp.
TrackerNode::SingleShotMode::SingleShotMode | ( | TrackerNode * | parent | ) | [inline] |
Definition at line 277 of file tracker_node.cpp.
void TrackerNode::SingleShotMode::cameraCallback | ( | const sensor_msgs::CameraInfoConstPtr & | camera_info | ) | [inline] |
Definition at line 305 of file tracker_node.cpp.
void TrackerNode::SingleShotMode::imageCallback | ( | const sensor_msgs::ImageConstPtr & | image | ) | [inline] |
Definition at line 295 of file tracker_node.cpp.
virtual void TrackerNode::SingleShotMode::reconf_callback | ( | blort_ros::TrackerConfig & | config, |
uint32_t | level | ||
) | [inline, virtual] |
Implements TrackerNode::Mode.
Definition at line 315 of file tracker_node.cpp.
virtual blort_ros::RecoveryCall TrackerNode::SingleShotMode::recovery | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [inline, virtual] |
Implements TrackerNode::Mode.
Definition at line 320 of file tracker_node.cpp.
bool TrackerNode::SingleShotMode::singleShotService | ( | blort_ros::EstimatePose::Request & | req, |
blort_ros::EstimatePose::Response & | resp | ||
) | [inline] |
Definition at line 333 of file tracker_node.cpp.
Definition at line 272 of file tracker_node.cpp.
Definition at line 267 of file tracker_node.cpp.
Definition at line 273 of file tracker_node.cpp.
Definition at line 268 of file tracker_node.cpp.
sensor_msgs::CameraInfoConstPtr TrackerNode::SingleShotMode::lastCameraInfo [private] |
Definition at line 275 of file tracker_node.cpp.
sensor_msgs::ImageConstPtr TrackerNode::SingleShotMode::lastImage [private] |
Definition at line 274 of file tracker_node.cpp.
TrackerNode* TrackerNode::SingleShotMode::parent_ [private] |
Definition at line 269 of file tracker_node.cpp.
Definition at line 270 of file tracker_node.cpp.
Definition at line 265 of file tracker_node.cpp.
double TrackerNode::SingleShotMode::time_to_run_singleshot [private] |
Definition at line 266 of file tracker_node.cpp.