#include <camera.h>
Public Member Functions | |
Camera (ros::NodeHandle comm_nh, ros::NodeHandle param_nh) | |
void | feedImages () |
void | onInit () |
void | sendInfo (sensor_msgs::ImagePtr &image, ros::Time time) |
void | sendInfoJpeg (ros::Time time) |
~Camera () | |
Private Attributes | |
uvc_cam::Cam * | cam |
std::string | device |
std::string | format |
int | fps |
std::string | frame |
int | frames_to_skip |
int | height |
boost::thread | image_thread |
camera_info_manager::CameraInfoManager | info_mgr |
ros::Publisher | info_pub |
image_transport::ImageTransport | it |
ros::NodeHandle | node |
bool | ok |
ros::NodeHandle | pnode |
image_transport::Publisher | pub |
ros::Publisher | pubjpeg |
bool | rotate |
int | skip_frames |
int | width |
uvc_camera::Camera::Camera | ( | ros::NodeHandle | comm_nh, |
ros::NodeHandle | param_nh | ||
) |
Definition at line 20 of file camera.cpp.
uvc_camera::Camera::~Camera | ( | ) |
Definition at line 293 of file camera.cpp.
void uvc_camera::Camera::feedImages | ( | ) |
Definition at line 228 of file camera.cpp.
void uvc_camera::Camera::onInit | ( | ) |
void uvc_camera::Camera::sendInfo | ( | sensor_msgs::ImagePtr & | image, |
ros::Time | time | ||
) |
Definition at line 198 of file camera.cpp.
void uvc_camera::Camera::sendInfoJpeg | ( | ros::Time | time | ) |
Definition at line 220 of file camera.cpp.
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |