#include <ndescs2disk.h>
Public Member Functions | |
Ndescs2Disk (char *pref_out) | |
constructor | |
Private Member Functions | |
void | points_callback (const normal_descriptor_node::ndesc_pc::ConstPtr &ndesc_pc_msg) |
void | write_point (FILE *pf, const normal_descriptor_node::ndesc &point) |
Private Attributes | |
int | counter_ |
bool | keep_nan_points_ |
ros::NodeHandle | node_handle_ |
ros::Subscriber | points_subscriber_ |
std::string | prefix_out_ |
Definition at line 16 of file ndescs2disk.h.
Ndescs2Disk::Ndescs2Disk | ( | char * | pref_out | ) |
constructor
This constructor mainly creates and initializes the WamActions topics through the given NodeHandle object. CIriNode attributes may be also modified to suit node specifications.
All kind of ROS topics (publishers, subscribers, servers or clients) can be easyly generated with the scripts in the iri_ros_scripts package. Refer to ROS and IRI Wiki pages for more details:
http://www.ros.org/wiki/ROS/Tutorials/WritingPublisherSubscriber(c++) http://www.ros.org/wiki/ROS/Tutorials/WritingServiceClient(c++) http://wikiri.upc.es/index.php/Robotics_Lab
nh | a reference to the node handle object to manage all ROS topics. |
Definition at line 54 of file ndescs2disk.cpp.
void Ndescs2Disk::points_callback | ( | const normal_descriptor_node::ndesc_pc::ConstPtr & | ndesc_pc_msg | ) | [private] |
Definition at line 78 of file ndescs2disk.cpp.
void Ndescs2Disk::write_point | ( | FILE * | pf, |
const normal_descriptor_node::ndesc & | point | ||
) | [private] |
Definition at line 32 of file ndescs2disk.cpp.
int Ndescs2Disk::counter_ [private] |
Definition at line 22 of file ndescs2disk.h.
bool Ndescs2Disk::keep_nan_points_ [private] |
Definition at line 23 of file ndescs2disk.h.
ros::NodeHandle Ndescs2Disk::node_handle_ [private] |
Definition at line 21 of file ndescs2disk.h.
Definition at line 29 of file ndescs2disk.h.
std::string Ndescs2Disk::prefix_out_ [private] |
Definition at line 20 of file ndescs2disk.h.