Classes | Functions | Variables
mux.cpp File Reference
#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"
Include dependency graph for mux.cpp:

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_latch = false
 
static bool g_lazy = false
 
static ros::NodeHandleg_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_tg_subs
 

Function Documentation

◆ add_topic_cb()

bool add_topic_cb ( topic_tools::MuxAdd::Request &  req,
topic_tools::MuxAdd::Response &  res 
)

Definition at line 199 of file mux.cpp.

◆ conn_cb()

void conn_cb ( const ros::SingleSubscriberPublisher )

Definition at line 71 of file mux.cpp.

◆ del_topic_cb()

bool del_topic_cb ( topic_tools::MuxDelete::Request &  req,
topic_tools::MuxDelete::Response &  res 
)

Definition at line 251 of file mux.cpp.

◆ in_cb()

void in_cb ( const boost::shared_ptr< ShapeShifter const > &  msg,
ShapeShifter s 
)

Definition at line 148 of file mux.cpp.

◆ list_topic_cb()

bool list_topic_cb ( topic_tools::MuxList::Request &  req,
topic_tools::MuxList::Response &  res 
)

Definition at line 185 of file mux.cpp.

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 284 of file mux.cpp.

◆ sel_srv_cb()

bool sel_srv_cb ( topic_tools::MuxSelect::Request &  req,
topic_tools::MuxSelect::Response &  res 
)

Definition at line 82 of file mux.cpp.

◆ sel_srv_cb_dep()

bool sel_srv_cb_dep ( topic_tools::MuxSelect::Request &  req,
topic_tools::MuxSelect::Response &  res 
)

Definition at line 140 of file mux.cpp.

Variable Documentation

◆ g_advertised

bool g_advertised = false
static

Definition at line 54 of file mux.cpp.

◆ g_latch

bool g_latch = false
static

Definition at line 53 of file mux.cpp.

◆ g_lazy

bool g_lazy = false
static

Definition at line 52 of file mux.cpp.

◆ g_node

ros::NodeHandle* g_node = NULL
static

Definition at line 51 of file mux.cpp.

◆ g_none_topic

const string g_none_topic = "__none"
static

Definition at line 49 of file mux.cpp.

◆ g_output_topic

string g_output_topic
static

Definition at line 55 of file mux.cpp.

◆ g_pub

ros::Publisher g_pub
static

Definition at line 56 of file mux.cpp.

◆ g_pub_selected

ros::Publisher g_pub_selected
static

Definition at line 57 of file mux.cpp.

◆ g_selected

list<struct sub_info_t>::iterator g_selected = g_subs.end()
static

Definition at line 69 of file mux.cpp.

◆ g_subs

list<struct sub_info_t> g_subs
static

Definition at line 68 of file mux.cpp.



topic_tools
Author(s): Morgan Quigley, Brian Gerkey, Dirk Thomas
autogenerated on Mon Feb 28 2022 23:34:17