Only released in EOL distros:
evapi_ros: evarobot_battery | evarobot_bumper | evarobot_controller | evarobot_driver | evarobot_eio | evarobot_infrared | evarobot_minimu9 | evarobot_odometry | evarobot_orientation | evarobot_sonar | evarobot_start | evarobot_teleop
Package Summary
Documented
evarobot_driver drives the motors on Evarobot with PWM(Pulse Width Modulation) technique.
- Maintainer status: developed
- Maintainer: Mehmet Akcakoca <akcakocamehmet AT gmail DOT com>
- Author: Mehmet Akcakoca
- License: BSD
- Bug / feature tracker: https://github.com/inomuh/evapi_ros/issues
- Source: git https://github.com/inomuh/evapi_ros.git (branch: eva50)
New Maintainer : Inovasyon Muhendislik <evarobot@inovasyonmuhendislik.com>
Contents
Nodes
evarobot_driver
evarobot_driver takes velocities and drives left and right motors on the Evarobot using PWM(Pulse Width Modulation).Subscribed Topics
cntr_wheel_vel (geometry_msgs/Twist)- Linear and angular velocities which are applied to the Evarobot.
Parameters
~commandTopic (string, default: cntr_wheel_vel)
- Topic name which is read.
- Maximum linear velocity of the Evarobot.
- Maximum angular velocity of the Evarobot.
- Distance between two wheels in meter.
- Wheel diameter in meter.
- PWM frequency.
- Max. duty cycle.
- Number of pwm count.
- 1: PWMMode (||||||.....), 2: MSMode (|.|.|.|.|.|).
- Pin number of M1_IN1.
- Pin number of M1_IN2.
- Pin number of M1_EN.
- Pin number of M2_IN1.
- Pin number of M2_IN2.
- Pin number of M2_EN.