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

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>

Inheritance diagram for GazeboRosColor:
Inheritance graph
[legend]

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...
 

Detailed Description

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.

Member Function Documentation

void GazeboRosColor::ColorCallback ( const std_msgs::ColorRGBAConstPtr &  _msg)
private

Callback for processing color change requests.

Parameters
[in]_msgThe 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.

Member Data Documentation

ros::Subscriber GazeboRosColor::colorSub
private

Subscriber to accept color change requests.

Definition at line 47 of file gazebo_ros_color.hh.

ros::NodeHandle GazeboRosColor::nh
private

ROS Node handle.

Definition at line 50 of file gazebo_ros_color.hh.

gazebo::rendering::VisualPtr GazeboRosColor::visual = nullptr
private

Pointer to the visual element to modify.

Definition at line 44 of file gazebo_ros_color.hh.


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


vmrc_gazebo
Author(s): Brian Bingham , Carlos Aguero
autogenerated on Sun Feb 17 2019 03:14:16