demux.cpp File Reference

#include "ros/node.h"
#include "std_msgs/String.h"
#include <string>
#include <vector>
#include <ostream>
#include "ros/serialization.h"
#include "ros/builtin_message_traits.h"
#include "ros/message.h"
#include "ros/time.h"
#include "topic_tools/DemuxSelect.h"
#include "ros/ros.h"
#include "ros/console.h"
#include "ros/assert.h"
#include <string.h>
#include <ros/message_traits.h>
Include dependency graph for demux.cpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Functions

void in_cb ()
int main (int argc, char **argv)
bool sel_srv_cb (topic_tools::DemuxSelect::Request &req, topic_tools::DemuxSelect::Response &res)

Variables

static bool g_advertised = false
static ShapeShifter g_in_msg
static ros::Node * g_node = NULL
static vector< string > g_output_topics
static std_msgs::String g_sel_msg
static vector< string > g_selected

Function Documentation

void in_cb (  ) 

Definition at line 59 of file demux.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 80 of file demux.cpp.

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

Definition at line 48 of file demux.cpp.


Variable Documentation

bool g_advertised = false [static]

Definition at line 44 of file demux.cpp.

Definition at line 46 of file demux.cpp.

ros::Node* g_node = NULL [static]

Definition at line 45 of file demux.cpp.

vector<string> g_output_topics [static]

Definition at line 43 of file demux.cpp.

std_msgs::String g_sel_msg [static]

Definition at line 42 of file demux.cpp.

vector<string> g_selected [static]

Definition at line 43 of file demux.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Defines


topic_tools
Author(s): Morgan Quigley, Brian Gerkey
autogenerated on Fri Jan 11 10:05:51 2013