#include <marker_array_publisher.h>
Public Types | |
| typedef boost::shared_ptr < MarkerArrayPublisher > | Ptr |
Public Member Functions | |
| virtual void | clear () |
| virtual void | clear (const std::string &name) |
| virtual void | insert (const std::string &name, visualization_msgs::Marker marker) |
| MarkerArrayPublisher (ros::NodeHandle &nh, const std::string &topic) | |
| virtual void | publish () |
Protected Member Functions | |
| virtual size_t | getID (const std::string &name) |
Protected Attributes | |
| std::map< std::string, visualization_msgs::Marker > | markers_ |
| std::map< std::string, size_t > | name_mapping_ |
| ros::Publisher | pub_ |
Definition at line 41 of file marker_array_publisher.h.
| typedef boost::shared_ptr<MarkerArrayPublisher> jsk_footstep_planner::MarkerArrayPublisher::Ptr |
Definition at line 44 of file marker_array_publisher.h.
| jsk_footstep_planner::MarkerArrayPublisher::MarkerArrayPublisher | ( | ros::NodeHandle & | nh, |
| const std::string & | topic | ||
| ) |
Definition at line 40 of file marker_array_publisher.cpp.
| void jsk_footstep_planner::MarkerArrayPublisher::clear | ( | void | ) | [virtual] |
Definition at line 75 of file marker_array_publisher.cpp.
| void jsk_footstep_planner::MarkerArrayPublisher::clear | ( | const std::string & | name | ) | [virtual] |
Definition at line 62 of file marker_array_publisher.cpp.
| size_t jsk_footstep_planner::MarkerArrayPublisher::getID | ( | const std::string & | name | ) | [protected, virtual] |
Definition at line 84 of file marker_array_publisher.cpp.
| void jsk_footstep_planner::MarkerArrayPublisher::insert | ( | const std::string & | name, |
| visualization_msgs::Marker | marker | ||
| ) | [virtual] |
Definition at line 45 of file marker_array_publisher.cpp.
| void jsk_footstep_planner::MarkerArrayPublisher::publish | ( | ) | [virtual] |
Definition at line 51 of file marker_array_publisher.cpp.
std::map<std::string, visualization_msgs::Marker> jsk_footstep_planner::MarkerArrayPublisher::markers_ [protected] |
Definition at line 56 of file marker_array_publisher.h.
std::map<std::string, size_t> jsk_footstep_planner::MarkerArrayPublisher::name_mapping_ [protected] |
Definition at line 55 of file marker_array_publisher.h.
Definition at line 54 of file marker_array_publisher.h.