Classes | Typedefs | Functions | Variables
topic_buffer_client.cpp File Reference
#include <cstdio>
#include <vector>
#include <list>
#include <boost/lambda/lambda.hpp>
#include "ros/ros.h"
#include "ros/header.h"
#include "ros/console.h"
#include "std_msgs/Header.h"
#include "std_msgs/String.h"
#include "jsk_topic_tools/List.h"
#include "jsk_topic_tools/Update.h"
#include "topic_tools/shape_shifter.h"
#include "topic_tools/parse.h"
Include dependency graph for topic_buffer_client.cpp:

Go to the source code of this file.

Classes

class  pub_info_t

Typedefs

typedef boost::shared_ptr
< pub_info_t
pub_info_ref

Functions

void in_cb (const boost::shared_ptr< ShapeShifter const > &msg, boost::shared_ptr< pub_info_t > s)
int main (int argc, char **argv)

Variables

static bool debug
static ros::NodeHandleg_node = NULL
static list< pub_info_refg_pubs
static bool use_fixed_rate
static bool use_periodic_rate = false

Typedef Documentation

typedef boost::shared_ptr<pub_info_t> pub_info_ref

Definition at line 61 of file topic_buffer_client.cpp.


Function Documentation

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

Definition at line 72 of file topic_buffer_client.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 115 of file topic_buffer_client.cpp.


Variable Documentation

bool debug [static]

Definition at line 19 of file topic_buffer_client.cpp.

ros::NodeHandle* g_node = NULL [static]

Definition at line 65 of file topic_buffer_client.cpp.

list<pub_info_ref> g_pubs [static]

Definition at line 63 of file topic_buffer_client.cpp.

bool use_fixed_rate [static]

Definition at line 67 of file topic_buffer_client.cpp.

bool use_periodic_rate = false [static]

Definition at line 68 of file topic_buffer_client.cpp.



jsk_topic_tools
Author(s): Kei Okada , Yusuke Furuta
autogenerated on Sun Jan 25 2015 12:38:34