22 #ifndef EV3_ULTRASONIC_CONTROLLER_H_
23 #define EV3_ULTRASONIC_CONTROLLER_H_
25 #include <controller_interface/controller.h>
26 #include <pluginlib/class_list_macros.h>
27 #include <realtime_tools/realtime_publisher.h>
28 #include <boost/shared_ptr.hpp>
29 #include <sensor_msgs/Range.h>
30 #include <std_msgs/Bool.h>
33 #include <h4r_ev3_control/Ev3SensorInterface.h>
57 Ev3Strings::Ev3UltrasonicMode mode_;
60 bool sensor_mode_needs_init_;
64 std::string frame_id_;
67 typedef boost::shared_ptr<
68 realtime_tools::RealtimePublisher<sensor_msgs::Range> > RtRangePublisherPtr;
69 RtRangePublisherPtr realtime_range_publisher_;
71 typedef boost::shared_ptr<
72 realtime_tools::RealtimePublisher<std_msgs::Bool> > RtBoolPublisherPtr;
73 RtBoolPublisherPtr realtime_bool_publisher_;
76 ros::Time last_publish_time_;
84 ros::NodeHandle &root_nh,
85 ros::NodeHandle& ctrl_nh);
87 virtual void starting(
const ros::Time& time);
88 virtual void update(
const ros::Time& time,
const ros::Duration& );
89 virtual void stopping(
const ros::Time& ){}
Definition: Ev3SensorInterface.h:35
Definition: ev3_ultrasonic_controller.h:52
Definition: Ev3SensorInterface.h:97