#include <rossensorpublisher.h>
Public Member Functions | |
| void | Publish (const ros::WallTimerEvent &event) |
| RobotPublisher (RobotBasePtr robot, const string &rosnamespace, dReal polltime, boost::shared_ptr< ros::NodeHandle > node) | |
| virtual | ~RobotPublisher () |
Public Attributes | |
| sensor_msgs::JointState | _jointstate |
| boost::shared_ptr < ros::NodeHandle > | _node |
| ros::Publisher | _pubjointstate |
| map < RobotBase::AttachedSensorPtr, boost::shared_ptr < SensorPublisher > > | _publishers |
| RobotBasePtr | _robot |
| string | _rosnamespace |
| ros::WallTimer | _timer |
Definition at line 528 of file rossensorpublisher.h.
| ROSSensorPublisher::RobotPublisher::RobotPublisher | ( | RobotBasePtr | robot, |
| const string & | rosnamespace, | ||
| dReal | polltime, | ||
| boost::shared_ptr< ros::NodeHandle > | node | ||
| ) | [inline] |
Definition at line 531 of file rossensorpublisher.h.
| virtual ROSSensorPublisher::RobotPublisher::~RobotPublisher | ( | ) | [inline, virtual] |
Definition at line 538 of file rossensorpublisher.h.
| void ROSSensorPublisher::RobotPublisher::Publish | ( | const ros::WallTimerEvent & | event | ) | [inline] |
Definition at line 541 of file rossensorpublisher.h.
| sensor_msgs::JointState ROSSensorPublisher::RobotPublisher::_jointstate |
Definition at line 594 of file rossensorpublisher.h.
| boost::shared_ptr<ros::NodeHandle> ROSSensorPublisher::RobotPublisher::_node |
Definition at line 592 of file rossensorpublisher.h.
Definition at line 595 of file rossensorpublisher.h.
| map<RobotBase::AttachedSensorPtr, boost::shared_ptr<SensorPublisher> > ROSSensorPublisher::RobotPublisher::_publishers |
Definition at line 593 of file rossensorpublisher.h.
| RobotBasePtr ROSSensorPublisher::RobotPublisher::_robot |
Definition at line 590 of file rossensorpublisher.h.
Definition at line 591 of file rossensorpublisher.h.
Definition at line 596 of file rossensorpublisher.h.