ROS Node. More...
#include <rawlog_record_node.h>
Classes | |
struct | ParametersNode |
Public Member Functions | |
void | callbackLaser (const sensor_msgs::LaserScan &) |
void | init () |
void | loop () |
RawlogRecordNode (ros::NodeHandle &n) | |
~RawlogRecordNode () | |
Private Member Functions | |
ParametersNode * | param () |
void | update () |
void | updateLaserPose (std::string frame_id) |
bool | waitForTransform (mrpt::poses::CPose3D &des, const std::string &target_frame, const std::string &source_frame, const ros::Time &time, const ros::Duration &timeout, const ros::Duration &polling_sleep_duration=ros::Duration(0.01)) |
Private Attributes | |
std::map< std::string, mrpt::poses::CPose3D > | laser_poses_ |
tf::TransformListener | listenerTF_ |
unsigned long | loop_count_ |
MRPT_ROS_LOG_MACROS | |
ros::NodeHandle | n_ |
ros::Subscriber | subLaser0_ |
ros::Subscriber | subLaser1_ |
ros::Subscriber | subLaser2_ |
ROS Node.
Definition at line 41 of file rawlog_record_node.h.
Definition at line 53 of file rawlog_record_node.cpp.
Definition at line 50 of file rawlog_record_node.cpp.
void RawlogRecordNode::callbackLaser | ( | const sensor_msgs::LaserScan & | _msg | ) |
Definition at line 95 of file rawlog_record_node.cpp.
void RawlogRecordNode::init | ( | ) |
Definition at line 62 of file rawlog_record_node.cpp.
void RawlogRecordNode::loop | ( | ) |
Definition at line 70 of file rawlog_record_node.cpp.
RawlogRecordNode::ParametersNode * RawlogRecordNode::param | ( | ) | [private] |
Definition at line 58 of file rawlog_record_node.cpp.
void RawlogRecordNode::update | ( | ) | [private] |
void RawlogRecordNode::updateLaserPose | ( | std::string | frame_id | ) | [private] |
Definition at line 126 of file rawlog_record_node.cpp.
bool RawlogRecordNode::waitForTransform | ( | mrpt::poses::CPose3D & | des, |
const std::string & | target_frame, | ||
const std::string & | source_frame, | ||
const ros::Time & | time, | ||
const ros::Duration & | timeout, | ||
const ros::Duration & | polling_sleep_duration = ros::Duration(0.01) |
||
) | [private] |
Definition at line 79 of file rawlog_record_node.cpp.
std::map<std::string, mrpt::poses::CPose3D> RawlogRecordNode::laser_poses_ [private] |
Definition at line 73 of file rawlog_record_node.h.
Definition at line 72 of file rawlog_record_node.h.
unsigned long RawlogRecordNode::loop_count_ [private] |
Definition at line 75 of file rawlog_record_node.h.
RawlogRecordNode::MRPT_ROS_LOG_MACROS [private] |
Definition at line 42 of file rawlog_record_node.h.
ros::NodeHandle RawlogRecordNode::n_ [private] |
Definition at line 74 of file rawlog_record_node.h.
ros::Subscriber RawlogRecordNode::subLaser0_ [private] |
Definition at line 69 of file rawlog_record_node.h.
ros::Subscriber RawlogRecordNode::subLaser1_ [private] |
Definition at line 70 of file rawlog_record_node.h.
ros::Subscriber RawlogRecordNode::subLaser2_ [private] |
Definition at line 71 of file rawlog_record_node.h.