Initalise easily a fake publisher, class used on debug mode. Avoiding to develop continually with the hardware part. More...
#include <pouco2000_debug.hpp>
Public Member Functions | |
FakePublisher (ros::NodeHandle &nh, std::string topic) | |
template<typename T_data > | |
void | run (int size_data, boost::function< T_data(void)> gen) |
Private Attributes | |
ros::Publisher | pub |
int | rate |
Static Private Attributes | |
static const int | QUEUE_SIZE_PUBLISHER = 1000 |
Initalise easily a fake publisher, class used on debug mode. Avoiding to develop continually with the hardware part.
T_msg |
Definition at line 47 of file pouco2000_debug.hpp.
FakePublisher< T_msg >::FakePublisher | ( | ros::NodeHandle & | nh, |
std::string | topic | ||
) |
Definition at line 60 of file pouco2000_debug.hpp.
void FakePublisher< T_msg >::run | ( | int | size_data, |
boost::function< T_data(void)> | gen | ||
) |
Definition at line 67 of file pouco2000_debug.hpp.
|
private |
Definition at line 51 of file pouco2000_debug.hpp.
|
staticprivate |
Definition at line 49 of file pouco2000_debug.hpp.
|
private |
Definition at line 50 of file pouco2000_debug.hpp.