Visualizer Class Reference
#include <Visualizer.h>
List of all members.
Classes |
struct | MarkerInfo |
Public Member Functions |
bool | createMarkers (const std_msgs::Header &header, long ID, const std::vector< wire_msgs::Property > &props, std::vector< visualization_msgs::Marker > &markers_out, const std::string &frame_id) |
bool | setParameters (ros::NodeHandle &n, const std::string &ns) |
void | setTFListener (tf::TransformListener *tf_listener) |
| Visualizer () |
virtual | ~Visualizer () |
Protected Member Functions |
bool | getAttributeSettings (ros::NodeHandle &n, const std::string &ns) |
const pbl::Gaussian * | getBestGaussian (const pbl::PDF &pdf, double min_weight=0) |
bool | getMarkerParameters (ros::NodeHandle &n, const std::string &ns) |
void | getStructValue (XmlRpc::XmlRpcValue &s, const std::string &name, std::string &str, const std::string &default_value) |
void | getStructValue (XmlRpc::XmlRpcValue &s, const std::string &name, bool &b, bool default_value) |
void | getStructValue (XmlRpc::XmlRpcValue &s, const std::string &name, double &d, double default_value) |
void | getStructValue (XmlRpc::XmlRpcValue &s, const std::string &name, float &f, float default_value) |
void | setMarkerType (XmlRpc::XmlRpcValue &v, MarkerInfo &m) |
Protected Attributes |
std::map< std::string, bool > | attribute_map_ |
std::map< std::string, Color > | color_mapping_ |
std::map< std::string, MarkerInfo > | object_class_to_marker_map_ |
tf::TransformListener * | tf_listener_ |
Detailed Description
Definition at line 36 of file Visualizer.h.
Constructor & Destructor Documentation
Visualizer::Visualizer |
( |
|
) |
|
Visualizer::~Visualizer |
( |
|
) |
[virtual] |
Member Function Documentation
bool Visualizer::getAttributeSettings |
( |
ros::NodeHandle & |
n, |
|
|
const std::string & |
ns | |
|
) |
| | [protected] |
const pbl::Gaussian * Visualizer::getBestGaussian |
( |
const pbl::PDF & |
pdf, |
|
|
double |
min_weight = 0 | |
|
) |
| | [protected] |
bool Visualizer::getMarkerParameters |
( |
ros::NodeHandle & |
n, |
|
|
const std::string & |
ns | |
|
) |
| | [protected] |
void Visualizer::getStructValue |
( |
XmlRpc::XmlRpcValue & |
s, |
|
|
const std::string & |
name, |
|
|
std::string & |
str, |
|
|
const std::string & |
default_value | |
|
) |
| | [protected] |
void Visualizer::getStructValue |
( |
XmlRpc::XmlRpcValue & |
s, |
|
|
const std::string & |
name, |
|
|
bool & |
b, |
|
|
bool |
default_value | |
|
) |
| | [protected] |
void Visualizer::getStructValue |
( |
XmlRpc::XmlRpcValue & |
s, |
|
|
const std::string & |
name, |
|
|
double & |
d, |
|
|
double |
default_value | |
|
) |
| | [protected] |
void Visualizer::getStructValue |
( |
XmlRpc::XmlRpcValue & |
s, |
|
|
const std::string & |
name, |
|
|
float & |
f, |
|
|
float |
default_value | |
|
) |
| | [protected] |
bool Visualizer::setParameters |
( |
ros::NodeHandle & |
n, |
|
|
const std::string & |
ns | |
|
) |
| | |
Member Data Documentation
The documentation for this class was generated from the following files: