Dispatches RigidBody data to the correct publisher. More...
#include <rigid_body_publisher.h>
| Public Member Functions | |
| void | publish (ros::Time const &time, std::vector< RigidBody > const &) | 
| RigidBodyPublishDispatcher (ros::NodeHandle &nh, Version const &natNetVersion, PublisherConfigurations const &configs) | |
| Private Types | |
| typedef std::map< int, RigidBodyPublisherPtr > | RigidBodyPublisherMap | 
| typedef std::shared_ptr< RigidBodyPublisher > | RigidBodyPublisherPtr | 
| Private Attributes | |
| RigidBodyPublisherMap | rigidBodyPublisherMap | 
Dispatches RigidBody data to the correct publisher.
Definition at line 68 of file rigid_body_publisher.h.
| 
 | private | 
Definition at line 71 of file rigid_body_publisher.h.
| 
 | private | 
Definition at line 70 of file rigid_body_publisher.h.
| mocap_optitrack::RigidBodyPublishDispatcher::RigidBodyPublishDispatcher | ( | ros::NodeHandle & | nh, | 
| Version const & | natNetVersion, | ||
| PublisherConfigurations const & | configs | ||
| ) | 
Definition at line 198 of file rigid_body_publisher.cpp.
| void mocap_optitrack::RigidBodyPublishDispatcher::publish | ( | ros::Time const & | time, | 
| std::vector< RigidBody > const & | rigidBodies | ||
| ) | 
Definition at line 210 of file rigid_body_publisher.cpp.
| 
 | private | 
Definition at line 72 of file rigid_body_publisher.h.