#include <cstdio>
#include <ros/ros.h>
#include <ros/time.h>
#include "uvc_cam/uvc_cam.h"
#include "sensor_msgs/Image.h"
#include "sensor_msgs/image_encodings.h"
#include <sensor_msgs/CameraInfo.h>
#include <string>
#include <vector>
#include <ostream>
#include "ros/serialization.h"
#include "ros/builtin_message_traits.h"
#include "ros/message_operations.h"
#include "ros/message.h"
#include "std_msgs/Header.h"
#include "ros/service_traits.h"
#include "sensor_msgs/CameraInfo.h"
#include <boost/noncopyable.hpp>
#include <boost/function.hpp>
#include <stdexcept>
#include "image_transport/exception.h"
#include "image_transport/loader_fwds.h"
#include "image_transport/single_subscriber_publisher.h"
#include "image_transport/transport_hints.h"
Go to the source code of this file.
Functions | |
template<class T > | |
string | arrayToString (T v) |
void | load_params (ros::NodeHandle &nh) |
int | main (int argc, char **argv) |
template<class T > | |
void | restoreVec (string s, T &vec) |
bool | setCameraInfo (sensor_msgs::SetCameraInfo::Request &req, sensor_msgs::SetCameraInfo::Response &rsp) |
Variables | |
sensor_msgs::CameraInfo | cam_info |
ros::ServiceServer | set_camera_info_service |
string arrayToString | ( | T | v | ) | [inline] |
Definition at line 45 of file sender.cpp.
void load_params | ( | ros::NodeHandle & | nh | ) |
Definition at line 63 of file sender.cpp.
int main | ( | int | argc, | |
char ** | argv | |||
) |
Definition at line 114 of file sender.cpp.
void restoreVec | ( | string | s, | |
T & | vec | |||
) | [inline] |
Definition at line 54 of file sender.cpp.
bool setCameraInfo | ( | sensor_msgs::SetCameraInfo::Request & | req, | |
sensor_msgs::SetCameraInfo::Response & | rsp | |||
) |
Definition at line 93 of file sender.cpp.
sensor_msgs::CameraInfo cam_info |
Definition at line 40 of file sender.cpp.
ros::ServiceServer set_camera_info_service |
Definition at line 41 of file sender.cpp.