Defines | Functions | Variables
node.cpp File Reference
#include "ros/ros.h"
#include "sensor_msgs/LaserScan.h"
#include "std_srvs/Empty.h"
#include "rplidar.h"
Include dependency graph for node.cpp:

Go to the source code of this file.

Defines

#define _countof(_Array)   (int)(sizeof(_Array) / sizeof(_Array[0]))
#define DEG2RAD(x)   ((x)*M_PI/180.)

Functions

bool checkRPLIDARHealth (RPlidarDriver *drv)
int main (int argc, char *argv[])
void publish_scan (ros::Publisher *pub, rplidar_response_measurement_node_t *nodes, size_t node_count, ros::Time start, double scan_time, bool inverted, float angle_min, float angle_max, std::string frame_id)
bool start_motor (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res)
bool stop_motor (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res)

Variables

RPlidarDriverdrv = NULL

Define Documentation

#define _countof (   _Array)    (int)(sizeof(_Array) / sizeof(_Array[0]))

Definition at line 46 of file node.cpp.

#define DEG2RAD (   x)    ((x)*M_PI/180.)

Definition at line 49 of file node.cpp.


Function Documentation

Definition at line 105 of file node.cpp.

int main ( int  argc,
char *  argv[] 
)

Definition at line 153 of file node.cpp.

void publish_scan ( ros::Publisher pub,
rplidar_response_measurement_node_t *  nodes,
size_t  node_count,
ros::Time  start,
double  scan_time,
bool  inverted,
float  angle_min,
float  angle_max,
std::string  frame_id 
)

Definition at line 55 of file node.cpp.

bool start_motor ( std_srvs::Empty::Request &  req,
std_srvs::Empty::Response &  res 
)

Definition at line 141 of file node.cpp.

bool stop_motor ( std_srvs::Empty::Request &  req,
std_srvs::Empty::Response &  res 
)

Definition at line 129 of file node.cpp.


Variable Documentation

RPlidarDriver* drv = NULL

Definition at line 53 of file node.cpp.



rplidar_ros
Author(s):
autogenerated on Fri Aug 28 2015 12:46:43