2 * System-dependent procedures for pppd under SunOS 4.
4 * Copyright (c) 1994 The Australian National University.
7 * Permission to use, copy, modify, and distribute this software and its
8 * documentation is hereby granted, provided that the above copyright
9 * notice appears in all copies. This software is provided without any
10 * warranty, express or implied. The Australian National University
11 * makes no representations about the suitability of this software for
14 * IN NO EVENT SHALL THE AUSTRALIAN NATIONAL UNIVERSITY BE LIABLE TO ANY
15 * PARTY FOR DIRECT, INDIRECT, SPECIAL, INCIDENTAL, OR CONSEQUENTIAL DAMAGES
16 * ARISING OUT OF THE USE OF THIS SOFTWARE AND ITS DOCUMENTATION, EVEN IF
17 * THE AUSTRALIAN NATIONAL UNIVERSITY HAVE BEEN ADVISED OF THE POSSIBILITY
20 * THE AUSTRALIAN NATIONAL UNIVERSITY SPECIFICALLY DISCLAIMS ANY WARRANTIES,
21 * INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY
22 * AND FITNESS FOR A PARTICULAR PURPOSE. THE SOFTWARE PROVIDED HEREUNDER IS
23 * ON AN "AS IS" BASIS, AND THE AUSTRALIAN NATIONAL UNIVERSITY HAS NO
24 * OBLIGATION TO PROVIDE MAINTENANCE, SUPPORT, UPDATES, ENHANCEMENTS,
29 static char rcsid[] = "$Id: sys-sunos4.c,v 1.20 1999/04/12 06:24:51 paulus Exp $";
44 #include <sys/types.h>
45 #include <sys/param.h>
46 #include <sys/socket.h>
47 #include <sys/sockio.h>
48 #include <sys/stream.h>
49 #include <sys/stropts.h>
54 #include <net/if_arp.h>
55 #include <net/nit_if.h>
56 #include <net/route.h>
57 #include <net/ppp_defs.h>
58 #include <net/pppio.h>
59 #include <netinet/in.h>
63 #if defined(sun) && defined(sparc)
66 extern void *alloca();
71 static int fdmuxid = -1;
75 static int restore_term;
76 static struct termios inittermios;
77 static struct winsize wsinfo; /* Initial window size info */
78 static pid_t parent_pid; /* PID of our parent */
80 extern u_char inpacket_buf[]; /* borrowed from main.c */
82 #define MAX_POLLFDS 32
83 static struct pollfd pollfds[MAX_POLLFDS];
86 static int link_mtu, link_mru;
89 static int tty_nmodules;
90 static char tty_modules[NMODULES][FMNAMESZ+1];
92 static int if_is_up; /* Interface has been marked up */
93 static u_int32_t ifaddrs[2]; /* local and remote addresses */
94 static u_int32_t default_route_gateway; /* Gateway for default route added */
95 static u_int32_t proxy_arp_addr; /* Addr for proxy arp entry added */
97 /* Prototypes for procedures local to this file. */
98 static int translate_speed __P((int));
99 static int baud_rate_of __P((int));
100 static int get_ether_addr __P((u_int32_t, struct sockaddr *));
101 static int strioctl __P((int, int, void *, int, int));
105 * sys_init - System-dependent initialization.
112 /* Get an internet socket for doing socket ioctl's on. */
113 if ((sockfd = socket(AF_INET, SOCK_DGRAM, 0)) < 0)
114 fatal("Couldn't create IP socket: %m");
117 * We may want to send a SIGHUP to the session leader associated
118 * with our controlling terminal later. Because SunOS doesn't
119 * have getsid(), we make do with sending the signal to our
122 parent_pid = getppid();
125 * Open the ppp device.
127 pppfd = open("/dev/ppp", O_RDWR | O_NONBLOCK, 0);
129 fatal("Can't open /dev/ppp: %m");
131 x = PPPDBG_LOG + PPPDBG_DRIVER;
132 strioctl(pppfd, PPPIO_DEBUG, &x, sizeof(int), 0);
135 /* Assign a new PPA and get its unit number. */
136 if (strioctl(pppfd, PPPIO_NEWPPA, &ifunit, 0, sizeof(int)) < 0)
137 fatal("Can't create new PPP interface: %m");
140 * Open the ppp device again and push the if_ppp module on it.
142 iffd = open("/dev/ppp", O_RDWR, 0);
144 fatal("Can't open /dev/ppp (2): %m");
146 x = PPPDBG_LOG + PPPDBG_DRIVER;
147 strioctl(iffd, PPPIO_DEBUG, &x, sizeof(int), 0);
149 if (strioctl(iffd, PPPIO_ATTACH, &ifunit, sizeof(int), 0) < 0)
150 fatal("Couldn't attach ppp interface to device: %m");
151 if (ioctl(iffd, I_PUSH, "if_ppp") < 0)
152 fatal("Can't push ppp interface module: %m");
154 x = PPPDBG_LOG + PPPDBG_IF;
155 strioctl(iffd, PPPIO_DEBUG, &x, sizeof(int), 0);
157 if (strioctl(iffd, PPPIO_NEWPPA, &ifunit, sizeof(int), 0) < 0)
158 fatal("Couldn't create ppp interface unit: %m");
160 if (strioctl(iffd, PPPIO_BIND, &x, sizeof(int), 0) < 0)
161 fatal("Couldn't bind ppp interface to IP SAP: %m");
167 * sys_cleanup - restore any system state we modified before exiting:
168 * mark the interface down, delete default route and/or proxy arp entry.
169 * This shouldn't call die() because it's called from die().
177 cifaddr(0, ifaddrs[0], ifaddrs[1]);
178 if (default_route_gateway)
179 cifdefaultroute(0, 0, default_route_gateway);
181 cifproxyarp(0, proxy_arp_addr);
185 * sys_close - Clean up in a child process before execing.
196 * sys_check_options - check the options that the user specified
206 * daemon - Detach us from controlling terminal session.
209 daemon(nochdir, noclose)
210 int nochdir, noclose;
214 if ((pid = fork()) < 0)
217 exit(0); /* parent dies */
222 fclose(stdin); /* don't need stdin, stdout, stderr */
231 * ppp_available - check whether the system has any ppp interfaces
238 return stat("/dev/ppp", &buf) >= 0;
242 * establish_ppp - Turn the serial port into a ppp interface.
250 /* Pop any existing modules off the tty stream. */
252 if (ioctl(fd, I_LOOK, tty_modules[i]) < 0
253 || ioctl(fd, I_POP, 0) < 0)
257 /* Push the async hdlc module and the compressor module. */
258 if (ioctl(fd, I_PUSH, "ppp_ahdl") < 0)
259 fatal("Couldn't push PPP Async HDLC module: %m");
260 if (ioctl(fd, I_PUSH, "ppp_comp") < 0)
261 error("Couldn't push PPP compression module: %m");
263 /* Link the serial port under the PPP multiplexor. */
264 if ((fdmuxid = ioctl(pppfd, I_LINK, fd)) < 0)
265 fatal("Can't link tty to PPP mux: %m");
271 * restore_loop - reattach the ppp unit to the loopback.
272 * This doesn't need to do anything because disestablish_ppp does it.
280 * disestablish_ppp - Restore the serial port to normal operation.
281 * It attempts to reconstruct the stream with the previously popped
282 * modules. This shouldn't call die() because it's called from die().
291 if (ioctl(pppfd, I_UNLINK, fdmuxid) < 0) {
293 error("Can't unlink tty from PPP mux: %m");
298 while (ioctl(fd, I_POP, 0) >= 0)
300 for (i = tty_nmodules - 1; i >= 0; --i)
301 if (ioctl(fd, I_PUSH, tty_modules[i]) < 0)
302 error("Couldn't restore tty module %s: %m",
305 if (hungup && default_device && parent_pid > 0) {
307 * If we have received a hangup, we need to send a SIGHUP
308 * to the terminal's controlling process. The reason is
309 * that the original stream head for the terminal hasn't
310 * seen the M_HANGUP message (it went up through the ppp
311 * driver to the stream head for our fd to /dev/ppp).
312 * Actually we send the signal to the process that invoked
313 * pppd, since SunOS doesn't have getsid().
315 kill(parent_pid, SIGHUP);
321 * Check whether the link seems not to be 8-bit clean.
329 if (strioctl(pppfd, PPPIO_GCLEAN, &x, 0, sizeof(x)) < 0)
334 s = "bit 7 set to 1";
337 s = "bit 7 set to 0";
347 warn("Serial link is not 8-bit clean:");
348 warn("All received characters had %s", s);
353 * List of valid speeds.
356 int speed_int, speed_val;
428 * Translate from bits/second to a speed_t.
434 struct speed *speedp;
438 for (speedp = speeds; speedp->speed_int; speedp++)
439 if (bps == speedp->speed_int)
440 return speedp->speed_val;
441 warn("speed %d not supported", bps);
446 * Translate from a speed_t to bits/second.
452 struct speed *speedp;
456 for (speedp = speeds; speedp->speed_int; speedp++)
457 if (speed == speedp->speed_val)
458 return speedp->speed_int;
463 * set_up_tty: Set up the serial port on `fd' for 8 bits, no parity,
464 * at the requested speed, etc. If `local' is true, set CLOCAL
465 * regardless of whether the modem option was specified.
468 set_up_tty(fd, local)
474 if (tcgetattr(fd, &tios) < 0)
475 fatal("tcgetattr: %m");
479 ioctl(fd, TIOCGWINSZ, &wsinfo);
482 tios.c_cflag &= ~(CSIZE | CSTOPB | PARENB | CLOCAL);
484 tios.c_cflag |= CRTSCTS;
485 else if (crtscts < 0)
486 tios.c_cflag &= ~CRTSCTS;
488 tios.c_cflag |= CS8 | CREAD | HUPCL;
490 tios.c_cflag |= CLOCAL;
491 tios.c_iflag = IGNBRK | IGNPAR;
495 tios.c_cc[VTIME] = 0;
498 tios.c_iflag |= IXON | IXOFF;
499 tios.c_cc[VSTOP] = 0x13; /* DC3 = XOFF = ^S */
500 tios.c_cc[VSTART] = 0x11; /* DC1 = XON = ^Q */
503 speed = translate_speed(inspeed);
505 cfsetospeed(&tios, speed);
506 cfsetispeed(&tios, speed);
508 speed = cfgetospeed(&tios);
510 * We can't proceed if the serial port speed is 0,
511 * since that implies that the serial port is disabled.
514 fatal("Baud rate for %s is 0; need explicit baud rate", devnam);
517 if (tcsetattr(fd, TCSAFLUSH, &tios) < 0)
518 fatal("tcsetattr: %m");
520 baud_rate = inspeed = baud_rate_of(speed);
525 * restore_tty - restore the terminal to the saved settings.
532 if (!default_device) {
534 * Turn off echoing, because otherwise we can get into
535 * a loop with the tty and the modem echoing to each other.
536 * We presume we are the sole user of this tty device, so
537 * when we close it, it will revert to its defaults anyway.
539 inittermios.c_lflag &= ~(ECHO | ECHONL);
541 if (tcsetattr(fd, TCSAFLUSH, &inittermios) < 0)
542 if (!hungup && errno != ENXIO)
543 warn("tcsetattr: %m");
544 ioctl(fd, TIOCSWINSZ, &wsinfo);
550 * setdtr - control the DTR line on the serial port.
551 * This is called from die(), so it shouldn't call die().
557 int modembits = TIOCM_DTR;
559 ioctl(fd, (on? TIOCMBIS: TIOCMBIC), &modembits);
563 * open_loopback - open the device we use for getting packets
564 * in demand mode. Under SunOS, we use our existing fd
574 * output - Output PPP packet.
587 dbglog("sent %P", p, len);
590 data.buf = (caddr_t) p;
592 while (putmsg(pppfd, NULL, &data, 0) < 0) {
593 if (--retries < 0 || (errno != EWOULDBLOCK && errno != EAGAIN)) {
595 error("Couldn't send packet: %m");
599 pfd.events = POLLOUT;
600 poll(&pfd, 1, 250); /* wait for up to 0.25 seconds */
606 * wait_input - wait until there is data available,
607 * for the length of time specified by *timo (indefinite
612 struct timeval *timo;
616 t = timo == NULL? -1: timo->tv_sec * 1000 + timo->tv_usec / 1000;
617 if (poll(pollfds, n_pollfds, t) < 0 && errno != EINTR)
622 * add_fd - add an fd to the set that wait_input waits for.
629 for (n = 0; n < n_pollfds; ++n)
630 if (pollfds[n].fd == fd)
632 if (n_pollfds < MAX_POLLFDS) {
633 pollfds[n_pollfds].fd = fd;
634 pollfds[n_pollfds].events = POLLIN | POLLPRI | POLLHUP;
637 error("Too many inputs!");
641 * remove_fd - remove an fd from the set that wait_input waits for.
648 for (n = 0; n < n_pollfds; ++n) {
649 if (pollfds[n].fd == fd) {
650 while (++n < n_pollfds)
651 pollfds[n-1] = pollfds[n];
660 * wait_loop_output - wait until there is data available on the
661 * loopback, for the length of time specified by *timo (indefinite
665 wait_loop_output(timo)
666 struct timeval *timo;
672 * wait_time - wait for a given length of time or until a
673 * signal is received.
677 struct timeval *timo;
681 n = select(0, NULL, NULL, NULL, timo);
682 if (n < 0 && errno != EINTR)
688 * read_packet - get a PPP packet from the serial device.
694 struct strbuf ctrl, data;
696 unsigned char ctrlbuf[64];
699 data.maxlen = PPP_MRU + PPP_HDRLEN;
700 data.buf = (caddr_t) buf;
701 ctrl.maxlen = sizeof(ctrlbuf);
702 ctrl.buf = (caddr_t) ctrlbuf;
704 len = getmsg(pppfd, &ctrl, &data, &flags);
706 if (errno = EAGAIN || errno == EINTR)
708 fatal("Error reading packet: %m");
715 * Got a M_PROTO or M_PCPROTO message. Huh?
718 dbglog("got ctrl msg len=%d", ctrl.len);
724 * get_loop_output - get outgoing packets from the ppp device,
725 * and detect when we want to bring the real link up.
726 * Return value is 1 if we need to bring up the link, 0 otherwise.
734 while ((len = read_packet(inpacket_buf)) > 0) {
735 if (loop_frame(inpacket_buf, len))
742 * ppp_send_config - configure the transmit characteristics of
746 ppp_send_config(unit, mtu, asyncmap, pcomp, accomp)
755 if (strioctl(pppfd, PPPIO_MTU, &mtu, sizeof(mtu), 0) < 0) {
756 if (hungup && errno == ENXIO)
758 error("Couldn't set MTU: %m");
760 if (strioctl(pppfd, PPPIO_XACCM, &asyncmap, sizeof(asyncmap), 0) < 0) {
761 error("Couldn't set transmit ACCM: %m");
763 cf[0] = (pcomp? COMP_PROT: 0) + (accomp? COMP_AC: 0);
764 cf[1] = COMP_PROT | COMP_AC;
765 if (strioctl(pppfd, PPPIO_CFLAGS, cf, sizeof(cf), sizeof(int)) < 0) {
766 error("Couldn't set prot/AC compression: %m");
769 /* set mtu for ip as well */
770 memset(&ifr, 0, sizeof(ifr));
771 strlcpy(ifr.ifr_name, ifname, sizeof(ifr.ifr_name));
772 ifr.ifr_metric = link_mtu;
773 if (ioctl(sockfd, SIOCSIFMTU, &ifr) < 0) {
774 error("Couldn't set IP MTU: %m");
779 * ppp_set_xaccm - set the extended transmit ACCM for the interface.
782 ppp_set_xaccm(unit, accm)
786 if (strioctl(pppfd, PPPIO_XACCM, accm, sizeof(ext_accm), 0) < 0) {
787 if (!hungup || errno != ENXIO)
788 warn("Couldn't set extended ACCM: %m");
793 * ppp_recv_config - configure the receive-side characteristics of
797 ppp_recv_config(unit, mru, asyncmap, pcomp, accomp)
805 if (strioctl(pppfd, PPPIO_MRU, &mru, sizeof(mru), 0) < 0) {
806 if (hungup && errno == ENXIO)
808 error("Couldn't set MRU: %m");
810 if (strioctl(pppfd, PPPIO_RACCM, &asyncmap, sizeof(asyncmap), 0) < 0) {
811 error("Couldn't set receive ACCM: %m");
813 cf[0] = (pcomp? DECOMP_PROT: 0) + (accomp? DECOMP_AC: 0);
814 cf[1] = DECOMP_PROT | DECOMP_AC;
815 if (strioctl(pppfd, PPPIO_CFLAGS, cf, sizeof(cf), sizeof(int)) < 0) {
816 error("Couldn't set prot/AC decompression: %m");
821 * ccp_test - ask kernel whether a given compression method
822 * is acceptable for use.
825 ccp_test(unit, opt_ptr, opt_len, for_transmit)
826 int unit, opt_len, for_transmit;
829 if (strioctl(pppfd, (for_transmit? PPPIO_XCOMP: PPPIO_RCOMP),
830 opt_ptr, opt_len, 0) >= 0)
832 return (errno == ENOSR)? 0: -1;
836 * ccp_flags_set - inform kernel about the current state of CCP.
839 ccp_flags_set(unit, isopen, isup)
840 int unit, isopen, isup;
844 cf[0] = (isopen? CCP_ISOPEN: 0) + (isup? CCP_ISUP: 0);
845 cf[1] = CCP_ISOPEN | CCP_ISUP | CCP_ERROR | CCP_FATALERROR;
846 if (strioctl(pppfd, PPPIO_CFLAGS, cf, sizeof(cf), sizeof(int)) < 0) {
847 if (!hungup || errno != ENXIO)
848 error("Couldn't set kernel CCP state: %m");
853 * get_idle_time - return how long the link has been idle.
860 return strioctl(pppfd, PPPIO_GIDLE, ip, 0, sizeof(struct ppp_idle)) >= 0;
864 * get_ppp_stats - return statistics for the link.
867 get_ppp_stats(u, stats)
869 struct pppd_stats *stats;
873 if (strioctl(pppfd, PPPIO_GETSTAT, &s, 0, sizeof(s)) < 0) {
874 error("Couldn't get link statistics: %m");
877 stats->bytes_in = s.p.ppp_ibytes;
878 stats->bytes_out = s.p.ppp_obytes;
884 * ccp_fatal_error - returns 1 if decompression was disabled as a
885 * result of an error detected after decompression of a packet,
886 * 0 otherwise. This is necessary because of patent nonsense.
889 ccp_fatal_error(unit)
895 if (strioctl(pppfd, PPPIO_CFLAGS, cf, sizeof(cf), sizeof(int)) < 0) {
896 if (errno != ENXIO && errno != EINVAL)
897 error("Couldn't get compression flags: %m");
900 return cf[0] & CCP_FATALERROR;
904 * sifvjcomp - config tcp header compression
907 sifvjcomp(u, vjcomp, xcidcomp, xmaxcid)
908 int u, vjcomp, xcidcomp, xmaxcid;
914 maxcid[0] = xcidcomp;
915 maxcid[1] = 15; /* XXX should be rmaxcid */
916 if (strioctl(pppfd, PPPIO_VJINIT, maxcid, sizeof(maxcid), 0) < 0) {
917 error("Couldn't initialize VJ compression: %m");
921 cf[0] = (vjcomp? COMP_VJC + DECOMP_VJC: 0) /* XXX this is wrong */
922 + (xcidcomp? COMP_VJCCID + DECOMP_VJCCID: 0);
923 cf[1] = COMP_VJC + DECOMP_VJC + COMP_VJCCID + DECOMP_VJCCID;
924 if (strioctl(pppfd, PPPIO_CFLAGS, cf, sizeof(cf), sizeof(int)) < 0) {
926 error("Couldn't enable VJ compression: %m");
933 * sifup - Config the interface up and enable IP packets to pass.
941 strlcpy(ifr.ifr_name, ifname, sizeof(ifr.ifr_name));
942 if (ioctl(sockfd, SIOCGIFFLAGS, &ifr) < 0) {
943 error("Couldn't mark interface up (get): %m");
946 ifr.ifr_flags |= IFF_UP;
947 if (ioctl(sockfd, SIOCSIFFLAGS, &ifr) < 0) {
948 error("Couldn't mark interface up (set): %m");
956 * sifdown - Config the interface down and disable IP.
964 strlcpy(ifr.ifr_name, ifname, sizeof(ifr.ifr_name));
965 if (ioctl(sockfd, SIOCGIFFLAGS, &ifr) < 0) {
966 error("Couldn't mark interface down (get): %m");
969 if ((ifr.ifr_flags & IFF_UP) != 0) {
970 ifr.ifr_flags &= ~IFF_UP;
971 if (ioctl(sockfd, SIOCSIFFLAGS, &ifr) < 0) {
972 error("Couldn't mark interface down (set): %m");
981 * sifnpmode - Set the mode for handling packets for a given NP.
984 sifnpmode(u, proto, mode)
993 if (strioctl(pppfd, PPPIO_NPMODE, npi, 2 * sizeof(int), 0) < 0) {
994 error("ioctl(set NP %d mode to %d): %m", proto, mode);
1000 #define INET_ADDR(x) (((struct sockaddr_in *) &(x))->sin_addr.s_addr)
1003 * sifaddr - Config the interface IP addresses and netmask.
1012 memset(&ifr, 0, sizeof(ifr));
1013 strlcpy(ifr.ifr_name, ifname, sizeof(ifr.ifr_name));
1014 ifr.ifr_addr.sa_family = AF_INET;
1015 INET_ADDR(ifr.ifr_addr) = m;
1016 if (ioctl(sockfd, SIOCSIFNETMASK, &ifr) < 0) {
1017 error("Couldn't set IP netmask: %m");
1019 ifr.ifr_addr.sa_family = AF_INET;
1020 INET_ADDR(ifr.ifr_addr) = o;
1021 if (ioctl(sockfd, SIOCSIFADDR, &ifr) < 0) {
1022 error("Couldn't set local IP address: %m");
1024 ifr.ifr_dstaddr.sa_family = AF_INET;
1025 INET_ADDR(ifr.ifr_dstaddr) = h;
1026 if (ioctl(sockfd, SIOCSIFDSTADDR, &ifr) < 0) {
1027 error("Couldn't set remote IP address: %m");
1029 #if 0 /* now done in ppp_send_config */
1030 ifr.ifr_metric = link_mtu;
1031 if (ioctl(sockfd, SIOCSIFMTU, &ifr) < 0) {
1032 error("Couldn't set IP MTU: %m");
1042 * cifaddr - Clear the interface IP addresses, and delete routes
1043 * through the interface if possible.
1052 bzero(&rt, sizeof(rt));
1053 rt.rt_dst.sa_family = AF_INET;
1054 INET_ADDR(rt.rt_dst) = h;
1055 rt.rt_gateway.sa_family = AF_INET;
1056 INET_ADDR(rt.rt_gateway) = o;
1057 rt.rt_flags = RTF_HOST;
1058 if (ioctl(sockfd, SIOCDELRT, &rt) < 0)
1059 error("Couldn't delete route through interface: %m");
1065 * sifdefaultroute - assign a default route through the address given.
1068 sifdefaultroute(u, l, g)
1074 bzero(&rt, sizeof(rt));
1075 rt.rt_dst.sa_family = AF_INET;
1076 INET_ADDR(rt.rt_dst) = 0;
1077 rt.rt_gateway.sa_family = AF_INET;
1078 INET_ADDR(rt.rt_gateway) = g;
1079 rt.rt_flags = RTF_GATEWAY;
1081 if (ioctl(sockfd, SIOCADDRT, &rt) < 0) {
1082 error("Can't add default route: %m");
1086 default_route_gateway = g;
1091 * cifdefaultroute - delete a default route through the address given.
1094 cifdefaultroute(u, l, g)
1100 bzero(&rt, sizeof(rt));
1101 rt.rt_dst.sa_family = AF_INET;
1102 INET_ADDR(rt.rt_dst) = 0;
1103 rt.rt_gateway.sa_family = AF_INET;
1104 INET_ADDR(rt.rt_gateway) = g;
1105 rt.rt_flags = RTF_GATEWAY;
1107 if (ioctl(sockfd, SIOCDELRT, &rt) < 0) {
1108 error("Can't delete default route: %m");
1112 default_route_gateway = 0;
1117 * sifproxyarp - Make a proxy ARP entry for the peer.
1120 sifproxyarp(unit, hisaddr)
1124 struct arpreq arpreq;
1126 bzero(&arpreq, sizeof(arpreq));
1127 if (!get_ether_addr(hisaddr, &arpreq.arp_ha))
1130 arpreq.arp_pa.sa_family = AF_INET;
1131 INET_ADDR(arpreq.arp_pa) = hisaddr;
1132 arpreq.arp_flags = ATF_PERM | ATF_PUBL;
1133 if (ioctl(sockfd, SIOCSARP, (caddr_t) &arpreq) < 0) {
1134 error("Couldn't set proxy ARP entry: %m");
1138 proxy_arp_addr = hisaddr;
1143 * cifproxyarp - Delete the proxy ARP entry for the peer.
1146 cifproxyarp(unit, hisaddr)
1150 struct arpreq arpreq;
1152 bzero(&arpreq, sizeof(arpreq));
1153 arpreq.arp_pa.sa_family = AF_INET;
1154 INET_ADDR(arpreq.arp_pa) = hisaddr;
1155 if (ioctl(sockfd, SIOCDARP, (caddr_t)&arpreq) < 0) {
1156 error("Couldn't delete proxy ARP entry: %m");
1165 * get_ether_addr - get the hardware address of an interface on the
1166 * the same subnet as ipaddr.
1171 get_ether_addr(ipaddr, hwaddr)
1173 struct sockaddr *hwaddr;
1175 struct ifreq *ifr, *ifend;
1176 u_int32_t ina, mask;
1179 struct ifreq ifs[MAX_IFS];
1182 ifc.ifc_len = sizeof(ifs);
1184 if (ioctl(sockfd, SIOCGIFCONF, &ifc) < 0) {
1185 error("ioctl(SIOCGIFCONF): %m");
1190 * Scan through looking for an interface with an Internet
1191 * address on the same subnet as `ipaddr'.
1193 ifend = (struct ifreq *) (ifc.ifc_buf + ifc.ifc_len);
1194 for (ifr = ifc.ifc_req; ifr < ifend; ifr = (struct ifreq *)
1195 ((char *)&ifr->ifr_addr + sizeof(struct sockaddr))) {
1196 if (ifr->ifr_addr.sa_family == AF_INET) {
1199 * Check that the interface is up, and not point-to-point
1202 strlcpy(ifreq.ifr_name, ifr->ifr_name, sizeof(ifreq.ifr_name));
1203 if (ioctl(sockfd, SIOCGIFFLAGS, &ifreq) < 0)
1205 if ((ifreq.ifr_flags &
1206 (IFF_UP|IFF_BROADCAST|IFF_POINTOPOINT|IFF_LOOPBACK|IFF_NOARP))
1207 != (IFF_UP|IFF_BROADCAST))
1211 * Get its netmask and check that it's on the right subnet.
1213 if (ioctl(sockfd, SIOCGIFNETMASK, &ifreq) < 0)
1215 ina = ((struct sockaddr_in *) &ifr->ifr_addr)->sin_addr.s_addr;
1216 mask = ((struct sockaddr_in *) &ifreq.ifr_addr)->sin_addr.s_addr;
1217 if ((ipaddr & mask) != (ina & mask))
1226 info("found interface %s for proxy arp", ifr->ifr_name);
1229 * Grab the physical address for this interface.
1231 if ((nit_fd = open("/dev/nit", O_RDONLY)) < 0) {
1232 error("Couldn't open /dev/nit: %m");
1235 strlcpy(ifreq.ifr_name, ifr->ifr_name, sizeof(ifreq.ifr_name));
1236 if (ioctl(nit_fd, NIOCBIND, &ifreq) < 0
1237 || ioctl(nit_fd, SIOCGIFADDR, &ifreq) < 0) {
1238 error("Couldn't get hardware address for %s: %m",
1244 hwaddr->sa_family = AF_UNSPEC;
1245 memcpy(hwaddr->sa_data, ifreq.ifr_addr.sa_data, 6);
1251 * have_route_to - determine if the system has any route to
1252 * a given IP address.
1253 * For demand mode to work properly, we have to ignore routes
1254 * through our own interface.
1256 int have_route_to(addr)
1262 #define WTMPFILE "/usr/adm/wtmp"
1265 logwtmp(line, name, host)
1266 const char *line, *name, *host;
1272 if ((fd = open(WTMPFILE, O_WRONLY|O_APPEND, 0)) < 0)
1274 if (!fstat(fd, &buf)) {
1275 strncpy(ut.ut_line, line, sizeof(ut.ut_line));
1276 strncpy(ut.ut_name, name, sizeof(ut.ut_name));
1277 strncpy(ut.ut_host, host, sizeof(ut.ut_host));
1278 (void)time(&ut.ut_time);
1279 if (write(fd, (char *)&ut, sizeof(struct utmp)) != sizeof(struct utmp))
1280 (void)ftruncate(fd, buf.st_size);
1286 * Return user specified netmask, modified by any mask we might determine
1287 * for address `addr' (in network byte order).
1288 * Here we scan through the system's list of interfaces, looking for
1289 * any non-point-to-point interfaces which might appear to be on the same
1290 * network as `addr'. If we find any, we OR in their netmask to the
1291 * user-specified netmask.
1297 u_int32_t mask, nmask, ina;
1298 struct ifreq *ifr, *ifend, ifreq;
1302 if (IN_CLASSA(addr)) /* determine network mask for address class */
1303 nmask = IN_CLASSA_NET;
1304 else if (IN_CLASSB(addr))
1305 nmask = IN_CLASSB_NET;
1307 nmask = IN_CLASSC_NET;
1308 /* class D nets are disallowed by bad_ip_adrs */
1309 mask = netmask | htonl(nmask);
1312 * Scan through the system's network interfaces.
1314 ifc.ifc_len = MAX_IFS * sizeof(struct ifreq);
1315 ifc.ifc_req = alloca(ifc.ifc_len);
1316 if (ifc.ifc_req == 0)
1318 if (ioctl(sockfd, SIOCGIFCONF, &ifc) < 0) {
1319 warn("Couldn't get system interface list: %m");
1322 ifend = (struct ifreq *) (ifc.ifc_buf + ifc.ifc_len);
1323 for (ifr = ifc.ifc_req; ifr < ifend; ++ifr) {
1325 * Check the interface's internet address.
1327 if (ifr->ifr_addr.sa_family != AF_INET)
1329 ina = INET_ADDR(ifr->ifr_addr);
1330 if ((ntohl(ina) & nmask) != (addr & nmask))
1333 * Check that the interface is up, and not point-to-point or loopback.
1335 strlcpy(ifreq.ifr_name, ifr->ifr_name, sizeof(ifreq.ifr_name));
1336 if (ioctl(sockfd, SIOCGIFFLAGS, &ifreq) < 0)
1338 if ((ifreq.ifr_flags & (IFF_UP|IFF_POINTOPOINT|IFF_LOOPBACK))
1342 * Get its netmask and OR it into our mask.
1344 if (ioctl(sockfd, SIOCGIFNETMASK, &ifreq) < 0)
1346 mask |= INET_ADDR(ifreq.ifr_addr);
1353 strioctl(fd, cmd, ptr, ilen, olen)
1354 int fd, cmd, ilen, olen;
1357 struct strioctl str;
1363 if (ioctl(fd, I_STR, &str) == -1)
1365 if (str.ic_len != olen)
1366 dbglog("strioctl: expected %d bytes, got %d for cmd %x\n",
1367 olen, str.ic_len, cmd);
1372 * Use the hostid as part of the random number seed.
1381 * Code for locking/unlocking the serial device.
1382 * This code is derived from chat.c.
1385 #if !defined(HDB) && !defined(SUNOS3)
1386 #define HDB 1 /* ascii lock files are the default */
1392 # define LOCK_PREFIX "/usr/spool/locks/LCK.."
1394 # define LOCK_PREFIX "/usr/spool/uucp/LCK.."
1396 #endif /* LOCK_DIR */
1398 static char *lock_file; /* name of lock file created */
1401 * lock - create a lock file for the named device.
1407 char hdb_lock_buffer[12];
1412 if ((p = strrchr(dev, '/')) != NULL)
1414 l = strlen(LOCK_PREFIX) + strlen(dev) + 1;
1415 lock_file = malloc(l);
1416 if (lock_file == NULL)
1417 novm("lock file name");
1418 slprintf(lock_file, l, "%s%s", LOCK_PREFIX, dev);
1420 while ((fd = open(lock_file, O_EXCL | O_CREAT | O_RDWR, 0644)) < 0) {
1422 && (fd = open(lock_file, O_RDONLY, 0)) >= 0) {
1423 /* Read the lock file to find out who has the device locked */
1425 n = read(fd, hdb_lock_buffer, 11);
1427 hdb_lock_buffer[n] = 0;
1428 pid = atoi(hdb_lock_buffer);
1431 n = read(fd, &pid, sizeof(pid));
1434 error("Can't read pid from lock file %s", lock_file);
1437 if (kill(pid, 0) == -1 && errno == ESRCH) {
1438 /* pid no longer exists - remove the lock file */
1439 if (unlink(lock_file) == 0) {
1441 notice("Removed stale lock on %s (pid %d)",
1445 warn("Couldn't remove stale lock on %s",
1448 notice("Device %s is locked by pid %d",
1453 error("Can't create lock file %s: %m", lock_file);
1460 slprintf(hdb_lock_buffer, sizeof(hdb_lock_buffer), "%10d\n", getpid());
1461 write(fd, hdb_lock_buffer, 11);
1464 write(fd, &pid, sizeof pid);
1472 * unlock - remove our lockfile
1485 * get_pty - get a pty master/slave pair and chown the slave side
1486 * to the uid given. Assumes slave_name points to >= 12 bytes of space.
1489 get_pty(master_fdp, slave_fdp, slave_name, uid)
1497 struct termios tios;
1500 for (i = 0; i < 64; ++i) {
1501 slprintf(pty_name, sizeof(pty_name), "/dev/pty%c%x",
1502 'p' + i / 16, i % 16);
1503 mfd = open(pty_name, O_RDWR, 0);
1506 sfd = open(pty_name, O_RDWR | O_NOCTTY, 0);
1515 strlcpy(slave_name, pty_name, 12);
1518 fchown(sfd, uid, -1);
1519 fchmod(sfd, S_IRUSR | S_IWUSR);
1520 if (tcgetattr(sfd, &tios) == 0) {
1521 tios.c_cflag &= ~(CSIZE | CSTOPB | PARENB);
1522 tios.c_cflag |= CS8 | CREAD;
1523 tios.c_iflag = IGNPAR | CLOCAL;
1526 if (tcsetattr(sfd, TCSAFLUSH, &tios) < 0)
1527 warn("couldn't set attributes on pty: %m");
1529 warn("couldn't get attributes on pty: %m");
1535 * SunOS doesn't have strtoul :-(
1538 strtoul(str, ptr, base)
1542 return (unsigned long) strtol(str, ptr, base);
1548 extern char *sys_errlist[];
1549 extern int sys_nerr;
1555 static char unknown[32];
1557 if (n > 0 && n < sys_nerr)
1558 return sys_errlist[n];
1559 slprintf(unknown, sizeof(unknown), "Error %d", n);