|
| void | addBlock (float x, float y, float z, float rz, float r, float g, float b, int n) |
| |
| | BlockManipulation () |
| |
| void | cloudCb (const sensor_msgs::PointCloud2ConstPtr &msg) |
| |
| Marker | makeBox (InteractiveMarker &msg, float r, float g, float b) |
| |
| void | moveBlock (const InteractiveMarkerFeedbackConstPtr &feedback) |
| |
Definition at line 85 of file block_manipulation.cpp.
| BlockManipulation::BlockManipulation |
( |
| ) |
|
|
inline |
| void BlockManipulation::addBlock |
( |
float |
x, |
|
|
float |
y, |
|
|
float |
z, |
|
|
float |
rz, |
|
|
float |
r, |
|
|
float |
g, |
|
|
float |
b, |
|
|
int |
n |
|
) |
| |
|
inline |
| void BlockManipulation::cloudCb |
( |
const sensor_msgs::PointCloud2ConstPtr & |
msg | ) |
|
|
inline |
| Marker BlockManipulation::makeBox |
( |
InteractiveMarker & |
msg, |
|
|
float |
r, |
|
|
float |
g, |
|
|
float |
b |
|
) |
| |
|
inline |
| void BlockManipulation::moveBlock |
( |
const InteractiveMarkerFeedbackConstPtr & |
feedback | ) |
|
|
inline |
| std::string BlockManipulation::last_block_ |
|
private |
| std::vector<Block> BlockManipulation::marker_names_ |
|
private |
| int BlockManipulation::markers_ |
|
private |
| int BlockManipulation::moving_ |
|
private |
| int BlockManipulation::skip_ |
|
private |
| float BlockManipulation::x_ |
|
private |
| float BlockManipulation::y_ |
|
private |
The documentation for this class was generated from the following file: