24 #ifndef EV3_COLOR_CONTROLLER_H_
25 #define EV3_COLOR_CONTROLLER_H_
27 #include <controller_interface/controller.h>
28 #include <pluginlib/class_list_macros.h>
29 #include <realtime_tools/realtime_publisher.h>
30 #include <boost/shared_ptr.hpp>
31 #include <sensor_msgs/Illuminance.h>
32 #include <std_msgs/ColorRGBA.h>
33 #include <std_msgs/UInt8.h>
36 #include <h4r_ev3_control/Ev3SensorInterface.h>
60 Ev3Strings::Ev3ColorMode mode_;
63 bool sensor_mode_needs_init_;
64 std::string frame_id_;
67 typedef boost::shared_ptr<
68 realtime_tools::RealtimePublisher<sensor_msgs::Illuminance> > RtIlluminancePublisherPtr;
69 RtIlluminancePublisherPtr realtime_illuminance_publisher_;
71 typedef boost::shared_ptr<
72 realtime_tools::RealtimePublisher<std_msgs::ColorRGBA> > RtColorPublisherPtr;
73 RtColorPublisherPtr realtime_color_publisher_;
75 typedef boost::shared_ptr<
76 realtime_tools::RealtimePublisher<std_msgs::UInt8> > RtColorNumberPublisherPtr;
77 RtColorNumberPublisherPtr realtime_color_number_publisher_;
79 ros::Time last_publish_time_;
87 ros::NodeHandle &root_nh,
88 ros::NodeHandle& ctrl_nh);
90 virtual void starting(
const ros::Time& time);
91 virtual void update(
const ros::Time& time,
const ros::Duration& );
92 virtual void stopping(
const ros::Time& ){}
Definition: ev3_color_controller.h:55
Definition: Ev3SensorInterface.h:35
Definition: Ev3SensorInterface.h:97