#include <cstdio>
#include <vector>
#include <list>
#include "ros/console.h"
#include "std_msgs/String.h"
#include "topic_tools/MuxSelect.h"
#include "topic_tools/MuxAdd.h"
#include "topic_tools/MuxList.h"
#include "topic_tools/MuxDelete.h"
#include "topic_tools/shape_shifter.h"
#include "topic_tools/parse.h"
Go to the source code of this file.
Classes | |
struct | sub_info_t |
Functions | |
bool | add_topic_cb (topic_tools::MuxAdd::Request &req, topic_tools::MuxAdd::Response &res) |
void | conn_cb (const ros::SingleSubscriberPublisher &) |
bool | del_topic_cb (topic_tools::MuxDelete::Request &req, topic_tools::MuxDelete::Response &res) |
void | in_cb (const boost::shared_ptr< ShapeShifter const > &msg, ShapeShifter *s) |
bool | list_topic_cb (topic_tools::MuxList::Request &req, topic_tools::MuxList::Response &res) |
int | main (int argc, char **argv) |
bool | sel_srv_cb (topic_tools::MuxSelect::Request &req, topic_tools::MuxSelect::Response &res) |
bool | sel_srv_cb_dep (topic_tools::MuxSelect::Request &req, topic_tools::MuxSelect::Response &res) |
Variables | |
static bool | g_advertised = false |
static bool | g_lazy = false |
static ros::NodeHandle * | g_node = NULL |
static const string | g_none_topic = "__none" |
static string | g_output_topic |
static ros::Publisher | g_pub |
static ros::Publisher | g_pub_selected |
static list< struct sub_info_t >::iterator | g_selected = g_subs.end() |
static list< struct sub_info_t > | g_subs |
bool add_topic_cb | ( | topic_tools::MuxAdd::Request & | req, |
topic_tools::MuxAdd::Response & | res | ||
) |
void conn_cb | ( | const ros::SingleSubscriberPublisher & | ) |
bool del_topic_cb | ( | topic_tools::MuxDelete::Request & | req, |
topic_tools::MuxDelete::Response & | res | ||
) |
void in_cb | ( | const boost::shared_ptr< ShapeShifter const > & | msg, |
ShapeShifter * | s | ||
) |
bool list_topic_cb | ( | topic_tools::MuxList::Request & | req, |
topic_tools::MuxList::Response & | res | ||
) |
bool sel_srv_cb | ( | topic_tools::MuxSelect::Request & | req, |
topic_tools::MuxSelect::Response & | res | ||
) |
bool sel_srv_cb_dep | ( | topic_tools::MuxSelect::Request & | req, |
topic_tools::MuxSelect::Response & | res | ||
) |
|
static |
|
static |
|
static |
|
static |
|
static |