#include <cstdio>
#include <vector>
#include <list>
#include "ros/console.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"
Go to the source code of this file.
Classes | |
class | sub_info_t |
Typedefs | |
typedef boost::shared_ptr < sub_info_t > | sub_info_ref |
Functions | |
void | in_cb (const boost::shared_ptr< ShapeShifter const > &msg, boost::shared_ptr< sub_info_t > s) |
bool | list_topic_cb (jsk_topic_tools::List::Request &req, jsk_topic_tools::List::Response &res) |
int | main (int argc, char **argv) |
void | update_topic_cb (const std_msgs::String::ConstPtr &msg) |
bool | update_topic_cb (jsk_topic_tools::Update::Request &req, jsk_topic_tools::Update::Response &res) |
Variables | |
static ros::NodeHandle * | g_node = NULL |
static list< sub_info_ref > | g_subs |
typedef boost::shared_ptr<sub_info_t> sub_info_ref |
Definition at line 28 of file topic_buffer_server.cpp.
void in_cb | ( | const boost::shared_ptr< ShapeShifter const > & | msg, |
boost::shared_ptr< sub_info_t > | s | ||
) |
Definition at line 34 of file topic_buffer_server.cpp.
bool list_topic_cb | ( | jsk_topic_tools::List::Request & | req, |
jsk_topic_tools::List::Response & | res | ||
) |
Definition at line 58 of file topic_buffer_server.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 123 of file topic_buffer_server.cpp.
void update_topic_cb | ( | const std_msgs::String::ConstPtr & | msg | ) |
Definition at line 77 of file topic_buffer_server.cpp.
bool update_topic_cb | ( | jsk_topic_tools::Update::Request & | req, |
jsk_topic_tools::Update::Response & | res | ||
) |
Definition at line 97 of file topic_buffer_server.cpp.
ros::NodeHandle* g_node = NULL [static] |
Definition at line 32 of file topic_buffer_server.cpp.
list<sub_info_ref> g_subs [static] |
Definition at line 30 of file topic_buffer_server.cpp.