#include <convert.h>
Classes | |
struct | Config |
configuration parameters More... | |
Public Member Functions | |
Convert (ros::NodeHandle node, ros::NodeHandle private_nh, std::string const &node_name=ros::this_node::getName()) | |
Constructor. More... | |
~Convert () | |
Private Member Functions | |
void | callback (velodyne_pointcloud::CloudNodeConfig &config, uint32_t level) |
void | processScan (const velodyne_msgs::VelodyneScan::ConstPtr &scanMsg) |
Callback for raw scan messages. More... | |
Private Attributes | |
Config | config_ |
boost::shared_ptr< velodyne_rawdata::DataContainerBase > | container_ptr_ |
boost::shared_ptr< velodyne_rawdata::RawData > | data_ |
double | diag_max_freq_ |
double | diag_min_freq_ |
boost::shared_ptr< diagnostic_updater::TopicDiagnostic > | diag_topic_ |
diagnostic_updater::Updater | diagnostics_ |
bool | first_rcfg_call |
ros::Publisher | output_ |
boost::mutex | reconfigure_mtx_ |
boost::shared_ptr< dynamic_reconfigure::Server< velodyne_pointcloud::CloudNodeConfig > > | srv_ |
ros::Subscriber | velodyne_scan_ |
velodyne_pointcloud::Convert::Convert | ( | ros::NodeHandle | node, |
ros::NodeHandle | private_nh, | ||
std::string const & | node_name = ros::this_node::getName() |
||
) |
Constructor.
Definition at line 24 of file convert.cc.
|
private |
Definition at line 93 of file convert.cc.
|
private |
Callback for raw scan messages.
Definition at line 129 of file convert.cc.
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |