Public Member Functions | |
ArrowOverlay () | |
void | doOverlay (const sensor_msgs::ImageConstPtr &img_msg, const sensor_msgs::CameraInfoConstPtr &info_msg) |
void | onInit () |
void | pixelCallback (const geometry_msgs::PoseStamped &msg) |
void | processCommand (const ArrowOverlayCmd &msg) |
~ArrowOverlay () | |
Public Attributes | |
double | ARROW_POINTS [7][3] |
std::vector < geometry_msgs::PoseStamped > | arrows |
bool | auto_clear |
image_geometry::PinholeCameraModel | cam_model |
image_transport::CameraSubscriber | camera_sub |
ros::Subscriber | command_sub |
image_transport::ImageTransport | img_trans |
ros::NodeHandle | nh |
image_transport::Publisher | overlay_pub |
ros::Subscriber | pixel3d_sub |
tf::TransformListener | tf_listener |
Definition at line 27 of file arrow_overlay.cpp.
Definition at line 51 of file arrow_overlay.cpp.
Definition at line 54 of file arrow_overlay.cpp.
void hrl_clickable_display::ArrowOverlay::doOverlay | ( | const sensor_msgs::ImageConstPtr & | img_msg, |
const sensor_msgs::CameraInfoConstPtr & | info_msg | ||
) |
Definition at line 88 of file arrow_overlay.cpp.
Definition at line 57 of file arrow_overlay.cpp.
void hrl_clickable_display::ArrowOverlay::pixelCallback | ( | const geometry_msgs::PoseStamped & | msg | ) |
Definition at line 148 of file arrow_overlay.cpp.
void hrl_clickable_display::ArrowOverlay::processCommand | ( | const ArrowOverlayCmd & | msg | ) |
Definition at line 136 of file arrow_overlay.cpp.
double hrl_clickable_display::ArrowOverlay::ARROW_POINTS[7][3] |
Definition at line 37 of file arrow_overlay.cpp.
std::vector<geometry_msgs::PoseStamped> hrl_clickable_display::ArrowOverlay::arrows |
Definition at line 40 of file arrow_overlay.cpp.
Definition at line 38 of file arrow_overlay.cpp.
Definition at line 35 of file arrow_overlay.cpp.
Definition at line 33 of file arrow_overlay.cpp.
Definition at line 30 of file arrow_overlay.cpp.
Definition at line 32 of file arrow_overlay.cpp.
Definition at line 29 of file arrow_overlay.cpp.
Definition at line 34 of file arrow_overlay.cpp.
Definition at line 31 of file arrow_overlay.cpp.
Definition at line 36 of file arrow_overlay.cpp.