#include <rawlog_play_node.h>

Public Member Functions | |
| void | callbackParameters (mrpt_rawlog::RawLogRecordConfig &config, uint32_t level) |
| ParametersNode () | |
| void | update (const unsigned long &loop_count) |
Public Attributes | |
| std::string | base_frame |
| ros::NodeHandle | node |
| std::string | odom_frame |
| int | parameter_update_skip |
| double | rate |
| dynamic_reconfigure::Server< mrpt_rawlog::RawLogRecordConfig >::CallbackType | reconfigureFnc_ |
| dynamic_reconfigure::Server< mrpt_rawlog::RawLogRecordConfig > | reconfigureServer_ |
| std::string | tf_prefix |
Static Public Attributes | |
| static const int | MOTION_MODEL_GAUSSIAN = 0 |
| static const int | MOTION_MODEL_THRUN = 1 |
Definition at line 53 of file rawlog_play_node.h.
| RawlogPlayNode::ParametersNode::ParametersNode | ( | ) |
Definition at line 37 of file rawlog_play_node_parameters.cpp.
| void RawlogPlayNode::ParametersNode::callbackParameters | ( | mrpt_rawlog::RawLogRecordConfig & | config, |
| uint32_t | level | ||
| ) |
Definition at line 65 of file rawlog_play_node_parameters.cpp.
Definition at line 58 of file rawlog_play_node_parameters.cpp.
| std::string RawlogPlayNode::ParametersNode::base_frame |
Definition at line 67 of file rawlog_play_node.h.
Definition at line 55 of file rawlog_play_node.h.
Definition at line 56 of file rawlog_play_node.h.
| ros::NodeHandle RawlogPlayNode::ParametersNode::node |
Definition at line 58 of file rawlog_play_node.h.
| std::string RawlogPlayNode::ParametersNode::odom_frame |
Definition at line 68 of file rawlog_play_node.h.
| int RawlogPlayNode::ParametersNode::parameter_update_skip |
Definition at line 70 of file rawlog_play_node.h.
| double RawlogPlayNode::ParametersNode::rate |
Definition at line 66 of file rawlog_play_node.h.
| dynamic_reconfigure::Server< mrpt_rawlog::RawLogRecordConfig>::CallbackType RawlogPlayNode::ParametersNode::reconfigureFnc_ |
Definition at line 64 of file rawlog_play_node.h.
| dynamic_reconfigure::Server<mrpt_rawlog::RawLogRecordConfig> RawlogPlayNode::ParametersNode::reconfigureServer_ |
Definition at line 62 of file rawlog_play_node.h.
| std::string RawlogPlayNode::ParametersNode::tf_prefix |
Definition at line 69 of file rawlog_play_node.h.