Visual plugin for changing the color of some visual elements using ROS messages. This plugin accepts the following SDF parameters: More...
#include <gazebo_ros_color.hh>

Public Member Functions | |
| void | Load (gazebo::rendering::VisualPtr _parent, sdf::ElementPtr _sdf) |
Private Member Functions | |
| void | ColorCallback (const std_msgs::ColorRGBAConstPtr &_msg) |
Private Attributes | |
| ros::Subscriber | colorSub |
| Subscriber to accept color change requests. More... | |
| ros::NodeHandle | nh |
| ROS Node handle. More... | |
| gazebo::rendering::VisualPtr | visual = nullptr |
| Pointer to the visual element to modify. More... | |
Visual plugin for changing the color of some visual elements using ROS messages. This plugin accepts the following SDF parameters:
<robotNamespace>: The ROS namespace for this node. If not present, the model name without any "::"" will be used. E.g.: The plugin under a visual named "model1::my_submodel::link::visual" will use "model1" as namespace unless a value is specified. <topicName>: The topic used to request color changes. The default topic name is /color
Definition at line 37 of file gazebo_ros_color.hh.
|
private |
Callback for processing color change requests.
| [in] | _msg | The message containing the color request. |
Definition at line 72 of file gazebo_ros_color.cc.
| void GazeboRosColor::Load | ( | gazebo::rendering::VisualPtr | _parent, |
| sdf::ElementPtr | _sdf | ||
| ) |
Definition at line 23 of file gazebo_ros_color.cc.
|
private |
Subscriber to accept color change requests.
Definition at line 47 of file gazebo_ros_color.hh.
|
private |
ROS Node handle.
Definition at line 50 of file gazebo_ros_color.hh.
|
private |
Pointer to the visual element to modify.
Definition at line 44 of file gazebo_ros_color.hh.