#include <cstdio>#include <vector>#include <list>#include "ros/console.h"#include "std_msgs/String.h"#include "camera_pose_toolkits/Switch.h"#include "ros/ros.h"#include "ros/topic.h"#include <sensor_msgs/CameraInfo.h>#include <sensor_msgs/Image.h>
Go to the source code of this file.
Classes | |
| struct | sub_pair | 
Functions | |
| void | in_cb1 (const sensor_msgs::CameraInfo::ConstPtr &msg, std::string &s1) | 
| void | in_cb2 (const sensor_msgs::Image::ConstPtr &msg, std::string &s2) | 
| int | main (int argc, char **argv) | 
| bool | switch_srv_cb (camera_pose_toolkits::Switch::Request &req, camera_pose_toolkits::Switch::Response &res) | 
Variables | |
| static bool | g_advertised1 = false | 
| static bool | g_advertised2 = false | 
| static ros::NodeHandle * | g_node = NULL | 
| static std::string | g_output_topic1 | 
| static std::string | g_output_topic2 | 
| static ros::Publisher | g_pub_1 | 
| static ros::Publisher | g_pub_2 | 
| static ros::Publisher | g_pub_selected | 
| static std::list< struct  sub_pair >::iterator  | g_selected = g_sub_pairs.end() | 
| static std::list< struct sub_pair > | g_sub_pairs | 
| static bool | save_bandwidth = false | 
| ros::Subscriber | sub_1 | 
| ros::Subscriber | sub_2 | 
| void in_cb1 | ( | const sensor_msgs::CameraInfo::ConstPtr & | msg, | 
| std::string & | s1 | ||
| ) | 
Definition at line 53 of file camera_dispatcher.cpp.
| void in_cb2 | ( | const sensor_msgs::Image::ConstPtr & | msg, | 
| std::string & | s2 | ||
| ) | 
Definition at line 68 of file camera_dispatcher.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 168 of file camera_dispatcher.cpp.
| bool switch_srv_cb | ( | camera_pose_toolkits::Switch::Request & | req, | 
| camera_pose_toolkits::Switch::Response & | res | ||
| ) | 
Definition at line 84 of file camera_dispatcher.cpp.
bool g_advertised1 = false [static] | 
        
Definition at line 25 of file camera_dispatcher.cpp.
bool g_advertised2 = false [static] | 
        
Definition at line 26 of file camera_dispatcher.cpp.
ros::NodeHandle* g_node = NULL [static] | 
        
Definition at line 24 of file camera_dispatcher.cpp.
std::string g_output_topic1 [static] | 
        
Definition at line 28 of file camera_dispatcher.cpp.
std::string g_output_topic2 [static] | 
        
Definition at line 29 of file camera_dispatcher.cpp.
ros::Publisher g_pub_1 [static] | 
        
Definition at line 31 of file camera_dispatcher.cpp.
ros::Publisher g_pub_2 [static] | 
        
Definition at line 32 of file camera_dispatcher.cpp.
ros::Publisher g_pub_selected [static] | 
        
Definition at line 37 of file camera_dispatcher.cpp.
std::list<struct sub_pair>::iterator g_selected = g_sub_pairs.end() [static] | 
        
Definition at line 49 of file camera_dispatcher.cpp.
std::list<struct sub_pair> g_sub_pairs [static] | 
        
Definition at line 48 of file camera_dispatcher.cpp.
bool save_bandwidth = false [static] | 
        
Definition at line 34 of file camera_dispatcher.cpp.
Definition at line 39 of file camera_dispatcher.cpp.
Definition at line 40 of file camera_dispatcher.cpp.