#include <cstdio>
#include "topic_tools/shape_shifter.h"
#include "topic_tools/parse.h"
#include "XmlRpc.h"
#include "ros/xmlrpc_manager.h"
#include "ros/network.h"
Go to the source code of this file.
Defines | |
#define | USAGE "USAGE: foreign_relay {adv|sub} FOREIGN_MASTER_URI FOREIGN_TOPIC LOCAL_TOPIC" |
Enumerations | |
enum | relay_mode_t { MODE_ADV, MODE_SUB } |
Functions | |
void | foreign_advertise (const std::string &type) |
void | foreign_subscribe () |
void | foreign_unadvertise () |
void | foreign_unsubscribe () |
void | in_cb (const boost::shared_ptr< ShapeShifter const > &msg) |
int | main (int argc, char **argv) |
Variables | |
static bool | g_advertised = false |
static bool | g_error = false |
static string | g_foreign_topic |
static string | g_host |
static string | g_local_topic |
static relay_mode_t | g_mode |
static ros::NodeHandle * | g_node = NULL |
static uint32_t | g_port = 0 |
static ros::Publisher | g_pub |
ros::XMLRPCManagerPtr | g_xmlrpc_manager = ros::XMLRPCManager::instance() |
#define USAGE "USAGE: foreign_relay {adv|sub} FOREIGN_MASTER_URI FOREIGN_TOPIC LOCAL_TOPIC" |
Definition at line 60 of file foreign_relay.cpp.
enum relay_mode_t |
Definition at line 53 of file foreign_relay.cpp.
void foreign_advertise | ( | const std::string & | type | ) |
Definition at line 70 of file foreign_relay.cpp.
void foreign_subscribe | ( | ) |
Definition at line 102 of file foreign_relay.cpp.
void foreign_unadvertise | ( | ) |
Definition at line 87 of file foreign_relay.cpp.
void foreign_unsubscribe | ( | ) |
Definition at line 164 of file foreign_relay.cpp.
void in_cb | ( | const boost::shared_ptr< ShapeShifter const > & | msg | ) |
Definition at line 179 of file foreign_relay.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 208 of file foreign_relay.cpp.
bool g_advertised = false [static] |
Definition at line 46 of file foreign_relay.cpp.
bool g_error = false [static] |
Definition at line 52 of file foreign_relay.cpp.
string g_foreign_topic [static] |
Definition at line 47 of file foreign_relay.cpp.
string g_host [static] |
Definition at line 50 of file foreign_relay.cpp.
string g_local_topic [static] |
Definition at line 48 of file foreign_relay.cpp.
relay_mode_t g_mode [static] |
Definition at line 58 of file foreign_relay.cpp.
ros::NodeHandle* g_node = NULL [static] |
Definition at line 45 of file foreign_relay.cpp.
uint32_t g_port = 0 [static] |
Definition at line 51 of file foreign_relay.cpp.
ros::Publisher g_pub [static] |
Definition at line 49 of file foreign_relay.cpp.
Definition at line 62 of file foreign_relay.cpp.