$search
#include <math.h>
#include <ros/ros.h>
#include <interactive_markers/interactive_marker_server.h>
Go to the source code of this file.
Functions | |
int | main (int argc, char **argv) |
vm::InteractiveMarker | makeMarker (std::string name, std::string description, int32_t type, float x, int num_points=10000, float scale=0.1f) |
void | makePoints (std::vector< geometry_msgs::Point > &points_out, int num_points) |
void | processFeedback (const vm::InteractiveMarkerFeedbackConstPtr &feedback) |
int main | ( | int | argc, | |
char ** | argv | |||
) |
Definition at line 130 of file point_cloud.cpp.
vm::InteractiveMarker makeMarker | ( | std::string | name, | |
std::string | description, | |||
int32_t | type, | |||
float | x, | |||
int | num_points = 10000 , |
|||
float | scale = 0.1f | |||
) |
Definition at line 85 of file point_cloud.cpp.
void makePoints | ( | std::vector< geometry_msgs::Point > & | points_out, | |
int | num_points | |||
) |
Definition at line 71 of file point_cloud.cpp.
void processFeedback | ( | const vm::InteractiveMarkerFeedbackConstPtr & | feedback | ) |
Definition at line 40 of file point_cloud.cpp.