26 #include "../tools/alvisiondefinitions.h"     35   is_initialized_(false),
    36   camera_source_( camera_source )
    67     std::vector<std::string> topic_list;
    68     topic_list.push_back(std::string(
"/") + node_name + 
"/" + 
topic_ + std::string(
"/compressedDepth"));
    69     topic_list.push_back(std::string(
"/") + node_name + 
"/" + 
topic_ + std::string(
"/compressedDepth/parameter_updates"));
    70     topic_list.push_back(std::string(
"/") + node_name + 
"/" + 
topic_ + std::string(
"/compressedDepth/parameter_descriptions"));
    73     for(std::vector<std::string>::const_iterator 
topic = topic_list.begin(); 
topic != topic_list.end(); ++
topic)
 void publish(const sensor_msgs::ImagePtr &img, const sensor_msgs::CameraInfo &camera_info)
void publish(const sensor_msgs::Image &image, const sensor_msgs::CameraInfo &info) const 
ROSCPP_DECL const std::string & getName()
CameraPublisher advertiseCamera(const std::string &base_topic, uint32_t queue_size, bool latch=false)
image_transport::CameraPublisher pub_
ROSCPP_DECL bool execute(const std::string &method, const XmlRpc::XmlRpcValue &request, XmlRpc::XmlRpcValue &response, XmlRpc::XmlRpcValue &payload, bool wait_for_master)
void reset(ros::NodeHandle &nh)
std::string topic() const 
CameraPublisher(const std::string &topic, int camera_source)