30 #ifndef TURTLESIM_TURTLE_H 31 #define TURTLESIM_TURTLE_H 34 #ifndef Q_MOC_RUN // See: https://bugreports.qt-project.org/browse/QTBUG-22829 36 # include <boost/shared_ptr.hpp> 38 # include <turtlesim/Pose.h> 39 # include <geometry_msgs/Twist.h> 40 # include <turtlesim/SetPen.h> 41 # include <turtlesim/TeleportRelative.h> 42 # include <turtlesim/TeleportAbsolute.h> 43 # include <turtlesim/Color.h> 61 bool update(
double dt, QPainter& path_painter,
const QImage& path_image, qreal canvas_width, qreal canvas_height);
62 void paint(QPainter &painter);
65 bool setPenCallback(turtlesim::SetPen::Request&, turtlesim::SetPen::Response&);
ros::Subscriber velocity_sub_
bool teleportAbsoluteCallback(turtlesim::TeleportAbsolute::Request &, turtlesim::TeleportAbsolute::Response &)
ros::ServiceServer set_pen_srv_
bool update(double dt, QPainter &path_painter, const QImage &path_image, qreal canvas_width, qreal canvas_height)
std::vector< TeleportRequest > V_TeleportRequest
QImage turtle_rotated_image_
void velocityCallback(const geometry_msgs::Twist::ConstPtr &vel)
bool teleportRelativeCallback(turtlesim::TeleportRelative::Request &, turtlesim::TeleportRelative::Response &)
ros::WallTime last_command_time_
boost::shared_ptr< Turtle > TurtlePtr
Turtle(const ros::NodeHandle &nh, const QImage &turtle_image, const QPointF &pos, float orient)
TeleportRequest(float x, float y, qreal _theta, qreal _linear, bool _relative)
ros::ServiceServer teleport_relative_srv_
ros::ServiceServer teleport_absolute_srv_
V_TeleportRequest teleport_requests_
ros::Publisher color_pub_
void paint(QPainter &painter)
bool setPenCallback(turtlesim::SetPen::Request &, turtlesim::SetPen::Response &)