22 #include <geometry_msgs/Twist.h> 46 double a = 0.6, b = 0.4, c = 0,
d = 0;
48 geometry_msgs::Twist command_msg;
53 x = (time - start_time).toSec();
55 double vel = a*
sin(b*x+c) +
d;
57 command_msg.angular.z = vel;
73 int main(
int argc,
char **argv)
75 ros::init(argc, argv,
"test_twist_command_execution_node");
ros::Publisher output_pub_
~TwistCommandExecutionTester()
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
void publish(const boost::shared_ptr< M > &message) const
int main(int argc, char **argv)
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
TwistCommandExecutionTester()
ROSCPP_DECL void spinOnce()
INLINE Rall1d< T, V, S > sin(const Rall1d< T, V, S > &arg)