Public Member Functions | |
void | detectCb (const sensor_msgs::ImageConstPtr &image_msg, const sensor_msgs::CameraInfoConstPtr &info_msg) |
DetectOutletAction (const std::string &name) | |
void | goalCb () |
void | preemptCb () |
void | publishDisplayImage (const cv::Mat &source, const std::vector< cv::Point2f > &image_points, bool success) |
void | timeoutCb (const ros::TimerEvent &e) |
Protected Attributes | |
std::string | action_name_ |
actionlib::SimpleActionServer < pr2_plugs_msgs::VisionOutletDetectionAction > | as_ |
image_geometry::PinholeCameraModel | cam_model_ |
outlet_pose_estimation::Detector | detector_ |
sensor_msgs::Image | display_img_ |
cv::Mat | display_img_cv_ |
image_transport::Publisher | display_pub_ |
sensor_msgs::CvBridge | img_bridge_ |
image_transport::ImageTransport | it_ |
ros::Publisher | marker_pub_ |
ros::NodeHandle | nh_ |
visual_pose_estimation::PoseEstimator | pose_estimator_ |
tf::Stamped< tf::Pose > | prior_ |
tf::Stamped< tf::Pose > | prior_in_camera_ |
ros::Timer | pub_timer_ |
image_transport::CameraSubscriber | sub_ |
tf::TransformBroadcaster | tf_broadcaster_ |
tf::TransformListener | tf_listener_ |
bool | update_transformed_prior_ |
tf::Stamped< tf::Vector3 > | wall_normal_ |
Definition at line 43 of file vision_detect_outlet.cpp.
DetectOutletAction::DetectOutletAction | ( | const std::string & | name | ) | [inline] |
Definition at line 46 of file vision_detect_outlet.cpp.
void DetectOutletAction::detectCb | ( | const sensor_msgs::ImageConstPtr & | image_msg, | |
const sensor_msgs::CameraInfoConstPtr & | info_msg | |||
) | [inline] |
Definition at line 107 of file vision_detect_outlet.cpp.
void DetectOutletAction::goalCb | ( | ) | [inline] |
Definition at line 79 of file vision_detect_outlet.cpp.
void DetectOutletAction::preemptCb | ( | ) | [inline] |
Definition at line 99 of file vision_detect_outlet.cpp.
void DetectOutletAction::publishDisplayImage | ( | const cv::Mat & | source, | |
const std::vector< cv::Point2f > & | image_points, | |||
bool | success | |||
) | [inline] |
Definition at line 204 of file vision_detect_outlet.cpp.
void DetectOutletAction::timeoutCb | ( | const ros::TimerEvent & | e | ) | [inline] |
Definition at line 68 of file vision_detect_outlet.cpp.
std::string DetectOutletAction::action_name_ [protected] |
Definition at line 218 of file vision_detect_outlet.cpp.
actionlib::SimpleActionServer<pr2_plugs_msgs::VisionOutletDetectionAction> DetectOutletAction::as_ [protected] |
Definition at line 217 of file vision_detect_outlet.cpp.
image_geometry::PinholeCameraModel DetectOutletAction::cam_model_ [protected] |
Definition at line 237 of file vision_detect_outlet.cpp.
outlet_pose_estimation::Detector DetectOutletAction::detector_ [protected] |
Definition at line 238 of file vision_detect_outlet.cpp.
sensor_msgs::Image DetectOutletAction::display_img_ [protected] |
Definition at line 227 of file vision_detect_outlet.cpp.
cv::Mat DetectOutletAction::display_img_cv_ [protected] |
Definition at line 228 of file vision_detect_outlet.cpp.
image_transport::Publisher DetectOutletAction::display_pub_ [protected] |
Definition at line 226 of file vision_detect_outlet.cpp.
sensor_msgs::CvBridge DetectOutletAction::img_bridge_ [protected] |
Definition at line 236 of file vision_detect_outlet.cpp.
image_transport::ImageTransport DetectOutletAction::it_ [protected] |
Definition at line 216 of file vision_detect_outlet.cpp.
ros::Publisher DetectOutletAction::marker_pub_ [protected] |
Definition at line 229 of file vision_detect_outlet.cpp.
ros::NodeHandle DetectOutletAction::nh_ [protected] |
Definition at line 215 of file vision_detect_outlet.cpp.
visual_pose_estimation::PoseEstimator DetectOutletAction::pose_estimator_ [protected] |
Definition at line 239 of file vision_detect_outlet.cpp.
tf::Stamped<tf::Pose> DetectOutletAction::prior_ [protected] |
Definition at line 240 of file vision_detect_outlet.cpp.
tf::Stamped<tf::Pose> DetectOutletAction::prior_in_camera_ [protected] |
Definition at line 241 of file vision_detect_outlet.cpp.
ros::Timer DetectOutletAction::pub_timer_ [protected] |
Definition at line 223 of file vision_detect_outlet.cpp.
image_transport::CameraSubscriber DetectOutletAction::sub_ [protected] |
Definition at line 221 of file vision_detect_outlet.cpp.
tf::TransformBroadcaster DetectOutletAction::tf_broadcaster_ [protected] |
Definition at line 233 of file vision_detect_outlet.cpp.
tf::TransformListener DetectOutletAction::tf_listener_ [protected] |
Definition at line 232 of file vision_detect_outlet.cpp.
bool DetectOutletAction::update_transformed_prior_ [protected] |
Definition at line 243 of file vision_detect_outlet.cpp.
tf::Stamped<tf::Vector3> DetectOutletAction::wall_normal_ [protected] |
Definition at line 242 of file vision_detect_outlet.cpp.