/baxter_interface_2

Baxter Interface for ROS2 is a Software Development Kit (SDK) and Library for developing modern applications on Baxter Robotic Platform

Primary LanguageC++MIT LicenseMIT

Baxter Interface for ROS2 Humble

Lines of code GitHub

Baxter Interface for ROS2 is a Software Development Kit (SDK) and Library for developing modern applications on Baxter Robotic Platform

Example Code

// Baxter Interface for ROS2 Library
#include <baxter_interface_2/robot.hpp>

int main(int argc, char **argv)
{
    rclcpp::init(argc, argv);

    auto const target_pose = []
    {
        geometry_msgs::msg::Pose msg;
        
        // TODO: Insert Pose Values

        return msg;
    }();

    // Example Code
    BaxterRobot robot;

    robot.print_pose();
    robot.left_arm_to_target(target_pose);

    rclcpp::shutdown();
    return 0;
}

Running on Moveit

Terminal GIF MoveIt GIF