Public Member Functions | Private Attributes | List of all members
PointCouldSelector Class Reference

Public Member Functions

vm::Marker makeBox (vm::InteractiveMarker &msg, tf::Vector3 min_bound, tf::Vector3 max_bound)
 
void makeSizeHandles ()
 
 PointCouldSelector (boost::shared_ptr< interactive_markers::InteractiveMarkerServer > server, std::vector< tf::Vector3 > &points)
 
void processAxisFeedback (const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback)
 
void updateBox ()
 
void updatePointCloud (std::string name, std_msgs::ColorRGBA color, std::vector< tf::Vector3 > &points)
 
void updatePointClouds ()
 
void updateSizeHandles ()
 

Private Attributes

tf::Vector3 max_sel_
 
tf::Vector3 min_sel_
 
std::vector< tf::Vector3 > points_
 
vm::InteractiveMarker sel_points_marker_
 
boost::shared_ptr< interactive_markers::InteractiveMarkerServerserver_
 
vm::InteractiveMarker unsel_points_marker_
 

Detailed Description

Definition at line 53 of file selection.cpp.

Constructor & Destructor Documentation

◆ PointCouldSelector()

PointCouldSelector::PointCouldSelector ( boost::shared_ptr< interactive_markers::InteractiveMarkerServer server,
std::vector< tf::Vector3 > &  points 
)
inline

Definition at line 56 of file selection.cpp.

Member Function Documentation

◆ makeBox()

vm::Marker PointCouldSelector::makeBox ( vm::InteractiveMarker &  msg,
tf::Vector3  min_bound,
tf::Vector3  max_bound 
)
inline

Definition at line 94 of file selection.cpp.

◆ makeSizeHandles()

void PointCouldSelector::makeSizeHandles ( )
inline

Definition at line 198 of file selection.cpp.

◆ processAxisFeedback()

void PointCouldSelector::processAxisFeedback ( const visualization_msgs::InteractiveMarkerFeedbackConstPtr &  feedback)
inline

Definition at line 69 of file selection.cpp.

◆ updateBox()

void PointCouldSelector::updateBox ( )
inline

Definition at line 114 of file selection.cpp.

◆ updatePointCloud()

void PointCouldSelector::updatePointCloud ( std::string  name,
std_msgs::ColorRGBA  color,
std::vector< tf::Vector3 > &  points 
)
inline

Definition at line 127 of file selection.cpp.

◆ updatePointClouds()

void PointCouldSelector::updatePointClouds ( )
inline

Definition at line 163 of file selection.cpp.

◆ updateSizeHandles()

void PointCouldSelector::updateSizeHandles ( )
inline

Definition at line 254 of file selection.cpp.

Member Data Documentation

◆ max_sel_

tf::Vector3 PointCouldSelector::max_sel_
private

Definition at line 293 of file selection.cpp.

◆ min_sel_

tf::Vector3 PointCouldSelector::min_sel_
private

Definition at line 293 of file selection.cpp.

◆ points_

std::vector<tf::Vector3> PointCouldSelector::points_
private

Definition at line 294 of file selection.cpp.

◆ sel_points_marker_

vm::InteractiveMarker PointCouldSelector::sel_points_marker_
private

Definition at line 296 of file selection.cpp.

◆ server_

Definition at line 291 of file selection.cpp.

◆ unsel_points_marker_

vm::InteractiveMarker PointCouldSelector::unsel_points_marker_
private

Definition at line 297 of file selection.cpp.


The documentation for this class was generated from the following file:


interactive_marker_tutorials
Author(s): David Gossow
autogenerated on Wed Mar 2 2022 01:13:07